Next Article in Journal
An Echo State Network-Based Light Framework for Online Anomaly Detection: An Approach to Using AI at the Edge
Previous Article in Journal
Study on the Effect of Cracks in Diaphragm Couplings on the Dynamic Characteristics of Shaft System
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Efficient Nonlinear Model Predictive Path Tracking Control for Autonomous Vehicle: Investigating the Effects of Vehicle Dynamics Stiffness

College of Energy Engineering, Zhejiang University, Hangzhou 310027, China
*
Author to whom correspondence should be addressed.
Machines 2024, 12(10), 742; https://doi.org/10.3390/machines12100742
Submission received: 2 September 2024 / Revised: 22 September 2024 / Accepted: 1 October 2024 / Published: 21 October 2024
(This article belongs to the Section Vehicle Engineering)

Abstract

:
Motion control is one of the three core modules of autonomous driving, and nonlinear model predictive control (NMPC) has recently attracted widespread attention in the field of motion control. Vehicle dynamics equations, as a widely used model, have a significant impact on the solution efficiency of NMPC due to their stiffness. This paper first theoretically analyzes the limitations on the discretized time step caused by the stiffness of the vehicle dynamics model equations when using existing common numerical methods to solve NMPC, thereby revealing the reasons for the low computational efficiency of NMPC. Then, an A-stable controller based on the finite element orthogonal collocation method is proposed, which greatly expands the stable domain range of the numerical solution process of NMPC, thus achieving the purpose of relaxing the discretized time step restrictions and improving the real-time performance of NMPC. Finally, through CarSim 8.0/Simulink 2021a co-simulation, it is verified that the vehicle dynamics model equations are with great stiffness when the vehicle speed is low, and the proposed controller can enhance the real-time performance of NMPC. As the vehicle speed increases, the stiffness of the vehicle dynamics model equation decreases. In addition to the superior capability in addressing the integration stability issues arising from the stiffness nature of the vehicle dynamics equations, the proposed NMPC controller also demonstrates higher accuracy across a broad range of vehicle speeds.

1. Introduction

Since industry pioneers such as Google, Baidu, and Tesla launched their research projects in self-driving car technologies [1,2], autonomous driving has gained escalating interest from both academia and industry during past few years.
Motion control is one of the core technologies in autonomous driving, which is responsible for stably and precisely tracking the reference trajectories. A variety of vehicle motion control techniques have been proposed over recent years, such as Proportional-Integral-Derivative (PID) control [3], the Stanley method [4], sliding mode control [5], Linear Quadratic Regulator (LQR) [6], Model Predictive Control (MPC) [7], and data-driven methodologies [8], etc. Due to the ability to take into account system constraints in an explicit fashion and address multivariable and multi-objective challenges, MPC is extensively utilized among these methods.
Linear model predictive control (LMPC) remains mainstream in existing commercial solutions. However, it encounters inherent limitations such as an inability to incorporate nonlinear constraints [9]. The impact of nonlinear tire dynamics on trajectory tracking control for autonomous vehicles was studied in [10]. The nonlinear dynamic characteristics of vehicle drift motion was analyzed in [11] and a feedback controller was designed to ensure stable and agile vehicle behavior during sharp turns on low adhesion surfaces. A Particle Swarm Optimization-Back Propagation neural network was developed in [12] to enhance Adaptive Model Predictive Controller for autonomous vehicles, focusing on optimizing trajectory tracking under diverse road conditions through real-time adjustments of the controller parameters and tire lateral stiffness. In [13], tire-road contact state estimation methods were reviewed and constructive strategies for intelligent tire sensing systems for autonomous vehicles were proposed, focusing on real-time tire-road contact monitoring to improve vehicle dynamics control and advance autonomous driving safety.
Recently, nonlinear model predictive control (NMPC) has gained popularity in the realm of autonomous vehicle motion control due to its proficiency in precisely predicting the dynamics of nonlinear systems. Compared with LMPC, stability and efficiency are primary obstacles impeding the adoption of NMPC in autonomous vehicle systems. This manuscript is dedicated to tackling these two challenges to align with the prerequisites for the operational deployment of NMPC on actual systems [14].
Both indirect and direct approaches for NMPC involve the transformation of a continuous system into a discrete-time one. The discretization of continuous system is in essence the process of integration. Consequently, numerical integration techniques designed for Ordinary Differential Equations (ODEs) could be utilized in the discretization of continuous systems.
The explicit Euler approach has been extensively employed in MPC-based vehicle motion control studies due to its simple formulation. Falcone et al. [7] introduced an MPC strategy based on the Euler discretization for controlling vehicular active front steering systems. Similarly, Peng et al. [15] proposed a hierarchical MPC control scheme for the dynamic wheel torque management in Four-Motor In-Wheel Drive Electric Vehicles (4MIDEV) steering systems, in which the Euler method is engaged for system discretization. Zhao and Xu et al. [16] implemented the Euler technique for the discretization of their Linear Model Predictive Control (LMPC) scheme, taking into account the energy dissipation due to slippage. Satzger [17] employed an identical approach within an integrated wheel-slip management and torque blending regulatory strategy. Although the Euler method has simple form, its precision for integration is insufficient. Furthermore, the region within which the Euler method maintains integration stability is rather confined.
The zero-order hold (ZOH) method, as referenced in [9], is the most attractive discretization method in the context of linear MPC-based studies. It could attain an accurate discretization and ensures stability throughout the discretization process, which means that the outcomes of its integration are in exact correspondence with the state of the continuous system at the discrete temporal intervals. Because of these exceptional properties, the ZOH method finds broad application in vehicle motion control [18] and is similarly instrumental in the domain of stability control [19,20,21]. However, the ZOH method does not demonstrate equivalent efficacy when applied to nonlinear systems.
The fourth-order Runge–Kutta (RK4) method serves as an alternative discretization technique that is commonly utilized in the context of NMPC-based control strategies. A real-time implementation of NMPC that utilizes the RK4 method for stabilizing a vehicle at its performance limits has been put forward in [22]. Allamaa and Listov have also incorporated the RK4 method within their Nonlinear Model Predictive Control (NMPC)-based motion control framework for autonomous vehicles [23]. The torque-vectoring control system proposed by Parra also utilizes the fourth-order Runge–Kutta (RK4) method for discretization within its framework [24]. While the RK4 method enhances the precision of integration, the enlargement of the stability region is limited.
The stiffness of the ordinary differential equations that correlate to the nonlinear dynamics of vehicles will lead to integration stability problems for vehicle motion control. A common strategy to address the challenge is to utilize a kinematic model as predictive model. Numerous kinematic-based Nonlinear Model Predictive Controls (NMPCs) have been confirmed effective through validation on actual vehicles [25,26,27,28]. However, relying solely on kinematics within these systems encounters emerging challenges, since kinematics fall short in precisely capturing vehicle dynamics at high speed. When utilizing the dynamics model as the predictive model in motion control systems based on NMPC, a smaller step size was adopted in [22,24] during the discretization phase to circumvent the problem of integration stability. However, this approach may introduce the issue of real-time performance. Stability control, due to its shorter prediction horizon, is less affected by real-time issues. Conversely, path following problems in motion control require a much longer prediction horizon and thus the necessity to use a small-time step for discretization inevitably poses challenges to real-time issues. The Runge–Kutta–Chebyshev technique, as employed in [29], is leveraged to deal with the integration stability problem by broadening the region of stability in the direction of the negative real axis, yet the stable zone remains restricted.
It is evident from the existing literature that the main challenge for vehicle motion control based on NMPC lies in the delicate balance between efficiency and stability. To address this challenge, it is imperative to utilize a smaller step size during the discretization of continuous systems within the NMPC problem-solving process. Moreover, path following control necessitates the adoption of a long prediction horizon. Consequently, this leads to an escalation in the dimension of the resulting optimization problem, which in turn increases the computational burden. This paper aims to develop an NMPC controller tailored for autonomous vehicle motion control, enabling the efficient tackling of the integration stability problem while maintaining the computational efficiency.
The main contributions of this paper are as follows: (1) the stability condition and corresponding stability region for both the Euler method and the explicit RK4 method were analyzed in theory to reveal the existing integration stability issue for autonomous vehicle motion control systems that utilize NMPC. (2) The stability region of the orthogonal collocation method was evaluated in comparison with those of the Euler method and the explicit RK4 method. Furthermore, an NMPC controller based on the orthogonal collocation method was designed. (3) The proposed NMPC controller was compared with controllers based on the explicit Euler method and RK4 method to demonstrate its superior effectiveness in addressing the integration stability problem without compromising computational efficiency.

2. Vehicle Dynamics

In this section, vehicle dynamics and the characteristics of the tires are described in detail to facilitate the simulation and the formulation of control strategies. As depicted in Figure 1, a simplified bicycle model for vehicle dynamics comprising five system states was established, which was achieved by aggregating the two front and two rear wheels at the geometric center of their respective axles. This model primarily considers lateral and yaw movements, with the assumption that the velocity in the longitudinal direction remains unchanged. The model utilized was formulated based on the following hypotheses: (i) the vehicle travels on a uniformly flat surface, (ii) the Ackermann steering relation is ignored and the difference in wheel angles between the left and right sides is not taken into account, (iii) the load transfer due to pitching and compliance of the suspension can be negligible. The resulting model was characterized by a set of differential equations, which are formulated as follows:
X ˙ = v x cos ψ v y sin ψ , Y ˙ = v x sin ψ + v y cos ψ , ψ ˙ = r , v ˙ y = 1 m F r , y + F f , y cos δ m v x r , r ˙ = 1 I z F f , y l f cos δ F r , y l r ,
where m denotes the mass of the vehicle, I z signifies the moment of inertia around the vertical Z axis, and l f   and l r are the distances from the center of gravity (CoG) to the front and rear wheels, respectively. The state vector x  = v y     r     ψ     Y     X T is composed of the coordinates of the center of gravity (COG), denoted as X and Y, the orientation angle of the vehicle with respect to the inertial reference frame ψ , the lateral velocity of the vehicle at the COG v y , and the yaw rate r. The control input, denoted as u = δ , is the steering angle of the front wheels. As a result, the dynamics of the continuous-time vehicle system can be expressed in a condensed form x ˙ = f ( x ,   u ) .
The tire forces play a pivotal role in the interaction between the automobile and the pavement, acting as the primary external influences on the vehicle’s maneuverability with the exception of aerodynamic forces. The pronounced nonlinear characteristics in vehicle dynamics, particularly at high speeds, are predominantly manifested through the complex behavior of tire forces. In this study, the Dugoff tire model [30] was employed to characterize the tire-road contact forces and the lateral tire forces could be expressed as:
F y = C α tan α , tan α < μ F z N / 2 C α s i g n α μ F z N 1 μ F z N / 4 C α tan α , e l s e ,
where F z N signifies the nominal vertical load exerted on the tire (3), α represents the tire sideslip angle (4), C α denotes the lateral stiffness coefficient (5), and μ symbolizes the friction coefficient between tire and the road surface.
F z f = l r m g 2 l f + l r , F z r = l f m g 2 l f + l r ,
α f = arctan ψ ˙ l f + v y v x δ ψ ˙ l f + v y v x δ α r = arctan ψ ˙ l r v y v x ψ ˙ l r v y v x ,
C α F z = F z F z N 2 C α F z N   1 2 C α 2 F z N 2 C α F z N   1 2 C α 2 F z N F z F z N .
The related vehicle and tire parameters are shown in Table 1, which will be used in the subsequent sections.

3. NMPC Formulation

This section begins with a detailed description of the general formulation for an optimal control problem. Subsequently, the specific design methodology for autonomous driving trajectory tracking based on nonlinear model predictive control (NMPC) is introduced. Finally, this section provides a theoretical analysis of the integral stability issues inherent in motion control problems based on NMPC.

3.1. Nonlinear Optimal Control Problem Formulation

Nonlinear Model Predictive Control (NMPC) involves the iterative solution of an online Nonlinear Optimal Control Problem (NOCP), taking into account the predicted future dynamics of the system. This prediction is facilitated by a high-fidelity model, which is essential for maintaining the system output in accordance with reference trajectories. The NMPC approach yields a feasible control law by minimizing a pre-designed cost function, subject to a suite of constraints. The general formulation of an NOCP can be articulated as follows:
O b j : min : J = E x ( t f ) + t 0 t f L x t , u t , t d t s . t . x ˙ t = f x t , u t , t x t 0 = x 0 g x t , u t , t 0 x min x t x max u min u t u max ,
where, t denotes time, with t0 and tf representing the initial and final time instances, respectively. The state variable vector is represented by x ( t ) R N x , the control variable vector by u ( t ) R N u and the initial state vector by x o . The performance index, denoted by J, encompasses both the Mayer term E ( · ) :   R N x R and the Lagrange term L ( · ) :   R N x × R N u × [ t 0 , t f ] R . Additionally, g ( · ) signifies the state constraints, and x min ,   u min , x max ,   u max represent the lower and upper bounds on the control variables, respectively.

3.2. Path Tracking Control Strategy

The objective of path tracking control for autonomous vehicles is to ensure that the vehicle adheres precisely to a predefined reference trajectory, characterized by the heading angle ψ and the lateral displacement Y. In Section 2, state variables are defined as x = [ v y     r     ψ     Y     X ] T and control variable is designated as the front steering angle u = δ . The output map, represented by p, serves as the functional relationship that projects the state vector x onto the observable outputs.
η = p x = 0 0 0 1 0 0 0 1 0 0 x ,
where η = [ Y ψ ] T , encapsulating lateral displacement Y and the yaw angle ψ .
Then, the objective function, which takes into account the reference signal η r e f = [ Y r e f ψ r e f ] T could be expressed as follows.
J = Y Y r e f φ φ r e f Q 2 + Δ u R 2 + ρ ε 2 ,
where Q = diag ( Q 1 , Q 2 ) are weights assigned to lateral error. The matrix R signifies the weight attributed to the control increment, the term ε denotes the relaxation factor, which is crucial for the optimization process and ρ serves as the weight factor for the slack variable, ensuring the robustness of the solution.
The objective function is composed of several terms, each serving a distinct purpose. The first term encapsulates the sum of the squares of the lateral displacement error and the heading error, quantifying the system’s deviation from the reference path during tracking. The second term, which is the sum of the squares of the control increment quantities, emphasizes the need to minimize control increments under normal conditions to prevent abrupt maneuvers. The third term introduces slack variables to ensure that the solvability of the optimization problem.
Within the domain of vehicular control systems, it is essential to impose constraints on the control quantities to guarantee the operational integrity and safety of the vehicle. As previously discussed, the control input for the vehicle is selected to be the front wheel steering angle, denoted by δ . Taking into account the mechanical properties of the steering system, it is imperative that the variation in the front wheel steering angle is kept within reasonable limits. Consequently, the permissible range of the front wheel steering angle and the increment of this angle are both subject to constraints.
u m i n u u m a x , Δ u m i n Δ u Δ u m a x ,

3.3. Integration Stability Analysis

Whether employing direct or indirect optimal control techniques, the process of discretizing a dynamic system relies heavily on the application of integrators. Consequently, the stability of these integrators is critical for guaranteeing the reliability and precision of the resulting control strategies. An integrator that exhibits instability is incapable of providing accurate predictions regarding the system’s future state, thereby compromising the tracking accuracy. Furthermore, the stability of the entire closed-loop system is also jeopardized. Drawing upon the principles of integration stability theory, this analysis delves into the integration stability issues encountered in the lateral motion control of vehicles.
As previously outlined, vehicle dynamics represented by ordinary differential equations (ODEs) are included in NMPC-based vehicle motion control problems. The stiffness inherent in these ODE-formulated vehicle dynamics equations exerts a significant influence on the integration stability of the control system when solving NMPC problems. To further the understanding of this stiffness, a rigorous analysis leveraging the Dahlquist test equation [31] is hereby presented.
y ˙ = λ y ,   y 0 = y 0 ,
when any single-step integrator is substituted into the above equation, the resulting discrete relationship is derived as follows,
y k + 1 = R h λ y k ,
where h denotes the integration step size. Set z = h λ , the stability function could be represented by R ( z ) . While the Dahlquist test equations are inherently formulated as linear systems, their significance extends to the analysis of general nonlinear systems as well. This is because nonlinear systems x ˙ = f x could be linearized around specific state x = x 0 . The Jacobian matrix for resulting linearized systems could be further converted to diagonal or Jordan form. Consequently, the parameters λ in Dahlquist test equations correspond directly to the eigenvalues of the system’s characteristic matrix, which in turn determine the stability properties of the numerical integration method.
Subsequently, the integration stability condition for the numerical integration methods is introduced.
Theorem 1
([31]). The numerical integration method is stable if any eigenvalue of Jacobian matrix of the system satisfies |R(z)| ≤ 1.
In conjunction with Equation (11), the following relationship needs to be satisfied in order to avoid y k divergence.
R h λ 1 ,
When employing the explicit Euler method to discretize continuous systems which utilizes the forward difference to approximate the derivative, the following equation can be derived.
y k + 1 = 1 + h λ y k = 1 + z y k ,
Thus, the stability function associated with the explicit Euler method is given by R e z = 1 + z .
While explicit Runge–Kutta methods of the same order may exhibit variations in their specific computational procedures, they are characterized by having identical stability functions. The stability function for the explicit Runge–Kutta method of order p is presented as follows:
R rk z = 1 + z + z 2 2 ! + z 3 3 ! + + z p p ! ,
As demonstrated in proceeding analyses, stability functions of numerical integrators are related to both the eigenvalues of systems’ Jacobian Matrices and the integration step size.
For specific vehicle motion control problem based on NMPC, the Jacobian matrix corresponding to vehicle dynamics state equations is,
A = C ~ α i α i v y m C ~ α i α i r m v x 0 0 0 l i C ~ α i α i v y I z l i C ~ α i α i r I z 0 0 0 0 1 0 0 0 cos φ 0 v x cos φ v y sin φ 0 0 sin φ 0 v x sin φ v y cos φ 0 0 ,
where i = f , r , α i v y = 1 v x , α f r = l f v x , α r r = l r v x , C ~ α i = F yi tan α i tan α i α i = C α , tan α < μ F z N / 2 C α sign α μ F z N 2 4 C α tan α 2 , o t h e r w i s e .
The Jacobian matrix of the state equations possesses two distinct nonzero eigenvalues, which are
λ 1 = A 11 + A 22 A 11 A 22 2 + 4 A 12 A 21 1 / 2 2 , λ 2 = A 11 + A 22 + A 11 A 22 2 + 4 A 12 A 21 1 / 2 2 ,
Further analysis of Equation (16) indicates that the eigenvalues are correlated with the vehicle’s speed and the cornering stiffness of the tires. The eigenvalues, as indicated by their relationship, increase with lower vehicle speeds and higher tire stiffnesses. Figure 2 illustrates the spectral Radii of the vehicle dynamics model at a vehicle speed of 1 m/s and 0.2 m/s, indicating the maximum eigenvalue magnitude of the Jacobian matrix associated with the state equation. This spectral radius is an indication of change rates for the corresponding system states, which confers a stiff nature upon the system.
To maintain integration stability, it is necessary to set limits on the length of integration step size referring to the stability condition and the limits vary for different integration method. As depicted in Figure 2, the spectral radius exceeds 180 at a vehicle speed of 1 m/s when the tire stiffness exceeds 150,000 N/m. When employing the explicit Euler method, the integration step size must be constrained to a maximum of 11 milliseconds to ensure that the stability function of the method complies with the criteria established in Equation (12). Similarly, when utilizing the explicit fourth-order Runge–Kutta method, the step size must not surpass 16 milliseconds to maintain the method’s stability criteria. That is, a relatively small integration step size is imperative to ensure the stability of the numerical integration process, which inevitably increase the online computing burden and can degrade the system’s real-time performance.

4. Orthogonal Collocation on Finite Elements Method

Integration stability necessitates the adoption of a small step size when employing both the Euler discretization method and the explicit fourth-order Runge–Kutta method. However, to ensure the stability of the integrator as a prerequisite, a comparatively larger step size is typically favored in the implementation of NMPC integration because it can enhance computational efficiency which is critical for the performance of NMPC. In this section, orthogonal collocation method is introduced, which is an A-stable method [32] and allows for a relaxation of the constraints on integration step size.
Orthogonal collocation method is a member of the weighted residual methods, which approximate the solutions of differential equations through a linear combination of trial functions [33]. When integrated with the finite element approach, the entire horizon is segmented, and the orthogonal collocation technique is applied within each individual element.

4.1. The Discretization of State Variables

As illustrated in Figure 3, the time domain is partitioned into N N T E elements. Within the i-th time element, defined by the interval t i 1 , t i , the state is approximated using the nodal approximation given by Equation (9). This approximation employs Lagrange interpolation polynomials, as described by Equation (8), based on a dimensionless time coordinate τ .
According to the principles outlined in orthogonal collocation [34], the discrete points within the method can be categorized into two distinct groups: collocated points and non-collocated points. The collocated points coincide with the zeros of the orthogonal polynomials, whereas the non-collocated points are typically situated at the endpoints of the time subintervals. Let N t denote the number of collocation points for state variables within each time element. Considering the i-th time subinterval t i 1 , t i as an exemplar, the set comprises N t + 1 discrete points, which include a non-collocated point at t i and N t collocated points. This configuration is adopted when employing Legendre–Gauss–Radau (LGR) collocation points.
τ = t t i 1 t i t i 1 ,   t [ t i 1 ,   t i ] ,
l j τ = k = 0 , k j N t τ τ k τ j τ k ,
x i t = j = 0 N t l j τ · x i , j t ,
where, t N T E = t f ; l j represents the Lagrange basis polynomial. The set τ k k = 1 N t consists of orthogonal collocation points, with τ 0 being the initial point. The state vector x i , j t is defined at the collocation point τ j within the i-th time subinterval. Here, j ranges from 0 to N t and i ranges from 1 to NTE.

4.2. The Discretization of Control Variables

Control variables are discretized within the time domain in a manner analogous to that of state variables. Let N u denote the number of collocation points allocated for control variables within each time element. It is important to note that, due to the potential discontinuity of control actions at the boundaries of these elements, the inclusion of a non-collocated point is typically precluded
l m τ = k = 1 , k m N u τ τ k τ j τ k ,
u n t = m = 0 N u l m τ · u n , m t ,
where n = 1 , 2 , , N T E .
More specifically, a piecewise-constant control strategy can be realized by setting N u = 1 , whereas a piecewise-linear control approach is achieved when N u = 2 .

4.3. Orthogonal Collocation Equations

The first-order derivatives of the Lagrange interpolating polynomials, commonly referred to as differential matrices, are presented in Equation (20). This expression illustrates that the differential matrices are solely dependent on the positions of the discrete points τ k k = 1 N t , suggesting that these matrices can be precomputed offline, thereby reducing the computational load during the online phase.
a r , s = d l s τ d τ τ = τ r , r ,   s = 0 , 1 , , N ,
Consequently, the first-order derivatives of the state variables, as detailed in Equation (21), are computed by differentiating the trial function presented in Equation (19).
d x i d t t = t j = 1 Δ t i k = 0 N t a j , k x i , k τ k , i = 1 , 2 , , N T E ; j = 0 , 1 , N t ,
where a j . k represents the differential matrix computed at the discrete temporal point τ j and Δ t i = t i t i 1 .
Hence, the original constraints of the ordinary differential equations (ODEs) can be discretized into a sequence of algebraic equations derived from the orthogonal collocation method, which are denoted by
F x i , j , u m i , t j i = 0 ,
where i = 1 , 2 N T E , j = 0 , 1 , N t , m = 0 , 1 , N u .

4.4. Initial Conditions and Continuity Conditions

Assuming that x 0 represents the state value at initial time t 0 , then the initial condition is defined as follows:
x 0 , 0 = x 0 ,
Furthermore, to ensure the attachment of time elements, appropriate continuity conditions must be imposed. With the selection of Legendre–Gauss–Radau (LGR) points, the final collocation point is precisely positioned at the right endpoint, which results in
x i + 1 , 0 = x i , N t , i = 1 , 2 , , N T E ,

4.5. Stability Region

As mentioned at the beginning, orthogonal collocation method is A-stable, whose stability domain satisfies S C = z ; R E z 0 referring to [31]. If the Legendre-Gauss–Radau (LGR) collocation points are selected and the number of collocation points is specified as three, the stability function of the orthogonal collocation method can also be articulated as follows by linearizing the nonlinear system and applying to the Dahlquist equation:
R z = 1 + 2 z / 5 + z 2 / 20 1 3 z / 5 + 3 z 2 / 20 z 3 / 60 ,
Substituting Equation (25) into (12) to satisfy the stability condition, the stable region for orthogonal collocation method is illustrated in Figure 4, alongside the stability regions for the explicit Euler method and the fourth-order Runge–Kutta (RK4) method. The x-y plane in the figure represents the complex plane of variable z.
The stable region of each method encompasses those areas within the complex plane where the method yields solutions that are both stable and accurate. It is evident that the stability region of the orthogonal collocation method is significantly expanded relative to that of the explicit Euler method and RK4 method. Furthermore, the orthogonal collocation method imposes no restrictions on the integration step size h, attributable to the entire left half-plane comprising its stability region. This characteristic renders the orthogonal collocation method particularly advantageous for addressing integration stability issues in stiff systems, as opposed to the explicit Euler and fourth-order Runge–Kutta (RK4) methods, which typically necessitate smaller step sizes to maintain stability.

5. Simulation and Discussions

In this section, the efficacy of the proposed control algorithm is rigorously evaluated within the CarSim/Simulink co-simulation environment, under the U-Turn maneuvers at different vehicle speeds. The open-source optimization framework CasADi is utilized to address the optimization problem [35]. For the sake of clarity in illustration, controllers that implement the control algorithm introduced in this study are designated as OCFE controllers. Controllers discretized based on the Euler discretization method are categorized as Euler controllers, while those founded on the fourth-order Runge–Kutta method are identified as RK4 controllers.

5.1. Simulation of Low-Speed U-Turn Maneuver

The U-turn reference path is defined by the following equations:
X r e f Y = 50 + 2 R r o a d Y Y 2 , φ r e f = c o t 1 R r o a d Y 50 + 2 R r o a d Y Y 2 ,   if   Y R r o a d π c o t 1 Y R r o a d 50 + 2 R r o a d Y Y 2 , i f Y R r o a d ,
where X r e f , Y r e f , φ r e f represent the position and heading angle of the reference path in global coordinate frame, respectively.
Under the low-speed condition specified, the vehicle’s longitudinal driving speed is set to v x = 1.0   m / s . The road surface adhesion coefficient is denoted by μ = 0.85 . Initially, the vehicle travels in a straight line for a distance of 5 m before commencing a U-Turn maneuver with a designated turning radius R road = 6   m .
Figure 5 shows the trajectory tracking results of the OCFE controller, Euler controller, and RK controller. Specifically, OCFE-T1 denotes the trajectory traced by the controller employing the OCFE discretization method at a discrete time step of T 1 = 0.05   s . The trajectories Euler-T1 and Euler-T2 correspond to the tracking performance of the controller utilizing the forward Euler discretization method at discrete time steps T 1 and T 2 , respectively, where T 2 = 0.01   s . Moreover, RK4-T3 signifies the tracking result of the controller based on the fourth-order Runge–Kutta discretization method with a discrete time step of T 3 = 0.015   s .
It can be seen from the figure that when the discrete time step is large ( T 1 = 0.05   s ), the controller Euler-T1 based on the forward Euler discrete method fails to completely track the given reference trajectory. Upon entering the turning part, the Euler-T1 controller struggles due to the problem of low-speed integral stability. Specifically, the state variations of the vehicle’s lateral and yaw speed of the vehicle characterized by large integral stiffness are ignored under large discrete time steps, leading to an inability to effectively manage the vehicle’s steering. Consequently, the tracking error accumulates, ultimately resulting in a complete divergence from the reference trajectory. In contrast, when the discrete time step is reduced to T 2 = 0.01   s , the Euler-T2 controller demonstrates the capacity to guide the vehicle in accurately following the reference trajectory. This simulation-based validation further verified the theoretical discrete stability analysis detailed in Section 3. Specifically, under the predefined vehicle parameter conditions, a vehicle speed of 1 m/s requires a discrete time step of 0.01 s or smaller to guarantee the discrete stability when employing the Euler discretization method.
The fourth-order Runge–Kutta discretization method also faces a comparable challenge. When subjected to large discrete time steps, it is unable to accurately capture the state changes in vehicle lateral speed and yaw velocity, thereby hindering the vehicle’s ability to track the prescribed U-shaped reference trajectory. By reducing the discrete time step to T 3 = 0.015   s , the RK4-T3 controller is capable of executing the vehicle trajectory tracking task effectively while circumventing the integral stability issues during the discretization process with a smaller time step.
In contrast to the traditional Euler discretization method and the fourth-order Runge–Kutta (RK4) discretization method, the OCFE-T1 controller demonstrates the ability to effectively track the reference trajectory even when the discrete time step is T 1 = 0.05   s . This indicates that the NMPC trajectory tracking control algorithm based on the OCFE discretization proposed in this study exhibits resilience against the challenges posed by low-speed integral stability. The stability remains preserved even under the condition of employing a large discrete time step.
From the foregoing analysis, it is evident that the OCFE-T1, Euler-T2, and RK4-T3 control methods are capable of ensuring integral stability within the numerical solutions of NMPC. The computational time required for their single-step iterative processes is depicted in Figure 6. This depiction illustrates the performance of the entire computation process, which was conducted on a personal laptop equipped with an Intel Core i5-9400 processor running at 2.9 GHz.
As illustrated in the Figure 6, the OCFE-T1 controller demonstrates a significant reduction in calculation, which is attributed to the increase in the discretization step length. The average computation time for the OCFE-T1 controller is recorded at 0.013 s, marking a reduction of 23.5% and 35% relative to the Euler-T2 controller’s 0.017 s and the RK4-T3 controller’s 0.02 s, respectively. This enhancement in computation time consequently bolsters the real-time performance.
Due to the vehicle’s low longitudinal speed, all three controllers are capable of guiding the vehicle to more accurately track the reference trajectory when an appropriate discrete time step is selected. The quantization results for lateral tacking errors are presented in Table 2. It is observed that selecting a larger integration step does not adversely affect the tracking performance of the orthogonal collocation controller. The maximum lateral tracking error for the three controllers is less than 0.11 m, indicating high tracking accuracy. Among them, the orthogonal collocation controller demonstrates the highest level of control precision.

5.2. Simulation of High-Speed U-Turn Maneuver

The conditions for high-speed U-Turn maneuvers are defined as follows: road adhesion coefficient is μ = 0.85 , and the vehicle’s longitudinal speed is v x = 72   km / h . The geometric configuration of reference path is similar to that of the low-speed U-Turn condition, where it first travels 40 m along a straight path before initiating the U-Turn with a steering radius of R road = 60   m . The reference track for the U-Turn under high-speed conditions is obtained by substituting the appropriate parameters of the described trajectory into Equation (26).
The preceding analysis in Section 3 indicates that vehicle dynamics model equations transition to a non-stiff form with the increase in the vehicle’s longitudinal driving speed. Consequently, the constraints on the discrete-time step inherent in traditional discrete-time methods within the NMPC solution process are alleviated. In this condition, Figure 7 presents the simulation results for the OCFE, RK4, and Euler controllers. As depicted in the figure, under the condition of a discrete time step of T 1 = 0.05   s , all three controllers are capable of successfully executing the tracking task for the reference U-shaped trajectory.
The yaw angle errors exhibited by the three controllers are closely comparable. The average course angle errors for the OCFE, RK4, and Euler controllers are recorded as 0.0051 rad, 0.0049 rad, and 0.0051 rad, respectively. Moreover, the absolute value of the maximum yaw angle error does not exceed 0.04 rad. Regarding lateral tracking error, the OCFE and RK4 controllers demonstrate average errors of 0.0451 m and 0.0479 m, respectively, with maximum errors reaching 0.1719 m and 0.1915 m, respectively. The OCFE controller exhibits enhanced precision in comparison to the RK4 controller. As depicted in the lateral error distribution Figure 7b, these two statistical indicators for the OCFE controller are significantly superior to those of the Euler discrete controller. Specifically, the average tracking error of the OCFE controller is 24.45% lower than that of the Euler controller, which is 0.0597 m. Additionally, the maximum lateral error is reduced by 27.19% in comparison to the Euler controller’s error of 0.2361 m. Therefore, the proposed OCFE-based NMPC controller shows higher accuracy compared to traditional controller while ensuring stability.

6. Conclusions

Vehicle dynamics equations, serving as a widely used model in motion control for autonomous vehicles, exert a considerable influence on computational efficiency of NMPC primarily due to its stiffness. This study first presented a theoretical analysis of the stiffness of the vehicle dynamics model equations and then derived the resulting constraints imposed on the integration time step when employing conventional numerical methods. The analysis revealed that the adoption of small-time steps leads to the increasing online computational loads. To address the issue, the finite element orthogonal collocation method (OCFE)-based NMPC controller was proposed, which could relax the discretized time step restrictions. The proposed controller was compared with the traditional NMPC controller through the CarSim/Simulink co-simulation platform. The results showed that the vehicle dynamics model equations are stiffer when the vehicle speed is low and the proposed OCFE-based NMPC controller can improve the real-time performance while ensuring the path tracking accuracy. The influence of the stiffness on the online computational time of the NMPC controller diminishes as the vehicle speed is larger. In addition to the superiority of addressing integration stability issues caused by the stiffness nature of the vehicle dynamics equations, the OCFE-based NMPC controller also showed its higher accuracy across a wide of vehicle speeds, from low to high speed. In the future work, the efficacy of the proposed strategy will be validated in both hardware-in-loop simulations and real-world vehicle testing scenarios.

Author Contributions

Conceptualization, G.Z. and W.H.; methodology, G.Z. and W.H.; software, G.Z.; investigation, G.Z.; resources, G.Z. and W.H.; data curation, G.Z.; writing—original draft preparation, G.Z.; writing—review and editing, G.Z. and W.H.; visualization, G.Z.; supervision, G.Z. and W.H.; project administration, G.Z. and W.H. All authors have read and agreed to the published version of the manuscript.

Funding

This research received no external funding.

Data Availability Statement

The data presented in this study are available on request from the corresponding author because the data are part of our ongoing study.

Conflicts of Interest

The authors declare no conflict of interest.

References

  1. Gomes, L. When will google’s self-driving car really be ready? It depends on where you live and what you mean by “ready” [news]. IEEE Spectr. 2016, 53, 13–14. [Google Scholar] [CrossRef]
  2. Greenblatt, N.A. Self-driving cars and the law. IEEE Spectr. 2016, 53, 46–51. [Google Scholar] [CrossRef]
  3. Chaib, S.; Netto, M.S.; Mammar, S. H /sub ∞/ adaptive, PID and fuzzy control: A comparison of controllers for vehicle lane keeping. In Proceedings of the IEEE Intelligent Vehicles Symposium, IEEE, Parma, Italy, 14–17 June 2004; pp. 139–144. [Google Scholar] [CrossRef]
  4. Paden, B.; Cap, M.; Yong, S.Z.; Yershov, D.; Frazzoli, E. A survey of motion planning and control techniques for self-driving urban vehicles. IEEE Trans. Intell. Veh. 2016, 1, 33–55. [Google Scholar] [CrossRef]
  5. Guo, J.; Luo, Y.; Li, K. Adaptive neural-network sliding mode cascade architecture of longitudinal tracking control for unmanned vehicles. Nonlinear Dyn. 2017, 87, 2497–2510. [Google Scholar] [CrossRef]
  6. Xu, S.; Peng, H. Design, analysis, and experiments of preview path tracking control for autonomous vehicles. IEEE Trans. Intell. Transport. Syst. 2020, 21, 48–58. [Google Scholar] [CrossRef]
  7. Falcone, P.; Borrelli, F.; Asgari, J.; Tseng, H.E.; Hrovat, D. Predictive active steering control for autonomous vehicle systems. IEEE Trans. Contr. Syst. Technol. 2007, 15, 566–580. [Google Scholar] [CrossRef]
  8. Wang, P.; Shi, T.; Zou, C.; Xin, L.; Chan, C.-Y. A data driven method of feedforward compensator optimization for autonomous vehicle control. In Proceedings of the 2019 IEEE Intelligent Vehicles Symposium (IV), IEEE, Paris, France, 9–12 June 2019; pp. 2012–2017. [Google Scholar] [CrossRef]
  9. Ge, L.; Zhao, Y.; Zhong, S.; Shan, Z.; Guo, K. Efficient nonlinear model predictive motion controller for autonomous vehicles from standstill to extreme conditions based on split integration method. Control Eng. Pract. 2023, 141, 105720. [Google Scholar] [CrossRef]
  10. Zhou, S.; Tian, Y.; Walker, P.; Zhang, N. Impact of the tyre dynamics on autonomous vehicle path following control with front wheel steering and differential motor torque. IET Intell. Transp. Syst. 2023, 17, 1629–1648. [Google Scholar] [CrossRef]
  11. Jia, F.; Jing, H.; Liu, Z. A novel nonlinear drift control for sharp turn of autonomous vehicles. Veh. Syst. Dyn. 2024, 62, 490–510. [Google Scholar] [CrossRef]
  12. Gao, Y.; Wang, X.; Huang, J.; Yuan, L. Adaptive model predictive control for intelligent vehicle trajectory tracking considering road curvature. Int. J. Automot. Technol. 2024, 25, 1051–1064. [Google Scholar] [CrossRef]
  13. Yang, S.; Chen, Y.; Shi, R.; Wang, R.; Cao, Y.; Lu, J. A survey of intelligent tires for tire-road interaction recognition toward autonomous vehicles. IEEE Trans. Intell. Veh. 2022, 7, 520–532. [Google Scholar] [CrossRef]
  14. Sun, X. Path tracking control strategy for the intelligent vehicle considering tire nonlinear cornering characteristics in the PWA form. J. Frankl. Inst. 2022, 359, 2487–2513. [Google Scholar] [CrossRef]
  15. Peng, H.; Wang, W.; Xiang, C.; Li, L.; Wang, X. Torque coordinated control of four in-wheel motor independent-drive vehicles with consideration of the safety and economy. IEEE Trans. Veh. Technol. 2019, 68, 9604–9618. [Google Scholar] [CrossRef]
  16. Zhao, B.; Xu, N.; Chen, H.; Guo, K.; Huang, Y. Design and experimental evaluations on energy-efficient control for 4wimd-evs considering tire slip energy. IEEE Trans. Veh. Technol. 2020, 69, 14631–14644. [Google Scholar] [CrossRef]
  17. Satzger, C.; de Castro, R. Combined wheel-slip control and torque blending using MPC. In Proceedings of the 2014 International Conference on Connected Vehicles and Expo (ICCVE), IEEE, Vienna, Austria, 3–7 November 2014; pp. 618–624. [Google Scholar] [CrossRef]
  18. Zou, Y.; Guo, N.; Zhang, X. An integrated control strategy of path following and lateral motion stabilization for autonomous distributed drive electric vehicles. Proc. Inst. Mech. Eng. Part D J. Automob. Eng. 2021, 235, 1164–1179. [Google Scholar] [CrossRef]
  19. Ataei, M.; Khajepour, A.; Jeon, S. A novel reconfigurable integrated vehicle stability control with omni actuation systems. IEEE Trans. Veh. Technol. 2018, 67, 2945–2957. [Google Scholar] [CrossRef]
  20. Zhang, Y.; Khajepour, A.; Ataei, M. A Universal and Reconfigurable Stability Control Methodology for Articulated Vehicles with Any Configurations. IEEE Trans. Veh. Technol. 2020, 69, 3748–3759. [Google Scholar] [CrossRef]
  21. Funke, J.; Brown, M.; Erlien, S.M.; Gerdes, J.C. Collision avoidance and stabilization for autonomous vehicles in emergency scenarios. IEEE Trans. Control Syst. Technol. 2017, 25, 1204–1216. [Google Scholar] [CrossRef]
  22. Siampis, E.; Velenis, E.; Gariuolo, S.; Longo, S. A real-time nonlinear model predictive control strategy for stabilization of an electric vehicle at the limits of handling. IEEE Trans. Control Syst. Technol. 2018, 26, 1982–1994. [Google Scholar] [CrossRef]
  23. Allamaa, J.P.; Patrinos, P.; Van Der Auweraer, H.; Son, T.D. Safety Envelope for Orthogonal Collocation Methods in Embedded Optimal Control. In Proceedings of the 2023 European Control Conference (ECC), Bucharest, Romania, 13–16 June 2023; pp. 1–7. [Google Scholar] [CrossRef]
  24. Parra, A.; Tavernini, D.; Gruber, P.; Sorniotti, A.; Zubizarreta, A.; Pérez, J. On nonlinear model predictive control for energy-efficient torque-vectoring. IEEE Trans. Veh. Technol. 2021, 70, 173–188. [Google Scholar] [CrossRef]
  25. Liu, X.; Wang, G.; Chen, K. Nonlinear Model Predictive Tracking Control with C/GMRES Method for Heavy-Duty AGVs. IEEE Trans. Veh. Technol. 2021, 70, 12567–12580. [Google Scholar] [CrossRef]
  26. Kayacan, E.; Saeys, W.; Ramon, H.; Belta, C.; Peschel, J.M. Experimental Validation of Linear and Nonlinear MPC on an Articulated Unmanned Ground Vehicle. IEEE/ASME Trans. Mechatron. 2018, 23, 2023–2030. [Google Scholar] [CrossRef]
  27. Bai, G.; Liu, L.; Meng, Y.; Luo, W.; Gu, Q.; Ma, B. Path Tracking of Mining Vehicles Based on Nonlinear Model Predictive Control. Appl. Sci. 2019, 9, 1372. [Google Scholar] [CrossRef]
  28. Verschueren, R.; De Bruyne, S.; Zanon, M.; Frasch, J.V.; Diehl, M. Towards time-optimal race car driving using nonlinear MPC in real-time. In Proceedings of the 53rd IEEE Conference on Decision and Control, Los Angeles, CA, USA, 15–17 December 2014; pp. 2505–2510. [Google Scholar] [CrossRef]
  29. Ge, L.; Zhao, Y.; Zhong, S.; Shan, Z.; Ma, F.; Han, Z.; Guo, K. Efficient and integration stable nonlinear model predictive controller for autonomous vehicles based on the stabilized explicit integration method. Nonlinear. Dyn. 2023, 111, 4325–4342. [Google Scholar] [CrossRef]
  30. Bian, M.; Chen, L.; Luo, Y.; Li, K. A Dynamic Model for Tire/Road Friction Estimation under Combined Longitudinal/Lateral Slip Situation. SAE Tech. Pap. 2014, 1, 0123. Available online: https://www.sae.org/content/2014-01-0123/ (accessed on 20 June 2023).
  31. Hairer, E.; Wanner, G. Solving Ordinary Differential Equations I; Springer: Berlin/Heidelberg, Germany, 1996. [Google Scholar] [CrossRef]
  32. Biegler, L.T. Nonlinear Programming; Society for Industrial and Applied Mathematics: Philadelphia, PA, USA, 2010. [Google Scholar] [CrossRef]
  33. Young, L.C. Orthogonal collocation revisited. Comput. Methods Appl. Mech. Eng. 2019, 345, 1033–1076. [Google Scholar] [CrossRef]
  34. Garg, D.; Patterson, M.; Hager, W.W.; Rao, A.V.; Benson, D.A.; Huntington, G.T. A unified framework for the numerical solution of optimal control problems using pseudospectral methods. Automatica 2010, 46, 1843–1851. [Google Scholar] [CrossRef]
  35. Andersson, J.A.E.; Gillis, J.; Horn, G.; Rawlings, J.B.; Diehl, M. CasADi: A software framework for nonlinear optimization and optimal control. Math. Prog. Comput. 2019, 11, 1–36. [Google Scholar] [CrossRef]
Figure 1. Schematic diagram of nonlinear bicycle model.
Figure 1. Schematic diagram of nonlinear bicycle model.
Machines 12 00742 g001
Figure 2. Spectral radius of vehicle dynamics equation.
Figure 2. Spectral radius of vehicle dynamics equation.
Machines 12 00742 g002
Figure 3. Collocation of state variables.
Figure 3. Collocation of state variables.
Machines 12 00742 g003
Figure 4. Stability regions for integrators.
Figure 4. Stability regions for integrators.
Machines 12 00742 g004
Figure 5. Trajectories of controllers with three integration methods.
Figure 5. Trajectories of controllers with three integration methods.
Machines 12 00742 g005
Figure 6. Single-step calculation time of OCFE-T1, Euler-T2, and RK4-T3 controllers.
Figure 6. Single-step calculation time of OCFE-T1, Euler-T2, and RK4-T3 controllers.
Machines 12 00742 g006
Figure 7. Simulation results of controllers with different discrete methods in high-speed U-Turn scenarios.
Figure 7. Simulation results of controllers with different discrete methods in high-speed U-Turn scenarios.
Machines 12 00742 g007
Table 1. Vehicle parameters.
Table 1. Vehicle parameters.
SymbolDefinitionValue (Unit)
mVehicle total mass1650 (kg)
I z Vehicle yaw inertial3234 (kg·m2)
l f Distance from CG to front axle1.4 (m)
l r Distance from CG to rear axle1.65 (m)
C f Cornering stiffness of front tires 66 , 900 × 2 (N/rad)
C r Cornering stiffness of rear tires 62 , 700 × 2 (N/rad)
Table 2. Lateral tracking error of three controllers.
Table 2. Lateral tracking error of three controllers.
Orthogonal-Ts1
Controller
Euler-Ts2
Controller
RK-Ts3
Controller
e y m a x (m)0.09850.10580.0995
e y R S M E (m)0.01180.02180.0214
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

Zhu, G.; Hong, W. Efficient Nonlinear Model Predictive Path Tracking Control for Autonomous Vehicle: Investigating the Effects of Vehicle Dynamics Stiffness. Machines 2024, 12, 742. https://doi.org/10.3390/machines12100742

AMA Style

Zhu G, Hong W. Efficient Nonlinear Model Predictive Path Tracking Control for Autonomous Vehicle: Investigating the Effects of Vehicle Dynamics Stiffness. Machines. 2024; 12(10):742. https://doi.org/10.3390/machines12100742

Chicago/Turabian Style

Zhu, Guozhu, and Weirong Hong. 2024. "Efficient Nonlinear Model Predictive Path Tracking Control for Autonomous Vehicle: Investigating the Effects of Vehicle Dynamics Stiffness" Machines 12, no. 10: 742. https://doi.org/10.3390/machines12100742

APA Style

Zhu, G., & Hong, W. (2024). Efficient Nonlinear Model Predictive Path Tracking Control for Autonomous Vehicle: Investigating the Effects of Vehicle Dynamics Stiffness. Machines, 12(10), 742. https://doi.org/10.3390/machines12100742

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