Next Article in Journal
A Query Language for Exploratory Analysis of Video-Based Tracking Data in Padel Matches
Next Article in Special Issue
Sensor Fusion and Advanced Controller for Connected and Automated Vehicles
Previous Article in Journal
Optimization of the Polarization Profile of Conical-Shaped Shells Piezoelectric Sensors
Previous Article in Special Issue
A Driving-Adapt Strategy for the Electric Vehicle with Magneto-Rheological Fluid Transmission Considering the Powertrain Characteristics
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

A Study on Dynamic Motion Planning for Autonomous Vehicles Based on Nonlinear Vehicle Model

1
Fok Ying Tung Research Institute, Hong Kong University of Science and Technology (HKUST), Guangzhou 511458, China
2
Research Centre for Intelligent Transportation, Zhejiang Lab., Hangzhou 311000, China
3
Faculty of Engineering and Information Science, University of Wollongong, Wollongong, NSW 2522, Australia
*
Authors to whom correspondence should be addressed.
Sensors 2023, 23(1), 443; https://doi.org/10.3390/s23010443
Submission received: 12 October 2022 / Revised: 28 December 2022 / Accepted: 28 December 2022 / Published: 31 December 2022

Abstract

:
Autonomous driving technology, especially motion planning and the trajectory tracking method, is the foundation of an intelligent interconnected vehicle, which needs to be improved urgently. Currently, research on path planning methods has improved, but few of the current studies consider the vehicle’s nonlinear characteristics in the reference model, due to the heavy computational effort. At present, most of the algorithms are designed by a linear vehicle model in order to achieve the real-time performance at the cost of lost accuracy. To achieve a better performance, the dynamics and kinematics characteristics of the vehicle must be simulated, and real-time computing ensured at the same time. In this article, a Takagi–Sugeno fuzzy-model-based closed-loop rapidly exploring random tree algorithm with on-line re-planning process is applied to build the motion planner, which effectively improves the vehicle performance of dynamic obstacle avoidance, and plans the local obstacle avoidance path in line with the dynamic characteristics of the vehicle. A nonlinear vehicle model is integrated into the motion planner design directly. For fast local path planning mission, the Takagi–Sugeno fuzzy modelling method is applied to the modeling process in the planner design, so that the vehicle state can be directly utilized into the path planner to create a feasible path in real-time. The performance of the planner was evaluated by numerical simulation. The results demonstrate that the proposed motion planner can effectively generate a reference trajectory that guarantees driving efficiency with a lower re-planning rate.

1. Introduction

The path planning and path-tracking control strategies have attracted focused attention in recent years. The design of path-tracking control usually considers the detailed vehicle model to improve the control performance [1,2,3]. Particularly, a adaptive path-tracking control approach is proposed based on the lateral dynamics model with uncertain vehicle parameters [1]. Furthermore, a nonlinear sliding mode controller is proposed for the path-tracking control of an unmanned agricultural tractor by considering the kinematic model with wheel slip [2]. Yao et al. design a deep reinforcement training approach to learn the vehicle dynamics behaviour during the path-tracking [3]. However, considering the vehicle dynamics model in the path planning strategy design has been less addressed in the literature and will be the focused topic in our study.
The random search method based on vehicle dynamics model has been widely applied to conduct local path planning [4,5,6]. However, most of them are established based on a linear dynamics model to reduce the difficulty of controller design. The path planner using a complex nonlinear vehicle dynamics model [7,8] is still a big gap in the research. In order to optimize the speed of planning and convergence, and the stability of the fuzzy neural network, Xiong et al. [9] presented a fuzzy neural network controller based on a Takagi–Sugeno (T–S) fuzzy model with simple membership function in the local obstacle avoidance path planning for autonomous mobile robots. However, the disadvantage of this type of algorithm is the planning of the obstacle avoidance path without consideration of the actual vehicle dynamics model. In vehicle attitude control, a high-speed vehicle in a complex dynamic environment has a limited degree of freedom compared to a low-speed robot with a high degree of freedom for rotation [10]. For this reason, it is difficult for an autonomous vehicle to avoid the dynamic obstacles quickly and ensure the stability of the vehicle dynamics simultaneously without considering the specific vehicle dynamic characteristics. More recently, Chen et al. presented an algorithm to optimize the path-planning performance based on the fourth-order Bezier curve [11]. However, the optimization of the feasible trajectory set in this research just considers the lateral slip of the vehicle body without the consideration of a vehicle dynamics model and constraints of vehicle actuators. Shiller and Gwo [12] presented a planner integrated with a single point dynamics model to analyze the alternative paths, and then the planner chose the feasible path selected from the ones that the vehicle does not slip on when steering. However, in this algorithm the trajectory generation should conduct the forward simulation on the vehicle’s dynamic model continuously, which makes it hard to meet the real-time control requirement.
On the other hand, choosing an appropriate algorithm makes the planning results faster and more feasible. The traditional dynamic path-planning methods, such as the RRT algorithm [13,14] and road grid search algorithm [15], conduct a random search program to create a series of alternative paths in advance, and to compare the paths one by one to select the optimal path. In order to improve controller performance in real-time [16], and to make it more robust [17], some researchers are trying to optimize the method of random search in dynamic path planning. Frazzoli and Dahleh proposed an optimal path search method [18], which applies a closed-loop planning process (to compare possible local target points by random sampling method with the optimal cost function) instead of an open-loop calculation process (to conduct random sampling in existing routes with multiple iterations). In [19], Kuwata and Jonathan further proposed an RRT algorithm integrated with a closed-loop forward simulation to conduct real-time dynamic path planning. It is noted in the feasibility analysis of the optional path that the planner effectively considers the constraints of vehicle rollover limit and the safety zone limit for obstacle avoidance. With this preliminary consideration, the feasible obstacle avoidance path can be selected under the high dynamic environmental conditions. However, it is also noted from the experiment result that the high nonlinearity of the vehicle model greatly limits the real-time performance and accuracy of the controller’s forward simulation process. Therefore, this controller is more suitable to be used in the situation of relative low vehicle speed rather than a high-speed situation in real-time dynamic path planning.
It can be seen from the abovementioned research that the influence of dynamic model nonlinearity on planner design has increasingly drawn attention, and how to simultaneously improve the planner’s real-time performance and the applied dynamic model completeness should be further studied. Representing a nonlinear vehicle dynamic model by a T–S fuzzy model [20], the path planner can be directly applied to the vehicle model to plan the path with the consideration of the nonlinear vehicle’s dynamic characteristics. In this paper, a Takagi–Sugeno fuzzy-model-based closed-loop rapidly exploring random tree (TS-RRT) planning algorithm is proposed. The nonlinear vehicle dynamics model is described by the T–S fuzzy modelling process. In particular, the dynamic response of the vehicle is precisely described by the T–S fuzzy model for the closed-loop search process and on-line re-planning program. Thus, the optimal local path can be obtained more directly by combining the vehicle dynamics and the environmental information into the path planner. After the uniform boundedness of systems and global asymptotic stability are proven in the controller design process, the steering and braking control output can be calculated by the TS-RRT planner in real-time, and then a proportional–integral–derivative (PID) controller is applied to conduct the trajectory tracking considering the command signal and the vehicle state.
In Section 2, the dynamics model is established and linearized by the T–S fuzzy modelling process. Section 3 presented the closed-loop RRT online planning program and the corresponding trajectory controller design. Section 4 presented the results of simulation evaluation. Finally, the conclusions are drawn in Section 5.

2. Modeling of the Vehicle System

The autonomous vehicle is a nonlinear system with strong coupling characteristics and uncertainty. Since the real vehicle dynamics model has high nonlinearity, it is very difficult to apply a linear path-planning algorithm in the practical experiment. For this reason, a T–S modelling method is utilized in this study to build the vehicle dynamic model and maintain the precision of the model. It is noted that this research focuses on the obstacle avoidance path planning in a highly dynamic environment, therefore, the applied dynamic model mainly takes the consideration of the coordinated control system of steering and braking, without a discussion of the driving force input system.

2.1. Takagi–Sugeno Fuzzy Model

A simplified three degree of freedom nonlinear vehicle dynamic model is applied in this research, as shown in Figure 1, which can be effectively described by longitudinal speed, lateral speed, and yaw rate. The dynamic model is derived under the following assumptions:
(1)
The vertical, roll, and pitch motion is ignored;
(2)
The braking and steering dynamic are approximated to a linear first-order system;
(3)
The influence of suspension on tire axle is ignored [21]. The nonlinear model used in our work to represent the vehicle’s dynamics is of the general form as follows:
v ˙ x = c x m v x + 2 k f ( v y + l f ψ ˙ ) m v x δ + 1 m a + τ ( Δ x ) , v ˙ y = 2 ( k f + k r ) m v y [ v x + 2 ( k f l f k r l r ) m ] ψ ˙   + 2 k f m δ c y m v y + τ ( Δ y ) , ψ ¨ = 2 ( k f l f 2 k r l r 2 ) I z ψ ˙ 2 ( k f l f k r l r ) I z v y   + 2 k f l f I z δ + τ ( Δ ψ ) , δ ˙ = 1 T z ( δ c δ ) , a ˙ = 1 T a ( a c a ) ,
where vx, vy, and ψ represent the longitudinal speed, lateral speed, and yaw angle, respectively; m represents the total mass of the vehicle; Iz is the yaw inertia; lf and lr the distance from the front axle and the rear axle to the center of gravity, respectively; cx and cy are the air resistance coefficients of longitudinal movement and lateral movement, respectively; fr represents rolling resistance coefficient; kf and kr are the stiffness of front and rear tires, respectively; τx), τy), and τψ) represent the external disturbances and uncertainties caused by time-varying parameters and unmodeled dynamics; Tz and Ta are the first-order hysteretic quantities of the relevant control output reference quantities; δc is the control input of steering angle; ac is the acceleration control input of vehicle body; δ is the actual steering angle of the vehicle; a is the actual longitudinal acceleration of the vehicle body, and the input signal constraints are
a min < a < a max , δ max δ , δ ˙ max δ ˙ ,
where amin and amax are the maximum and minimum acceleration of vehicle body, respectively; δmax represents the maximum steering angle of vehicle; and δ ˙ max represents the maximum slew rate for steering.
It is noted that the vehicle dynamics model in (1) is based on the assumption that the uncertainty and external disturbance of the model are limited in a certain range. Under this assumption, we have the continuous function ∏τi(i = 1,2,3) satisfying the following inequality conditions
τ ( Δ x ) τ ¯ 1 ( v x , v y , ψ ˙ ) , τ ( Δ y ) τ ¯ 2 ( v x , v y , ψ ˙ ) , τ ( Δ ψ ˙ ) τ ¯ 3 ( v x , v y , ψ ˙ ) .
For the process of T–S fuzzy modelling, the state variables of the vehicle dynamics model can be defined as follows:
x 1 = v x , x 2 = v y , x 3 = ψ ˙ , x 4 = δ , x 5 = a ,
and the state vector as:
x = [ x 1 x 2 x 3 x 4 x 5 ] T .
We can write a state-space for system (1) as:
x ˙ = A x + B 1 w + B 2 u ,
where w is the external disturbance of the vehicle, u is the input of the control system, and
w = [ w 1 w 2 w 3 ] T , u = [ u 1 u 2 ] T
where w1 = τx), w2 = τy), w 3 = τ ( Δ ψ ˙ ) , u1 = δc and u2 = ac. Adding the state to Equation (1), we obtain
x ˙ 1 = c x m x 1 + 2 k f ( x 2 + l f x 3 ) m x 1 x 4 + 1 m x 5 + w 1 , x ˙ 2 = 2 ( k f + k r ) m x 2 [ x 1 + 2 ( k f l f k r l r ) m ] x 3   + 2 k f m x 4 c y m x 2 + w 2 , x ˙ 3 = 2 ( k f l f 2 k r l r 2 ) I z x 3 2 ( k f l f k r l r ) I z x 2   + 2 k f l f I z x 4 + w 3 , x ˙ 4 = 1 T z ( u 1 x 4 ) , x ˙ 5 = 1 T a ( u 2 x 5 ) .
In order to simplify the high nonlinearity of the proposed model, f1 and f2 are defined as:
f 1 = 2 k f ( x 2 + l f x 3 ) m x 1 , f 2 = x 1 + 2 ( k f l f k r l r ) m .
Then, Equation (7) can be rewritten as
x ˙ 1 = c x m x 1 + f 1 x 4 + 1 m x 5 + w 1 , x ˙ 2 = c y + 2 ( k f + k r ) m x 2 f 2 x 3 + 2 k f m x 4 + w 2 , x ˙ 3 = 2 ( k f l f k r l r ) I z x 2 2 ( k f l f 2 k r l r 2 ) I z x 3   + 2 k f l f I z x 4 + w 3 , x ˙ 4 = 1 T z ( x 4 + u 1 ) , x ˙ 5 = 1 T a ( x 5 + u 2 ) .
Therefore, the matrices A, B1 B2 can be written as
A ( 5 × 5 ) = [ c x m 0 0 f 1 1 m 0 c y + 2 ( k f + k r ) m f 2 2 k f m 0 0 2 ( k f l f k r l r ) I z 2 ( k f l f 2 k r l r 2 ) I z 2 k f l f I z 0 0 0 0 1 T z 0 0 0 0 0 1 T a ] , B 1 ( 5 × 3 ) = [ 1 0 0 0 0 0 1 0 0 0 0 0 1 0 0 ] T ,   B 2 ( 5 × 2 ) = [ 0 0 0 1 T z 0 0 0 0 0 1 T a ] T .
The T–S fuzzy modelling method is applied here to approximate the high nonlinearity of the system (6). It is noted that the state variables x1, x2, and x3 are actually limited for a stable system, and that the nonlinear f1 and f2 should also be bounded. We represent f1 and f2 using their minimum values and maximum values by following a “sector nonlinearity” approach:
f 1 = M 1 f 1 max + M 2 f 1 min , f 2 = N 1 f 2 max + N 2 f 2 min ,
where f(i)max (i = 1, 2) represents the maximum values and f(i)min (i = 1, 2) is the minimum value of the nonlinear f(i) (i = 1, 2). M(i) and N(i) (i = 1, 2) are fuzzy membership functions and satisfy:
M 1 + M 2 = 1 , N 1 + N 2 = 1 ,
and the member functions are defined as:
M 1 = f 1 f 1 min f 1 max f 1 min , M 2 = f 1 max f 1 f 1 max f 1 min , N 1 = f 2 f 2 min f 2 max f 2 min , N 2 = f 2 max f 2 f 2 max f 2 min .
Then, the nonlinear vehicle model system can be described by the above linear subsystems. For each possibility, there is a corresponding state–space equation:
if f 1 = M 1 ,   f 2 = N 1 ,   then   x ˙ = A ( 1 ) x + B 1 w + B 2 u , if f 1 = M 1 ,   f 2 = N 2 ,   then   x ˙ = A ( 2 ) x + B 1 w + B 2 u , if f 1 = M 2 ,   f 2 = N 1 ,   then   x ˙ = A ( 3 ) x + B 1 w + B 2 u , if f 1 = M 2 ,   f 2 = N 2 ,   then   x ˙ = A ( 4 ) x + B 1 w + B 2 u ,
where A(i)(i = 1, 2, 3, 4). (i = 1, 2, 3, 4) are obtained by replacing f(i)(i = 1, 2) in matrix A of (6) with f(i)max and f(i)min. Then, the T–S fuzzy model for the nonlinear vehicle model under the bounded state variables is obtained as:
x ˙ = i = 1 4 h i [ A ( i ) x + B 1 w + B 2 u ] = A h x + B 1 w + B 2 u ,
where A h = i = 1 4 h i A i , and h1 = M1N1, h2 = M1N2, h3 = M2N1, h4 = M2N2, and h(i)(i = 1, 2, 3, 4) satisfy Σ i = 1 4 h 1 = 1 .

2.2. State Observer

In practice, not all the state variables are available to be measured in real-time. In particular, the velocities are nearly unmeasurable since the direct integration from acceleration to estimate the vertical velocities means the accuracy of the estimation deteriorates as a consequence. To meet input requirements, a planner must be constructed using the estimated state variables and premise variables; that is, to estimate the state variables in real-time, a state observer is designed and integrated with the planner. In terms of the vehicle model, both the steering angle, δ, and the longitudinal acceleration of vehicle body, a, can be measured by sensors. Therefore, the observer measurement is defined as:
Y = [ δ a ] T = C 1 x ,
where
C 1 = [ 0 0 0 1 0 0 0 0 0 1 ] .
To effectively estimate the state by using the easily measured signals, the estimation error can be defined based on the observer measurement as
e = x x ^ .
Therefore, the state observer can be designed as
x ^ ˙ = i = 1 4 h i [ A ( i ) x ^ + L ( Y Y ^ ) + B 2 u ] = A h x ^ + L ( Y Y ^ ) + B 2 u ,
where L are the state observer gains to be designed. Rearrangement of (16) provides:
x ^ ˙ = ( A h L C 1 ) x ^ + L Y + B 2 u .
In Equation (15), the error vector of real and estimated states is defined as e = x x ^ . , then the dynamic behavior of error can be deduced as:
e ˙ = x ˙ x ^ ˙ = A h x + B 1 w + B 2 u ( A h L C 1 ) x ^ B 2 u L Y = A h x ( A h L C 1 ) x ^ L C 1 x + B 1 w = ( A h L C 1 ) e + B 1 w .
Here, we have two assumptions that the external disturbance w is a Gaussian white noise, whose mean value tends to be zero, and the values of ( A h T , C 1 T ) are fully controllable and fully measurable. In system (18), the attenuation of the error is determined by the poles’ locations of the matrix (AhLC1). For a known system, Ah and C1 are determined by the system characteristics. Therefore, the gain matrix L of the designed observer should be chosen to maintain the stability of the system, which is degenerated into a pole assignment problem. Specifically, if the matrix (AhLC1) has an appropriate eigenvalue, the error of the system has a certain decay rate to make the system stable. We have
det [ λ I ( A h L C 1 ) ] = det [ λ I ( A h L C 1 ) T ] = det [ λ I ( A h T L T C 1 ) ]
and since the object control model has been linearized by the Takagi–Sugeno modelling process, the observer design problem can be transformed into a pole assignment problem of ( A h T , C 1 T ) . To set L = [ 0 0 0 l 1 0 0 0 0 0 l 2 ] T , then (AhLC1) can be represented as
( A h L C 1 ) = [ c x m 0 0 f 1 1 m 0 c y + 2 ( k f + k r ) m f 2 2 k f m 0 0 2 ( k f l f k r l r ) I z 2 ( k f l f 2 k r l r 2 ) I z 2 k f l f I z 0 0 0 0 1 T z + l 1 0 0 0 0 0 1 T a + l 2 ] .
In order to ensure that the system is approaching zero, the eigenvalue set λ of the system need to all be negative values. Then, the corresponding matrix L content (l1 and l2) can be calculated to complete the observer design. Thus, the T–S fuzzy model and the corresponding state observer is established and can be applied in the closed-loop RRT planning program.

3. Control System Design

To determine the vehicle control input, the existing stochastic planning algorithms generally apply a look-up table to perform the reverse calculation based on the sampled control input value. In this section, the T–S fuzzy-model-based closed-loop RRT algorithm is proposed, which is integrated with a low-order controller to expand the RRT and conduct the on-line re-planning process by considering the closed-loop dynamics. Different from the existing work [15], the proposed TS-RRT samples the input of the stable closed-loop system composed of the controller and the T–S fuzzy dynamic state space. The complete planning and control system is shown in Figure 2.

3.1. Takagi–Sugeno Fuzzy-Model-Based Path Planner

In this study, the controller output consists of a series of tuples, which include the steering angle profile of the steering controller and the speed command profile of the speed controller. The TS-RRT uses the controller outputs and the T–S fuzzy dynamics model to conduct a forward simulation process, to calculate the predicted trajectory, and then to check the feasibility of the controller output signal according to the vehicle and environmental boundaries including rollover and obstacle avoidance constraints.
The main idea of this TS-RRT algorithm is to rapidly reduce the distance between a randomly selected node and the tree until all nodes meet the planning requirements. The goal is to find a feasible path from the start point (xm, ym) to the end point (xgoal, ygoal). Note that the term q show below is equivalent to (x, y). The exploration process of the RRT planner is shown as follow:
1.
Generate a random pot qrand;
2.
Find the node qnearest to qrand on the tree;
3.
Connect qrand and qnearest;
4.
Search for nodes on the tree with qrand as the center and rc as the radius;
5.
Find out the potential set of parent nodes qparent_potential. The purpose is to update qrand to find if there are any better parent nodes;
6.
Start to evaluate a random note of potential parent qparent_potential;
7.
Calculate the cost of qparent_potential as a parent node;
8.
Before the detection of collision, connect qparent_potential with qchild (that is, qrand) first;
9.
Calculate the cost of this path Ω(t), t ∈ [t1, t2];
10.
Compare the cost of the new path to the cost of the original path. If the cost of the new path is less, conduct the collision detection on it, or it should be replaced by the next potential parent node;
11.
Collision detection failed, the qparent_potential is not a new parent;
12.
Start to evaluate the next potential parent;
13.
Connect potential parent nodes to qchild;
14.
Calculate the cost of this path Ω(t), t ∈ [t3, t4];
15.
Again, compare the cost of the new path to the cost of the original path. If the cost of the new path is less, conduct the collision detection on it, or it should be replaced by the next potential parent node;
16.
Collision detection passed;
17.
Delete the previous edge in the tree;
18.
Add the new edge in the tree, and make qparent_potential as qparent.
Thus, the trajectory of a finite period, which depends on the cycle of calculation, can be predicted by the expansion process of the random tree shown above. However, in a dynamic and uncertain environment, trees need to grow continuously in the process of execution, due to the continuously updated vehicle dynamic status and environmental information. Therefore, real-time planning requires the vehicle dynamic model state and the reuse of the information from previous calculation cycles [22,23]. The re-planning program of the TS-RRT planner, which is also demonstrated in Figure 3, is designed as follows:
1.
Open the re-planning program;
2.
Update the current vehicle T–S fuzzy states xTS(t0);
3.
Update the environmental constraints Γfeasible (t) from the obstacle configuration space;
4.
Apply the state observer to propagate the states by a computational time step Δt and obtain xTS(t0 + Δt);
5.
Conduct the random tree exploring process;
6.
Until calculation time limit Δt is reached;
7.
If no such sequence exists, then send emergency stop to controller and return to step 2;
8.
End if;
9.
Choose the best safe node sequence in the tree;
10.
Re-propagate the latest T–S fuzzy state xTS(t0 + Δt) using the Ω(t) with the best node sequence, and then obtain x(t);
11.
If xTS(t)∈Γfeasible(t), then send the best potential path Ω(t) to the controller;
12.
If anything else, delete the previous infeasible path in the tree and return step 9;
13.
End if;
14.
Until the vehicle reaches goal.
The algorithm shown above illustrates the program of the TS-RRT algorithm to execute the part of tree exploring and to grow the tree while the controller executes the path planning in real-time. The planner sends the input to the controller at a fixed rate per second and the extension of the tree continues until the time limit (line 7) is reached. After each computation cycle, the best track is selected as the node sequence with control input Ucmd = [δcmdacmd]T. These signals are sent to the controller to be added to the reference path for trajectory control (line 13).
It is noted that when selecting the best path, only the sequence of nodes that end in a safe state is considered. If not, the planner commands the controller to perform an emergency brake to stop the car as soon as possible for security.

3.2. Trajectory Controller Design

During the TS-RRT planner conducting the path planning program, we use a simple and effective PID controller to track the designed trajectory in real-time.
For acceleration tracking, a simple PID controller is considered. However, due to the inherent speed damping of the vehicle and the noise of the acceleration signal, a PID controller has no obvious advantage to a PI controller, which has fewer parameters to be designed. Therefore, a PI controller is applied here and shown as follows:
a c = K p ( a ) ( a c m d a ) + K i ( a ) 0 t ( a c m d a ) d r
where u is the dimensionless speed control signal; Kp and Ki are proportional gain and integral gain, respectively.
Similarly, our steering controller is designed as:
δ c = K p ( δ ) ( δ c m d δ ) + K δ ( δ ) 0 t ( δ c m d δ ) d r
After constructing the planner and the trajectory controller, the T–S fuzzy model is left aside in the simulation work, and the complete closed-loop control system is shown in Figure 2.
For vehicles with complex dynamics, the dimension of vehicle state might be established with a very high dimension. However, the control signal output from the applied PID controller has a lower dimension, which can effectively guarantee the real-time performance of trajectory tracking.

4. Numerical Evaluation

In the section, an experiment in the loop simulation was conducted with a 1000 Hz real-time simulation frequency to verify the algorithm’s effectiveness. The nonlinear vehicle dynamic model, considering the dug-off tire model [24], is applied as the plant model. Meanwhile, the designed TS-RRT planner runs at 20 Hz based on an AGX Xavier chip with the vehicle model parameters listed in Table 1. To validate the performance of the TS-RRT, a traditional RRT planner is adopted for a comparison. The simulation result in Figure 4 presents the planned path of the autonomous vehicle in the presence of three moving obstacles. The vehicle adjusts its speed and direction when it detects the moving obstacle in its path, and sometimes it slows down when making its decision. It is noted that only the results of TS-RRT are shown in Figure 4, and the results of the competing controller, traditional RRT, are omitted for clarity.
To further illustrate the effectiveness of the TS-RRT algorithm, we constructed two test scenes including a highway case and a parking case, using a traditional artificial potential field (APF) method and an A* algorithm as a competitor for the simulation. The results of several typical scenarios are shown in Figure 5 and Figure 6.
The simulation result in Figure 5 presents the planned paths of the two competing planners, TS-RRT and APF, in the scene of motorway driving. It can be detected from Figure 5a that the APF algorithm has the same planning effect as TS-RRT when the environment complexity is low. However, in a complex and jam-packed environment, as shown in Figure 5b, the potential field force of the APF algorithm is trapped in the dilemma of local optimum, which results in the planning failure and the vehicle’s emergency stop. In Figure 5c, it can be seen that the front car is intending to slow down and merge to the left lane. In this case, with rolling optimization that includes re-planning and stitching, the TS-RRT planner generates a shorter and smoother trajectory than the APF one to complete the overtaking task.
The result in Figure 6 presents the planned paths of the two competing planners, TS-RRT and A*, in the scene of parallel parking. Comparing the results in Figure 6b,c, it can be found that the TS-RRT algorithm, which effectively considers the vehicle kinematics and dynamic characteristics, is appropriate for dealing with the narrow parking scenarios, and can complete the side parallel parking planning without collision. On the other hand, although the A* planner is improved with grid subdivision processing and accessibility path filtering, the final planned path is not available (a collision occurs) since the algorithm is lacking in dynamic characteristics consideration in the situation of tire slipping (simulated by the low road friction coefficient setting) and deceleration strip passing.
In order to illustrate the simulation results more clearly, the performance of the TS-RRT algorithm, the traditional RRT algorithm, and APF algorithm are compared in Table 2 in terms of the total planned distance, the time consumption, and the average vehicle speed. The value of the specific object is the average of ten simulation results. By the comparing the results, it can be seen that the proposed TS-RRT algorithm is optimized in terms of the total distance and the time consumption compared with the competing methods in the dynamic obstacle environment.
Table 3 illustrates the planning results and the time consumption of the two controllers in ten simulations. Under the dynamic obstacle environment, the search speed of TS-RRT is significantly faster compared with the traditional RRT search algorithm, and the search success rate is greatly improved with more propagations.
Furthermore, the observer’s effect that collected the simulation are organized and shown in Figure 7. Specifically, the four subfigures demonstrate the results of the two-observable states, steering angle and longitudinal acceleration, with measured inputs from sensors and the corresponding estimated value from the state observer, respectively. Moreover, the estimated input and output signals of the estimator calculate the delay as around 0.5–1 ms, which could be accepted within a 5 ms calculation period mission.

5. Conclusions

In this paper, a nonlinear vehicle dynamic model is considered in the control system design. For local path planning, the T–S fuzzy modelling method is applied to the nonlinear dynamic model to help the path planner to create a feasible path. Then, a closed-loop RRT algorithm with an on-line re-planning process is applied to build the path planner, which effectively improves the vehicle performance of dynamic obstacle avoidance, and plan the local obstacle avoidance path in line with the dynamic characteristics of the vehicle. Finally, the performance of the planner is evaluated by numerical simulation. The results demonstrate that the proposed controller can effectively plan the path and support a favorable trajectory.

Author Contributions

Writing—original draft preparation, X.T.; writing—review and editing, B.L.; supervision, H.D. All authors have read and agreed to the published version of the manuscript.

Funding

This research was supported by Zhejiang Lab, under PI support funding (No. 2022NL0PI01).

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Data Availability Statement

Not applicable.

Conflicts of Interest

The authors declare no conflict of interest.

References

  1. Mohammadzadeh, A.; Taghavifar, H. A novel adaptive control approach for path tracking control of autonomous vehicles subject to uncertain dynamics. Proc. Inst. Mech. Eng. Part D J. Automob. Eng. 2020, 234, 2115–2126. [Google Scholar] [CrossRef]
  2. Matveev, A.S.; Hoy, M.; Katupitiya, J.; Savkin, A.V. Nonlinear sliding mode control of an unmanned agricultural tractor in the presence of sliding and control saturation. Robot. Auton. Syst. 2013, 61, 973–987. [Google Scholar] [CrossRef]
  3. Yao, J.; Ge, Z. Path-Tracking Control Strategy of Unmanned Vehicle Based on DDPG Algorithm. Sensors 2022, 22, 7881. [Google Scholar] [CrossRef] [PubMed]
  4. Pepy, R.; Lambert, A.; Mounier, H. Reducing navigation errors by planning with realistic vehicle model. In Proceedings of the IEEE Intelligent Vehicles Symposium, Tokyo, Japan, 13–15 June 2006; pp. 300–307. [Google Scholar]
  5. Pepy, R.; Lambert, A.; Mounier, H. Path planning using a dynamic vehicle model. In Proceedings of the 2006 2nd International Conference on Information & Communication Technologies, Berkeley, CA, USA, 25–26 May 2006; pp. 781–786. [Google Scholar]
  6. Yang, S.; Wang, Z.; Zhang, H. Kinematic model based real-time path planning method with guide line for autonomous vehicle. In Proceedings of the 2017 36th Chinese Control Conference (CCC), Dalian, China, 26–28 July 2017; pp. 990–994. [Google Scholar]
  7. Park, C.; Pan, J.; Manocha, D. ITOMP: Incremental trajectory optimization for real-time replanning in dynamic environments. In Proceedings of the Twenty-Second International Conference on Automated Planning and Scheduling, Atibaia, Sao Paulo Brazil, 25–29 June 2012. [Google Scholar]
  8. Bouraine, S.; Fraichard, T.; Salhi, H. Provably safe navigation for mobile robots with limited field-of-views in dynamic environments. Auton. Robot. 2012, 32, 267–283. [Google Scholar] [CrossRef] [Green Version]
  9. Xiong, K.; Hua, H. Path plan for mobile robot under dynamic environment based on the actual membership function. Bull. Sci. Technol. 2015, 31, 168–173. [Google Scholar]
  10. ChaborAlwawi, B.K.; Roth, H.; Kazem, B.I.; Abdullah, M.W. Mobile robot motion planning and multi objective optimization using improved approach. Int. J. Mech. Eng. Robot. Res. 2015, 4, 325–330. [Google Scholar] [CrossRef]
  11. Chen, C.; He, Y.; Bu, C.; Han, J. Feasible trajectory generation for autonomous vehicles based on quartic bezier curve. Acta Autom. Sin. 2015, 44, 486–496. [Google Scholar]
  12. Shiller, Z.; Gwo, Y. Dynamic motion planning of autonomous vehicles. IEEE Trans. Robot. Autom. 1991, 7, 241–249. [Google Scholar] [CrossRef]
  13. LaValle, S.; Kuffner, J.; Donald, B. Algorithmic and Computational Robotics: New Directions 2000 WAFR, 1st ed.; A K Peters/CRC Press: Boca Raton, FL, USA, 2001. [Google Scholar]
  14. Zucker, M.; Kuffner, J.; Branicky, M. Multipartite RRTs for rapid replanning in dynamic environments. In Proceedings of the 2007 IEEE International Conference on Robotics and Automation, Roma, Italy, 10–14 April 2007; pp. 1603–1609. [Google Scholar]
  15. Branicky, M.; LaValle, S.; Olson, K. Quasi-randomized path planning. In Proceedings of the 2001 ICRA IEEE International Conference on Robotics and Automation, Seoul, Korea, 21–26 May 2003; pp. 1481–1487. [Google Scholar]
  16. An, Z.; Hao, L.; Liu, Y.; Dai, L. Development of mobile robot SLAM based on ROS. Int. J. Mech. Eng. Robot. Res. 2016, 5, 47–51. [Google Scholar] [CrossRef]
  17. Widhiada, W.; Nindhia, T.; Budiarsa, N. Robust control for the motion five fingered robot gripper. Int. J. Mech. Eng. Robot. Res. 2015, 4, 226–232. [Google Scholar] [CrossRef]
  18. Frazzoli, E.; Dahleh, M.; Feron, E. Real-time motion planning for agile autonomous vehicles. J. Guid. Control. Dyn. 2002, 25, 116–129. [Google Scholar] [CrossRef] [Green Version]
  19. Kuwata, Y.; Teo, J.; Fiore, G.; Karaman, S.; Frazzoli, E.; How, J. Real-time motion planning with applications to autonomous urban driving. IEEE Trans. Control. Syst. Technol. 2009, 17, 1105–1118. [Google Scholar] [CrossRef]
  20. Tang, X.; Du, H.; Sun, S.; Ning, D.; Xing, Z.; Li, W. Takagi-Sugeno fuzzy control for semi-active vehicle suspension with a magnetorheological damper and experimental validation. IEEE/ASME Trans. Mechatron. 2016, 22, 291–300. [Google Scholar] [CrossRef]
  21. Guo, J.; Li, K.; Luo, Y. Coordinated control of autonomous four wheel drive electric vehicles for platooning and trajectory tracking using a hierarchical architecture. J. Dyn. Syst. Meas. Control 2015, 137, 101001. [Google Scholar] [CrossRef]
  22. Stentz, A. Optimal and efficient path planning for partially known environments. In Intelligent Unmanned Ground Vehicles; Springer: Boston, MA, USA, 1997; pp. 203–220. [Google Scholar]
  23. Petti, S.; Fraichard, T. Safe motion planning in dynamic environments. In Proceedings of the 2005 IEEE/RSJ International Conference on Intelligent Robots and Systems, Edmonton, AB, Canada, 2–6 August 2005; pp. 2210–2215. [Google Scholar]
  24. Boada, B.; Boada, M.; Díaz, V. Fuzzy-logic applied to yaw moment control for vehicle stability. Veh. Syst. Dyn. 2005, 43, 753–770. [Google Scholar] [CrossRef]
Figure 1. Vehicle dynamics model.
Figure 1. Vehicle dynamics model.
Sensors 23 00443 g001
Figure 2. The control flow of the closed-loop system.
Figure 2. The control flow of the closed-loop system.
Sensors 23 00443 g002
Figure 3. The pipeline of the TS-RRT planner.
Figure 3. The pipeline of the TS-RRT planner.
Sensors 23 00443 g003
Figure 4. The planning results in dynamic environment: (a) at 1/4 of the total time, (b) at half of the total time, (c) at 3/4 of the total time, (d) at the end of the planned period.
Figure 4. The planning results in dynamic environment: (a) at 1/4 of the total time, (b) at half of the total time, (c) at 3/4 of the total time, (d) at the end of the planned period.
Sensors 23 00443 g004
Figure 5. Comparison of algorithm effectiveness under motorway running: (a) bypassing in jam-packed case, (b) bypassing in normal case, (c) overtaking case.
Figure 5. Comparison of algorithm effectiveness under motorway running: (a) bypassing in jam-packed case, (b) bypassing in normal case, (c) overtaking case.
Sensors 23 00443 g005
Figure 6. Comparison of algorithm effectiveness in parking planning: (a) start status of TS-RRT planning, (b) end status of TS-RRT with successful planning, (c) end status of A* planning with collision failure.
Figure 6. Comparison of algorithm effectiveness in parking planning: (a) start status of TS-RRT planning, (b) end status of TS-RRT with successful planning, (c) end status of A* planning with collision failure.
Sensors 23 00443 g006
Figure 7. State monitoring and estimation: (a) steering angle with large amplitude, (b) steering angle with small amplitude, (c) longitudinal acceleration with large amplitude, (d) longitudinal acceleration with small amplitude.
Figure 7. State monitoring and estimation: (a) steering angle with large amplitude, (b) steering angle with small amplitude, (c) longitudinal acceleration with large amplitude, (d) longitudinal acceleration with small amplitude.
Sensors 23 00443 g007
Table 1. Model parameters.
Table 1. Model parameters.
ParameterValueParameterValue
δmax0.539 radm1589 kg
δ ˙ max 0.331 rad/sIz36,918 kg·m2
amin−8.2 m/s2lf1.38 m
amax3.8 m/s2lr1.67 m
Ta0.35 skf379 kN/m
Tz0.35 skr388 kN/m
Table 2. Comparison of results (average value of 10 times).
Table 2. Comparison of results (average value of 10 times).
StrategyAPF AlgorithmTraditional RRTTS-RRT
Trajectory distance338.30 m325.93 m304.23 m
Time consumption24.09 s25.11 s21.38 s
Average vehicle speed14.04 m/s12.98 m/s14.23 m/s
Table 3. Iterations and time consumed to generate the optimal track.
Table 3. Iterations and time consumed to generate the optimal track.
StrategyTraditional RRTTS-RRT
Potential trajectory86112
Total propagation11,40814,253
Time cost11.85 s10.24 s
Propagation/cycle310402
Time cost/cycle0.32 s0.29 s
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

Tang, X.; Li, B.; Du, H. A Study on Dynamic Motion Planning for Autonomous Vehicles Based on Nonlinear Vehicle Model. Sensors 2023, 23, 443. https://doi.org/10.3390/s23010443

AMA Style

Tang X, Li B, Du H. A Study on Dynamic Motion Planning for Autonomous Vehicles Based on Nonlinear Vehicle Model. Sensors. 2023; 23(1):443. https://doi.org/10.3390/s23010443

Chicago/Turabian Style

Tang, Xin, Boyuan Li, and Haiping Du. 2023. "A Study on Dynamic Motion Planning for Autonomous Vehicles Based on Nonlinear Vehicle Model" Sensors 23, no. 1: 443. https://doi.org/10.3390/s23010443

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