5-7 Tiv2
5-7 Tiv2
4, APRIL 2024
Abstract—Accurate trajectory tracking is unrealistic in real- brain, which processes the perception information obtained from
world scenarios, however, which is commonly assumed to facilitate sensors to generate a safe motion or trajectory without collisions.
motion planning algorithm design. In this paper, a safe and reliable The control level [10] designs a suitable controller to track the
motion planning and control framework is proposed to handle the desired motion or trajectory. To simplify motion planning algo-
tracking errors caused by inaccurate tracking by coordinating the rithm design, it is commonly assumed that the planned trajectory
motion planning layer and controller. Specifically, motion space
is divided into safe regions and risky regions by designing the
can be tracked with complete accuracy [11]. Because tracking
movement restraint size dependent on tracking error to construct errors caused by inaccurate tracking are difficult to obtain in
the repulsive potential field. The collision-free waypoint set can advance, it leads to collision risk caused by tracking errors in the
then be obtained by combining global search and the proposed planning layer that are hard to avoid. In this paper, it is expected
waypoint set filtering method. The planned trajectory is fitted by to design a motion planning and control scheme that allows the
an optimization-based approach which minimizes the acceleration system to be safe and collision-free under inaccurate tracking
of the reference trajectory. Then, the planned trajectory is checked by coordinating motion control and planning algorithms in the
and modified by the designed anti-collision modification to ensure presence of tracking errors.
safety. Using invertible transformation and adaptive compensation The collision-free [12], [13] safe trajectory generation from
allows the transient trajectory tracking errors to be limited within the start point to the target point generally contains two stages:
the designed region even with actuator faults. Because tracking
error is considered and margined at the planning level, safety
searching the global path and performing local smoothing [11].
and reliability can be guaranteed by the coordination between Classical motion planning methods for global path search in-
the planning and control levels under inaccurate tracking and clude Dijkstra [14], A∗ [15], [16], [17] algorithms and arti-
actuator faults. The advantages and effectiveness of the proposed ficial potential field (APF) approach [18], etc. The APF can
motion planning and control method are verified by simulation and model the motion space intuitively, however, the traditional APF
experimental results. tends to fall into local optimality. The heuristic search, such as
Dijkstra and A∗ algorithms, can search the optimal path. A∗
Index Terms—Inaccurate tracking, safe motion planning,
actuator faults, reliable control, autonomous vehicles.
algorithm is used to search for the original point set of the
global path in this paper. The global path search algorithms are
mature, and this part is not the focus of this paper. In contrast,
I. INTRODUCTION many interesting algorithms have emerged for local trajectory
smoothing. The challenge of how to ensure the safety of planned
UTONOMOUS vehicles [1], including autonomous robot
A vehicles [2], unmanned vehicles [3], and surface vehi-
cles [4], performing a basic navigation task generally require
trajectories while performing local smoothing is an important
and attractive one that needs further research. It is worth noting
that Bezier-type [19] motion planning methods, such as the
perception, motion planning, and control to work together [3], classical Bezier algorithm and the B-Spline algorithm [20], can
[5]. The motion planning [6], [7], [8], [9] layer is taken as the significantly improve trajectory smoothness. Bezier algorithm
can ensure that the generated trajectories are arbitrary-order
Manuscript received 14 January 2024; accepted 27 January 2024. Date of differentiable. Polynomial-type trajectory planning methods,
publication 31 January 2024; date of current version 12 June 2024. This work including cubic spline [21], [22] and quintic spline, can generate
was supported in part by the National Natural Science Foundation of China under time-dependent motion trajectories based on the location of
Grant 62173108, in part by the Heilongjiang Post Doctoral Science Foundation the start and target points, desired velocity, and desired ac-
under Grant LBH-TZ2111, in part by the Major Scientific and Technological
Special Project of Heilongjiang Province under Grant 2021ZX05A01, and in part celeration. Further, optimization-based polynomial trajectory
by the Fundamental Research Funds for the Central Universities under Grant planning algorithms [23], including minimum velocity, mini
HIT.OCEF.2022012. (Corresponding author: Huihui Pan.) acceleration, minimum jerk [24], and minimum snap algorithms,
Huihui Pan, Mao Luo, Tenglong Huang, and Weichao Sun are with take the first to fourth-order derivatives of the trajectory as
the Research Institute of Intelligent Control and Systems, Harbin Insti-
tute of Technology, Harbin 150001, China (e-mail: [email protected];
cost. It is worth noting that, to produce a sufficiently smooth
[email protected]; [email protected]; [email protected]). reference trajectory, Bezier-type motion planning methods do
Jue Wang is with the Ningbo Institute of Intelligent Equipment Technology not guarantee the generated planned trajectory passes through
Company Ltd., Ningbo 315200, China, and also with the Department of Au- waypoints. Polynomial-type algorithms can constrain the refer-
tomation, University of Science and Technology of China, Hefei 230027, China ence trajectory to pass through the waypoints, and optimization-
(e-mail: [email protected]).
Color versions of one or more figures in this article are available at based polynomial planning algorithms can further optimize
https://doi.org/10.1109/TIV.2024.3360418. trajectory performance. However, by fitting the trajectory ac-
Digital Object Identifier 10.1109/TIV.2024.3360418 cording to the original waypoints in safety areas, the generated
2379-8858 © 2024 IEEE. Personal use is permitted, but republication/redistribution requires IEEE permission.
See https://www.ieee.org/publications/rights/index.html for more information.
Authorized licensed use limited to: Harbin Institute of Technology. Downloaded on July 10,2024 at 11:30:58 UTC from IEEE Xplore. Restrictions apply.
PAN et al.: SAFE MOTION PLANNING AND RELIABLE CONTROL FRAMEWORK FOR AUTONOMOUS VEHICLES 4781
Authorized licensed use limited to: Harbin Institute of Technology. Downloaded on July 10,2024 at 11:30:58 UTC from IEEE Xplore. Restrictions apply.
4782 IEEE TRANSACTIONS ON INTELLIGENT VEHICLES, VOL. 9, NO. 4, APRIL 2024
Fig. 4. Global path waypoint set Ωf search process. The start point PS is
facilitates the partitioning of the search space into the obstacle marked with a green pentagram grid, the target point PT with a purple pentagon
area Aobst , safe area As , and risky area Ar . grid, and the obstacles with orange grids. Both green and yellow grids are initial
waypoints and belong to the point set Ω0 . The yellow and red grids represent
feature points and corner points, respectively.
D. Waypoint Set Filtering
Waypoint set filtering and trajectory optimization are per-
formed within the safety region As determined by the con-
structed motion restraint size Se and repulsive potential field
Ure (Xc ). Waypoint set filtering aims to reduce the path length,
number of waypoints, and turns, thereby facilitating subsequent
trajectory smoothing. As illustrated in Fig. 5, the A∗ planning
algorithm is utilized to generate the initial waypoint set, denoted
as Ω0 . A heuristic distance is introduced into the search process
as follows:
f (Xc ) = g(Xc ) + h(Xc ) (6)
where Xc = (x, y) indicates the current position, f (Xc ) denotes
the search priority. Xc_f ather denotes the father point which is Fig. 5. Implementation of A∗ algorithm.
the same as the parent node in [16]. We can obtain
g(Xc ) = g(Xc_f ather ) + dis(g(Xc ), g(Xc_f ather )) (7)
h(Xc ) = |x − xtarget | + |y − ytarget | (8) set Ω0 {PS , A, B, C, D, E, F, G, H, I, J, K, L, M, PT } filter-
ing process is described as follows:
where dis(g(Xc ), g(Xc_f ather )) is the Euclidean distance, 1) Selecting Feature Points (SFP): The initial point set Ω0
Xtarget (xtarget , ytarget ) denotes the target point. The one-step contains numerous points that move in the same direction,
search process and the overall search process are illustrated in providing limited trajectory information. Thus, the key feature
Fig. 5(a) and (b), respectively. The search principle is identical points, specifically the waypoints where the direction of the path
to [15], [16]. By using the classical A∗ algorithm, Ω0 is obtained. −−→
changes, are extracted. As shown in Fig. 4(a), vector BC has
Then, Ω0 is refined by selecting feature points, transforming −−→
corner points, and removing redundant points to obtain the final a different direction than vector CD, indicating that point C
−−→ −−→
waypoint set Ωf . For clarity, the principle is illustrated with a is a feature point. Since vector CD and DE are in the same
simple scene search in Fig. 4. As depicted in Fig. 4(a), the A∗ direction, point D is not considered a feature point. The waypoint
algorithm is used to search the initial waypoint set Ω0 , which set Ω0 is simplified to Ω1 {PS , A, B, C, H, J, K, L, M, PT },
includes the yellow and green grids. The substantial number of resulting in a reduction of the number of waypoints by one-third
waypoints generated by the A∗ algorithm can pose challenges while preserving the feature points that contain critical path
for trajectory fitting and lead to poor tracking behavior. There- information.
fore, it is crucial to meticulously optimize and filter the initial 2) Transforming Corner Points (TCP): During the trajectory
point set Ω0 to guarantee that the resulting trajectory is both smoothing process, it is evident that corner points situated in
secure and well-suited for autonomous vehicles. The initial point close proximity to obstacles are prone to collision, such as
Authorized licensed use limited to: Harbin Institute of Technology. Downloaded on July 10,2024 at 11:30:58 UTC from IEEE Xplore. Restrictions apply.
4784 IEEE TRANSACTIONS ON INTELLIGENT VEHICLES, VOL. 9, NO. 4, APRIL 2024
Authorized licensed use limited to: Harbin Institute of Technology. Downloaded on July 10,2024 at 11:30:58 UTC from IEEE Xplore. Restrictions apply.
PAN et al.: SAFE MOTION PLANNING AND RELIABLE CONTROL FRAMEWORK FOR AUTONOMOUS VEHICLES 4785
¨ (τ̈ ) , −∇
[06(i−1) , ∇ ¨ (τ̈ ) , 06(k−i−1) ]Θr = 0 (23)
i i
Authorized licensed use limited to: Harbin Institute of Technology. Downloaded on July 10,2024 at 11:30:58 UTC from IEEE Xplore. Restrictions apply.
4786 IEEE TRANSACTIONS ON INTELLIGENT VEHICLES, VOL. 9, NO. 4, APRIL 2024
ζ = G −1 (ω 1 (t)) π π
de (t) > Φ, − < ϕe (t) < (39)
1 2 2
= (ln (ω 1 (t) − ς 1 ) + ln (υ 1 − ς 1 −θ)
2ε1 where Φ is a positive constant. Meanwhile, the controller pa-
− ln (θυ 1 − θω 1 (t))) (29) rameters are adjusted to satisfy υ 1 ψ 0 < Ae , ensuring that the
system remains collision-free even in the presence of actuator
ϑ = H−1 (ω 2 (t)) failures and tracking errors. In summary, the motion planning
1 and control framework guarantees the safety and reliability of
= (ln (ω 2 (t)υ 2 + ς 2 υ 2 ) − ln (ς 2 υ 2 − ω 2 (t)ς 2 )) (30) the system.
2ε2 Proof: The following Lyapunov candidate function V is
2 2 k1 2
where the superscript −1 denotes the inverse function, ω 1 (t) = chosen as V = ζ2 + ϑ2 + 2β β̃ + k22 β̃12b + 2β
1 1
k3 2
β̃ + k24 β̃22b ,
2 2
de (t) ϕe (t) where ˜∗ := ˆ∗ − ∗ denotes the estimation error of ∗.
ψ(t) , and ω 2 (t) = ψ(t) .
The derivative of V can be derived as follows
Correspondingly, the derivatives of ζ and ϑ are written as
˙ ˙
k1 β̃ 1 β̂1 ˙ k3 β̃ 2 β̂2 ˙
xe ye de ψ̇ V̇ = ζ ζ̇ + + k2 β̃ 1b β̂1b + ϑϑ̇ + + k4 β̃ 2b β̂2b
ζ̇ = 1 (− cos (ϕe ) v + ( ẋr + ẏr ) − ) β1 β2
de de ψ
Substituting the designed controller (31)–(33) and the adaptive
ye xe ϕe ψ̇
ϑ̇ = 2 w+ 2 (ẋr − v cos(ϕ))− 2 (ẏr − v sin(ϕ))− laws (34)–(37), we can obtain
de de ψ
k 1 k σ1 2 k 2 k σ2 2
V̇ ≤ − m1 ζ 2 − β̃ − β̃1b
where 1 = 1 1
− 1
, 2 = 1 2β1 1 2
2ε1 ψ ω 1 (t)−ς 1 ω 1 (t)−υ 1 2ε2 ψ
k 3 k σ3 2 k 4 k σ4 2
1
− 1
. − m2 ϑ 2 − β̃ − β̃2b + Cσ
ω 2 (t)+ς 2 ω 2 (t)−υ 2 2β2 2 2
The following adaptive reliable controllers are constructed
≤ − mσ V + C σ (40)
v=β̂ 1 ν 1 , = β̂ 2 ν 2 (31) where mσ = min(2m1 ,2m2 , kσ1 , kσ2 , kσ3 , kσ4 ), Cσ =
k1 kσ1 kσ2 k2 2 kσ3 k3 kσ4 k4 2
1 2 β1 + 2 β 1b + 2 β 2 + 2 β 2b .
ν1= − β̂1b Γ1 + Υ1 + m1 ζ (32)
Γ1 Thus, the system is ultimately uniformly bounded [39], [40],
and ζ and ϑ are bounded and accordingly, it is easy to obtain
1
ν2= − Υ2 β̂1b + Υ2 ν 1 + β̂2b ε2 + Υ3 + m2 ϑ (33) that de (t) ∈ (ς 1 ψ(t), υ 1 ψ(t)) and ϕe (t) ∈ (−ς 2 ψ(t), υ 2 ψ(t)).
ε2 By choosing the parameters as in Theorem 1, we can obtain
de (t) > Φ and ϕe (t) ∈ (− π2 , π2 ). Since we take into account
where β1 := α11 , β2 := α12 , β1b := α1b , β2b := α2b , and ˆ◦ de- the tracking error margin Ae in the movement restraint size Se ,
l l
notes the estimation of ◦. The adaptive laws are given by the system can be made safe and collision-free by adjusting the
parameters so that υ 1 ψ 0 < Ae holds. The proof of Theorem 1
˙ 1 is complete.
β̂ 1 = − (ζΓ1 ν 1 + ϑΥ2 ν 1 ) − kσ1 β̂ 1 (34)
k1 Remark 2: The controller developed in this paper can enhance
1 the system reliability by addressing actuator faults, including
˙
β̂1b = (ζΓ1 + ϑΥ2 ) − kσ2 β̂ 1b (35) actuator loss-of-effectiveness faults and bias faults. By con-
k2 sidering the tracking error caused by inaccurate tracking in
˙ 1 the controller design, the dynamic response can be constrained
β̂ 2 = − (ϑ2 ν 2 ) − kσ3 β̂ 2 (36) to safe performance boundaries to ensure system safety. The
k3
designed control method can be easily applied to autonomous
˙ 1 surface vehicles, mobile robots, etc. To enhance the proposed
β̂2b = (ϑ2 ) − kσ4 β̂ 2b (37)
k4 method, future work focuses on improving the system safety in
Authorized licensed use limited to: Harbin Institute of Technology. Downloaded on July 10,2024 at 11:30:58 UTC from IEEE Xplore. Restrictions apply.
PAN et al.: SAFE MOTION PLANNING AND RELIABLE CONTROL FRAMEWORK FOR AUTONOMOUS VEHICLES 4787
TABLE I
MOTION PLANNING PARAMETER SETTINGS
TABLE II
BENEFITS OF WAYPOINT SET FILTERING
V. SIMULATION RESULTS
Fig. 10. Collision avoidance by the proposed anti-collision modification.
In this section, a complex indoor simulation scenario com-
prising multiple irregular obstacles is constructed to validate the
effectiveness of the designed planning and control method. It is
assumed that the map information is available through sensors. part of the original set of AStarPoints. By selecting feature
To achieve collision-free motion planning, the map informa- points as described above, the set Ω1 is generated, namely the
tion is first pre-processed using the proposed map grid method. FeaturePoints in Fig. 9. The points in set Ω1 are then judged
Combined with the repulsive potential field, the region division and transformed to produce the corner point set Ω2 , which are
with different Se is provided in Fig. 8. The Se in Fig. 8(a), (b), denoted by the CornerPoints in Fig. 9. The redundant points that
and (c) are chosen as Se = 1, Se = 3, and Se = 5, respectively. do not contain valuable path information are removed to obtain
It can be seen that a larger Se , caused by a larger tracking error the final set Ωf , namely WayPoints in Fig. 9.
margin or robot size W , results in a smaller safety zone, which is Meanwhile, quantitative results of Dijkstra, A∗ , A∗ 2SFP (A∗ +
consistent with the actual situation. Then, the waypoint point set SFP), A∗ 2TCP (A∗ + SFP + TCP), and A∗ 2RRP (A∗ + SFP +
Ωf can be generated using the presented waypoint set filtering TCP + RRP) are provided in Table II to evaluate the proposed
strategy. For clarity, the parameter settings of motion planning waypoint set filtering method. From Table II, by combining
are provided and summarized in Table I. with the designed waypoint set filtering strategy, the generated
Specifically, the A∗ algorithm is used to search the map planned path obtains a shorter path length and fewer nodes.
space to find a feasible global path from PS to the PT . The Moreover, the number of path turns is reduced, which contributes
points involved and searched are represented as AStarExten- to generating and smoothing the planned trajectory. Based on
sionPoints in Fig. 9, and the final generated path Ω0 is indicated the proposed safe trajectory smoothing method, the planned
as AStarPoints. Note that the FeaturePoints in Fig. 9 are also trajectory is obtained by fitting the waypoints in set Ωf .
Authorized licensed use limited to: Harbin Institute of Technology. Downloaded on July 10,2024 at 11:30:58 UTC from IEEE Xplore. Restrictions apply.
4788 IEEE TRANSACTIONS ON INTELLIGENT VEHICLES, VOL. 9, NO. 4, APRIL 2024
TABLE III
PLANNING ALGORITHMS EVALUATION
TABLE IV
COMPARISON OF TRAJECTORY PERFORMANCE
Authorized licensed use limited to: Harbin Institute of Technology. Downloaded on July 10,2024 at 11:30:58 UTC from IEEE Xplore. Restrictions apply.
PAN et al.: SAFE MOTION PLANNING AND RELIABLE CONTROL FRAMEWORK FOR AUTONOMOUS VEHICLES 4789
Fig. 12. Final trajectory with movement restraint size Se . RT denotes the
final reference trajectory. LSPB and USPB are the lower boundary and upper Fig. 13. Tracking performance with various control methods. LB and UB are
boundary dependent on Se . the trajectory lower boundary and upper boundary. RT represents the reference
trajectory.
Authorized licensed use limited to: Harbin Institute of Technology. Downloaded on July 10,2024 at 11:30:58 UTC from IEEE Xplore. Restrictions apply.
4790 IEEE TRANSACTIONS ON INTELLIGENT VEHICLES, VOL. 9, NO. 4, APRIL 2024
TABLE V
RUNNING TIME AND TRACKING ERRORS
Fig. 15. Tracking performance in the x and y directions. XRV and YRV denote
the reference values in the x and y directions, respectively. Fig. 17. Experimental setup.
Authorized licensed use limited to: Harbin Institute of Technology. Downloaded on July 10,2024 at 11:30:58 UTC from IEEE Xplore. Restrictions apply.
PAN et al.: SAFE MOTION PLANNING AND RELIABLE CONTROL FRAMEWORK FOR AUTONOMOUS VEHICLES 4791
Fig. 18. Tracking performance comparative results. LB and UB are the trajec-
tory lower boundary and upper boundary. RT represents the reference trajectory. Fig. 20. Tracking performance in the x and y directions. XRV and YRV denote
the reference values in the x and y directions, respectively.
seen that the transient responses are within the performance [10] F.-Y. Wang, “Parallel control and management for intelligent transporta-
constraints, which is theoretically guaranteed and verified by tion systems: Concepts, architectures, and applications,” IEEE Trans.
the experimental results in Fig. 19. This means that not only is Intell. Transp. Syst., vol. 11, no. 3, pp. 630–638, Sep. 2010.
[11] L. Chen et al., “Milestones in autonomous driving and intelligent vehicles:
the tracking performance and reliability improved as in Table VI, Survey of surveys,” IEEE Trans. Intell. Veh., vol. 8, no. 2, pp. 1046–1056,
but the safety of the system is ensured combined with motion Feb. 2023.
restraint size Se in the planning level. [12] B. Li et al., “From formula one to autonomous one: History, achieve-
ments, and future perspectives,” IEEE Trans. Intell. Veh., vol. 8, no. 5,
pp. 3217–3223, May 2023.
[13] S. Teng, L. Chen, Y. Ai, Y. Zhou, Z. Xuanyuan, and X. Hu, “Hierarchical
VII. CONCLUSION interpretable imitation learning for end-to-end autonomous driving,” IEEE
Trans. Intell. Veh., vol. 8, no. 1, pp. 673–683, Jan. 2023.
This paper presents a safe and reliable motion planning and [14] A. J. Rimmer and D. Cebon, “Planning collision-free trajectories for
control framework that can ensure the safety and reliability reversing multiply-articulated vehicles,” IEEE Trans. Intell. Transp. Syst.,
of autonomous vehicles in the presence of inaccurate tracking vol. 17, no. 7, pp. 1998–2007, Jul. 2016.
and actuator faults by coordinating the planning and control [15] P. E. Hart, N. J. Nilsson, and B. Raphael, “A formal basis for the heuristic
layers. The motion restraint size is introduced into the planning determination of minimum cost paths,” IEEE Trans. Syst. Sci. Cybern.,
vol. 4, no. 2, pp. 100–107, Jul. 1968.
layer to leave a safe margin for inaccurate tracking, and the [16] H. Pan, X. Chang, and W. Sun, “Multitask knowledge distillation guides
potential field based on Se is constructed to divide safe regions. end-to-end lane detection,” IEEE Trans. Ind. Inform., vol. 19, no. 9,
The original point set generated using A∗ algorithm in the safe pp. 9703–9712, Sep. 2023.
region is refined and modified by the proposed waypoint set [17] S. M. Persson and I. Sharf, “Sampling-based A* algorithm for robot path-
planning,” Int. J. Robot. Res., vol. 33, no. 13, pp. 1683–1708, 2014.
filtering operation. Then safe planned trajectory is obtained by [18] T. Huang, H. Pan, W. Sun, and H. Gao, “Sine resistance network-based mo-
combining the optimization-based polynomial planning method tion planning approach for autonomous electric vehicles in dynamic envi-
and anti-collision modification. ronments,” IEEE Trans. Transport. Electrific., vol. 8, no. 2, pp. 2862–2873,
Comparative results with classical planning and control algo- Jun. 2022.
rithms show that the proposed planning algorithm can generate a [19] J. Faigl and P. Váňa, “Surveillance planning with bézier curves,” IEEE
Robot. Automat. Lett., vol. 3, no. 2, pp. 750–757, Apr. 2018.
smooth trajectory that satisfies the given constraints, including [20] C.-C. Tsai, H.-C. Huang, and C.-K. Chan, “Parallel elite genetic algo-
position, velocity, and acceleration constraints at PS and PT . rithm and its application to global path planning for autonomous robot
Satisfactory tracking performance even under actuator faults can navigation,” IEEE Trans. Ind. Electron., vol. 58, no. 10, pp. 4813–4821,
be achieved by employing the proposed adaptive fault-tolerant Oct. 2011.
[21] A. M. Lekkas and T. I. Fossen, “Integral LOS path following for curved
controller. In future work, we focus on further improving the paths based on a monotone cubic hermite spline parametrization,” IEEE
proposed method to ensure the safety of autonomous vehicles in Trans. Control Syst. Technol., vol. 22, no. 6, pp. 2287–2301, Nov. 2014.
dynamic scenarios [18]. Meanwhile, reducing travel delay and [22] J. Wittmann and D. J. Rixen, “Time-optimization of trajectories using
energy consumption by using advanced techniques [42], such zero-clamped cubic splines and their analytical gradients,” IEEE Robot.
as reinforcement learning-based multi-objective optimization, Automat. Lett., vol. 7, no. 2, pp. 4528–4534, Apr. 2022.
[23] D. Mellinger and V. Kumar, “Minimum snap trajectory generation and
to further improve energy efficiency while ensuring safety is an control for quadrotors,” in Proc. IEEE Int. Conf. Robot. Automat., 2011,
interesting topic. pp. 2520–2525.
[24] A. Piazzi and A. Visioli, “Global minimum-jerk trajectory planning
of robot manipulators,” IEEE Trans. Ind. Electron., vol. 47, no. 1,
REFERENCES pp. 140–149, Feb. 2000.
[25] A. D. Ames, X. Xu, J. W. Grizzle, and P. Tabuada, “Control barrier function
[1] S. Park and S. Hashimoto, “Autonomous mobile robot navigation using based quadratic programs for safety critical systems,” IEEE Trans. Autom.
passive RFID in indoor environment,” IEEE Trans. Ind. Electron., vol. 56, Control, vol. 62, no. 8, pp. 3861–3876, Aug. 2017.
no. 7, pp. 2366–2373, Jul. 2009. [26] A. D. Ames, S. Coogan, M. Egerstedt, G. Notomista, K. Sreenath, and P.
[2] D. Dolgov, S. Thrun, M. Montemerlo, and J. Diebel, “Path planning for Tabuada, “Control barrier functions: Theory and applications,” in Proc.
autonomous vehicles in unknown semi-structured environments,” Int. J. IEEE 18th Eur. Control Conf., 2019, pp. 3420–3431.
Robot. Res., vol. 29, no. 5, pp. 485–501, 2010. [27] H. Pan, D. Zhang, W. Sun, and X. Yu, “Event-triggered adaptive asymptotic
[3] D. Cao et al., “Future directions of intelligent vehicles: Potentials, possi- tracking control of uncertain MIMO nonlinear systems with actuator
bilities, and perspectives,” IEEE Trans. Intell. Veh., vol. 7, no. 1, pp. 7–10, faults,” IEEE Trans. Cybern., vol. 52, no. 9, pp. 8655–8667, Sep. 2022.
Mar. 2022. [28] S. L. Herbert, M. Chen, S. Han, S. Bansal, J. F. Fisac, and C. J. Tom-
[4] D. K. M. Kufoalor, T. A. Johansen, E. F. Brekke, A. Hepsø, and K. lin, “FaSTrack: A modular framework for fast and guaranteed safe mo-
Trnka, “Autonomous maritime collision avoidance: Field verification of tion planning,” in Proc. IEEE 56th Annu. Conf. Decis. Control, 2017,
autonomous surface vehicle behavior in challenging scenarios,” J. Field pp. 1517–1522.
Robot., vol. 37, no. 3, pp. 387–403, 2020. [29] M. Chen, S. Herbert, and C. J. Tomlin, “Exact and efficient Hamilton-
[5] F.-Y. Wang et al., “Verification and validation of intelligent vehicles: Jacobi guaranteed safety analysis via system decomposition,” in Proc.
Objectives and efforts from China,” IEEE Trans. Intell. Veh., vol. 7, no. 2, IEEE Int. Conf. Robot. Automat., 2017, pp. 87–92.
pp. 164–169, Jun. 2022. [30] G. E. Fainekos, A. Girard, H. Kress-Gazit, and G. J. Pappas, “Temporal
[6] F.-Y. Wang, N.-N. Zheng, D. Cao, C. M. Martinez, L. Li, and T. Liu, logic motion planning for dynamic robots,” Automatica, vol. 45, no. 2,
“Parallel driving in CPSS: A unified approach for transport automation pp. 343–352, 2009.
and vehicle intelligence,” IEEE/CAA J. Automatica Sinica, vol. 4, no. 4, [31] H. Kress-Gazit, G. E. Fainekos, and G. J. Pappas, “Temporal-logic-based
pp. 577–587, Oct. 2017. reactive mission and motion planning,” IEEE Trans. Robot., vol. 25, no. 6,
[7] E. A. Sisbot, L. F. Marin-Urias, R. Alami, and T. Simeon, “A human pp. 1370–1381, Dec. 2009.
aware mobile robot motion planner,” IEEE Trans. Robot., vol. 23, no. 5, [32] W. Chung et al., “Safe navigation of a mobile robot considering visibility of
pp. 874–883, Oct. 2007. environment,” IEEE Trans. Ind. Electron., vol. 56, no. 10, pp. 3941–3950,
[8] T. Huang, J. Wang, and H. Pan, “Adaptive bioinspired preview suspension Oct. 2009.
control with constrained velocity planning for autonomous vehicles,” IEEE [33] C. J. Ostafew, A. P. Schoellig, and T. D. Barfoot, “Robust constrained
Trans. Intell. Veh., vol. 8, no. 7, pp. 3925–3935, Jul. 2023. learning-based NMPC enabling reliable mobile robot path tracking,” Int.
[9] H. Pan, Y. Hong, W. Sun, and Y. Jia, “Deep dual-resolution net- J. Robot. Res., vol. 35, no. 13, pp. 1547–1563, 2016.
works for real-time and accurate semantic segmentation of traffic [34] H. Pan, C. Zhang, and W. Sun, “Fault-tolerant multiplayer tracking control
scenes,” IEEE Trans. Intell. Transp. Syst., vol. 24, no. 3, pp. 3448–3460, for autonomous vehicle via model-free adaptive dynamic programming,”
Mar. 2023. IEEE Trans. Rel., vol. 72, no. 4, pp. 1395–1406, Dec. 2023.
Authorized licensed use limited to: Harbin Institute of Technology. Downloaded on July 10,2024 at 11:30:58 UTC from IEEE Xplore. Restrictions apply.
PAN et al.: SAFE MOTION PLANNING AND RELIABLE CONTROL FRAMEWORK FOR AUTONOMOUS VEHICLES 4793
[35] W. Wang, J. Huang, and C. Wen, “Prescribed performance bound- Jue Wang received the B.S. degree in automation and
based adaptive path-following control of uncertain nonholonomic mo- the M.S. degree in pattern recognition and intelligent
bile robots,” Int. J. Adaptive Control Signal Process., vol. 31, no. 5, systems from Huaqiao University, Xiamen, China, in
pp. 805–822, 2017. 2016 and 2019, respectively, and the Ph.D. degree
[36] S. Teng et al., “Motion planning for autonomous driving: The state of from the Harbin Institute of Technology, Harbin,
the art and future perspectives,” IEEE Trans. Intell. Veh., vol. 8, no. 6, China, in 2023. She is currently a Postdoctoral Fel-
pp. 3692–3711, Jun. 2023. low with the Ningbo Institute of Intelligent Equip-
[37] C. P. Bechlioulis and G. A. Rovithakis, “Robust adaptive control of feed- ment Technology Company Ltd., Ningbo, China, and
back linearizable MIMO nonlinear systems with prescribed performance,” the University of Science and Technology of China,
IEEE Trans. Autom. Control, vol. 53, no. 9, pp. 2090–2099, Oct. 2008. Hefei, China. Her research interests include adap-
[38] X. Tao, N. Lang, H. Li, and D. Xu, “Path planning in uncertain environment tive control, fault-tolerant control, mechatronics, and
with moving obstacles using warm start cross entropy,” IEEE/ASME Trans. intelligent vehicles.
Mechatron., vol. 27, no. 2, pp. 800–810, Apr. 2022.
[39] N. Wang, S. Lv, M. J. Er, and W.-H. Chen, “Fast and accurate trajectory
tracking control of an autonomous surface vehicle with unmodeled dynam-
ics and disturbances,” IEEE Trans. Intell. Veh., vol. 1, no. 3, pp. 230–243,
Sep. 2016.
[40] P. Shi, X. Yu, X. Yang, J. J. Rodrguez-Andina, W. Sun, and H. Gao,
“Composite adaptive synchronous control of dual-drive gantry stage with
load movement,” IEEE Open J. Ind. Electron. Soc., vol. 4, pp. 63–74, 2023. Tenglong Huang (Graduate Student Member, IEEE)
[41] J. Hu, Y. Zhang, and S. Rakheja, “Adaptive lane change trajectory planning received the B.E. degree in automation from the
scheme for autonomous vehicles under various road frictions and vehicle Henan University of Technology, Zhengzhou, China,
speeds,” IEEE Trans. Intell. Veh., vol. 8, no. 2, pp. 1252–1265, Feb. 2023. in 2019. He is currently working toward the Ph.D.
[42] S. Lim, H. Balakrishnan, D. Gifford, S. Madden, and D. Rus, “Stochastic degree with the Research Institute of Intelligent Con-
motion planning and applications to traffic,” Int. J. Robot. Res., vol. 30, trol and Systems, Harbin Institute of Technology,
no. 6, pp. 699–712, 2011. Harbin, China. His research interests include motion
planning, vehicle dynamics control, adaptive control,
fault-tolerant control, and intelligent vehicles.
Huihui Pan (Senior Member, IEEE) received the
Ph.D. degree in control science and engineering from
the Harbin Institute of Technology, Harbin, China, in
2017, and the Ph.D. degree in mechanical engineering
from the Hong Kong Polytechnic University, Hong
Kong, in 2018. He is currently a Professor with the
Research Institute of Intelligent Control and Systems, Weichao Sun (Senior Member, IEEE) received the
Harbin Institute of Technology. His research interests Ph.D. degree in control science and engineering from
include nonlinear control, vehicle dynamic control, the Harbin Institute of Technology, Harbin, China, in
and intelligent vehicles. He is an Associate Editor for 2013. He is currently a Professor with the Research
IEEE TRANSACTIONS ON INTELLIGENT VEHICLES, Institute of Intelligent Control Systems, Harbin In-
IEEE TRANSACTIONS ON SYSTEMS, MAN, AND CYBERNETICS: SYSTEMS, and stitute of Technology. His research interests include
Mechatronics. adaptive robust control, mechatronics, robotics, and
autonomous vehicles. He is an Associate Editor
for IEEE/ASME TRANSACTIONS ON MECHATRON-
Mao Luo received the B.S. degree in automation and ICS, IEEE TRANSACTIONS ON SYSTEMS, MAN, AND
the M.S. degree in control science and engineering CYBERNETICS: SYSTEMS, and Journal of Dynamic
from the Harbin Institute of Technology, Harbin, Systems, Measurement and Control.
China, in 2021 and 2023, respectively. His research
interests include motion planning and intelligent ve-
hicles.
Authorized licensed use limited to: Harbin Institute of Technology. Downloaded on July 10,2024 at 11:30:58 UTC from IEEE Xplore. Restrictions apply.