Wevj 13 00097
Wevj 13 00097
Abstract: In the study of autonomous obstacle avoidance of intelligent vehicles, the traditional
artificial potential field method has the problem that the vehicle may fall into the local minima and
lead to obstacle avoidance failure. Therefore, this paper improves the traditional potential field
function. Based on the vehicle dynamics model, a strategy of jumping out of local minima based
on smaller steering angles is proposed. By finding a smaller steering angle and setting a suitable
jump out step length, the intelligent vehicle is enabled to jump out of the local minima. Simulation
experiments by MATLAB show that the improved method can jump out of the local minima. By
comparing the planned trajectories of the traditional method and the improved method in static
and dynamic obstacles situations, the trajectory planned by the improved method is smooth and the
curvature is smaller. The planned trajectory is tracked by the Carsim platform, and the test results
show that the improved method reduces the front steering wheel angle while the intelligent vehicle
Citation: Tian, J.; Bei, S.; Li, B.; Hu, satisfies the vehicle dynamics constraints during active obstacle avoidance, which verifies the stability
H.; Quan, Z.; Zhou, D.; Zhou, X.; and rationality of the improved method.
Tang, H. Research on Active Obstacle
Avoidance of Intelligent Vehicles Keywords: artificial potential field; local minima; path planning; intelligent vehicle
Based on Improved Artificial
Potential Field Method. World Electr.
Veh. J. 2022, 13, 97. https://doi.org/
10.3390/wevj13060097
1. Introduction
Academic Editor: Joeri Van Mierlo Intelligent vehicles are advanced cars that integrate technologies such as computer
Received: 22 April 2022
science, sensors, and data processing. It has received extensive attention and research in
Accepted: 23 May 2022
academia and has been applied to some extent. Currently, most of the intelligent vehicles
Published: 28 May 2022
use advanced sensing technology to obtain vehicle location, speed, and other data through
data fusion technology to achieve the extraction and analysis of characteristic data infor-
Publisher’s Note: MDPI stays neutral
mation between “human-vehicle-road”, and finally making the vehicle environmentally
with regard to jurisdictional claims in
aware, enabling autonomous decision-making and motion planning capabilities [1].
published maps and institutional affil-
Path planning, as an important technology for intelligent vehicles to achieve au-
iations.
tonomous driving, frequently refers to motions of a vehicle in a 2D or 3D world that
contains obstacles [2]. The path planning technology of intelligent vehicles is to analyze
and process the data collected by vehicle sensors and plan the vehicle trajectory inde-
Copyright: © 2022 by the authors.
pendently without a human driver through a certain algorithm. This technology can not
Licensee MDPI, Basel, Switzerland. only plan the appropriate trajectory, but also reduce the traffic accidents caused by road
This article is an open access article environment changes and driver’s operation errors, which is important to build a safe,
distributed under the terms and efficient, and convenient driving environment.
conditions of the Creative Commons According to the degree of grasp of environmental information, path planning can
Attribution (CC BY) license (https:// be divided into global path planning based on a priori complete information and local
creativecommons.org/licenses/by/ path planning based on sensor information [3,4]. The path planning techniques applied
4.0/). in automated driving scenarios can be roughly divided into four categories: graph search
based planners, sampling based planners, interpolating curve planners, and numerical
optimization approaches [5]. Here are common path planning algorithms used in early
applications for intelligent vehicles: (1) Grid method [6,7]: The grid method was earlier
applied to the path planning of robots. It divides the robot’s workspace into a grid, and the
size of the grid cells is determined by the smallest rectangular space in which the robot can
move freely, and the path is planned by calculating the shortest distance between the grids.
(2) Dijkstra algorithm: Dijkstra’s algorithm was proposed by the Dutch computer scientist
Dijkstra in 1959 [8]. It is a classic graph searching algorithm; however, it has disadvantages
such as high data computation and low efficiency. (3) A* algorithm [9,10]: It is an extension
of Dijkstra’s graph search algorithm. Its most important design aspect is the determination
of the cost function, which defines the weights of the nodes [5]. (4) RRT (rapidly exploring
random trees) algorithm [11,12]: RRT algorithm is a random sampling planning algorithm.
It permits fast planning in semi-structured spaces by performing random searches in the
navigation area [13].
The classical graph searching algorithms and sampling-based algorithm mentioned
above have shortcomings and drawbacks. Vega-Brown et al. [14] proposed some asymp-
totically optimal algorithms for motion planning problems, the ideas in these algorithms
can likely be combined with the ideas in many other sampling-based motion planning and
graph search algorithms. Other scholars have also proposed some novel path planning
algorithms based on advanced sensors and natural sciences: Nakrani et al. [15] designed a
fuzzy-based obstacle avoidance navigation controller, which obtains information from an
ultrasonic sensor array. Chen Y. et al. [16] proposed padding mean neural dynamic model
(PMNDM), planning paths by transmitting nerve impulses in a topologically organized
network. Jafari M. et al. [17] proposed a novel biologically inspired approach based on a
computational model of emotional learning in mammalian limbic system, and it is applied
for the first time in a synthetic UAV (Unmanned Aerial Vehicles) path planning scenario.
In real driving scenarios, when the drivers or sensors detect obstacles, they will slow
down or steer to avoid the obstacles. This shows that the obstacle avoidance behavior of the
vehicle depends on whether the location of the obstacles will influence the driving safety of
the vehicle. Although the vehicle does not contact the obstacles during obstacle avoidance,
the vehicle’s motion is altered. This indicates that there is at least one virtual force acting
on the vehicle, and this virtual force belongs to a field force [18]. This means that there is a
potential field that changes the motion of the vehicle during the obstacle avoidance process.
Therefore, we can explain the phenomenon of vehicle obstacle avoidance process in terms
of fields and field forces.
The artificial potential field (APF) method has received much attention and research
for its simplicity of calculation and high real-time performance. The APF method was first
proposed by Khatib [19] in 1986 and it is commonly used for local path planning. The
principle of APF method is to transform the real environment into a virtual potential field,
which is the attractive field generated by the target and the repulsive field generated by the
obstacle, and the vector superposition of the attractive field and repulsive field forms the
combined potential field. Ultimately, the intelligent vehicle plans its path under the action
of the combined potential field.
However, the traditional APF method has many drawbacks, the most typical of which
is the problem of local minima and unable to reach target. To address the problem of
local minima, scholars at home and abroad have proposed several improved methods.
Choe, T.S. et al. [20] proposed the concept of steering potential fields, using overlapping
integrated force fields to avoid obstacles and follow the planned path. Huang, Y. et al. [21]
generate a diamond-shaped grid on a local map, add a voltage source between the starting
point and the target, assign the resistance value of each edge on the grid by the APF method,
and plan the local path by calculating the current maximum. Fan, S. [22] optimized the
gravity model by setting tracking target points and optimized the potential field function
by adjusting factors to eliminate local minima. Li, E. [23] proposed the SOPC-APF method
World Electr. Veh. J. 2022, 13, 97 3 of 21
that introduces the idea of collision prediction and makes decisions before the robot enters
the trap area or the minimum point problem.
APF method can also be combined with other intelligent algorithms. Bounini, F. et al. [24]
find the
World Electr. Veh. J. 2022, 13, x FOR PEER REVIEW
actual path in the potential field according to a potential gradient3 descent of 21
algorithm
and add a repulsive potential field to the current state with a local minimum. Cummings,
M.L. [25] studied the path planning problem by combining the ant colony algorithm with
the APF algorithm.
APF method can alsoLuo, D. et al. [26].
be combined proposed
with other to use
intelligent the gridBounini,
algorithms. method F. to
et establish the
planning
al. [24] findspace andpath
the actual use in
thetheant colonyfield
potential algorithm
according astothe global path
a potential search
gradient strategy to search
descent
algorithm and addpath.
for the optimal a repulsive potentialdue
In addition, fieldtotothe
the early
current state with a of
application local
theminimum.
APF method to robot
Cummings,
kinematics,M.L. the [25] studied constraints
restrictive the path planningof theproblem
intelligentby combining
vehicle mustthe antbe colony
considered when it
algorithm with the APF algorithm. Luo, D. et al. [26]. proposed to use the grid method to
is referenced as a local path planning algorithm for intelligent vehicles.
establish the planning space and use the ant colony algorithm as the global path search
To address the above problems, this paper first improves the potential field functions.
strategy to search for the optimal path. In addition, due to the early application of the APF
method tothe
Second, robot road boundary
kinematics, potentialconstraints
the restrictive field is added to constrain
of the intelligent themust
vehicle motion
be region and
limit the when
considered lateral it ismotion of as
referenced the intelligent
a local vehicle.
path planning Finally,
algorithm combining
for intelligent with the vehicle
vehicles.
dynamics
To addressmodel, a strategy
the above problems, for this
jumping
paper outfirst of local minima
improves based
the potential onfunc-
field smaller steering
tions.
angles Second, the road when
is proposed boundary thepotential field vehicle
intelligent is added falls
to constrain the motion
into local minima. regionThe intelligent
and limitwill
vehicle the lateral
searchmotion of the intelligent
for potential jump-out vehicle.
pointsFinally,
in thecombining
direction with
of the vehicle
smaller steering angles
dynamics model, a strategy for jumping out of local minima based on smaller steering
within the maximum steering angle range of the intelligent vehicle. The improved APF
angles is proposed when the intelligent vehicle falls into local minima. The intelligent ve-
method
hicle will is verified
search and analyzed
for potential jump-out bypoints
MATLAB in the and Carsim
direction platform,
of smaller andangles
steering the improved APF
method can successfully jump out of the local minima,
within the maximum steering angle range of the intelligent vehicle. The improved APF at the same time, comparing the
method is verified and analyzed by MATLAB and Carsim platform, and the improved environment.
trajectory curvature before and after the improvement in the same obstacle
The method
APF trajectories planned byjump
can successfully the out
improved APF
of the local method
minima, hassame
at the smaller
time,curvature
comparingand are easier
the trajectory curvature before and after the improvement
to be tracked under the same Carsim tracking model. This paper provides in the same obstacle environ-a new idea for
ment. The trajectories planned by the improved APF
intelligent vehicle path planning based on potential field theory. method has smaller curvature and
are easier to be tracked under the same Carsim tracking model. This paper provides a new
idea for intelligent vehicle path planning based on potential field theory.
2. APF Method
2.1.
2. Traditional
APF Method APF Method
The principle
2.1. Traditional of APF is to assume that the vehicle is in a virtual space; the attractive
APF Method
potential field generated
The principle of APF is toby the target
assume that theand the isrepulsive
vehicle in a virtualpotential
space; thefield generated by the
attractive
obstacles.
potential fieldAttractive
generated byfield
the has
targetlow
andpotential energy
the repulsive andfield
potential both start point
generated by theand repulsive
obstacles.
field have Attractive field has low
high potential potential
energy. Theenergy and both start
superposition point and
of these tworepulsive
potentialfield
fields forms an
have high potential
undulating spaceenergy.
as shownThe in
superposition of these two potential fields forms an un-
Figure 1 [27].
dulating space as shown in Figure 1 [27].
Figure
Figure1.1.Potential fields.
Potential fields.
InInattractive
attractivefield, the the
field, magnitude
magnitudevariesvaries
with the distance
with between between
the distance the vehiclethe
posi-
vehicle position
tion and the target. The potential field function in this paper is referenced to Zhu, W.
and the target. The potential field function in this paper is referenced to Zhu, W. [28] and[28]
and the attractive potential field is defined as:
the attractive potential field is defined1as:
𝑈 (𝑋) = 𝐾 𝜌 (𝑃, 𝑃 ) (1)
2
1 2
where 𝑈 (𝑋) is the attractive potential Ufield, ) =is the
att ( X𝐾 Ka ρ P, Pg (1)
2 attractive field coefficient, 𝜌(𝑃, 𝑃 )
is a vector whose magnitude is the Euclidean distance between the vehicle position 𝑃 and
the target
Uposition 𝑃 , the direction is the vehicle position toward the target position.
where att ( X ) is the attractive potential field, K a is the attractive field coefficient, ρ P, Pg
is a vector whose magnitude is the Euclidean distance between the vehicle position P and
the target position Pg , the direction is the vehicle position toward the target position.
World Electr. Veh. J. 2022, 13, 97 4 of 21
The attractive force is the negative gradient of the attractive potential field which can
World Electr. Veh. J. 2022, 13, x FOR PEER REVIEW 4 of 21
be calculated from the following equation:
Fatt ( X ) = −∇Uatt ( X ) = Ka ρ P, Pg (2)
The attractive force is the negative gradient of the attractive potential field which can
be calculated
Repulsive fields arefrom the following
virtual potentialequation:
fields generated by obstacles. Each obstacle has
its own range of influence. When the vehicle 𝐹 (𝑋)is=not −∇𝑈 within
(𝑋) the
= 𝐾influence
𝜌(𝑃, 𝑃 ) range of an obstacle,(2)
the potential energy magnitude of the vehicle is zero; when the vehicle enters the influence
Repulsive fields are virtual potential fields generated by obstacles. Each obstacle has
range of the obstacle, the potential energy of the vehicle varies with the distance between
its own range of influence. When the vehicle is not within the influence range of an obsta-
the vehicle position and the obstacles. The repulsive potential field is defined as:
cle, the potential energy magnitude of the vehicle is zero; when the vehicle enters the in-
fluence range of the(obstacle, the potential 2energy of the vehicle varies with the distance
1 1
between 2 Kr ( ρand − ρ10 ) 0 < ρ( P, Pobs ) ≤potential
ρ0
Uthe vehicle position
rep ( X ) =
the
( P,Pobs ) obstacles. The repulsive field is defined
(3) as:
0 ρ( P, Pobs1) > ρ0 1 1
𝐾( − ) 0<𝜌(𝑃, 𝑃 )≤𝜌
𝑈 (𝑋) = 2 𝜌(𝑃, 𝑃 ) 𝜌 (3)
where Urep ( X ) is the repulsive potential field,0 𝜌(𝑃,K𝑃r is )the> 𝜌repulsive field coefficient, ρ( P, Pobs )
is a vector whose magnitude is the Euclidean distance between the vehicle position P and
the obstaclewhere 𝑈 P (𝑋), the
position is the repulsive
direction potential
is from field, 𝐾to the
the obstacle is the repulsive
vehicle, ρ0 is field coefficient,
the radius of
obs
𝜌(𝑃, 𝑃 ) is a vector whose magnitude is the Euclidean distance between the vehicle po-
the obstacle’s influence range.
sition 𝑃 and the obstacle position 𝑃 , the direction is from the obstacle to the vehicle,
The repulsive force is the negative gradient of the repulsive potential field which can
𝜌 is the radius of the obstacle’s influence range.
be calculated from the following equation:
The repulsive force is the negative gradient of the repulsive potential field which can
be calculated from the following
( equation:
1
Kr ρ( P,P − ρ10 ρ2 ( P,P
1
0 <ρ( P, Pobs ) ≤ ρ0
Frep ( X ) = −∇Urep ( X ) = obs ) 1 1 obs ) 1 (4)
0 ρ ( P, P𝐾 () > ρ − ) 0<𝜌(𝑃, 𝑃 ) ≤ 𝜌
𝐹 (𝑋) = −∇𝑈 (𝑋) = obs 𝜌(𝑃, 𝑃 ) 𝜌 𝜌 (𝑃, 𝑃 )
0 (4)
0 𝜌(𝑃, 𝑃 )>𝜌
Vehicle is often affected by the repulsive field of multiple obstacles while moving
Vehicle
toward the target. is oftenthe
Therefore, affected by theforce
combined repulsive
fieldfield
is a of multiple obstacles
superposition of anwhile moving
attractive
toward the target. Therefore,
field and multiple repulsive fields. the combined force field is a superposition of an attractive
field and multiple repulsive fields.
The combined force potential field function can be expressed as:
The combined force potential field function can be expressed as:
n
( X )=+𝑈 ∑(𝑋)
Utotal ( X ) =𝑈 Uatt(𝑋) Urep
+ ( X )𝑈 (𝑋) (5) (5)
i =1
Frep
Ftotal
Ftotal
Frep
Fatt
Fatt
Fatt Fatt
Target
Obstacle
The range of
obstacle influence
Figure
Figure 2. Forces on 2.the
Forces on the vehicle.
vehicle.
World Electr. Veh. J. 2022, 13, 97 5 of 21
World Electr. Veh. J. 2022, 13, x FOR PEER REVIEW 5 of
Y Vf
y lf αf
lr
V δ
Vy x
Vr β
φ Vx
αr Fyf
Fyr X
Based on
Based on the balance the balance
of forces in the of forces
y-axis in the y-axis
direction, direction,
the vehicle the vehicle
dynamics dynamics equili
equilibrium
rium equation
equation can be expressed as:can be expressed as:
Fy f cosδ + Fyr =𝐹 ma
𝑐𝑜𝑠𝛿
y + 𝐹 = 𝑚𝑎 (7) (
The relationship
Thebetween lateral
relationship force of
between the front
lateral force wheel and the
of the front rearand
wheel wheel, lateral
the rear wheel, later
deflection angle and lateral deflection stiffness can be expressed as:
deflection angle and lateral deflection stiffness can be expressed as:
Fy f = C f α f 𝐹 = 𝐶 𝛼
(8) (
Fyr = Cr αr 𝐹 =𝐶 𝛼
where 𝐶 and 𝐶 are the front wheel lateral deflection stiffness and the rear wheel later
where C f and Cr are the front wheel lateral deflection stiffness and the rear wheel lateral
deflection stiffness, respectively. According to the coordinate system, the lateral deflectio
deflection stiffness,
anglerespectively. According
of the front and to the
rear wheels of coordinate system,
the vehicle can the lateral
be expressed as:deflection
angle of the front and rear wheels of the vehicle can be expressed as:
World Electr. Veh. J. 2022, 13, 97 6 of 21
.
α = ϕl f +Vy − δ
f Vx. (9)
α = Vy − ϕlr
r Vx
Assuming the front tire angle δ at a small angle, we can regard cosδ ≈ 1. According to
the Equations (8) and (9), Equation (7) can be transformed as:
. . ! . .
.. . ϕl f + y y − ϕlr
m y + Vx ϕ = C f − δ + Cr (10)
Vx Vx
Note that the velocity and acceleration in the y-axis direction can be expressed as:
.
Vy = y
.. . (11)
ay = y + Vx ϕ
Finally, the vehicle dynamics model based on the front tire angle δ can be expressed as:
C f + Cr . l f C f − lr Cr Cf
.. .
y= y+ − Vx ϕ − δ (12)
mVx mVx m
where d0 is the threshold value for the distance between the vehicle and the target; ε is the
attractive field modulation factor. The most significant difference after the improvement is
that when the distance between the vehicle and the target is greater than d0 , the gravitational
force is considered constant.
To address the problem of vehicle oscillation near the target, an adjustment factor
ρn P, Pg is added to the repulsive field function. The improved repulsive field function
1 2 n
(
1 1
Urep ( X ) = 2 Kr ( ρ( P,Pobs ) − ρ0 ) ρ P, Pg 0 < ρ ( P, Pobs ) ≤ ρ0 (15)
0 ρ( P, Pobs ) > ρ0
Y
D
D−W/2
W/2
X
0
−W/2
−D+W/2
−D
where W is the vehicle width, D is the lane width, Kroad is the road boundary potential field
coefficient, λ is the modulation factor, and Py is the vertical coordinate of the vehicle center
of mass position in the road coordinate system XOY. The direction of repulsion of the
road boundary potential field is perpendicular to the road boundary. When the intelligent
vehicle can avoid the obstacle without changing lanes, the intelligent vehicle is restricted to
remain in the current lane, unless the longitudinal repulsive force on the vehicle is greater
than the maximum repulsive force of the road boundary without changing lanes to reduce
the driving risk of changing lanes.
World Electr. Veh. J. 2022, 13, 97 8 of 21
U𝑈
total ==
U𝑈att ++
U𝑈rep ++
U𝑈road (20)
The equilibrium
The equilibrium equation
equation for
for the
the forces
forces on
on the
the vehicle
vehicle can
can be
be expressed
expressed as:
as:
𝐹 =𝐹 +𝐹 +𝐹 (21)
Ftotal = Fatt + Frep + Froad (21)
4.2. Strategies for Jump out of Local Minima Based on Smaller Steering Angles Angles
The intelligent
intelligentvehicle
vehiclewill
willstall
stallororoscillate
oscillate when
when it falls
it falls intointo local
local minima.
minima. To solve
To solve this
this problem, this paper proposed a strategy, that is searching for
problem, this paper proposed a strategy, that is searching for potential jump potential jump out points
within
within the steering angle
the steering angle range
range asasshown
shownin inFigure
Figure5.5.The
Thespecific
specificsteps
stepsare
areasasfollows:
follows:
40° n=5
Potential jump-out
point B
Forward step
length Sf n=1
Current location A
θ
θ
Virtual backward step Obstacle Target
length Sb Forward step
n=1
length Sf
Potential jump-out
point C
−40° n=5
Figure 5. Strategy for jumping out of local minima.
P𝑃−−Pg𝑃 ≥≥step
𝑠𝑡𝑒𝑝length
𝑙𝑒𝑛𝑔𝑡ℎ (22)
(22)
The local minima are defined as:
The local minima are defined as:
|𝑃 − 𝑃 | ≤ 0.1 ∗ 𝑠𝑡𝑒𝑝 𝑙𝑒𝑛𝑔𝑡ℎ || 𝐹 =0 (23)
| Pi+2 − Pi | ≤ 0.1 ∗ step length || Fsum = 0 (23)
where 𝑖 is the serial number of step. When the intelligent vehicle falls into the local min-
ima, the
where i iscoordinates of the of
the serial number intelligent
step. Whenvehicle at that moment
the intelligent vehiclearefallsnoted 𝐴(𝑥 ,minima,
as local
into the 𝑦 ), the
direction
the of vehicle
coordinates of themotion at that
intelligent moment
vehicle at thatismoment
taken asare
thenoted
reference
as A(line.
x0 , y0Initializing the
), the direction
number
of vehicleofmotion
angle changes 𝑛 = 1, and
at that moment picking
is taken the reference
as the angles online.
bothInitializing
sides of thethe reference
numberline
of
direction,
angle changes n = 1, 𝜃and are
the angles determined
picking by Equations
the angles (24) of
on both sides andthe(25):
reference line direction,
the angles θth are determined by Equations (24) 1 and (25):
⎡ ⎤
1⎢1024⎥
1024 1
1⎢ ⎥
256
1⎢ 256⎥
1
⎢ ⎥ 1 · · · n
nth = ±
64 (24)
1
= ±16
𝑛 ⎢ 64 1 ⋯ 𝑛
⎥ (24)
1
4⎢ 1 ⎥
1⎢ 16 ⎥
⎢ 1q ⎥
n
θth = th⎢ ∗4 |⎥320 ∗ nth | (25)
|nth⎣| 1 ⎦
𝑛
𝜃 = ∗ |320 ∗ 𝑛 | (25)
|𝑛 |
The magnitude of the front tire angle 𝛿 of a vehicle can be expressed as:
World Electr. Veh. J. 2022, 13, 97 9 of 21
The magnitude of the front tire angle δ of a vehicle can be expressed as:
θth Fsumy
δ = 2π ∗ + arctan + π ∗ ( Fsumx < 0) (26)
360 Fsumx
At the same time, according to Equation (27) to obtain the former step length S f .
where ∆U X Ai − X Ai−2 is the potential field magnitude difference between the point A
and the position twice the length steps before the point A. Based on the front tire angle δ
and the former step length S f , the vehicle gets two potential jump-out points, sit marked
as B( x1 , y1 ) and C ( x2 , y2 ).
Calculate the value of the potential field when the vehicle is at positions A, B, and
C respectively and write U ( x0 ), U ( x1 ), and U ( x2 ). Comparing the magnitude of U ( x0 ),
U ( x1 ) and U ( x2 ):
If the potential field value satisfies both U ( x0 ) < U ( x1 ) and U ( x0 ) < U ( x2 ), it means
that the potential field value at point A is the lowest. Neither point B nor point C can be the
suitable jump-out point. Then increase the number of angle changes once and perform the
above step operation again. Meanwhile, the steering angle of the intelligent vehicle should
satisfy its dynamics constraints in the actual driving scenario. The maximum steering angle
of the vehicle does not exceed 40◦ and n should be no more than 5. If n is greater than
5, then the vehicle is set back two times the virtual step length to obtain a critical local
minima, and performed again from the beginning.
If it does not satisfy U ( x0 ) < U ( x1 ) or U ( x0 ) < U ( x2 ), it means that point B and
point C have at least one point with a lower potential field value than point A. Then
comparing the magnitude of U ( x1 ) and U ( x2 ), the vehicle moves to point C if potential
field value satisfied U ( x1 ) > U ( x2 ) and moves to point B if potential field value satisfied
U ( x2 ) > U ( x1 ).
When determining the potential jump-out points, attention should be paid to whether
the line between the current position of the intelligent vehicle and the potential jump-out
point will collide with the obstacle. If a collision occurs, the potential jump-out point should
be discarded and searched again. The planned trajectory and front tire angle should satisfy
Equation (12). The flowchart of the strategy is shown in Figure 6.
World
WorldElectr.
Electr.Veh.
Veh. J.J. 2022,
2022,13,
13,97
x FOR PEER REVIEW 10 of
10 of 21
Start
No
The vehicle backs up on the original path
n<5?
with 2 times the virtual step length
Yes
Calculate U(x0),U(x1),U(x2)
Yes
U(x0) < U(x1) and
n=n+1
U(x0) < U(x2)?
No
No
U(x1) > U(x2)?
Yes
C(x 2,y 2) is the potential jump-out point B(x1,y 1)is the potential jump-out point
Does the smart car Yes Yes Does the smart car
collide with obstacles in collide with obstacles in
the planned path? the planned path?
No No
End
Figure 6.
Figure 6. Flowchart
Flowchart of
of the
the strategy
strategy for
for jump
jump out
out of
of the
the local
local minima.
minima.
World Electr. Veh. J. 2022,
World13, 97 Veh. J. 2022, 13, x FOR PEER REVIEW
Electr. 11 of 21 11 of
Table
Table 1. Simulation 1. Simulation
parameters parameters
setting table. setting table.
Parameter
Parameter Name and Symbol Name and Symbol Representation
Representation Value/Unit Value/Unit
Attractive field action coefficient 𝐾 15
Attractive field action coefficient Ka 15
Repulsive
Repulsive field action coefficient Kr field action coefficient 𝐾 10 10
Road boundary potentialRoadfield boundary
coefficient potential
Kroad field coefficient 𝐾 20 20
Radius
Radius of the influence range of the
of the obstacle ρ0 range of the obstacle 5𝜌m
influence 5m
Vehicle length L Vehicle length 𝐿 4.7 m 4.7 m
Vehicle width W Vehicle width 𝑊 1.8 m 1.8 m
Lane width D 3.5 m
Lane width 𝐷 3.5 m
Step length 0.1 m
Step length 0.1 m
-2
-4
0 10 20 30 40 50 60
(a)
4
Obstacle
Target
2
Starting Point
Path
0
-2
-4
0 10 20 30 40 50 60
(b)
Figure 7.
Figure 7. Local minima Local minima
formed formed APF
by traditional by traditional
method. APF method.
(a) Single (a) Single
obstacle; (b)obstacle;
multiple(b)obstacles.
multiple obstacles.
-4 4
0 10 20 30 40 50 60
Obstacle
Target
World Electr. Veh. J. 2022,
World13, 97 Veh. J. 2022, 13, x FOR PEER REVIEW
Electr. 42
(a) Starting Point 12 of 21 12 of
Path
Obstacle
Target
4 20
Starting Point
PathObstacle
-2
0 Target
2
Starting Point
Path
-4
-2
0 0 10 20 30 40 50 60
4
-2
2
-4
0 10 20 (a) 30 40 50
Obstacle
Target
60
4 Starting Point
-4
0
0 10 20
(a) 30 40 50
Path
Obstacle
Target 60
42 Starting Point
Path
Obstacle
-2
20 (b) Target
Starting Point
Path
-4
-2
0 0 10 20 30 40 50 60
-4
-2
improved APF method. (a) Single obstacle; (b) multiple obstacl
Figure 8. Trajectory planned by the(a)
0 10 20 30 40 50 60
4
-4
(b) 0 10 20 30 40 50 Obstacle 60
2
From Figure 8, it can be seen that the vehicle jump out of the local minima by us Target
Starting Point
(b) Path
0
Figure 8. Trajectory
the improved planned bythe
APF method, the planned
improved APF method.is
trajectory (a)continuous
Single obstacle;and(b) multiple
smooth.obstacles.
As can
-2
Figure 8. Trajectory planned by the improved APF method. (a) Single
seen from Figure 9, the absolute values of the curvature of the trajectories planned by obstacle; (b) multiple obstacles.
From Figure 8, it can be seen that the vehicle jump out of the local minima by using
improved APF method are all less than 0.4 m−1 , which satisfies the requirements of p
-4
0 10 20 30 40 50 60
the improved
From Figure APF8, method,
it can be(b) the
seen planned
that thetrajectory is continuous
vehicle jump out of theandlocalsmooth.
minimaAs bycan be
using
planning. It also indicates
seenimproved
from Figure
that the strategy of jump out of the local minima based
the APF9,method,
the absolute values oftrajectory
the planned the curvature of the trajectories
is continuous and smooth.planned by the
As can be
smaller
Figure
Figure 8. Trajectory
seen steering
planned
from
improved by angle
8. Trajectory
Figure
APF
is effective.
planned
themethod
improved
9, the by APF
the
all improved
absolute
are method.
lessvalues APF
0.4
(a)
than of −1 obstacle;
method.
m
Single
the (a) Single
curvature
, which theobstacle;
of (b) multiple
satisfies (b) multiple
obstacles.
trajectories planned
the requirements obstacle
bypath
of the
−1
planning. APF
improved It also indicates
method that
are all less thethan 0.4 mof ,jump
strategy whichout of thethe
satisfies local minima based
requirements on
of path
0.4 0.04
Fromsteering
smaller
planning. Figure 8,
It alsoangleit can bethat
seen
is effective.
indicates the that the vehicle
strategy jump
of jump outoutof of
thethe local
local minima
minima by usin
based on
0.3
the improved
smaller steeringAPF method,
angle the0.03
is effective. planned trajectory is continuous and smooth. As can b
0.4 seen from Figure 9, the absolute0.02 values
0.04 of the curvature of the trajectories planned by th
0.2 0.4
improved APF method are all less
0.010.04
than
0.03
0.4 m−1 , which satisfies the requirements of pa
Curvature/m -1
Curvature/m-1
0.3
0.1 0.3
planning. It also indicates that the 0 0.02
0.03
strategy of jump out of the local minima based o
0.2 0.01
smaller steering angle is effective. -0.010.02
Curvature/m -1
Curvature/m-1
0.2 0.010
0 -0.02
-1
0.1
-1
Curvature/m
Curvature/m
0.4 -0.01
0
0.04
0.1
-0.03
-0.1 0 -0.02
-0.01
0.03
-0.04
0.3
0 -0.03
-0.02
0.02
-0.2 -0.1 -0.05
0 5 10 15 20 25 30 35 40 45 50 0
-0.04 5 10 15 20 25 30 35 40 45 50
0.2 -0.03
0.01
-0.1 Longitudinal displacement / m Longitudinal displacement / m
Curvature/m -1
Curvature/m-1
-0.2 -0.05
-0.04
0 5 10 15 20 25 30 35 40 45 50 0
0.1
-0.2
(a)
Longitudinal displacement / m -0.05
0 5 10 15 20
(b) 25
Longitudinal displacement / m
30 35 40 45 50
0 5 10 15 20 25 30 35 40 45 50 -0.01 0 5 10 15 20 25 30 35 40 45 50
-4 0
0 -4
-2 that the subject vehicle moves at a constant speed of 10 m/s, the initial positions of stat
0
20
20
40
40
60
60
80
80
100
100
Target
Starting Point
Path
-4
Figure 11.The
Trajectory planned results
by the traditional APFplanned
methodby in statictraditional
obstacles drivingimproved AP
environment
Figure
methods
Figure 11. Trajectory 11. Trajectory
are by
planned shown planned by the
in FiguresAPF
the traditional traditional
11 and APF method in static obstacles driving
12. in static obstacles driving environment.
method environment.
4
Obstacle 1
2
0
Although the traditional APF method also successfully planned the trajectory, it can Obstacle 2
Obstacle 3
Target
-2
-4
be seen that the improved APF method planned a smoother trajectory than the traditional Starting Point
Path
0 20 40 60 80 100 120
APF method by comparing Section 5.2.2 and Figure 12, which is also confirmed by the
Figure 11.in
curvature comparison Trajectory
Figure planned
13. by the traditional APF method in static obstacles driving environment.
4
Obstacle 1
World Electr.
2 Veh. J. 2022, 13, x FOR PEER REVIEW Obstacle 2
Obstacle 3
13 of 21
0
Target
-2 Starting Point
Path
-4
0 20 40 60 80 100
4
Obstacle 1
4
World Electr. Veh. J. 2022, 13, 97
World
2
Electr. Veh.2 J. 2022, 13, x FOR PEER REVIEW 13 of 21
Obstacle
Obstacle
Obstacle
1 2
2 3
Obstacle 13 of 21
0 Obstacle 3
0
Target
-2 Target
Starting Point
-2 Starting
PathPoint
-4 Path
0 -4 20 40 60 80 100
0 20 40 60 80 100
4
4 Obstacle 1
Obstacle 1
2 24 Obstacle
Obstacle 2 2
Obstacle 1
Obstacle
0 Obstacle 3 3
02 Obstacle 2
Target
Target
Obstacle 3
Starting
-2 -20 Starting PointPoint
Target
PathPath
-4 -2
-4 Starting Point
0 0 20 20 40 40 60 60 8080 100
100 Path
-4
4 4
0 20 40 60 80 100 Obstacle 1 1
Obstacle
2 24 Obstacle 2 2
Obstacle
Obstacle 1
Obstacle 3
02 Obstacle
Obstacle 2 3
0 Target
Target
Obstacle 3
-20 Starting Point
Target
-2 PathStarting Point
-2
-4 Starting
PathPoint
-4 0 20 40 60 80 100 Path
0 -4 20 40 60 80 100
4
0 20 40 60 80 100 Obstacle 1
24 Obstacle 2
Obstacle 1
Obstacle 3
02
-20
Figure 12. Trajectory planned by the improved APF method in static obstacles driving environme Obstacle 2
Target
Obstacle 3
Starting Point
Target
Path
-2
-4 Starting Point
0 20 40 60 80 100 Path
-4
4
0
Although the traditional APF method also successfully planned the trajectory, it c
20 40
Figure 12. Trajectory planned by the improved APF method in static obstacles driving environment
60 80 100
Obstacle 1
2 Obstacle 2
0 be seen that the improved APF method planned a smoother trajectory than the traditio Obstacle 3
Target
-2 Starting Point
0 20 40 60 80 100
1.5 be seen that the improved APF method planned a smoother trajectory than the traditiona
0.4
2 0.6
1 APF method by comparing Figures 11 and 12, which is also confirmed by the curvature
1.5
0.5 comparison in Figure 13. 0.2 0.4
Curvature/m-1
Curvature/m-1
1
0
0.5 0 0.2
-0.5
Curvature/m-1
Curvature/m-1
2 0.6
0
-1 1.5 -0.2 0
-0.5 0.4
1
-1.5
-1 -0.2
-0.4
0.5 0.2
-2
-1.5
Curvature/m-1
Curvature/m-1
0 -0.4
-2.5 -2 -0.6 0
0 10 20 30 40 50 60 70 80 90 100 0 10 20 30 40 50 60 70 80 90 100
-0.5
-2.5 Longitudinal displacement / m -0.6 Longitudinal displacement / m
-1 0 10 20 30 40 50 60 70 80 90 100 -0.20 10 20 30 40 50 60 70 80 90 100
-1.5
(a)
Longitudinal displacement / m (b)
Longitudinal displacement / m
0
0 sitions of dynamic obstacle vehicle 1 and dynamic obstacle vehicle 2 are (15 m, 1.75 m) Obstacle vehicle 2
Target
Target
Starting Point
-2 Starting Point
-2
-4
and (50 m, −2.5 m) respectively, the location relationships are shown in Figure 14. Path
Path
-4 0 20 40 60 80 100
0 20 40 60 80 100
4
Figure
Figure 14. Dynamic 14. Dynamic
obstacles obstacles
driving driving environment.
environment. Obstacle vehicle 1
2
0
Figure 14. Dynamic obstacles driving environment. Obstacle vehicle 2
Target
Starting Point
-2
Path
-4 Assume that
Assume that dynamic dynamic
obstacle obstacle
vehicle vehicle
1 and 1 and dynamic
dynamic obstacleobstacle
vehiclevehicle
2 are at2 are
a at a uni-
Assume that dynamic obstacle vehicle 1 and
form
0
speedand
of 5 3m/s and respectively.
3 m/s, respectively.
The
dynamic
simulation
obstacle
20
results
vehicle 2 are at a u
oftrajectory
40
trajectory planned
60 80 100
uniform
World Electr. Veh. J. 2022, 13, speed of 5REVIEW
x FOR PEER
Figure 14.m/s m/s, The simulation results of 14 of 21
formby speed ofDynamic
the traditional
obstacles
5 m/s and
and 3 m/s,driving
improved
environment.
respectively. The simulation results 15
of and
trajectory plann
planned by the traditional and improved APF APF methods
methods are are shown
shown in Figures
in Figures 15 and 16.
16.
by the traditional and improved APF methods are shown in Figures 15 and 16.
Assume that dynamic obstacle vehicle 1 and dynamic obstacle vehicle 2 are at a uni-
4
2 form speed of 5 m/s and 3 m/s, respectively. The simulation results of trajectory planned Obstacle vehicle 1
Obstacle vehicle 2
0 Target
-2
by the traditional and improved APF methods are shown in Figures 15 and 16. Starting Point
Path
-4
0 20 40 60 80 100
Figure
Figure 15. Trajectory 15. Trajectory
planned planned byAPF
by the traditional the traditional
method inAPF methodobstacles
dynamic in dynamic obstacles
driving driving environment
environment.
4
Obstacle vehicle 1
2 It can be seen from the figure that the trajectories are successfully planned by the APF Obstacle vehicle 2
Target
0
method before and after the improvement. However, as can be seen from Figure 17, the
-2
Starting Point
Path
-4
peak curvature of the trajectory planned by the improved APF method is approximately
4
0 20 40 60 80 100
Obstacle vehicle 1
half of the curvature of the trajectory planned by the traditional APF method. This means
2
0
Obstacle vehicle 2
Target
Starting Point
-2
Path
-4
0 20 40 60 80 100
4
Obstacle vehicle 1
2 Obstacle vehicle 2
0 Target
Starting Point
-2
Path
-4
0 20 40 60 80 100
Path
-4
0 20 40 60 80 100
Figure 15. Trajectory planned by the traditional APF method in dynamic obstacles driving environme
World Electr.
4 Veh. J. 2022, 13, x FOR PEER REVIEW 14 of 21
Obstacle vehicle 1
2 Obstacle vehicle 2
0 Target
World Electr. Veh. J. 2022, 13, 97
-2
14 of 21
Starting Point
Path
-4
0 4 20 40 60 80 100
Obstacle vehicle 1
4
2 Obstacle
Obstacle vehicle
vehicle 2 1
2 0 Target
Obstacle vehicle 2
Starting
TargetPoint
0 -2
Path
Starting Point
-2
-4
that the improved APF method planned the trajectory more smoothly and the vehicle is
-4
0 20 40 60 80 100
Path
0 20 40 60 80 100
4 easier to maneuver when
Figure avoiding
15. Trajectory obstacles.
planned by the traditional APF method in dynamic obstacles driving environment Obstacle vehicle 1
2 Obstacle vehicle 2
0 Target
4 Starting Point
-2 Obstacle
Path vehicle 1
2 Obstacle vehicle 2
-4
0 0 20 40 60 80 100 Target
Starting Point
-2
Path
-4
0 Figure 16. Trajectory planned by the improved APF method in dynamic obstacles driving environme
20 40 60 80 100
4
Obstacle vehicle 1
2 Obstacle vehicle 2
0 Target
-2 It can be seen from the figure that the trajectories are successfully planned by the AP Starting Point
Path
-4
4
method before and after the improvement. However, as can be seen from Figure 17, t
0 20 40 60 80 100
Obstacle vehicle 1
2
0
peak curvature of the trajectory planned by the improved APF method is approximate Obstacle vehicle 2
Target
Starting Point
-2
-4
half of the curvature of the trajectory planned by the traditional APF method. This mea Path
0 20 40 60 80 100
that the improved APF method planned the trajectory more smoothly and the vehicle
easierFigure
Figure 16. Trajectory 16. Trajectory
toplanned
maneuverby the planned byAPF
improved
when the improved
avoiding method inAPF
obstacles. method
dynamic in dynamic
obstacles obstacles
driving driving environment
environment.
0.7
It can be seen from the figure
0.35
that the trajectories are successfully planned by the APF
0.6
method before and after the improvement.
0.3
However, as can be seen from Figure 17, the
peak curvature of the trajectory planned by the improved APF method is approximately
0.5 0.25
half of the curvature of the trajectory planned by the traditional APF method. This means
0.4 0.2
that the improved APF method planned the trajectory more smoothly and the vehicle is
Curvature/m-1
Curvature/m-1
0.3 0.15
easier to maneuver when avoiding obstacles.
0.2 0.1
0 0.6 0 0.3
0.5
-0.1 -0.05 0.25
0.4 0.2
-0.2 -0.1
Curvature/m-1
Curvature/m-1
0 10 20 30 40 50 60 70 80 90 100 0 10 20 30 40 50 60 70 80 90 100
0.3 0.15
Longitudinal displacement / m Longitudinal displacement / m
0.2 0.1
(a) (b)
0.1 0.05
improved-0.2 improved
0APF.
10 20 30
APF.
40 50 60 70 80 90 100
-0.1
0 10 20 30 40 50 60 70 80 90 100
Longitudinal displacement / m Longitudinal displacement / m
(a) (a)
(a)
(b)
Figure 18.(b)
Comparison of planned trajectory and actual trajectory for expected vehicle speed of 10
Figure 18. Comparison of planned trajectory and actual trajectory for expected vehicle speed of
m/s in static obstacles driving environment. (a) Planned trajectory by traditional APF and actual
10 m/s18.
Figure inComparison
static obstacles driving
of planned
trajectory environment.
trajectory
of vehicle; (a)
and actual
(b) planned Planned trajectory
trajectory
trajectory byand
for expected
by improved APF traditional
vehicle APFofof
speed
actual trajectory and actual
10vehicle.
m/s in staticofobstacles
trajectory driving
vehicle; (b) environment.
planned trajectory(a) (b)
byPlanned trajectory
improved APF and by actual
traditional APF and
trajectory actual
of vehicle.
trajectory of vehicle; Figure
(b) planned trajectory by improved APF and
18. Comparison of planned trajectory andactual
actualtrajectory
trajectoryof
forvehicle.
expected vehicle speed of 10
m/s in static obstacles driving environment. (a) Planned trajectory by traditional APF and actual
trajectory of vehicle; (b) planned trajectory by improved APF and actual trajectory of vehicle.
Euclidean error / m
Euclidean error / m
Euclidean error / m
Figure 19. Euclidean errors of trajectories planned for expected vehicle speed of 10 m/s in static
obstacles driving environment.
Figure
Figure19. Euclidean
19.Euclidean errors
errors of of trajectories
trajectories planned
planned for expected
for expected vehicle
vehicle speedspeed of 10
of 10 m/s inm/s
staticin static
obstacles driving environment.
obstacles driving environment.
Figure 19. Euclidean errors of trajectories planned for expected vehicle speed of 10 m/s in static
obstacles driving environment.
Figure 20. Steering wheel angles for expected vehicle speed of 10 m/s in static obstacles driving
environment.
Figure 20. Steering wheel angles for expected vehicle speed of 10 m/s in static obstacles driving
environment.
environment.
Figure 21 compared the planned trajectory and the actual trajectory for expected ve-
Figure 21 compared the planned trajectory and the actual trajectory for expected ve-
hicle speed of 15 m/s. The Euclidean errors of the planned trajectory and the actual trajec-
hicle speed of 15 m/s. The Euclidean errors of the planned trajectory and the actual trajec-
tory for expected vehicle speed of 15 m/s are shown in Figure 22. The variation curves of
World Electr. Veh. J. 2022, 13, 97 tory for expected vehicle speed of 15 m/s are shown in Figure 22. The variation curves16 ofof
21
steering wheel angle for expected vehicle speed of 15 m/s in static obstacles driving envi-
steering wheel angle for expected vehicle speed of 15 m/s in static obstacles driving envi-
ronment are shown in Figure 23.
ronment are shown in Figure 23.
(a)
(a)
(b)
(b)
Figure Figure
21. Comparison of planned
21. Comparison trajectory
of planned and actual
trajectory andtrajectory for expected
actual trajectory vehicle speed
for expected of 15
vehicle speed of
m/s in Figure
static 21. Comparison
obstacles driving ofenvironment.
planned trajectory
(a) and actual
Planned trajectory
trajectory by for expected
traditional APF vehicle
and speed of 15
actual
15 m/s in static obstacles driving environment. (a) Planned trajectory by traditional APF and actual
m/sofinvehicle;
trajectory static obstacles driving
(b) planned environment.
trajectory (a) Planned
by improved APF and trajectory
actual by traditional APF and actual
trajectory of vehicle; (b) planned trajectory by improved APF and trajectory of vehicle.
actual trajectory of vehicle.
trajectory of vehicle; (b) planned trajectory by improved APF and actual trajectory of vehicle.
1.4
1.4 Traditional APF
Improved APFTraditional APF
1.2 Improved APF
1.2
1
1
0.8
0.8
0.6
0.6
0.4
0.4
0.2
0.2
0
0 0 1.25 2.5 3.75 5 6.25 7.5
0 1.25 2.5
Time / s 3.75 5 6.25 7.5
Time / s
Figure 22. Euclidean errors of trajectories planned for expected vehicle speed of 15 m/s in static
obstacles driving environment.
Figure 23. Steering wheel angles for expected vehicle speed of 15 m/s in static obstacles driving
environment.
(a)
(a)
(b)
(b)
Figure 24. Comparison of planned trajectory and actual trajectory for expected vehicle speed of 10
m/s in dynamic obstacles driving environment. (a) Planned trajectory by traditional APF and actual
trajectory of vehicle; (b) planned trajectory by improved APF and actual trajectory of vehicle.
Figure 25. Euclidean errors of trajectories planned for expected vehicle speed of 10 m/s in dynamic
Figure 25. Euclidean errors of trajectories planned for expected vehicle speed of 10 m/s in dynamic
obstacles driving environment.
obstacles driving environment.
Figure 25. Euclidean errors of trajectories planned for expected vehicle speed of 10 m/s in dynamic
World Electr. Veh. J. 2022, 13, 97 obstacles driving environment. 18 of 21
Figure 25. Euclidean errors of trajectories planned for expected vehicle speed of 10 m/s in dynamic
obstacles driving environment.
Figure 26. Steering wheel angles for expected vehicle speed of 10 m/s in dynamic obstacles driving
Figure 26. Steering Figure
environment. wheel26. Steering
angles wheel angles
for expected for expected
vehicle vehicle
speed of 10 m/sspeed of 10 m/s obstacles
in dynamic in dynamicdriving
obstacles driving
environment.
environment.
Figure 27 compared the27planned
Figure compared trajectory andtrajectory
the planned the actualandtrajectory
the actualfor expected
trajectory ve-
for expected ve-
Figure 27 compared
hicle speed of 15 m/s. the planned trajectory and the actual trajectory for expected
hicle The
speedEuclidean
of 15 m/s. errors of the planned
The Euclidean errors of trajectory
the plannedand the actual
trajectory trajec-
and the actual trajec-
vehicle
tory for speed of tory
expected 15 m/s.
vehicle The Euclidean
speed
for expected ofvehicle
15 m/sspeederrors
are of m/s
shown
of 15 the planned
inare
Figure
shown28.trajectory
inThe andThethe
variation
Figure 28. actual
curves ofcurves of
variation
trajectory for expected
steering wheel angle vehicle
for wheel
steering speed
expectedangle of 15
vehicle m/s are shown
speedvehicle
for expected of 15 m/sin Figure
speed 28.
inofdynamic The variation
15 m/s inobstacles curves
dynamic driving
obstacles driving
of steering wheel
environment angle for
in expected
are environment
shown 29.vehicle
are shown
Figure speed
in Figure 29.of 15 m/s in dynamic obstacles driving
environment are shown in Figure 29.
(a)
(b)
Figure
Figure 27. Comparisonof
27. Comparison ofplanned
plannedtrajectory
trajectoryand
andactual
actualtrajectory
trajectory
forfor expected
expected vehicle
vehicle speed
speed of
of 15
15 m/s in dynamic obstacles driving environment. (a) Planned trajectory by traditional
m/s in dynamic obstacles driving environment. (a) Planned trajectory by traditional APF and actual APF and
actual trajectory
trajectory of vehicle;
of vehicle; (b) planned
(b) planned trajectory
trajectory by improved
by improved APFactual
APF and and actual trajectory
trajectory of vehicle.
of vehicle.
As can be seen in figure about Euclidean errors of trajectories planned, by using the
same Carsim tracking model, the tracking Euclidean error of the trajectory planned by the
improved APF is smaller, which indicates that the trajectory planned by the improved APF
method is easier to be tracked. Due to the better tracked trajectory obtained, the steering
wheel angle of the vehicle is smaller when tracking the trajectory planned by the improved
APF. It indicates that the intelligent vehicle is easier to be maneuvered.
(b)
due to the inertia of the vehicle, which may directly cause the vehicle to have a lateral
collision with the obstacle and lead to the failure of the path planning. In this paper,
under the assumption of uniform vehicle motion, the vehicle trajectory planning
under high-speed motion is not considered.
2. The APF model in this paper does not consider the differences of obstacle avoidance
trajectories of different vehicle types in the actual road environment, and only consid-
ers the obstacle avoidance scenarios of flat and straight roads, which is a relatively
single scene.
In view of the above deficiencies, the subsequent research will keep improve the APF
model and enhance the adaptability of the model. Hence, future work should be devoted to
establishing the APF model under high-speed motion. In addition, an avenue for our future
work would be to research the interaction between the subject vehicle and the obstacle
vehicle with different parameters in the obstacle avoidance process.
Author Contributions: Conceptualization, J.T.; methodology, J.T.; software, J.T.; validation, J.T.;
formal analysis, B.L. and S.B.; investigation, J.T.; resources, J.T., B.L. and S.B.; data curation, J.T.;
writing—original draft preparation, J.T., H.H. and Z.Q.; writing—review and editing, J.T., S.B., B.L.,
D.Z., X.Z. and H.T.; visualization, J.T.; supervision, B.L. and S.B.; project administration, B.L. and S.B.;
funding acquisition, not applicable. All authors have read and agreed to the published version of
the manuscript.
Funding: This research was funded by the Natural Science Foundation of the Jiangsu Higher Educa-
tion of China under grant number 21KJA580001, the National Natural Science Foundation of China
under grant number 52172367, and the National Natural Science Foundation of China under grant
number 52105260. The APC was funded by 52172367.
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. Zhang, Y.; Xu, K.; Zheng, C.; Feng, W.; Xu, G. Advanced research on information perception technologies of intelligent electric
vehicles. Chin. J. Sci. Instrum. 2017, 38, 794–805.
2. LaValle, S.M. Planning Algorithms; Cambridge University Press: Cambridge, UK, 2006; pp. 64–76.
3. Bao, Q.; Li, S.; Shen, Z.; Men, X. Survey of local path planning of autonomous mobile robot. Transducer Microsyst. Technol. 2009,
28, 1–4.
4. Ma, R.; Guan, Z. Summarization for Present Situation and Future Development of Path Planning Technology. Mod. Mach. 2008, 3,
22–24.
5. González, D.; Pérez, J.; Milanés, V.; Nashashibi, F. A review of motion planning techniques for automated vehicles. IEEE Trans.
Intell. Transp. Syst. 2015, 17, 1135–1145. [CrossRef]
6. Yu, H.; Li, X. Fast Path Planning Based on Grid Model of Robot. Microelectron. Comput. 2005, 6, 98–100.
7. Ouyang, X.; Yang, S. Obstacle Avoidance Path Planning of Mobile Robots Based on Potential Grid Method. Control Eng. China
2014, 21, 134–137.
8. Dijkstra, E.W. A note on two problems in connexion with graphs. Numer. Math. 1959, 1, 269–271. [CrossRef]
9. Wang, D. Indoor mobile-robot path planning based on an improved A*algorithm. J. Tsinghua Univ. (Sci. Technol.) 2012, 52,
1085–1089.
10. Zhao, X.; Wang, Z.; Huang, C.; Zhao, Y. Mobile Robot Path Planning Based on an Improved A* Algorithm. Robot 2018, 40, 903–910.
11. Chen, Q.; Jiang, H.; Zheng, Y. Summary of Rapidly-Exploring Random Tree Algorithm in Robot Path Planning. Comput. Eng.
Appl. 2019, 55, 10–17.
12. Lindqvist, B.; Agha-Mohammadi, A.A.; Nikolakopoulos, G. Exploration-rrt: A multi-objective path planning and exploration
framework for unknown and unstructured environments. arXiv 2021, arXiv:2104.03724.
13. LaValle, S.M.; Kuffner, J.J., Jr. Randomized kinodynamic planning. Int. J. Robot. Res. 2001, 20, 378–400. [CrossRef]
14. Vega-Brown, W.; Roy, N. Asymptotically optimal planning under piecewise-analytic constraints. In Algorithmic Foundations of
Robotics XII; Springer: Berlin/Heidelberg, Germany, 2020; pp. 528–543.
15. Nakrani, N.M.; Joshi, M.M. A human-like decision intelligence for obstacle avoidance in autonomous vehicle parking. Appl. Intell.
2022, 52, 3728–3747. [CrossRef]
World Electr. Veh. J. 2022, 13, 97 21 of 21
16. Chen, Y.; Liang, J.; Wang, Y.; Pan, Q.; Tan, J.; Mao, J. Autonomous mobile robot path planning in unknown dynamic environments
using neural dynamics. Soft Comput. 2020, 1420, 289–299. [CrossRef]
17. Jafari, M.; Xu, H.; Carrillo, L.R.G. Brain emotional learning-based path planning and intelligent control co-design for unmanned
aerial vehicle in presence of system uncertainties and dynamic environment. In Proceedings of the 2018 IEEE Symposium Series
on Computational Intelligence (SSCI), Bangalore, India, 18–21 November 2018; pp. 1435–1440.
18. Li, L.; Gan, J.; Qu, X.; Mao, P.; Ran, B. Car-following Model Based on Safety Potential Field Theory Under Connected and
Automated Vehicle Environment. China J. Highw. Transp. 2019, 32, 76–87.
19. Khatib, O. Real-time obstacle avoidance for manipulators and mobile robots. In Autonomous Robot Vehicles; Springer: New York,
NY, USA, 1986; pp. 396–404.
20. Choe, T.S.; Jin, W.H.; Chae, J.S.; Park, Y.W. Real-time collision avoidance method for unmanned ground vehicle. In Proceedings of
the International Conference on Control, Honolulu, HI, USA, 8–11 July 2008.
21. Huang, Y.; Ding, H.; Zhang, Y.; Wang, H.; Cao, D.; Xu, N.; Hu, C. A motion planning and tracking framework for autonomous
vehicles based on artificial potential field-elaborated resistance network (apfe-rn) approach. IEEE Trans. Ind. Electron. 2019, 67,
1376–1386. [CrossRef]
22. Fan, S.; Zhang, H. Research on Local Path Planning of Vehicles Active Obstacle Avoidance Based on Improved Artificial Potential
Field Method. J. Qingdao Univ. (Eng. Technol. Ed.) 2022, 37, 50–57.
23. Li, E.; Wang, Y. Research on Obstacle Avoidance Trajectory of Mobile Robot Based on lmproved Artificial Potential Field. Comput.
Eng. Appl. 2022, 58, 296–304.
24. Bounini, F.; Gingras, D.; Pollart, H.; Gruyer, D. Modified Artificial Potential Field Method for Online Path Planning Applications.
In Proceedings of the Intelligent Vehicles Symposium, Los Angeles, CA, USA, 11–14 June 2017.
25. Cummings, M.L.M.; Marquez, J.J.; Roy, N.G.D. Human-automated path planning optimization and decision support. Int. J.
Hum.-Comput. Stud. 2012, 70, 116–128. [CrossRef]
26. Luo, D.; Wu, S. Ant colony optimization with potential field heuristic for robot path planning. Syst. Eng. Electron. 2010, 32,
1277–1280.
27. Cheng, Z. Robot Path Planning Based on Artificial Potential Field Method. Master Thesis, Yanshan University, Hebei, China, 2016.
28. Zhu, W. Research on Path Planning and Obstacle Avoidance Method for Vehicle Based on Improved Artificial Potential Field.
Master’s Thesis, Jiangsu University, Jiangsu, China, 2017.
29. Osman, K.; Ghommam, J.; Mehrjerdi, H.; Saad, M. Vision-based curved lane keeping control for intelligent vehicle highway
system. Proceedings of the Institution of Mechanical Engineers Part I. J. Syst. Control Eng. 2018, 233, 961–979.