Next Article in Journal
Numerical Study of the Toughness of Complex Metal Matrix Composite Topologies
Previous Article in Journal
Quality Assessment of 3D Printed Surfaces Using Combined Metrics Based on Mutual Structural Similarity Approach Correlated with Subjective Aesthetic Evaluation
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Robust Path Tracking Control for Autonomous Vehicle Based on a Novel Fault Tolerant Adaptive Model Predictive Control Algorithm

School of Mechanical Engineering, Southeast University, Nanjing 211189, China
*
Author to whom correspondence should be addressed.
Appl. Sci. 2020, 10(18), 6249; https://doi.org/10.3390/app10186249
Submission received: 11 August 2020 / Revised: 31 August 2020 / Accepted: 4 September 2020 / Published: 9 September 2020

Abstract

:
Autonomous vehicles are expected to completely change the development model of the transportation industry and bring great convenience to our lives. Autonomous vehicles need to constantly obtain the motion status information with on-board sensors in order to formulate reasonable motion control strategies. Therefore, abnormal sensor readings or vehicle sensor failures can cause devastating consequences and can lead to fatal vehicle accidents. Hence, research on the fault tolerant control method is critical for autonomous vehicles. In this paper, we develop a robust fault tolerant path tracking control algorithm through combining the adaptive model predictive control algorithm for lateral path tracking control, improved weight assignment method for multi-sensor data fusion and fault isolation, and novel federal Kalman filtering approach with two states chi-square detector and residual chi-square detector for detection and identification of sensor fault in autonomous vehicles. Our numerical simulation and experiment demonstrate that the developed approach can detect fault signals and identify their sources with high accuracy and sensitivity. In the double line change path tracking control experiment, when the sensors failure occurs, the proposed method shows better robustness and effectiveness than the traditional methods. It is foreseeable that this research will contribute to the development of safer and more intelligent autonomous driving system, which in turn will promote the industrial development of intelligent transportation system.

1. Introduction

With the development of autonomous driving technology, autonomous vehicles have shown great value in improving vehicle safety, enhancing traffic efficiency, liberating the driver’s hands, etc., which has attracted more and more attention from relevant scholars [1]. One of the most challenging and significant research issues for autonomous vehicle is the smooth and accurate automatic path tracking control, which is important for insuring the driving safety and accurately tracking the reference trajectory [2]. The main goal of the automatic path tracking control system is to guarantee the lateral path following errors with maintaining the lateral driving stability and considering the dynamic constraints of autonomous vehicle.
Many vehicle control algorithms have been presented to obtain active safety and enhance the lateral dynamic stability and path tracking performance. In [3], the authors presented a robust control algorithm of path tracking with considering the problem of delay and data dropout for autonomous vehicle. In [4], the active disturbance rejection control method and differential flatness theory were used for lateral path tracking control of autonomous vehicle. In [5] the disturbances within a finite preview window were augmented as the state vector and a preview steering control strategy was presented for linear augmented error system. However, all these automatic control strategies focus on constant velocity. Due to the inevitable variation of vehicle longitudinal velocity, the previous studies on a fixed constant longitudinal velocity face a significant limitation in real driving conditions.
To track the reference path within limited velocity without collisions, the autonomous vehicle needs to accurately acquire the motion states information and percept the immediate physical traffic environment. Therefore, numerous sensors are adopted for autonomous vehicles, such as camera, inertial measurement unit (IMU), LIDAR, RADAR and GPS (Global Positioning System) integrated navigation system. The effective working conditions of each type of sensors are not the same. For example, the camera cannot work normally when the illumination conditions are insufficient. The detection accuracies of RADAR and LIDAR sensors are easily affected by bad weather such as smoke, rain, and snow. The GPS signal is easily blocked in the environment with tall trees, urban buildings, and tunnels, which can cause signal interruption. Therefore, the sensors of autonomous vehicle may be influenced by illumination, signal outage, poor weather conditions, magnetic interference, and other environmental circumstances. In addition, the sensors age and inherent errors may also result in sensor failure and affecting data availability. All these issues may be the reasons prompting the transmission of faulty information [6,7,8]. The possibility of sensors fault increases with the numbers and types of vehicle sensors, which can result in disruptive consequences and fatal crashes.
The method of sensor redundancy and data fusion can be used to avoid sensor fault. The same motion parameters of an autonomous vehicle can be obtained by multiple different sensors [9]. For instance, the vision system used for vehicle detection can be affected by traffic lights and high-brightness lights of vehicle in nighttime; however, RADAR and LIDAR would not be affected in these cases. Hence, by using the method of sensor redundancy, the impact of sensor fault can be reduced into an acceptable level. However, the reliability of measured parameters after data fusion is still doubtful, if the faulty sensor data are not detected and isolated. Many methods for sensor fault detection have been proposed; however, few of them are focused on autonomous vehicles. Some methods use the distances as the metrics for sensor fault detection, for instance the Mahalabobis distance, affinity propagation clustering, and graph theory [10,11,12,13]. In [14,15], the Kalman filtering method was used for fault detection. With the development of deep learning technology, more and more researchers develop the application of deep learning methods for fault detection, such as convolution neural network [16], recurrent neural network [17], and multilayer neural network models [18,19]. In [20,21], Bayesian networks were used for sensors fault detection of autonomous vehicle. Even though the deep learning neural network can deal with the raw data without manually feature extraction, deep learning-based methods require a large-scale dataset with manual annotations, which is difficult to collect.
The large-scale implementation of autonomous vehicles in transportation systems require the effective sensor fault detection and robust path tracking motion control. One of the significant contributions of this work is to detect the source fault sensor and isolated the fault signal in real-time for autonomous vehicle to enhance the reliability of fused data. The other one is the realization of robust path tracking control when sensor failures occur. Specifically, we develop a fault-tolerant path tracking control approach with combining the model of adaptive model predictive control algorithm and a novel sensor fault detection method based on federal Kalman filtering and chi-square detector. The main contributions of this work can be described as: (1) a single-track 3DOF vehicle dynamics model is established and Taylor expansion is performed for modelling linearization; (2) an adaptive model predictive control algorithm is developed for robust path tracking control; (3) an improved weight assignment method based data fusion method is proposed for multi-sensor data fusion and fault signal isolation; and (4) a novel sensor fault detection approach is proposed using federal Kalman filtering and fault detector with parallel structure for each sensing source, consisting of two state chi-square detector and residual chi-square detector. The simulation and experimental results of double lane changing show the effectiveness of the proposed method in this work.
The rest of this paper is organized as follows. The vehicle dynamic model is established and model linearization process is described in Section 2.1 and Section 2.2. The constraints and objective functions are constructed in Section 2.3, Section 2.4, Section 2.5 and Section 2.6, and the path tracking control algorithm based on model predictive control is designed in Section 2.7. The multi-sensor information fusion algorithm and fault signal detection and isolation algorithm are described in Section 2.8 and Section 2.9, respectively. In Section 3, the simulation and experimental verification using double lane changing path tracking scenario is presented. Finally, the conclusions are given.

2. Methodology

The flowchart of the fault-tolerant model predictive control algorithm (FTAMPC) designed in this paper is shown in Figure 1. Vehicle motion status information can be obtained by GPS combined navigation system, visual odometer system, and LIDAR SLAM system. The multi-sensor signals are fused by the proposed data fusion algorithm and fault signals are detected by the proposed fault detectors based on federal Kalman filtering chi-square detector. The fault signals are isolated in the data fusion process. Finally, the designed adaptive model predictive controller is used for robust path tracking control of autonomous vehicle.

2.1. Modeling and Problem Formulation

The main goal of this work is to enable the vehicle to track the target path quickly and steadily. The vehicle suspension characteristics are relatively small in relation to the research content, so the single-track model is selected. At the same time, the dynamic model established in this paper is mainly used to design the predictive model in the model predictive controller. It needs to be simplified as much as possible while accurately describing the dynamic characteristics of the vehicle. The following idealized assumptions are first proposed when performing dynamic modeling: (1) road fluctuations are ignored, assuming that the vehicle is always driving without vertical motion; (2) suspension motion is ignored; (3) the load movement of the front and rear axles is not considered, and the left and right transfer of the load is ignored; (4) the tire cornering characteristics are considered, but the vertical and horizontal coupling relationships are ignored; and (5) the mechanical effects of steering system are ignored. In this paper, a three-degree-of-freedom vehicle dynamics model is constructed, including longitudinal motion, lateral motion, and yaw (see Figure 2).
The longitudinal force, lateral force, and yaw moment received by the vehicle can be written as:
{ m ( x ¨ y ˙ φ ˙ ) = F x = 2 F l f cos δ f 2 F c f sin δ f + 2 F l r m ( y ¨ + x ˙ φ ˙ ) = F y = 2 F l f sin δ f 2 F c f cos δ f + 2 F c r I z φ ¨ = M z = 2 L f ( F l f sin δ f + F c f cos δ f ) 2 L r F c r
where m is the vehicle mass; x is the longitudinal position; φ is the yaw angle; δ f is the front wheel rotation angle; y is the lateral position; I z is the z -axis moment of inertia; F x is the total longitudinal force; F y is the total lateral force; M z is the total yaw moment; F c f and F c r are the lateral forces on the front and rear tires of the vehicle and are related to the corner stiffness and corner angle of tires; F l f and F l r are the longitudinal force on the front and rear tires of vehicle, which are related to the longitudinal stiffness and slip rate of the tire; F x f and F x r are the forces on the front and rear tires of the vehicle in the x direction; F y f and F y r are the forces on the front and rear tires of the vehicle in the y direction; and L f and L r are the distances from the front and rear axis to the center of mass.
Generally, the stable driving vehicle has small variation angle and slip rate. The tire forces involved in this paper are all approximated by a linear function. In addition, there are many trigonometric functions in the vehicle dynamics model described by formulas. Since each angle involved in the dynamics model is in a small angle interval, each trigonometric function can satisfy the following approximate conditions: cos θ 1 , sin θ = 0 , tan θ = θ . Hence, the tire force of the vehicle can be expressed as:
{ F l f = C l f s f F l r = C l r s r F c f = C c f [ δ f ( y ˙ + L f φ ˙ ) / x ˙ ] F c r = C c r ( L r φ ˙ y ˙ ) / x ˙
where C c f and C c r are the lateral stiffness of the front and rear tires; C l f and C l r are the longitudinal stiffness of the front and rear tires; and s f and s r are the slip ratio of the front and rear tires.
The non-linear dynamic vehicle model can be written as:
{ x ¨ = y ˙ φ ˙ + ( 2 / m ) { C l f s f C c f [ δ f ( y ˙ + L f φ ˙ ) / x ˙ ] δ f + C l r s r } y ¨ = x ˙ φ ˙ + ( 2 / m ) { C l f s f δ f + C c f [ δ f ( y ˙ + L f φ ˙ ) / x ˙ ] C c r ( y ˙ L r φ ˙ ) / x ˙ } φ ˙ = φ ˙ φ ¨ = ( 2 L f / I z ) { C l f s f δ f + C c f [ δ f ( y ˙ + L f φ ˙ ) / x ˙ ] } + ( 2 L r / I z ) C c r ( y ˙ L r φ ˙ ) / x ˙ Y ˙ = x ˙ sin φ + y ˙ cos φ X ˙ = x ˙ cos φ y ˙ sin φ
For convenience, we use ξ d y n = [ y ˙ , x ˙ , φ , φ ˙ , Y , X ] T as the system state quantities and u d y n = δ f as the system control quantity.

2.2. Linearization of Vehicle Dynamics Model

The lateral motion control of autonomous vehicle is to control the front wheel rotation angle for lateral movement, and then realize the path tracking purpose. Therefore, this paper selects path tracking as the ultimate goal of autonomous vehicle lateral control and the tracking accuracy as the main indicator to measure the performance of the control system. Model predictive control can be divided into linear time-varying model predictive control (LMPC) and non-linear model predictive control (NMPC) [22,23]. The linear time-varying model predictive control algorithm uses the linear time-varying model as the predictive model. Compared with the nonlinear model predictive control, the real-time performance of the linear time-varying model predictive control is much better. For the motion control of autonomous vehicles, the real-time performance of the control algorithm is very important; therefore, we use LMPC for lateral motion control of autonomous vehicles in our work.
Firstly, the non-linear dynamic vehicle model needs to be linearized. The state quantity and control quantity of the system satisfy the following relationship:
ξ ˙ d y n = f ( ξ d y n , u d y n )
Performing the Taylor expansion at any point ( ξ r , u r ) , retaining the first-order term and ignoring the higher-order terms, we can get:
ξ ˙ = f ( ξ r , u r ) + f f ξ | ξ = ξ r u = u r ( ξ ξ r ) + f u | ξ = ξ r u = u r ( u u r )
The formula can be transformed into:
ξ ˙ = f ( ξ r , u r ) + J f ( ξ ) ( ξ ξ r ) + J f ( u ) ( u u r )
where J f ( ξ ) and J f ( u ) are the Jacobian matrixes of f relative to ξ and u , respectively.
The linearized system equation can be written as:
ξ ˙ = A ( t ) ξ ( t ) + B ( t ) u ( t ) ζ = C ξ ( t )
where A ( t ) = J f ( ξ ) , B ( t ) = J f ( u ) , C = ( 0 , 0 , 0 , 0 , 1 , 0 ) T .
After introducing the incremental model, the state space equation is written as:
{ Δ ξ ( k + 1 ) = A ( k ) Δ ξ ( k ) + B ( k ) Δ u ( k ) ζ ( k ) = C Δ ξ ( k )

2.3. Construct the Constraints

In the general control process, the control quantity limit constraint and the control increment constraint must be considered. The expression of the limit constraint of the control variable is:
u min ( t + k ) u ( t + k ) u max ( t + k ) , k = 0 , 1 , , N c 1
where N c is the control time domain.
The expression of the control incremental constraints is:
Δ u min ( t + k ) Δ u ( t + k ) Δ u max ( t + k ) , k = 0 , 1 , , N c 1
We assume that:
{ u ( t + k ) = u ( t + k 1 ) + Δ u ( t + k ) U t = 1 N c u ( k 1 ) A ^ = A I m
where 1 N c is column vector with rows N c ; I m is m-dimensional identity matrix; is the Kronecker product; and u ( k 1 ) is the actual control quantity of the system at the last moment.
The expression of the limit constraint of the controlled variable and the expression of the control incremental constraints can be converted into:
{ Δ U min Δ U t Δ U max U min A ^ Δ U t + U t U max
where U min and U max represent the minimum and maximum value of the control variable in the control time domain.

2.4. Dynamic Constraint of Tire Cornering

The vehicle may slip due to wet or slippery roads during autonomous driving process, which is extremely risky for vehicle safety. Therefore, it is particularly important to increase vehicle dynamics constraints and reduce the possibility of vehicle sideslip.
The sideslip of the vehicle is closely related to the tire slip angle. On the absolute horizontal road, the tire slip angle α = 0 ; when the tire is elastically deformed by lateral force without lateral slip, α α max ; and when the tire is subjected to excessive lateral force, the vehicle slips α > α max . It can be concluded that the slip angle of the vehicle tire directly reflects whether the vehicle is slipping, and limiting the tire slip angle limits the risk of sideslip.
Since the established vehicle dynamics space equation does not take the tire slip angle as a state quantity, and cannot directly constrain the tire slip angle, this paper needs to find the relationship between the tire slip angle α and the state quantity ξ . The relationship is to restrain the tire slip angle by imposing a specific relationship constraint on the state quantity.
The available tire front and rear wheel angles can be written as [24]:
{ α f = ( y ˙ + L f φ ˙ ) / x ˙ δ f α r = ( y ˙ L r φ ˙ ) / x ˙
The linearization of the above formula can be written as:
{ α = E ξ ( k , t ) + F u d y n ( k , t ) E = [ 1 x ˙ y ˙ + L f φ ˙ x ˙ 2 0 L f x ˙ 0 0 1 x ˙ y ˙ L r φ ˙ x ˙ 2 0 L r x ˙ 0 0 ]
where α = [ α f , α r ] T is the tire corner angle matrix, F = [ 1 , 0 ] T , and E is the transform matrix.
The incremental constraint of tire cornering can be described as:
Δ α min Δ α Δ α max
where α min and α max represent the minimum and maximum value of the tire cornering.

2.5. Lateral Acceleration Constraints

The road adhesion coefficient has a great influence on the dynamics of the vehicle. In addition, if the lateral acceleration is too large, the vehicle dynamic, driving comfort and driving safety will be seriously affected. If the constraints of lateral acceleration are too small, the solution of the controller may fail. Hence, the incremental constraint of lateral acceleration can be described as:
a y , min + ε a y a y , max ε
where a y , min and a y , max represent the minimum and maximum value of the lateral acceleration, ε is the relaxation factor, and a y = μ g is a quantity proportional to the road adhesion coefficient.

2.6. Construct the Objective Function

This article uses the following objective function [25]:
J ( k ) = i = 1 N p Δ η ( k + i | k ) Q 2 + i = 1 N c 1 Δ u ( k + i | k ) R 2 + ρ ε 2
where ρ is the weight coefficient; ε is the relaxation factor; N p is the prediction time domain; N c is the control time domain; Q is the state weighting matrix; R is the control weighting matrix; Δ η ( k + i | k ) = η ( k + i | k ) η r ( k + i | k ) is difference between actual output and reference path; and Δ u ( k + i | k ) is control deviation. Considering the complexity of the vehicle dynamic model and constraints, to avoid the occurrence of no optimal solution, the relaxation factor ε is added to the objective function.

2.7. Adaptive Model Predictive Controller for Vehicle Lateral Motion Control

Based on the above objective function and constraints, the optimization problem of the vehicle lateral motion controller can be described as:
{ min Δ U , ε i = 1 N p Δ η ( t + i | t ) Q 2 + i = 1 N c 1 Δ u ( t + i | t ) R 2 + ρ ε 2 Δ U min Δ U Δ U max Δ U min A Δ U + U f Δ U max α min Δ α Δ α max a y , min + ε a y a y , max ε ε 0
Optimize and solve the above formula to get the control increment and relaxation factor sequence in the control time domain:
Δ U d y n , t * = [ Δ u d y n , t * , Δ u d y n , t + 1 * , , Δ u d y n , t + N c 1 * , ε ] T
The first element of the sequence acts as an actual control increment:
u d y n ( t ) = u d y n ( t 1 ) + Δ u d y n , t *
In the following time domain, the above processes are repeated, and the vehicle tracks the target path cyclically.

2.8. Merging Multi-Sensor Data and Isolating Fault Signals

If we use multiple sensors to measure the same parameter of autonomous vehicle, we can merge the outputs of all sensors using the weight assignment method for data fusion purpose. The result of data fusion can be written as follows:
O = W I = [ w 1 , w 2 , , w n ] [ i 1 , i 2 , , i n ] T
where O is the result of data fusion; W = [ w 1 , w 2 , , w n ] is the weight matrix; I = [ i 1 , i 2 , , i n ] T is outputs of sensors; n is the number of sensors.
The principle of the method of weight assignment can be written as follows:
{ w j = m j / [ σ j 2 i = 1 n ( m i / σ i 2 ) ] i = 1 n w j = 1
where σ i and σ j are the dispersions of the output errors of the ith and jth sensors, i = 1 , 2 , , n ; M = [ m 1 , m 2 , , m n ] is the fault detection matrix.
As the true values of vehicle motion states cannot be obtained, the work determines the average value of the different sensors outputs, which is usually used as the true value. However, this method is not suitable for our situation, since different types of sensors in different conditions can give a deliberately low accuracy or even failure; thus, the average value may have a large difference with the true value, which is extremely harmful for vehicle safety.
Assume that at moment k sensor j gives the measured value T j ( k ) ; then:
{ Δ T j ( k ) = T j ( k ) T ^ j ( k ) Δ T ¯ j = 1 N k = 1 N Δ T j ( k ) σ j ( k ) = 1 N k = 1 N [ Δ T j ( k ) Δ T ¯ j ] 2 k = 1 , 2 , , N
where Δ T j ( k ) is the measurement error of the jth sensor at moment k; Δ T ¯ j is the average value of the jth sensor; σ j ( k ) is the variance of the output error of the jth sensor at moment k; T ^ j ( k ) is prognostic assessment of states information obtained using the Kalman filter; and N is the number measurements from each sensor.
Since the outputs of federal Kalman filters are obtained after unreliable data detection and isolation, we can approximately consider the estimated information as true values of vehicle motion states.

2.9. Fault Signal Detector Design

Figure 3 shows the block diagram of proposed faults signals detector based on federal Kalman filter and chi-square detector.
Every Kalman filter used in our work is standard; we take the sub Kalman_Filter_1 for GPS signal channel as example. The state vector and measurement vector can be written as:
{ X G P S = [ Δ x ˙ , Δ y ˙ , Δ φ , Δ φ ˙ , Δ X , Δ Y ] Y G P S = Δ φ
The state space and measurement space equations of Kalman Filter from moment k − 1 to moment k can be written as:
{ X G P S , k = F G P S , k X G P S , k 1 + w G P S , k Y G P S , k = H G P S , k X G P S , k + v G P S , k
where F G P S , k is the state transition matrix, w G P S , k is the process noise, H G P S , k is the measurement transition matrix, and v G P S , k is the measurement noise.
The equations of Kalman Filter can be written as:
{ X ^ G P S , k | k 1 = F G P S , k X ^ G P S , k 1 | k 1 P G P S , k | k 1 = F G P S , k P G P S , k 1 | k 1 F G P S , k T + Q G P S , k K G P S , k = P G P S , k | k 1 H G P S , k T ( H G P S , k P G P S , k | k 1 + R G P S , k T ) 1 X ^ G P S , k | k = X ^ G P S , k | k 1 + K G P S , k ( Y G P S , k H G P S , k X ^ G P S , k | k 1 ) P G P S , k | k = ( I K G P S , k H G P S , k ) P G P S , k | k 1
where P G P S , k | k is systematic covariance matrix, K G P S , k is the gain matrix, Q G P S , k is the process noise covariance matrix, and R G P S , k is the measurement noise covariance matrix.
The state propagator can be written as:
{ X ^ i , k | k 1 = F i , k X ^ i , k 1 | k 1 P i , k | k 1 = F i , k P i , k 1 | k 1 F i , k T + Q i , k , i = 1 , 2
The χ 2 chi-square detector is widely used to detect malfunctions in stochastic dynamic systems [26]. This method can be divided into three types: (1) χ 2 detector for residual error, which can be used for sensor fault detection; (2) χ 2 detector state with a single state propagator, which can be used for the state transfer error detection and sensor fault detecting with the disadvantage of error accumulation; and (3) χ 2 detector with a double state propagators, which can be used for the state transfer error detection without error accumulation.
In this paper, we use the χ 2 detector for residual error and the χ 2 detector with a double state propagators to form a fault signal detector with a parallel structure, as shown in Figure 4.
To reduce the number of propagators, we designed two double state propagators, the outputs of which are used for each state χ 2 detector. The working principle can be described as following: during t k there is a malfunction and a switch K 1 is in position “ L 1 ”, switch K 2 is in position “ L 2 ”, and State_Propagator_1 is “dirty” due to this malfunction, but the output of State_Propagator_2 was obtained using the previous correct state, that is, this output is correct and can be used to correct malfunctions. During t k + 1 , errors in prediction 1 are corrected using the output of Kalman filter. After time Δ t , the K 1 switch is in position “ L 2 ”, the switch K 2 is in position “ L 1 “, and the State_Propagator_2 is used to correct the malfunction of the state.
The error state vectors of state propagators can be defined as:
{ e i , k = X k X ^ i , k e G P S , k = X k X ^ G P S , k
where X k is true state vector, X ^ G P S , k is estimation error from Sub_Kalman_Filter_1, and X ^ i , k is estimation error from state propagator i. In this paper, we use the following variable to define the detector statistic:
β G P S , k = e i , k e G P S , k = X ^ G P S , k X ^ i , k
The variance of this variable can be written as:
T G P S , k = E { β G P S , k β G P S , k T } = E { e G P S , k e G P S , k T e G P S , k e i , k T e i , k e G P S , k T + e i , k e i , k T } = P G P S , k P G P S _ i , k P i _ G P S , k + P i , k
where P G P S _ i , k and P i _ G P S , k are the cross covariance between the Sub_Kalman_Filter_1 and the state propagator i.
We set the same initial conditions for the Sub_Kalman_Filter_1 and the state propagator i; then, P G P S _ i , k = P i _ G P S , k = P i , k , thus the variance can be written as:
T G P S , k = P G P S , k P i , k
Define the fault detection function:
λ G P S , k = β G P S T T G P S , k 1 β G P S
Define the fault detection criteria:
{ λ G P S , k ε β , f a u l t λ G P S , k < ε β , n o   f a u l t
where the threshold ε β is determined by the function of false alarm rate.
Detector χ 2 residual error of Sub_Kalman_Filter_1 can be written as:
d G P S , k = Δ φ G P S , k Δ φ ^ i , k
Covariance residual error:
S G P S , k = H G P S , k P G P S , k H G P S , k T + R G P S , k
Define the fault detection function:
γ G P S , k = d G P S , k T S G P S , k 1 d G P S , k
Define the fault detection criteria:
{ γ G P S , k ε d , f a u l t γ G P S , k < ε d , n o   f a u l t
where the threshold ε d is determined by the function of false alarm rate.
If the state χ 2 detector or the residual χ 2 detector detects a fault signal of GPS system, then m g = 0 , otherwise m g = 1 . Thus, we can generate a fault detection matrix, which will be used for fault signal isolation in the process of data fusion.

3. Results

3.1. Simulation Verification

To verify the feasibility and effectiveness of the proposed method, we simulated a driving environment of straight lane with two lanes, as shown in Figure 5a. The details about the system and vehicle platform setup for the simulations follows the parameters of our own developed autonomous vehicle, as shown in Table 1. The single lane width is 4 m and the longitudinal driving speed is 15 km/h. The driving condition chosen in this work is double lane changing path control, which is a very typical and common condition for autonomous vehicle.
In Figure 5b, we can see that the curve of the trajectory is relatively smooth, the yaw angle changes within a small range, the longitudinal travel distance is about 190 m, and the initial and ending yaw angles are basically 0 rad.
Figure 6a shows the yaw angle changes detected by vision, GPS, and LIDAR sensing systems and Figure 6b shows the errors between the reference yaw angel and the yaw angles obtained by vision, GPS, and LIDAR sensing systems.
In Figure 6a, we can see that, within the time intervals of 3–5 and 8–10 s, the sensor failure occurs to the GPS sensing system. In Figure 6b, we can see that the yaw angle errors of vision and LIDAR sensing systems maintained in an extremely small range, which are cause by measurement noises. However, since the peak yaw angle error of GPS sensing system reaches 0.07 rad, considering the maximum yaw angle of vehicle in simulation is about 0.1 rad, the sensor fault of GPS channel cannot be ignored and needs to be detected and isolated.
The values of fault detection function based double state chi-square detector and residuals chi-square detector can be seen in Figure 7a,b, respectively.
Based on the results shown in Figure 7, we can see that the proposed method can easily detect the fault signal. In Figure 7a, the peak value of fault detection function λ for GPS signal channel by using double state chi-square detector reaches 5 × 10 6 and 4 × 10 6 at 3 and 5 s, which is the moment when the yaw angle error of GPS signal reaches its peak. However, the peak values of fault detection function λ for vision and LIDAR sensing system reach no more than 2 × 10 7 and 5 × 10 8 , respectively. In Figure 7b, the value of fault detection function γ for GPS signal channel by using residuals chi-square detector remains in the order of magnitude 10 7 , and this value is proportional to the absolute value of the yaw angle error within the time intervals of 3–5 and 8–10 s. However, the order of magnitude of the fault detection function γ for vision and LIDAR sensing systems is 10 8 . Through the above analysis, we know that, by setting the appropriate threshold, the fault signals can be easily detected when sensor failure occurs.
Figure 8a shows the yaw angle changes detected by vision, GPS, and LIDAR sensing systems and Figure 8b shows the errors between the reference yaw angel and the yaw angles obtained vision, GPS, and LIDAR sensing systems.
In Figure 8, we can see that the lateral position detected by GPS sensing system has obvious fault due to the sensor failure within the time intervals of 3–5 and 8–10 s. The peak lateral position error of GPS sensing system reaches 3.5 m, which is extremely large considering the maximum lateral position of vehicle in simulation is about 4 m and width of road lane is 4 m. Therefore, the sensor fault of GPS channel cannot be ignored and needs to be detected and isolated.
The fault detection results for lateral position in simulation are shown in Figure 9.
In Figure 9, we can see that the detection results of the fault signal are obviously different compared to the normal signals. In Figure 9a, the peak value of fault detection function λ for GPS signal channel by using double state chi-square detector reaches 2.5 × 10 3 , 1.1 × 10 2 , 1.2 × 10 2 , and 4.5 × 10 3 at 3, 6, 8, and 10 s, which correspond to the moments when the fault signal of GPS sensing system appears and disappears. However, the peak values of fault detection function λ for vision and LIDAR sensing system reach no more than 2 × 10 4 and 5 × 10 4 , respectively. In Figure 9b, the value of fault detection function γ for GPS signal channel by using residuals chi-square detector remains in the order of magnitude of 10 3 when sensor failure occurs, and this value is proportional to the absolute value of the lateral position error within the time intervals of 3–5 and 8–10 s. However, the order of magnitude of the fault detection functions γ for vision and LIDAR sensing systems are 10 6 . Hence, the fault lateral position signal can be easily detected in simulation process by setting appropriate thresholds for the fault detection functions.
To confirm the effect of sensor fault to the path tracking control system of autonomous vehicle, the simulation results are compared by using MPC, adaptive MPC (AMPC), fault-tolerant MPC (FTMPC), and fault-tolerant Adaptive MPC FTAMPC algorithms, as shown in Figure 10.
In Figure 10a,b, we can see that the curves of lateral position and lateral position error are divergent, which means that the vehicle is gradually moving away from the reference path, and the accurately path tracking of the autonomous vehicle cannot be realized using the fault sensor information. In Figure 10c,d, we can see that the curves of yaw angle and yaw angle error are irregular and the changes are very dramatic, which also means that the autonomous vehicle cannot track the reference path, and the risk of overturning exists without fault detection and isolation. In addition, because the longitudinal velocity is a constant, FTMPC and FTAMPC reflect almost the same path tracking control performance.

3.2. Experimental Verification

We also conducted a path tracking control experiment using self-developed autonomous vehicle. The details about the sensor system and autonomous vehicle platform setup are shown in Table 1.
The driving condition is double lane changing. Figure 11a shows the autonomous vehicle and the equipped sensing system, including the vision, GPS, and LIDAR sensing systems. The width of lane is about 4 m. Figure 11b shows the vehicle trajectory of double lane changing obtained by GPS sensing system with manual driving mode. We use the record yaw angle and lateral position as reference in the following autonomous path tracking process. As shown in Figure 11b, the trajectory of double lane changing is not perfect; the final yaw angle is not 0 rad and the longitudinal travel distance is about 70 m.
Figure 12a shows the yaw angle changes detected by vision, GPS, and LIDAR sensing systems in the autonomous path tracking process and Figure 12b shows the errors between the reference yaw angel and the measured yaw angles.
In Figure 12a, we can see that the total travel time is about 23 s, and, within the time intervals of 5–10 and 15–20 s, the sensor failure occurs to the GPS sensing system. In Figure 12b, we can see that the yaw angle errors of vision and LIDAR sensing systems are maintained in an extremely small range and the peak of yaw angle error is less than 0.03 rad, which may cause by measurement noises or too few feature points for LIDAR and vision algorithms. However, the peak value of yaw angle error of GPS sensing system reaches 0.22 rad at 7 s; considering the maximum yaw angle of vehicle in the experiment is about 0.3 rad, the sensor fault of GPS channel cannot be ignored and needs to be detected and isolated.
The values of fault detection function for yaw angle in our experiment based on double state chi-square detector and residuals chi-square detector are shown in Figure 13a,b, respectively. Based on the results shown in Figure 13, we can see that the fault signal can be exactly detected by using the proposed method. In Figure 13a, the peak values of fault detection function λ for GPS signal channel by using double state chi-square detector reaches 2 × 10 6 , 2 × 10 6 , 2 × 10 5 , and 1 × 10 6 at 5, 10, 15, and 20 s, which are the moments when the yaw angle error of GPS signal reaches its peak. However, the peak values of fault detection function λ for vision and LIDAR sensing system reach no more than 1 × 10 8 and 2 × 10 8 , respectively. In Figure 13b, the value of fault detection function γ for GPS signal channel by using residuals chi-square detector remains in the order of magnitude of 10 6 , and this value is proportional to the absolute value of the yaw angle error within the time intervals of 5–10 and 15–20 s. However, the order of magnitude of the fault detection function γ for vision and LIDAR sensing systems remain at 10 7 . Through the above analysis, we obtained similar results as in the simulation process, which means that the fault signals can be detected by our proposed method with setting the appropriate threshold.
Figure 14a shows the lateral position changes detected by vision, GPS, and LIDAR sensing systems and Figure 14b shows the errors between the reference lateral position and the lateral position obtained by vision, GPS, and LIDAR sensing systems.
In Figure 14a, we can see that due to the sensor failure within the time intervals of 5–10 s and 15–50 s the lateral position detected by GPS sensing system is fault signal. In Figure 14b, we can see that the peak lateral position error of GPS sensing system reaches almost 2.5 m, which is extremely large considering the maximum lateral position of vehicle in simulation is about 4 m and width of road lane is 4 m. Therefore, the sensor fault of GPS channel cannot be ignored and needs to be detected and isolated in the experiment.
Figure 15 shows the curves of fault detection functions for lateral position in experiment based on chi-square detector. In Figure 15a, we can see that the value of fault detection functions λ for vision and LIDAR sensing systems by using double state chi-square detector remain in the ranges of 0 ~ 5 × 10 7 and 0 ~ 5 × 10 9 , respectively. However, the peak value of the fault detection functions λ for GPS signal channel reaches 2 × 10 4 , 3.8 × 10 3 , 3.7 × 10 3 , and 5 × 10 4 at 5, 10, 15, and 20 s, which correspond with the moments when the fault GPS signal occurs and disappears. In Figure 15b, we can see that there are peaks on the curves of fault detection functions γ for vision and LIDAR signal channels by using residuals chi-square detector, which correspond with the lateral position error curves. It is worth noting that the order of magnitude of fault detection functions γ for vision and LIDAR signal channels are 10 6 . However, the order of magnitude of fault detection functions γ for GPS signal channels are 10 4 within the time intervals of 5–10 and 15–20 s, which means we can easily detect the fault lateral position signals by setting the appropriate threshold.
From the above simulation results, we know that directly sending the fault signal to the path tracking controller may seriously affect the driving safety of the autonomous vehicle; therefore, in the experiment, we only compared the performance of FTMPC and FTAMPC, as shown in Figure 16.
In Figure 16a,b, we can see that the path tracking performances of FTMPC and FTAMPC are obviously different, although both algorithms can control the autonomous vehicle to move along the reference path. During the experiment process, the longitudinal velocity of autonomous vehicle is not a constant. The autonomous vehicle accelerates first and then decelerates; under this circumstance, FTAMPC shows better performance. Figure 16c,d shows that, compared with the tracking results of the lateral position, the tracking performance of yaw angle is relatively poor. This is mainly due to the short longitudinal travel distance and large changes of longitudinal velocity and yaw angle, which make it difficult to accurately yaw angle tracking control.

4. Conclusions

In this paper, we focus on a fault tolerant adaptive model predictive control algorithm of autonomous vehicles for robust lateral path tracking control when sensor failures occur. A robust fault tolerant path tracking control algorithm is proposed combining the adaptive model predictive control algorithm for lateral path tracking control, improved weight assignment method for multi-sensor data fusion and fault isolation, and novel federal Kalman filtering approach with two states chi-square detector and residual chi-square detector for detection and identification sensor fault in autonomous vehicles. Simulation and experimental results show that the proposed algorithm can efficiently detect the fault signal. After the fault signal isolation, the reference path can be effectively tracked with the proposed approach in our work. In the further studies, we will explore the possibility of combining the proposed method with reinforcement learning to optimize the fault detection and isolation performance.

Author Contributions

Methodology, K.G.; writing—original draft preparation, K.G.; project administration, S.L.; data curation, S.L.; investigation, K.G.; and resources, K.G. All authors have read and agreed to the published version of the manuscript.

Funding

This work was supported by National Natural Science Foundation of China (Grant No. 51905095) and Natural Science Foundation of Jiangsu Province (Grant No. BK20180401).

Conflicts of Interest

The authors declare no conflict of interest.

References

  1. Kim, M.-H.; Lee, S.; Ha, K.-N.; Lee, K.-C. Implementation of a fuzzy-inference-based, low-speed, close-range collision-warning system for urban areas. Proc. Inst. Mech. Eng. Part D J. Automob. Eng. 2012, 227, 234–245. [Google Scholar] [CrossRef]
  2. Cui, Q.; Ding, R.; Zhou, B.; Wu, X. Path-tracking of an autonomous vehicle via model predictive control and nonlinear filtering. Proc. Inst. Mech. Eng. Part D J. Automob. Eng. 2017, 232, 1237–1252. [Google Scholar] [CrossRef]
  3. Wang, R.; Jing, H.; Hu, C.; Yan, F.; Chen, N. Robust H∞ path following control for autonomous ground vehicles with delay and data dropout. IEEE Trans. Intell. Transp. Syst. 2016, 17, 2042–2050. [Google Scholar] [CrossRef]
  4. Xia, Y.; Pu, F.; Li, S.; Gao, Y. Lateral path tracking control of autonomous land vehicle based on ADRC and differential flatness. IEEE Trans. Ind. Electron. 2016, 63, 3091–3099. [Google Scholar] [CrossRef]
  5. Xu, S.; Peng, H. Design, analysis, and experiments of preview path tracking control for autonomous vehicles. IEEE Trans. Intell. Transp. Syst. 2019, 21, 48–58. [Google Scholar] [CrossRef]
  6. Checkoway, S.; Mccoy, D.; Anderson, D. Comprehensive experimental analyses of automotive attack surfaces. In Proceedings of the 21st Usenix Security Symposium, Bellevue, WA, USA, 6–7 August 2012; USENIX Association: Berkeley, CA, USA, 2012. [Google Scholar]
  7. Realpe, M.; Vintimilla, B.X.; Vlacic, L. Sensor fault detection and diagnosis for autonomous vehicles. MATEC Web Conf. 2015, 30, 4003. [Google Scholar] [CrossRef] [Green Version]
  8. Nicolas, P.; Denis, G.; Dominique, G. Intelligent vehicle embedded sensors fault detection and identification using analytical redundancy and non-linear transformations. J. Control Sci. Eng. 2017, 2017, 1763934. [Google Scholar]
  9. Darms, M.; Rybski, P.; Urmson, C. Classification and tracking of dynamic objects with multiple sensors for autonomous driving in urban environments. In Proceedings of the 2008 IEEE Intelligent Vehicles Symposium, Eindhoven, The Netherlands, 4–6 June 2008; pp. 1197–1202. [Google Scholar] [CrossRef] [Green Version]
  10. Yang, S.; Liu, Z.; Li, J.; Wang, S. Anomaly detection for internet of vehicles: A trust management scheme with affinity propagation. Mob. Inf. Syst. 2016, 2016, 1–10. [Google Scholar] [CrossRef] [Green Version]
  11. Lin, R.; Khalastchi, E.; Kaminka, G.A. Detecting anomalies in unmanned vehicles using the Mahalanobis distance. In Proceedings of the 2010 IEEE International Conference on Robotics and Automation, Anchorage, AK, USA, 3–8 May 2010; pp. 3038–3044. [Google Scholar] [CrossRef]
  12. Khalastchi, E.; Kaminka, G.A.; Kalech, M. Anomaly detection in unmanned vehicles. In Proceedings of the International Conference on Autonomous Agents & Multiagent Systems—Volume 1, Taipei, Taiwan, 2–6 May 2011. [Google Scholar]
  13. Park, J.; Ivanov, R.; Weimer, J.; Pajic, M.; Lee, I. Sensor attack detection in the presence of transient faults. In Proceedings of the ACM/IEEE Sixth International Conference on Cyber-Physical Systems—ICCPS ’15, Seattle, WA, USA, 14–16 April 2015; Association for Computing Machinery (ACM): New York, NY, USA, 2015. [Google Scholar]
  14. Foo, G.H.B.; Zhang, X.; Vilathgamuwa, D.M. A sensor fault detection and isolation method in interior permanent-magnet synchronous motor drives based on an extended Kalman filter. IEEE Trans. Ind. Electron. 2013, 60, 3485–3495. [Google Scholar] [CrossRef]
  15. Wei, X.; Verhaegen, M.; Van Engelen, T. Sensor fault detection and isolation for wind turbines based on subspace identification and Kalman filter techniques. Int. J. Adapt. Control. Signal Process. 2009, 24. [Google Scholar] [CrossRef]
  16. Schmidhuber, J. Deep learning in neural networks: An overview. Neural Netw. 2015, 61, 85–117. [Google Scholar] [CrossRef] [PubMed] [Green Version]
  17. Malhotra, P.; Vig, L.; Shroff, G. Long short term memory networks for anomaly detection in time series. In Proceedings of the 23rd European Symposium on Artificial Neural Networks, Computational Intelligence and Machine Learning, ESANN 2015, Bruges, Belgium, 22–24 April 2015. [Google Scholar]
  18. Christiansen, P.; Nielsen, L.N.; Steen, K.A.; Jørgensen, R.N.; Karstoft, H. Deep anomaly: Combining background subtraction and deep learning for detecting obstacles and anomalies in an agricultural field. Sensors 2016, 16, 1904. [Google Scholar] [CrossRef] [PubMed] [Green Version]
  19. Min-Joo, K.; Je-Won, K.; Tieqiao, T. Intrusion detection system using deep neural network for in-vehicle network security. PLoS ONE 2016, 11, e0155781. [Google Scholar]
  20. Bezemskij, A.; Loukas, G.; Gan, D.; Anthony, R.J. Detecting cyber-physical threats in an autonomous robotic vehicle using bayesian networks. In Proceedings of the 2017 IEEE International Conference on Internet of Things (iThings) and IEEE Green Computing and Communications (GreenCom) and IEEE Cyber, Physical and Social Computing (CPSCom) and IEEE Smart Data (SmartData), Exeter, UK, 21–23 June 2017; pp. 98–103. [Google Scholar] [CrossRef]
  21. Muter, M.; Asaj, N. Entropy-based anomaly detection for in-vehicle networks. In Proceedings of the 2011 IEEE Intelligent Vehicles Symposium (IV), Baden-Baden, Germany, 5–9 June 2011; pp. 1110–1115. [Google Scholar] [CrossRef]
  22. Dai, Y.; Yu, S.; Yan, Y.; Yu, X. An EKF-based fast tube MPC scheme for moving target tracking of a redundant underwater vehicle-manipulator system. IEEE/ASME Trans. Mechatron. 2019, 24, 2803–2814. [Google Scholar] [CrossRef]
  23. Li, Y.; Sun, D.; Zhao, M.; Chen, J.; Liu, Z.; Cheng, S.L.; Chen, T. MPC-based switched driving model for human vehicle co-piloting considering human factors. Transp. Res. Part C Emerg. Technol. 2020, 115, 102612. [Google Scholar] [CrossRef]
  24. Zhou, G.; Wang, Y.; Du, H. A generalized method for three-dimensional dynamic analysis of a full-vehicle model. Proc. Inst. Mech. Eng. Part D J. Automob. Eng. 2020, 2020. [Google Scholar] [CrossRef]
  25. Kuhne, F.; Lages, W.F. Model Predictive Control of a Mobile Robot Using Linearization. Available online: http://www.ece.ufrgs.br/~fetter/mechrob04_553.pdf (accessed on 21 June 2020).
  26. Da, R. Failure detection of dynamical systems with the state chi-square test. J. Guid. Control Dyn. 1994, 17, 271–277. [Google Scholar] [CrossRef]
Figure 1. The flowchart of the proposed method.
Figure 1. The flowchart of the proposed method.
Applsci 10 06249 g001
Figure 2. Schematic of the single-track model.
Figure 2. Schematic of the single-track model.
Applsci 10 06249 g002
Figure 3. The block diagram of proposed faults signals detector.
Figure 3. The block diagram of proposed faults signals detector.
Applsci 10 06249 g003
Figure 4. The principle of fault signal detector.
Figure 4. The principle of fault signal detector.
Applsci 10 06249 g004
Figure 5. Double lane changing control simulation: (a) driving scenario; and (b) reference trajectory.
Figure 5. Double lane changing control simulation: (a) driving scenario; and (b) reference trajectory.
Applsci 10 06249 g005
Figure 6. The yaw angle changes in simulation: (a) detected yaw angle using different sensors; and (b) the yaw angle error.
Figure 6. The yaw angle changes in simulation: (a) detected yaw angle using different sensors; and (b) the yaw angle error.
Applsci 10 06249 g006
Figure 7. The changes of fault detection function for yaw angles in simulation based on: (a) double state chi-square detector; and (b) residuals chi-square detector.
Figure 7. The changes of fault detection function for yaw angles in simulation based on: (a) double state chi-square detector; and (b) residuals chi-square detector.
Applsci 10 06249 g007
Figure 8. The lateral position changes in simulation: (a) lateral position detected by using different sensors; and (b) the lateral position error.
Figure 8. The lateral position changes in simulation: (a) lateral position detected by using different sensors; and (b) the lateral position error.
Applsci 10 06249 g008
Figure 9. The changes of fault detection function for lateral positions based on: (a) double state chi-square detector; and (b) residuals chi-square detector.
Figure 9. The changes of fault detection function for lateral positions based on: (a) double state chi-square detector; and (b) residuals chi-square detector.
Applsci 10 06249 g009
Figure 10. The path tracking control simulation results: (a) the lateral position changes; (b) the lateral position error before and after fault isolation; (c) the yaw angle changes; and (d) the yaw angle error before and after fault isolation.
Figure 10. The path tracking control simulation results: (a) the lateral position changes; (b) the lateral position error before and after fault isolation; (c) the yaw angle changes; and (d) the yaw angle error before and after fault isolation.
Applsci 10 06249 g010
Figure 11. The experimental scene: (a) self-developed autonomous vehicle; and (b) trajectory of double lane changing obtained by GPS sensing system.
Figure 11. The experimental scene: (a) self-developed autonomous vehicle; and (b) trajectory of double lane changing obtained by GPS sensing system.
Applsci 10 06249 g011
Figure 12. The yaw angle changes in experiment: (a) detected yaw angle using different sensors; and (b) the yaw angle error.
Figure 12. The yaw angle changes in experiment: (a) detected yaw angle using different sensors; and (b) the yaw angle error.
Applsci 10 06249 g012
Figure 13. The changes of fault detection function for yaw angles in experiment based on: (a) double state chi-square detector; and (b) residuals chi-square detector.
Figure 13. The changes of fault detection function for yaw angles in experiment based on: (a) double state chi-square detector; and (b) residuals chi-square detector.
Applsci 10 06249 g013
Figure 14. The lateral position changes in experiment: (a) lateral position detected by using different sensors; and (b) the lateral position error.
Figure 14. The lateral position changes in experiment: (a) lateral position detected by using different sensors; and (b) the lateral position error.
Applsci 10 06249 g014
Figure 15. The changes of fault detection function for lateral position in experiment based on: (a) double state chi-square detector; and (b) residuals chi-square detector.
Figure 15. The changes of fault detection function for lateral position in experiment based on: (a) double state chi-square detector; and (b) residuals chi-square detector.
Applsci 10 06249 g015
Figure 16. The path tracking control experiment results: (a) the lateral position changes; (b) the lateral position error; (c) the yaw angle changes; and (d) the yaw angle error.
Figure 16. The path tracking control experiment results: (a) the lateral position changes; (b) the lateral position error; (c) the yaw angle changes; and (d) the yaw angle error.
Applsci 10 06249 g016
Table 1. Configurations of autonomous vehicle.
Table 1. Configurations of autonomous vehicle.
HardwareProperty
Laser LIDAR: HESAI Pandar 40Lines: 40; Range: 200 m; Angular resolution: 0.1°; Updating: 20 Hz; Accuracy: ±2 cm
Radar: Delphi ESRRange: 100 m; Viewing field: ±10 deg; Updating: 20 Hz; Accuracy: ±5 cm, ±0.12 m/s, ±0.5°
Navigation system: NovAtel SPAN-CPTAccuracy: ±1 cm, ±0.02 m/s, ±0.05° (Pitch/Roll), 0.1° (Azimuth); Updating: 10 Hz
Camera: SY8031Resolution: 3264 × 2448; FPS: 15;Viewing field: 65° (vertical), 50° (horizontal)
Image processer: NVIDIA JTX 2CPU: ARM Cortex-A57 (Quad-core, 2 GHz); GPU: Pascal TM (256 core, 1300 MHz); RAM: LPDDR4 (8 G, 1866 MHz, 58.3 GB/s)
Controller: ARK-3520PCPU: Intel Core i5-6440EQ (Quad-core, 2.8 GHz); RAM: LPDDR4 (32 G, 2133 MHz, 100 GB/s)

Share and Cite

MDPI and ACS Style

Geng, K.; Liu, S. Robust Path Tracking Control for Autonomous Vehicle Based on a Novel Fault Tolerant Adaptive Model Predictive Control Algorithm. Appl. Sci. 2020, 10, 6249. https://doi.org/10.3390/app10186249

AMA Style

Geng K, Liu S. Robust Path Tracking Control for Autonomous Vehicle Based on a Novel Fault Tolerant Adaptive Model Predictive Control Algorithm. Applied Sciences. 2020; 10(18):6249. https://doi.org/10.3390/app10186249

Chicago/Turabian Style

Geng, Keke, and Shuaipeng Liu. 2020. "Robust Path Tracking Control for Autonomous Vehicle Based on a Novel Fault Tolerant Adaptive Model Predictive Control Algorithm" Applied Sciences 10, no. 18: 6249. https://doi.org/10.3390/app10186249

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