Next Article in Journal
Deep Subdomain Transfer Learning with Spatial Attention ConvLSTM Network for Fault Diagnosis of Wheelset Bearing in High-Speed Trains
Next Article in Special Issue
Research on Braking Energy Regeneration for Hybrid Electric Vehicles
Previous Article in Journal
Fingerprinting-Based Indoor Positioning Using Data Fusion of Different Radiocommunication-Based Technologies
Previous Article in Special Issue
Integrated Adhesion Coefficient Estimation of 3D Road Surfaces Based on Dimensionless Data-Driven Tire Model
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

An Integrated Obstacle Avoidance Controller Based on Scene-Adaptive Safety Envelopes

1
School of Automotive Engineering, Wuhan University of Technology, Wuhan 430070, China
2
Foshan Xianhu Laboratory of the Advanced Energy Science and Technology Guangdong Laboratory, Foshan 528200, China
3
Hubei Key Laboratory of Advanced Technology for Automotive Components, Wuhan University of Technology, Wuhan 430070, China
4
Hubei Collaborative Innovation Center for Automotive Components Technology, Wuhan University of Technology, Wuhan 430070, China
5
Hubei Research Center for New Energy & Intelligent Connected Vehicle, Wuhan University of Technology, Wuhan 430070, China
*
Author to whom correspondence should be addressed.
Machines 2023, 11(2), 303; https://doi.org/10.3390/machines11020303
Submission received: 31 December 2022 / Revised: 11 February 2023 / Accepted: 16 February 2023 / Published: 17 February 2023
(This article belongs to the Special Issue Advanced Modeling, Analysis and Control for Electrified Vehicles)

Abstract

:
This paper presents an integrated active obstacle avoidance controller in the Model Predictive Control (MPC) framework to ensure adaptive collision-free obstacle avoidance under complex scenarios while maintaining a good level of vehicle stability and steering smoothness. Firstly, with the observed road conditions and obstacle states as inputs, a data-driven Gaussian Process Regression (GPR) model is constructed and trained to generate confidence intervals, as scene-adaptive dynamic safety envelopes represent the safety boundaries of obstacle avoidance. Subsequently, the generated safety envelopes are transformed into soft and hard constraints, incorporated into the MPC controller and rolling updated in the prediction horizon to further cope with uncertain and rapidly evolving driving conditions. Minimizing both the control increments and stability feature parameters are formulated into the objectives of the MPC controller. By solving the multi-objective optimization problem with soft and hard constraints imposed, control commands are obtained to steer the vehicle in order to avoid the obstacles safely and smoothly with guaranteed vehicle stability. The experiments conducted on a motion-base driving simulator show that the proposed controller manages to perform safe and stable obstacle avoidance even under hazardous conditions. It is also verified that the proposed controller can be applied to more complex scenarios with dynamic obstacles presented.

1. Introduction

In recent years, technologies related to Intelligent Connected Vehicles (ICV) have been developed rapidly, showing great potential in addressing traffic safety concerns [1,2,3,4]. Active obstacle avoidance systems can effectively improve traffic safety and have become a research hotspot in the field of ICV [5].
Existing obstacle avoidance controllers are mainly devised in a hierarchical structure, in which the path planner generates a collision-free path, which is then tracked by the lower-level tracking controller [6]. In this hierarchical and sequential framework, paths are usually planned regardless of the complex dynamics of the vehicle, without taking into account the stability feature parameters of the vehicle, such as sideslip angle and yaw rate, as well as the road parameters that affect the stability of the vehicle, such as the road adhesion coefficient [7]. As a result, when the driving conditions are complex, especially when the road conditions change rapidly or the vehicle exhibits prominent nonlinearity, the path planning module may generate infeasible paths due to neglect of road conditions and vehicle state. In this case, the tracking controller is prone to either cause vehicle instability in attempting to accurately track the infeasible path, or lead to collision due to sacrificing tracking accuracy in order to maintain vehicle stability, neither of which are desirable for an obstacle avoidance system.
To address the above issue, some studies have proposed integrating path planning and tracking into a single module and performing path planning and tracking simultaneously by solving a constrained optimization problem with the same vehicle model to ensure that obtained control commands are feasible from the perspective of tracking. Febbo et al. [8] combined path planning and tracking into a single optimization problem by incorporating obstacles in the form of hard constraints into a nonlinear model predictive controller (MPC). Li et al. [9] constructed a motion trend function to predict the position of obstacles in the MPC prediction horizon to optimize the front wheel steering angle for simultaneous path planning and tracking. Guo et al. [10] achieved simultaneous obstacle avoidance path planning and tracking by calculating the ideal obstacle avoidance lateral displacement at a future moment and incorporating this into the optimization objective of the tracking controller. Although the above methods effectively improve the vehicle obstacle avoidance performance, the optimization functions constructed are nonconvex [11] and the constraints are complex, leading to sizeable computational overheads. Meanwhile, these methods tend to fall into local optimality due to the limited horizon. Inspired by the envelope-based control of aircraft, scholars have explored methods using safety envelopes to improve obstacle avoidance performance. Erlien et al. [12,13] constructed a safe driving envelope consisting of both a vehicle stability envelope and the physical boundaries of lanes and obstacles, so that the vehicle is allowed to safely deviate from the path when necessary in order to ensure vehicle stability. However, it is worth noting that the proposed envelope is not continuous and does not match the steering characteristics of the vehicle. More importantly, the kinematics and physical boundary-based envelopes are nonadaptive to arbitrary obstacle avoidance scenarios.
Obviously, effectively constructing safety envelopes is an essential issue in devising scene-adaptive and robust obstacle avoidance controllers. However, it is a rather nontrivial task to obtain the safety envelopes, since the integrated effects of the complex vehicle dynamics and the evolving driving situation, and the probabilistic uncertainty due to modeling errors and inaccuracies in observing the environment, should also be taken into account. The Gaussian process regression (GPR) model has significant advantages in modeling nonlinear dynamical systems with uncertainties, due to its native ability to express probabilistic uncertainty by calculating confidence intervals for the estimates through variance prediction [14]. Therefore, in this paper, a data-driven GPR model is proposed to generate the safety envelope of obstacle avoidance using the distances of the obstacles relative to the ego-vehicle and the road boundaries as inputs.
Furthermore, exploiting the predictive capability of MPC and its unique advantages in rolling optimization when dealing with optimization problems [15,16], this paper proposes to incorporate the constructed safety obstacle avoidance envelope into the framework of MPC and rolling updates the safety envelope in the MPC prediction horizon to further improve the adaptability to uncertain environments. Suh et al. [17] calculate the ideal steering angle to keep the vehicle located within the envelope, which is then tracked by a tracking controller. Brown et al. [13] incorporate the distance between the vehicle and the envelope boundary as a penalty term in the tracking controller objective function. However, the above method still requires calculating the ideal reference trajectory and then balancing the tracking accuracy and stability. Instead of planning a reference trajectory beforehand, we impose the safety envelopes as constraints, so that the controller is allowed to obtain the collision-free control commands within the safety envelopes, subject to optimization objectives of vehicle stability and steering smoothness. Moreover, in order to improve the robustness and safety of the controller, this paper adopts two confidence intervals ( m ± σ ) and ( m ± 2 σ ) as the soft and hard constraints for obstacle avoidance, respectively. The interval between soft and hard constraints is considered as a buffer area. When the driving condition is challenging, such as on low-adhesion roads, the vehicle can cross the soft constraints to avoid instability by driving in the buffer zone.
The contributions of this paper are summarized as follows:
(1)
A GPR-based vehicle obstacle avoidance safety envelope is proposed, which is more scene-adaptive and consistent with the steering characteristics of the vehicle as compared to envelopes constructed based on explicit metrics and physical boundaries. Moreover, the safety envelope is rolling updated in the MPC prediction horizon. Combined with the advantages of the GPR model in modeling uncertainties, the proposed method can better cope with uncertain and rapidly evolving driving conditions.
(2)
A multi-objective MPC controller incorporating the safety obstacle avoidance envelopes as constraints is proposed. With soft and hard constraints imposed, the MPC controller solves the optimization problem, with vehicle stability and steering smoothness as the objectives, to obtain control commands that guarantee collision-free obstacle avoidance, meanwhile maintaining a good level of vehicle stability and steering smoothness. The experiments prove that, in challenging and dynamic scenes, the stability of the vehicle is significantly improved under the premise of avoiding obstacles safely.
The framework of the proposed obstacle avoidance controller is illustrated in Figure 1. The remainder of the paper is organized as follows. Section 2 describes the methodology for constructing the obstacle avoidance controller. The simulation results and analysis of the proposed obstacle avoidance controller are introduced in Section 3. Finally, conclusions are presented in Section 4.

2. Methodology

2.1. Vehicle Models

This section introduces the vehicle dynamics model of the ego-vehicle and the obstacle vehicle model, both adopted as prediction models for MPC-based obstacle avoidance controllers.

2.1.1. Ego-Vehicle Dynamics Model

Considering the trade-off between computational efficiency and modeling accuracy of the MPC controller, the bicycle model shown in Figure 2 [18] is adopted as the ego-vehicle dynamics model, and the corresponding model parameters are shown in Table 1.
Analyzing the forces on the model, the expression for the vehicle dynamics force can be obtained as given in Equation (1):
{ v ˙ y = v x φ ˙ + 2 F Y r + 2 ( F Y f cos ( δ f ) + F X f sin ( δ f ) ) m v ˙ x = v y φ ˙ + 2 F X r + 2 ( F X f cos ( δ f ) F Y f sin ( δ f ) ) m φ ¨ = 2 L f ( F Y f cos ( δ f ) + F X f sin ( δ f ) ) 2 L r F Y r I Z Y ˙ = v x sin φ + v y cos φ X ˙ = v x cos φ v y sin φ
where I Z represents the yaw inertia and X and Y are the vehicle’s longitudinal and lateral positions in the Cartesian coordinate system. When the sideslip angle and the longitudinal slip ratio are small, the tire force is simplified as follows [19]:
{ F Y [ f , r ] = C c [ f , r ] α [ f , r ] F X [ f , r ] = C l [ f , r ] κ [ f , r ]
where C c [ f , r ] and C l [ f , r ] represent the cornering and longitudinal stiffness of front (rear) tires, respectively, and κ [ f , r ] represents the slip ratio of front (rear) tires, which can be measured when the vehicle is equipped with an Antilock Brake System (ABS). α [ f , r ] represents the sideslip angle of front (rear) tires, which can be obtained by analyzing the geometric relationship of the vehicle model shown in Figure 2:
{ α f = v y + L f φ ˙ v x δ f α r = v y L r φ ˙ v x
The sideslip angle of the vehicle mass can be obtained with the following formula:
β = v y v x
Combining Equations (1)–(4), the dynamic force equation of the vehicle can be obtained as follows:
{ Y ˙ = v x sin φ + v x β cos φ β ˙ = 2 ( C c r + C c f ) m v x β + ( 2 C c r L r 2 C c f L f m v x 2 1 ) φ ˙ + 2 C c f m v x δ f φ ˙ = φ ˙ φ ¨ = 2 C c r L r 2 C c f L f I z β 2 C c r L r 2 + 2 C c f L f 2 I z v x φ ˙ + 2 C c f L f I z δ f
Setting the state vector of the vehicle as ζ = [ Y , β , φ , φ ˙ ] T and the control vector u = [ δ f ] , the nonlinear dynamics model of the vehicle can be obtained by Equation (6):
ζ ˙ ( t ) = f ( ζ ( t ) , u ( t ) )

2.1.2. Obstacle Vehicle Model

In order to ensure safe obstacle avoidance, it is necessary to consider both the current position and the future motion trend of the dynamic obstacles. Previous studies have extensively investigated the measurement of coordinates, yaw angle and yaw rate of obstacles [20,21]. In this paper, based on the premise that the obstacle parameters mentioned above are obtainable at each sampling moment, the motion model of an obstacle vehicle in the MPC prediction horizon is modeled with the following equations:
{ X obs ( s + 1 ) = X obs ( s ) + T S V o b s ( s ) cos ( φ o b s ( s ) ) Y obs ( s + 1 ) = Y obs ( s ) + T S V o b s ( s ) sin ( φ o b s ( s ) ) φ o b s ( s + 1 ) = φ o b s ( s ) + T S φ ˙ o b s ( s )
where X obs ( s ) and Y obs ( s ) represent the longitudinal and lateral coordinates of the obstacle vehicle in the geodetic coordinate system at moment s. V o b s ( k ) , φ o b s ( s ) and φ ˙ o b s ( s ) are the current speed, yaw angle and yaw rate, respectively, and T S is the sampling interval.

2.2. GPR-Based Obstacle Avoidance Safety Envelope

Nonlinear safety avoidance envelopes are produced with a GPR model whose inputs are the main feature parameters of road conditions and obstacle states. Subsequently, the model was trained with safety avoidance data for human drivers collected through a driving simulator.
A Gaussian Process is a stochastic process specified by its mean function and covariance function [14,22]. Essentially, a GP is a set of random variables and any finite number of random variables have a joint Gaussian distribution [23,24]. With GP regressions, the mapping relationship between the input feature vector f and the Gaussian distribution of the output d is established by the GPR model, which can be expressed mathematically as follows:
d ( f ) G P ( m ( f ) , K ( f , f ) )
where m ( f ) and K ( f , f ) represent the mean function and covariance function, respectively:
m ( f ) = Ε [ d ( f ) ]
K ( f , f ) = Ε [ ( d ( f ) m ( f ) ) ( d ( f ) m ( f ) ) ]
The E represents mathematical expectation. Assume the mean functions are zero and adopt the square exponential kernel function shown in Equation (11) as the covariance function to obtain the prior distribution of the sample:
K ( f , f ) = σ f 2 exp ( 1 2 ( f f ) T M 1 ( f f ) ) σ n 2
where M = d i a g ( [ l 1 l 2 l 3 ] ) represents the weight matrix consisting of feature length scales for each dimension of the input vector. σ f 2 and σ n 2 represent the process standard deviation and the noise variance, respectively. M , σ f 2 and σ n 2 are hyperparameters and are represented by the parameter vector h = [ M , σ f 2 , σ n 2 ] . The hyperparameters have a significant impact on the performance of the GPR model [25]. In this paper, given a training set containing N inputs and corresponding outputs, hyperparameters are obtained with the maximum log-likelihood estimation as follows:
D = { F = [ f 1 , f 2 , , f N ] , Y = [ d 1 , d 2 , , d N ] }
h = arg max ( log p ( Y | F , h ) )
where
{ log p ( Y | F , h ) = 1 2 Y T K Y Y 1 2 log | K Y | N 2 log ( 2 π ) K Y = K ( F , F ) + σ n 2 I [ K ( F , F ) ] i j = K ( f i , f j )
where I represents the unit matrix. After obtaining the optimal set of hyperparameters and updating the kernel function, for the new prediction points f , the predicted values d ( f ) and the training set output Y should satisfy the joint Gaussian distribution as follows:
( Y d ( f ) ) N ( ( m ( F ) m ( f ) ) , ( K ( F , F ) + σ n 2 I K ( F , f ) K ( f , F ) K ( f , f ) ) )
Furthermore, the posterior distribution of the predicted values d ( f ) is also a Gaussian distribution with mean and variance.
d ( f ) N ( K ( f , F ) Y K ( F , F ) + σ n 2 I , k ( f , f ) K ( f , F ) K ( F , f ) K ( F , F ) + σ n 2 I )
As shown in Figure 3, in order to consider the size of the obstacle and the relative position between the obstacle and the road boundary, in this paper we adopt the concept of “channel tubes”, used in the literature [12,26] to link the infeasible gaps between the obstacles and the road boundaries, unifying the representation of the obstacles through the uncrossable area.
Further, the farthest distance L between the ego-vehicle and the uncrossable area and the width W of the uncrossable area are selected as the feature parameters. Considering the difference of obstacle avoidance behaviors under different vehicle speeds, the feature vector f = [ L , W , V ] is adopted as the input of the GPR model. In order to unify the probability distribution of obstacle avoidance trajectory points regardless of the lane that the ego-vehicle is in, the relative distance d between the ego-vehicle and the boundary of the starting lane of obstacle avoidance is adopted as the output of the model.
The training data of the GPR model is collected using a motion-base driving simulator consisting of a real vehicle cockpit and a 180° ring screen as shown in Figure 4. A standard two-lane road is constructed as shown in Figure 5, with obstacles in the left and right lanes at intervals with a longitudinal distance (120–150) m. Drivers with extensive driving experience are recruited to drive the vehicle to complete the obstacle avoidance experiments. Drivers are instructed to perform obstacle avoidance operations at diverse safe distances based on their driving experiences. To consider the impact of driving speed on the process of obstacle avoidance without increasing the operational difficulty, we set up three groups of experiments; the speed intervals of each group are (0–30 km/h), (30–50 km/h) and (50–70 km/h), respectively. In each group of obstacle avoidance experiments, drivers can accelerate and decelerate appropriately within the speed interval according to their driving habits.
The data obtained by collecting samples are expressed in the form of data pairs:
D d y n = { f k , d k } = { L k , W k , V k , d k } , k { 0 , 1 , , N }
The size of the GPR data dictionary has a significant impact on the performance of the model [27]. As the dictionary data increases, the accuracy of the GPR model is improved, but the computational burden also increases significantly, often causing failures of model convergence. In this study, the maximum size of the GPR data dictionary is set to 1000 empirically. Once the training data size reaches the maximum, referring to the literature [28], we evaluate the new data using distance measures to determine which data samples are substituted with new ones. This distance measure is defined as the posterior variance of the new data f points as follows:
Θ = K f , f K f , F ( K F , F + σ I ) 1 K F , f
where σ is the optimization adjustment parameter and K F , F represents the covariance matrix. F is the dataset in the dictionary. The new data is evaluated by feedback gain and the data point with the smallest measurement distance will be replaced.

2.3. Envelope-Based Obstacle Avoidance Tracking Controller

Based on the obstacle avoidance safety envelope produced by the GPR model, a novel MPC control scheme is proposed. The obstacle avoidance safety envelope is transformed into soft and hard constraints. Both optimizing vehicle stability and steering smoothness are formulated into the objective functions to realize stable and smooth control of the vehicle.
To improve the computational efficiency and real-time performance of the controller, the vehicle dynamics model established in Section 2 is discretized with a fixed sampling time T S and Taylor expansion at the operating point, the following expression being obtained:
ζ ( s + 1 ) = A s ζ ( s ) + B s u ( s )
Y ( s ) = H s ζ ( s )
η ( s ) = C s ζ ( s )
where
A s = [ 1 T S v x cos φ T S ( v x cos φ v y sin φ ) 0 0 1 2 T S ( C c f + C c r ) m v x 0 2 T S ( C c r L r C c f L f ) m v x 2 T S 0 0 1 T S 0 2 T S ( C c r L r C c f L f ) I z 0 1 2 T S ( C c r L r 2 + C c f L f 2 ) I z v x ]
B s = [ 0 , 2 T S C c f m v x , 0 , 2 T S C c f l f I z ] T , C s = [ 1 0 0 0 ] , H s = [ 0 1 0 0 0 0 0 1 ]
Adding the control factors u ( s 1 ) to ξ ( s ) , a new state quantity ξ ˜ ( s ) is given by the following equations.
ζ ˜ ( s + 1 ) = A ˜ s ζ ˜ ( s ) + B ˜ s Δ u ( s )
Y ( s ) = H ˜ s ζ ( s )
η ( s ) = C ˜ s ζ ˜ ( s )
where
ζ ˜ ( s ) = [ Y ( s ) β ( s ) φ ( s ) φ ˙ ( s ) δ f ( s 1 ) ] T , Δ u ( s ) = u ( s ) u ( s 1 )
A ˜ s = [ A s B s 0 I ] , B ˜ s = [ B s I ] T , H ˜ s = [ H s 0 2 × 1 ] , C ˜ s = [ C s 0 ]
Assuming that the vehicle speed remains constant in the predicted horizon, as shown in Figure 6, based on the obstacle vehicle model constructed in Section 2, at each sampling moment the feature input of the GPR model at the next P N prediction points can be obtained.
F P N = { f k + 1 f k + 2 f k + P N } = { { L k + 1 , W k + 1 , v x ( k ) } { L k + 2 , W k + 2 , v x ( k ) } { L k + P N , W k + P N , v x ( k ) } }
Inputting F P N into the GPR model to obtain a Gaussian distribution corresponding to the future N predicted outputs and transforming them into the global coordinate system:
Y ( k + i ) ~ N ( m k + i , σ k + i ) , i = 1 , 2 , , P N
Referring to [29], when the obstacle avoidance trajectory point is located in a small probability interval with high uncertainty, it is identified as having a collision risk. Therefore, two confidence intervals ( m k + i ± σ k + i ) and ( m k + i ± 2 σ k + i ) are adopted as the soft and hard constraints to ensure driving safety and vehicle stability. The hard constraint ensures that the obstacle avoidance trajectory of the vehicle is collision-free. The soft constraint ensures that the vehicle drives along the center of the safety region when possible while allowing the vehicle to go beyond the soft intervals to maintain vehicle stability. Assuming that the current time step is k, the vehicle control increment remains constant between the control horizon and the prediction horizon, and the vehicle states in the state matrix have been obtained from the on-board sensors and the state observer, the designed multi-objective MPC is expressed as in Equations (27)–(32). The stability feature parameters sideslip angle β and yaw rate φ ˙ are selected as outputs.
min Δ U ( k ) J k = i = 1 P N η ( k + i ) 2 Q + i = 0 C N 1 Δ u ( k + i ) 2 R + ρ ε 2
subj. to Equations (28)–(32)
ζ ˜ ( k + 1 ) = A ˜ k ζ ˜ ( k ) + B ˜ k Δ u ( k ) Y ( k ) = H ˜ k ζ ( k ) η ( k ) = C ˜ k ζ ˜ ( k )
Δ u ( k ) = u ( k ) u ( k 1 )
m k + i ( 1 + ε ) σ k + i Y ( k + i ) m k + i + ( 1 + ε ) σ k + i
0 ε 1
u min u ( k ) u max Δ u min Δ u ( k ) Δ u max
where Q , R and ρ are the weight matrices of output, input and slack variables respectively. Equations (31) and (32) represent the constraints on the slack factor, control input and control increment, respectively.
It is assumed that the control input remains constant during each control step. Transform Equation (27) into standard quadratic form combined with the constraints:
min Δ U ( k ) , ε 1 2 [ Δ U ( k ) ε ] T P e [ Δ U ( k ) ε ] + G e [ Δ U ( k ) ε ]
subj. to
[ I 0 I 0 0 0 0 1 0 1 Θ k Ω k Θ k Ω k ] [ Δ U ( k ) ε ] [ Δ δ f , max × o n e s ( C N , 1 ) Δ δ f , min × o n e s ( C N , 1 ) δ f , max × o n e s ( C N , 1 ) δ f , min × o n e s ( C N , 1 ) 1 0 M k + Ω k Ψ k ζ ˜ ( k ) M k + Ω k + Ψ k ζ ˜ ( k ) ]
where
Ω k = [ σ k + 1 σ k + 2 σ k + P N ] T , Μ k = [ m k + 1 m k + 2 m k + P N ] T Δ U ( k ) = [ Δ u ( k ) Δ u ( k + 1 ) Δ u ( k + C N 1 ) ] T , Q e = I P N Q , R e = I C N R P e = [ 2 ( Ξ k T Q e Ξ k + R e ) 0 C N × 1 0 1 × c N ρ ] G e = [ 2 ζ ˜ ( k ) T Γ k T Q e Ξ k 0 ]
Ξ k = [ C ˜ k B ˜ K 0 0 C ˜ k A ˜ k B ˜ K C ˜ k B ˜ k + 1 0 C ˜ k i = 0 P N 1 A ˜ k + i B ˜ k C ˜ k i = 1 P N 1 A ˜ k + i B ˜ k + 1 C ˜ k i = C N 1 P N 1 A ˜ k + i B ˜ k + C N 1 ] P N × C N
= [ 1 0 0 1 1 0 0 1 1 1 ] C N × C N Γ k = [ C ˜ k A ˜ k C ˜ k A ˜ k A ˜ k + 1 C ˜ k i = 0 P N 1 A ˜ k + i ] P N × 1
Θ k = [ H ˜ k B ˜ K 0 0 H ˜ k A ˜ k B ˜ K H ˜ k B ˜ k + 1 0 H ˜ k i = 0 P N 1 A ˜ k + i B ˜ k H ˜ k i = 1 P N 1 A ˜ k + i B ˜ k + 1 H ˜ k i = C N 1 P N 1 A ˜ k + i B ˜ k + C N 1 ] P N × C N Ψ k = [ H ˜ k A ˜ k H ˜ k A ˜ k A ˜ k + 1 H ˜ k i = 0 P N 1 A ˜ k + i ] P N × 1
By solving Equation (33), the sequence of control inputs at each step is obtained and the first element is chosen as the control variable. As a result, the trajectory that satisfies the objectives of optimal vehicle stability and steering smoothness within the safe obstacle avoidance region is executed:
δ f ( k ) = δ f ( k 1 ) + Δ δ f , k

3. Experiments

To verify the proposed obstacle avoidance strategy, a series of obstacle avoidance simulation studies are conducted using the motion-base driving simulator described in Section 2.2. The vehicle dynamics are simulated using the CarSim B-class sedan model, which outputs the vehicle states at a frequency of 50 Hz. The driving simulation program provides a MATLAB/Simulink interface which receives real-time control commands generated by the proposed obstacle avoidance controller. The parameters of the vehicle dynamics model and the MPC controller are presented in Table 2 and Table 3.

3.1. Scenario A

Scenario A is a standard two-lane continuous obstacle avoidance scenario with lane width of 3.5 m, where three static obstacle vehicles of 4.65 m length and 2.1 m width are set at positions (99, 2.75), (190, 6.25) and (295, 2.75), respectively. In order to verify the effectiveness of the proposed MPC controller based on the GPR safe obstacle avoidance envelope, in ensuring vehicle stability and control smoothness while performing safe obstacle avoidance, another MPC controller is built as a comparison. The comparison controller uses the mean value of the GPR real-time output as the reference trajectory and the objective functions and weight coefficients are defined referring to the literature [30]. The proposed obstacle avoidance controller in this paper is denoted as controller A and the controller for comparison is denoted as controller B. A fine driving condition with a high ground adhesion coefficient (μ = 0.85) and a hazardous driving condition with a low adhesion coefficient (μ = 0.2) are used to compare the tracking performance of the controllers and the vehicle speed was set at a constant 72 km/h. The experimental results are shown in Figure 7 and Figure 8, respectively.
Figure 7 illustrates the experimental results of obstacle avoidance on the high-adhesion road. As shown in Figure 7a, both controller A and controller B achieve safe obstacle avoidance. Since no specific reference trajectory is given, controller A would start the obstacle avoidance operation in advance when facing each obstacle and choose the smoothest obstacle avoidance route possible within the soft constraints ( μ ± σ ) to ensure high level of safety, as well as optimal stability and control smoothness. As shown in Figure 7b, the front wheel steering angles of controller A and controller B both stay within a reasonable range throughout the obstacle avoidance process and the front wheel steering angle of controller B is significantly greater than that of controller A, with a maximum steering angle of 1.55 deg compared to 1.1 deg for controller A. It is also shown in Figure 7c,d that, throughout the obstacle avoidance process, the control increment of controller A is smoother and the slip angle and yaw rate of controller A are both smaller than those of controller B, demonstrating better vehicle stability.
When the vehicle is driven under hazardous conditions with low adhesion, as shown in Figure 8, controller B yields significant tracking errors due to handling limits (Figure 8a). To eliminate the tracking error, the steering control command of controller B increases rapidly to a maximum of more than 4 deg. Meanwhile, the yaw rate and sideslip angle of controller B increase significantly, exceeding 0.3 rad/s and 1.1 deg, respectively, indicating that the vehicle has already become instable in attempting to track the reference trajectory. By contrast, the trajectory of controller A exceeds the interval ( μ ± σ ) , but is still located within ( μ ± 2 σ ) , indicating that the vehicle exceeds the soft constraint in order to maintain stability, but still ensures safe driving without collision. As presented in Figure 8b–d, the steering angle, yaw rate and sideslip angle of controller A are much smaller than those of controller B, proving the capability of controller A in maintaining a good level of stability while safely avoiding the obstacles, even under challenging conditions.
The results presented above clearly show that the proposed MPC tracking controller based on the safety avoidance envelope can make full use of the vehicle’s handling limit to ensure stable and smooth driving under the premise of safe obstacle avoidance.

3.2. Scenario B

In scenario B, to verify the effectiveness of the proposed obstacle avoidance control scheme in more complex situations where both dynamic and static vehicles are presented, we set a dynamic vehicle with a speed of 10 m/s in the first lane and a static obstacle is placed at position (180, 2.75) in the second lane. The ego-vehicle is driving in the first lane at a speed of 20 m/s. To avoid collision with the dynamic vehicle in the first lane, the vehicle needs to change to the second lane for overtaking and then return to the original lane to avoid the static vehicle.
Figure 9 shows the experimental results of scenario B. As shown in Figure 9a,b, the obstacle avoidance trajectory of the ego-vehicle is always located within the interval ( μ ± σ ) and the minimum distances between the ego-vehicle and the dynamic and static obstacle are 3.44 m and 2.99 m, respectively, both greater than the safety distance of 2.1 m, considering the length of the vehicles. As shown in Figure 9c,e,f, during the entire process, the front steering angle of the vehicle is quite smooth, which ensures the smoothness and comfort of the obstacle avoidance process. The maximum yaw rate and the sideslip angle were no more than 0.07 rad/s and 0.08 deg, respectively, indicating that the vehicle is maintained at a stable state.
The results presented verify that the data–driven GPR model proposed in this paper can accurately generate nonlinear safety envelopes under complex scenarios with dynamic obstacles.

3.3. Scenario C

In scenario C, to verify the effectiveness of the proposed obstacle avoidance scheme in coping with environmental uncertainty through the prediction of obstacle motion trends in the MPC prediction horizon, we set up a standard three-lane continuous obstacle avoidance scenario with a lane width of 3.5 m. As shown in Figure 10a, from the top down, the first lane, second lane and third lane are shown, respectively. The ego-vehicle starts at (0, 6.2) and drives in the second lane at a speed of 20 m/s. In the third lane, a dynamic obstacle vehicle changes lanes towards the second lane at a speed of 10 m/s and a static obstacle vehicle is placed at position (160, 9.75) in the first lane. There will be a collision between the two vehicles if both the ego-vehicle and the obstacle vehicle drive in their current state. To avoid collisions, the ego-vehicle needs to change to the first lane and, after the overtaking is completed, the ego-vehicle needs to return to the second lane to avoid the static obstacle.
Figure 10 shows the experimental results of scenario C. As shown in Figure 10a,b, based on the constructed obstacle vehicle model, the ego-vehicle enables active and safe obstacle avoidance when the obstacle vehicle merges in, and the minimum distances between the ego-vehicle and the dynamic and static obstacle are 3.19 m and 3.45 m, respectively, both reasonable safe distances. Although there are some abrupt changes in the generated GPR envelope due to sudden changes in the motions of the dynamic vehicle, the proposed controller ensures smooth obstacle avoidance by crossing the soft constraint and avoids collision by staying within the hard constraint ( μ ± 2 σ ) . As shown in Figure 10d,e, during the entire process, the maximum yaw rate and the sideslip angle were no more than 0.08 rad/s and 0.18 deg, respectively, indicating that the vehicle is maintained at a stable state. The experimental results prove that the obstacle avoidance controller is robust to environmental uncertainties in the sense that the GPR model is capable of generating safety envelopes in response to abrupt changes in the motion states of surrounding obstacles. Furthermore the proposed constrained multi-objective MPC controller is able to perform safe and stable obstacle avoidance based on the dynamically generated envelopes.

4. Conclusions

This paper presents an active obstacle avoidance framework for collision-free obstacle avoidance while ensuring vehicle stability and steering smoothness. First, scene-adaptive safety envelopes representing the safety boundaries of obstacle avoidance are generated with a GPR model from observed road conditions and the states of obstacles. On the basis of the safety envelopes, soft and hard constraints are generated and incorporated into the MPC controller, and are rolling updated in the prediction horizon. Both minimizing the control increments and stability feature parameters are formulated into the objectives of the MPC controller. By solving the constrained multi-objective optimization problem, control commands that guarantee safe obstacle avoidance with complex vehicle dynamics taken into account are obtained. In contrast to hierarchical and sequential methodologies consisting of separated path planning and trajectory tracking procedures, the proposed framework solves the dilemma of tracking infeasible paths by modeling the procedure of obstacle avoidance as an integrated constrained multi-objective optimization problem. A series of experiments are conducted on a motion-base driving simulator to verify the effectiveness of the proposed framework under various conditions. The results prove that the data-driven GPR model proposed in this paper is highly adaptable to complex obstacle avoidance scenarios and can accurately and robustly produce safety envelopes in various scenes. Consequently, the proposed MPC controller built upon the safety envelopes is robust and adaptive to challenging conditions, demonstrating optimal performance in avoiding obstacles safely, with vehicle stability guaranteed.

Author Contributions

Conceptualization, K.L. and Z.Y.; data curation, K.L., Y.B. and Y.Y.; formal analysis, K.L., Z.Y. and Y.K.; funding acquisition, Z.Y.; Investigation, K.L. and Y.B.; Methodology, K.L., Z.Y. and Y.K.; project administration, Z.Y.; resources, K.L. and Y.B.; software, K.L., Z.Y. and E.S.; supervision, Z.Y.; validation, K.L. and Y.B.; visualization, K.L., Y.B. and Y.Y.; writing—original draft, K.L., Y.B. and E.S.; writing—review and editing, K.L., Z.Y., Y.B. and E.S. All authors have read and agreed to the published version of the manuscript.

Funding

This work was supported in part by the National Natural Science Foundation of China under Grant 51805388, and in part by the Open Foundation of Foshan Xianhu Laboratory of the Advanced Energy Science and Technology Guangdong Laboratory under Grant XHD2020-003. This study is also supported by National Key R&D Program of China with 2022YFB2502901.

Data Availability Statement

Not applicable.

Conflicts of Interest

The authors declare no conflict of interest.

References

  1. Abbas, M.A.; Milman, R.; Eklund, J.M. Obstacle avoidance in real time with nonlinear model predictive control of autonomous vehicles. Can. J. Electr. Comput. Eng. 2017, 40, 12–22. [Google Scholar] [CrossRef]
  2. Maurer, M.; Gerdes, J.C.; Lenz, B.; Winner, H. Autonomous Driving: Technical, Legal and Social Aspects; Springer Nature: Cham, Switzerland, 2016. [Google Scholar]
  3. Jin, X.; Wang, J.; Yan, Z.; Xu, L.; Yin, G.; Chen, N. Robust vibration control for active suspension system of in-wheel-motor-driven electric vehicle via μ-synthesis methodology. J. Dyn. Syst. Meas. Control 2022, 144, 051007. [Google Scholar] [CrossRef]
  4. Jin, X.; Wang, J.; He, X.; Yan, Z.; Xu, L.; Wei, C.; Yin, G. Improving Vibration Performance of Electric Vehicles Based on In-Wheel Motor-Active Suspension System via Robust Finite Frequency Control. IEEE Trans. Intell. Transp. Syst. 2023, 24, 1631–1643. [Google Scholar] [CrossRef]
  5. He, S.; Wang, M.; Dai, S.-L.; Luo, F. Leader–follower formation control of USVs with prescribed performance and collision avoidance. IEEE Trans. Ind. Inform. 2018, 15, 572–581. [Google Scholar] [CrossRef]
  6. Sun, Q.; Guo, Y.; Fu, R.; Wang, C.; Yuan, W. Human-Like Obstacle Avoidance Trajectory Planning and Tracking Model for Autonomous Vehicles That Considers the Driver’s Operation Characteristics. Sensors 2020, 20, 4821. [Google Scholar] [CrossRef]
  7. Xie, Y.; Li, C.; Jing, H.; An, W.; Qin, J. Integrated Control for Path Tracking and Stability Based on the Model Predictive Control for Four-Wheel Independently Driven Electric Vehicles. Machines 2022, 10, 859. [Google Scholar] [CrossRef]
  8. Febbo, H.; Liu, J.; Jayakumar, P.; Stein, J.L.; Ersal, T. Moving obstacle avoidance for large, high-speed autonomous ground vehicles. In Proceedings of the 2017 American Control Conference (ACC), Seattle, WA, USA, 3 July 2017; pp. 5568–5573. [Google Scholar]
  9. Li, S.; Li, Z.; Yu, Z.; Zhang, B.; Zhang, N. Dynamic trajectory planning and tracking for autonomous vehicle with obstacle avoidance based on model predictive control. IEEE Access 2019, 7, 132074–132086. [Google Scholar] [CrossRef]
  10. Guo, H.; Shen, C.; Zhang, H.; Chen, H.; Jia, R. Simultaneous trajectory planning and tracking using an MPC method for cyber-physical systems: A case study of obstacle avoidance for an intelligent vehicle. IEEE Trans. Ind. Inform. 2018, 14, 4273–4283. [Google Scholar] [CrossRef]
  11. Li, X.; Sun, Z.; Cao, D.; Liu, D.; He, H. Development of a new integrated local trajectory planning and tracking control framework for autonomous ground vehicles. Mech. Syst. Signal Process. 2017, 87, 118–137. [Google Scholar] [CrossRef]
  12. Erlien, S.M.; Fujita, S.; Gerdes, J.C. Shared steering control using safe envelopes for obstacle avoidance and vehicle stability. IEEE Trans. Intell. Transp. Syst. 2015, 17, 441–451. [Google Scholar] [CrossRef]
  13. Brown, M.; Funke, J.; Erlien, S.; Gerdes, J.C. Safe driving envelopes for path tracking in autonomous vehicles. Control Eng. Pract. 2017, 61, 307–316. [Google Scholar] [CrossRef]
  14. Ryan, C.; Murphy, F.; Mullins, M. End-to-end autonomous driving risk analysis: A behavioural anomaly detection approach. IEEE Trans. Intell. Transp. Syst. 2020, 22, 1650–1662. [Google Scholar] [CrossRef]
  15. Wu, H.; Si, Z.; Li, Z. Trajectory tracking control for four-wheel independent drive intelligent vehicle based on model predictive control. IEEE Access 2020, 8, 73071–73081. [Google Scholar] [CrossRef]
  16. Albin, T.; Ritter, D.; Liberda, N.; Quirynen, R.; Diehl, M. In-vehicle realization of nonlinear MPC for gasoline two-stage turbocharging airpath control. IEEE Trans. Control Syst. Technol. 2017, 26, 1606–1618. [Google Scholar] [CrossRef]
  17. Suh, J.; Kim, B.; Yi, K. Design and evaluation of a driving mode decision algorithm for automated driving vehicle on a motorway. IFAC-PapersOnLine 2016, 49, 115–120. [Google Scholar] [CrossRef]
  18. Chen, S.; Chen, H.; Negrut, D. Implementation of MPC-Based trajectory tracking considering different fidelity vehicle models. J. Beijing Inst. Technol. 2020, 29, 303–316. [Google Scholar]
  19. Wei, S.; Zou, Y.; Zhang, X.; Zhang, T.; Li, X. An integrated longitudinal and lateral vehicle following control system with radar and vehicle-to-vehicle communication. IEEE Trans. Veh. Technol. 2019, 68, 1116–1127. [Google Scholar] [CrossRef]
  20. Chang, B.R.; Tsai, H.F.; Young, C.-P. Intelligent data fusion system for predicting vehicle collision warning using vision/GPS sensing. Expert Syst. Appl. 2010, 37, 2439–2450. [Google Scholar] [CrossRef]
  21. Nassi, B.; Mirsky, Y.; Nassi, D.; Ben-Netanel, R.; Drokin, O.; Elovici, Y. Phantom of the ADAS: Securing advanced driver-assistance systems from split-second phantom attacks. In Proceedings of the 2020 ACM SIGSAC Conference on Computer and Communications Security, Virtual, 9–13 November 2020; pp. 293–308. [Google Scholar]
  22. Schulz, E.; Speekenbrink, M.; Krause, A. A tutorial on Gaussian process regression: Modelling, exploring, and exploiting functions. J. Math. Psychol. 2018, 85, 1–16. [Google Scholar] [CrossRef]
  23. Goli, S.A.; Far, B.H.; Fapojuwo, A.O. Vehicle Trajectory Prediction with Gaussian Process Regression in Connected Vehicle Environment $\star$. In Proceedings of the 2018 IEEE Intelligent Vehicles Symposium (IV), Changshu, China, 26–30 June 2018; pp. 550–555. [Google Scholar]
  24. Williams, C.K.; Rasmussen, C.E. Gaussian Processes for Machine Learning; MIT Press: Cambridge, MA, USA, 2006; Volume 2. [Google Scholar]
  25. Li, Z.; Zhao, P.; Jiang, C.; Huang, W.; Liang, H. A Learning-Based Model Predictive Trajectory Planning Controller for Automated Driving in Unstructured Dynamic Environments. IEEE Trans. Veh. Technol. 2022, 71, 5944–5959. [Google Scholar] [CrossRef]
  26. Suh, S.H.; Bishop, A.B. Collision-avoidance trajectory planning using tube concept: Analysis and simulation. J. Robot. Syst. 1988, 5, 497–525. [Google Scholar] [CrossRef]
  27. Deisenroth, M.P. Efficient Reinforcement Learning Using Gaussian Processes; KIT Scientific Publishing: Karlsruhe, Germany, 2010; Volume 9. [Google Scholar]
  28. Kabzan, J.; Hewing, L.; Liniger, A.; Zeilinger, M.N. Learning-based model predictive control for autonomous racing. IEEE Robot. Autom. Lett. 2019, 4, 3363–3370. [Google Scholar] [CrossRef] [Green Version]
  29. Ryan, C.; Murphy, F.; Mullins, M. Semiautonomous vehicle risk analysis: A telematics-based anomaly detection approach. Risk Anal. 2019, 39, 1125–1140. [Google Scholar] [CrossRef] [PubMed]
  30. Wang, H.; Liu, B.; Ping, X.; An, Q. Path tracking control for autonomous vehicles based on an improved MPC. IEEE Access 2019, 7, 161064–161073. [Google Scholar] [CrossRef]
Figure 1. The framework of the proposed obstacle avoidance controller.
Figure 1. The framework of the proposed obstacle avoidance controller.
Machines 11 00303 g001
Figure 2. Vehicle dynamics model.
Figure 2. Vehicle dynamics model.
Machines 11 00303 g002
Figure 3. Non-crossable area generation.
Figure 3. Non-crossable area generation.
Machines 11 00303 g003
Figure 4. The motion-base driving simulators. (a,b) Outside, (c,d) Inside.
Figure 4. The motion-base driving simulators. (a,b) Outside, (c,d) Inside.
Machines 11 00303 g004
Figure 5. Training scenes.
Figure 5. Training scenes.
Machines 11 00303 g005
Figure 6. Collection of GPR model input parameters in MPC prediction horizon.
Figure 6. Collection of GPR model input parameters in MPC prediction horizon.
Machines 11 00303 g006
Figure 7. Experimental results of obstacle avoidance with ground adhesion coefficient 0.85. (a) GPR −based obstacle avoidance envelope and the obstacle avoidance trajectories. (b) The front wheel steering angle. (c) Yaw rate (d) Vehicle sideslip angle.
Figure 7. Experimental results of obstacle avoidance with ground adhesion coefficient 0.85. (a) GPR −based obstacle avoidance envelope and the obstacle avoidance trajectories. (b) The front wheel steering angle. (c) Yaw rate (d) Vehicle sideslip angle.
Machines 11 00303 g007
Figure 8. Experimental results of obstacle avoidance with ground adhesion coefficient 0.2. (a) GPR −based obstacle avoidance envelope and the obstacle avoidance trajectories. (b) The front wheel steering angle. (c) Yaw rate (d) Vehicle sideslip angle.
Figure 8. Experimental results of obstacle avoidance with ground adhesion coefficient 0.2. (a) GPR −based obstacle avoidance envelope and the obstacle avoidance trajectories. (b) The front wheel steering angle. (c) Yaw rate (d) Vehicle sideslip angle.
Machines 11 00303 g008
Figure 9. Obstacle avoidance experiment results of scenario B. (a) GPR−based obstacle avoidance envelope and the obstacle avoidance trajectory. (b) Relative distance. (c) The front wheel steering angle. (d) Yaw rate (e) Vehicle sideslip angle.
Figure 9. Obstacle avoidance experiment results of scenario B. (a) GPR−based obstacle avoidance envelope and the obstacle avoidance trajectory. (b) Relative distance. (c) The front wheel steering angle. (d) Yaw rate (e) Vehicle sideslip angle.
Machines 11 00303 g009aMachines 11 00303 g009b
Figure 10. Obstacle avoidance experiment results of scenario C. (a) GPR−based obstacle avoidance envelope and vehicle obstacle avoidance trajectory. (b) Relative distance. (c) The front wheel steering angle. (d) Yaw rate (e) Vehicle sideslip angle.
Figure 10. Obstacle avoidance experiment results of scenario C. (a) GPR−based obstacle avoidance envelope and vehicle obstacle avoidance trajectory. (b) Relative distance. (c) The front wheel steering angle. (d) Yaw rate (e) Vehicle sideslip angle.
Machines 11 00303 g010
Table 1. Vehicle Dynamics Parameters.
Table 1. Vehicle Dynamics Parameters.
DescriptionSymbol
Vehicle Massm
Distance from the center of mass to the front/rear axis L f   / L r
Longitudinal force of the front/rear tires F X f   / F X r
Lateral force of front/rear tires F Y f   / F Y r
Sideslip angle of front/rear tires     α f   / α r
Steering angle of the front wheel δ f
Longitudinal/Lateral speed v x / v y
Yaw rate φ ˙
Sideslip Angle β
Table 2. Parameters of the vehicle model.
Table 2. Parameters of the vehicle model.
SymbolValue
m1723 kg
I Z 4175 kg⋅ m 2
L f 1230 mm
L r 1470 mm
C c r 62,700 N⋅ rad 1
C c f 66,900 N⋅ rad 1
Table 3. Parameters of the MPC controller.
Table 3. Parameters of the MPC controller.
SymbolValue
T0.02
P N 20
C N 5
Q [ 10000 0 0 2000 ]
R50000
ε 1000
Disclaimer/Publisher’s Note: The statements, opinions and data contained in all publications are solely those of the individual author(s) and contributor(s) and not of MDPI and/or the editor(s). MDPI and/or the editor(s) disclaim responsibility for any injury to people or property resulting from any ideas, methods, instructions or products referred to in the content.

Share and Cite

MDPI and ACS Style

Li, K.; Yin, Z.; Ba, Y.; Yang, Y.; Kuang, Y.; Sun, E. An Integrated Obstacle Avoidance Controller Based on Scene-Adaptive Safety Envelopes. Machines 2023, 11, 303. https://doi.org/10.3390/machines11020303

AMA Style

Li K, Yin Z, Ba Y, Yang Y, Kuang Y, Sun E. An Integrated Obstacle Avoidance Controller Based on Scene-Adaptive Safety Envelopes. Machines. 2023; 11(2):303. https://doi.org/10.3390/machines11020303

Chicago/Turabian Style

Li, Kang, Zhishuai Yin, Yuanxin Ba, Yue Yang, Yuanhao Kuang, and Erqian Sun. 2023. "An Integrated Obstacle Avoidance Controller Based on Scene-Adaptive Safety Envelopes" Machines 11, no. 2: 303. https://doi.org/10.3390/machines11020303

Note that from the first issue of 2016, this journal uses article numbers instead of page numbers. See further details here.

Article Metrics

Back to TopTop