Next Article in Journal
Reliability of Trapezius Muscle Hardness Measurement: A Comparison between Portable Muscle Hardness Meter and Ultrasound Strain Elastography
Next Article in Special Issue
Multi-Task End-to-End Self-Driving Architecture for CAV Platoons
Previous Article in Journal
Near-Field to Far-Field RCS Prediction on Arbitrary Scanning Surfaces Based on Spherical Wave Expansion
Previous Article in Special Issue
A Novel Path Planning Algorithm for Truck Platooning Using V2V Communication
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

Hybrid Path Planning Combining Potential Field with Sigmoid Curve for Autonomous Driving

1
National Engineering Laboratory for Electric Vehicles, Beijing Institute of Technology, Beijing 100081, China
2
Department of Mechanical and Mechatronics Engineering, Waterloo University, Waterloo, ON N2L 3G1, Canada
3
Tsinghua Intelligent Vehicle Design and Safety Research Institute, Tsinghua University, Beijing 100084, China
4
College of Mechatronics and Control Engineering, Shenzhen University, Shenzhen 518060, China
*
Author to whom correspondence should be addressed.
Sensors 2020, 20(24), 7197; https://doi.org/10.3390/s20247197
Submission received: 10 November 2020 / Revised: 1 December 2020 / Accepted: 8 December 2020 / Published: 16 December 2020
(This article belongs to the Special Issue Advanced Sensing and Control for Connected and Automated Vehicles)

Abstract

:
The traditional potential field-based path planning is likely to generate unexpected path by strictly following the minimum potential field, especially in the driving scenarios with multiple obstacles closely distributed. A hybrid path planning is proposed to avoid the unsatisfying path generation and to improve the performance of autonomous driving by combining the potential field with the sigmoid curve. The repulsive and attractive potential fields are redesigned by considering the safety and the feasibility. Based on the objective of the shortest path generation, the optimized trajectory is obtained to improve the vehicle stability and driving safety by considering the constraints of collision avoidance and vehicle dynamics. The effectiveness is examined by simulations in multiobstacle dynamic and static scenarios. The simulation results indicate that the proposed method shows better performance on vehicle stability and ride comfortability than that of the traditional potential field-based method in all the examined scenarios during the autonomous driving.

1. Introduction

Path planning as an essential part of the autonomous driving has been widely researched in recent years. The path planning layer of autonomous vehicles (AVs) can be classified into the global and local path planners according to the planning horizon [1,2]. The global path planners are mainly focused on the navigation with the optimal economic, the least congestion and the highest average speed by considering the entire configurable space from the start point to the target point [3]. Different from the global path planners, local path planners usually pay more attention to the improvements on the driving safety and the vehicle stability in the process of dynamic obstacle avoidance by considering the constraints of kinematics and dynamics, during autonomous driving [4].
Many planning algorithms of AVs are inherited from wheeled-robotics principles because of their similarities in structure and control. In the wheeled robotics community, path planning methodologies can be classified into four groups, including graph search-based, sampling-based, interpolation-based and numerical optimization-based [5]. The idea behind graph search-based methods is to construct a configurable state-space based on graph theory and then use different search strategies (e.g., Voronoi diagrams [6], the Dijkstras algorithm [7], the A * algorithm [8] or the State Lattice algorithm [9]) to generate a discrete route with grid or lattice occupancy. Being different from graph search-based methods, sampling-based methods can be further categorized into stochastic sampling and deterministic sampling depending on the sampling space used. Deterministic sampling-based methods [10] require less computation cost than the stochastic sampling-based methods [11], as they sample in a semistructured space instead of an entire configuration action-space or state-space. There are some common features between graph-based and sampling-based methods. For example, the paths generated from both methods are connected by a series of discrete waypoints [12], and these paths need further smoothing for practical application in AVs or wheeled-robotics. Since continuous curvature is a necessary requirement of drivable paths, interpolation-based path planning methods have been developed to generate smooth and continuous-curvature routes based on different curve models, such as spline curves model [13], clothoid curve model [14], etc.
The feasible solutions of satisfying the smooth and drivable constraints are usually not unique. Thus, numerical optimization-based path planning methods are developed to obtain the optimal route based on designing an objective function [15], e.g., the shortest-distance, the highest-efficiency, the shortest-time, etc. A potential field-based path planning method (PFBM), as a typical numerical optimization approach, was proposed by establishing the attractive potential field (PF) around a target point and the repulsive potential fields around obstacles to realize the obstacle avoidance of a robot in [16]. A composite PF is established with the constructed repulsive and attractive PFs, to automatically guide a robot to the destination by searching the gradient descent direction. Up to now, the PFBM has been applied both in structured [17,18] and unstructured [19] environments for AV path planning. Traditional PFBMs are usually based on a known target point and span the entire discrete space, which makes them reasonable and efficient for robotics control in indoor or simple environments. However, these requirements are difficult to accurately determine for autonomous driving in practical road environments. Furthermore, there is no qualitative assessment of the reasonability of the paths generated using PFBM, especially in driving scenarios with multiple obstacles. Besides, the planned paths are very sensitive to the configuration of the parameters [16]. For example, if the parameters of the PF functions are inappropriately configured or the obstacles are located with short distances, the route generated using PFBM is likely to fall into local minima, resulting in rough and unexpected routes.
To address the above mentioned problems, in this paper we propose a hybrid potential field sigmoid curve method (HPFSM) as shown in Figure 1, which aims to optimize the planned path of PFBM and to achieve an expected collision-free trajectory to improve the performance of autonomous driving. Firstly, the PF functions are designed based on the geometric shape, relative position and distance, etc. Then, the potential fields are established for the obstacles, the target lane and the road boundaries according to the defined PF functions, respectively. A collision-free route with the minimum PF can be achieved by fusing the established PFs. A constrained nonlinear optimization problem is constructed based on the collision-free path and the sigmoid curves. Finally, an optimal path of satisfying the constraints of collision avoidance and vehicle dynamics can be achieved by solving with the interior point algorithm. The main contributions of this study include:
(1)
A novel hybrid path planning method is proposed to get better collision-free path for improvements on vehicle stability and ride comfort during autonomous driving by combining potential field with sigmoid curve.
(2)
Based on the distribution function of two-dimensional joint probability density, an improved potential field of the obstacle is designed to mimic more realistic distribution of collision risk by decoupling the PF in longitudinal and lateral directions.
(3)
With the designed objective of the shortest path generation, the trajectory is optimized to improve the vehicle stability and the ride comfort during autonomous driving by considering the constraints of collision avoidance and vehicle dynamics.
This paper is organized as follows: Section 2 designs a potential field-based path planning and shows how PFBM can generate unexpected paths. Section 3 introduces the proposed HPFSM. Section 4 presents the validation and evaluation results by comparing the proposed method with PFBM both in the static and dynamic driving scenarios. Finally, Section 5 presents our conclusions.

2. An Improved Potential Field-Based Path Planning

Because of the good collision-free performance, PFBM has been widely used as a path planning approach for AVs [20]. The path planning process of PFBM can be mainly divided into two parts, namely, the part for designing PF functions and the collision-free route generation part for obstacle avoidance.

2.1. The Design of PF Functions

The PF is affected by obstacle properties including the obstacle’s physical characteristics (e.g., geometric shape and structure), and its dangerous degree is affected by the mass and motion state of the obstacle [21,22].

2.1.1. Road PFs

Road PFs include the PF of road boundary and the PF of target lane. Since the potential field-based path planning is likely to fall into the local minima, especially in an unknown environment [23]. To avoid the local minima problem in our proposed path planning method, both the driving environment and the obstacles (vehicles) are assumed to be known, thus the potential fields can be designed and established more appropriately. In real intelligent transportation systems, these information can be obtained via the vehicle-to-vehicle and vehicle-to-infrastructure technologies [24]. Besides, we design the attractive potential field with the center line of the target lane to attract the ego vehicle driving to the target lane instead of with only one target point [25,26], which will reduce the chance to trap into the local minima by solving a series of optimization subproblems. In this study, the attractive PF is defined as:
U TrgL = a Y Y TrgL 2 .
The road boundary is designed as a repulsive PF in Equation (2), which is used for preventing the ego vehicle driving out of the road.
U RBd = b Y Y Br 2 Y Y Br b Y Bl Y 2 Y Y Bl 0 Y Y Br , Y Bl ,
where a , b R , Y Br < Y Bl and Y TrgL Y Br , Y Bl ; a and b respectively denote the shape coefficients of the target-lane PF and the road-boundary PF, which are used to adjust the amplitude of PF; Y denotes the lateral position of the ego vehicle; Y TrgL denotes the lateral position of the center line of the target lane; Y Bl and Y Br denote the lateral positions of the left and right road boundaries, respectively.
Two examples of the successful applications without the local minima problem are shown in Figure 2. In the situation without obstacle vehicles, Figure 2a shows that the ego vehicle will always drive along the path (the central line of the target lane) with the minimum potential field when using our proposed method. In the situation with an obstacle vehicle in the target lane, Figure 2b shows that the planned path with minimum PF will lead the ego vehicle to overtake the obstacle vehicle and then drive back to the target lane.

2.1.2. Obstacle Potential Field

The obstacle potential field (OPF) function is defined to construct the repulsive PF according to the longitudinal and lateral safe distances. The calculations of the safe distances are based on the relative speed (between the ego vehicle and the obstacle) and the maximum longitudinal/lateral deceleration of the ego vehicle [12], which means the velocities of the ego vehicle and the obstacle are required. The longitudinal and lateral safe distances ( X s ( t ) , Y s ( t ) ) are calculated as:
X s ( t ) = X o 2 + V x ( t ) V obs , x ( t ) 2 2 a x , max ( t ) Y s ( t ) = Y o 2 + V y ( t ) V obs , y ( t ) 2 2 a y , max ( t ) ,
where a x , max ( t ) 0 and a y , max ( t ) 0 are the maximum longitudinal and lateral decelerations of the ego vehicle; X o and Y o are the length and width of the obstacle, respectively; V obs , x ( t ) and V obs , y ( t ) represent the longitudinal and lateral velocities of the obstacle, respectively; V x ( t ) and V y ( t ) are the longitudinal and lateral velocities of the ego vehicle, respectively.
The OPF can be decomposed along the longitudinal and lateral directions of the road coordinate system, and the definition domains of the two directions are usually independent and different [18]. Considering the above characteristics, a two-dimensional (2D) joint probability density distribution function is used as the basic function to define the OPF as:
U OPF , μ , Σ = a sta 2 π Σ e 1 2 μ T Σ 1 μ ,
where
μ = X obs ( t ) , Y obs ( t ) T , Σ = X s 2 ( t ) 0 0 Y s 2 ( t ) , = X ( t ) , Y ( t ) T ,
where μ and Σ denote the mean and covariance matrix; X obs ( t ) , Y obs ( t ) and X ( t ) , Y ( t ) denote the positions of the obstacle and the ego vehicle at time t, respectively; a sta R is the shape coefficient used to adjust the amplitude of OPF; X s ( t ) and Y s ( t ) are the calculated safe distances along the longitudinal and lateral directions of the road coordinate system at time t, respectively. Figure 3 is shown to illustrate that the OPF is adaptive to the safe distance, i.e., the OPF will vary with the velocities of the ego vehicle and the obstacles.

2.2. Collision-Free Path Generation

The idea behind PFBM is to generate a collision-free path occupied the minimum PF along the driving direction. The related attractive and repulsive PFs can be constructed and integrated according to the parameters described in Table 1.
The fused PF is shown in Figure 4. Based on this, the minimum PF path is obtained along the longitudinal direction of the road coordinate (X direction). Obviously, the generated collision-free path (the blue trajectory) is optimal subject to the defined PFs.
However, the path obtained using PFBM is not always smooth and expected, especially in these driving scenarios with multiple closely distributed obstacles. The blue path in Figure 5 shows the trajectory planned using PFBM [27] in a driving scenario with two closely distributed obstacles. Although the planned path is collision-free, it involves undesired driving maneuvering, which will affect the efficiency of obstacle avoidance and the tracking performance. An expected trajectory to mimic the real driver (e.g., the red route) is required for AV path planning to ensure the efficiency of the obstacle avoidance and to improve tracking performance.
The unexpected maneuvers of the planned path are more evident when the number of obstacles increases, as shown in Figure 6. In practical applications, the AVs would result in frequent unnecessary steering maneuvers when tracking this unexpected path. The planned paths in Figure 5 and Figure 6 indicate that the PFBMs are disadvantaged to be applied in the driving scenarios with multiple closely distributed obstacles. Therefore, a novel hybrid path planning method is proposed, which combines PFs with sigmoid curves to solve the problem of generating unexpected trajectory.

3. A Hybrid Path Planning Method

Based on the deterministic curve models, e.g., splines [28], clothoid curves [14], and polynomials [29], etc, the smooth candidate routes can be generated quickly and efficiently. However, it is difficult to shape desiring driving trajectory using the B-spline, C-spline, clothoid and even quintic polynomial models because of the strong coupling relationship among the tunable parameters. Considering the tunable feature of the parameters in the sigmoid curve model [30], which the amplitude, slope, and central symmetry point of the sigmoid curve can be adjusted independently. Therefore, a hybrid path planning method is proposed by combining the PFBM with sigmoid curves to obtain a smooth collision-free and efficient expected route.

3.1. Definition of the Sigmoid Curve

The process of obstacle avoidance is similar to that of vehicle lane change. The trajectory is tangent to the center lines of the related lanes at the start and end points according to the standard lane change path [31]. In this paper, the sigmoid function is introduced as an essential function for generating obstacle avoidance paths. The definition is presented in Equation (5):
f sig ( x ) = P b · s i g m o i d x , P c , P a s i g m o i d x , P c , P a = 1 1 + e P a x P c ,
where P a , P b and P c are the related parameters to shape the sigmoid curve. The parameter P a represents the maximum slope, P b is the amplitude coefficient, P c denotes the centrosymmetric point and the point of maximum slope. These parameters can be used to determine a sigmoid curve uniquely.

3.2. Tunable Features of the Sigmoid Curve

Figure 7 shows the tunable features of the sigmoid curve including the maximum slop, the amplitude and the central point. Figure 7a shows that the centrosymmetric point can be adjusted independently using the parameter of P c , which can be used to move the sigmoid curve in longitudinal direction. Figure 7b shows that the amplitude can be adjusted using the parameter of P b , which can be applied to compress or stretch the sigmoid curve in the lateral direction. Furthermore, Figure 7c indicates that the maximum slope is also independently tunable using the parameter of P a , which can be used to adjust the maximum slope of the sigmoid curve at the centrosymmetric point.

3.3. Configuration of the Sigmoid Curve

3.3.1. Collision-Free Path Generation of PFBM

The potential fields are integrated according to Equation (6):
U PF ( t ) = U TargL ( t ) + U RBd ( t ) + U OPF ( t ) ,
where U PF ( t ) is the integrated PF, U TargL ( t ) , U RBd ( t ) and U OPF ( t ) are the corresponding target lane PF, the road boundary PF and the obstacle PF at time t, respectively.
The PFBM collision-free path is obtained through Equation (7):
X min , Y min = min x min ( t ) , y min ( t ) U PF ( t ) ,
where X min , Y min represent the collision-free path with the minimum PF along the longitudinal direction.
The corresponding lateral positions of the obstacles mapping to the collision-free path are obtained by interpolation through Equation (8):
: x obs j x i , x i + 1 , j M : y obs j = i n t e r p 1 X min , Y min , x obs j y obs j = y i + 1 y i x i + 1 x i x obs j x i + y i ,
where x i , y i X min , Y min and x i + 1 , y i + 1 X min , Y min are two known waypoints in the collision-free path; i n t e r p 1 denotes the one-dimensional linear interpolation function for calculating the corresponding lateral coordinates to the collision-free path; i and j denote the index of the waypoints and the index of the obstacles, respectively; M is the amount of the obstacle; x obs j and y obs j are the longitudinal and lateral coordinates corresponding to the PFBM path, respectively.
The planned collision-free path is composed of several sigmoid curves, and the definition domains are varying with the positions of obstacles. The definition domains of the sigmoid curves are determined using Equation (9):
Ω x , i = [ x start , x obs i ] i = 1 x obs i 1 , x obs i i ( 1 , n ) x obs i 1 , x end i = n ,
where Ω x , i denotes the definition domain of the ith sigmoid curve, x start and x end indicate the start and end points of the planning horizon, n = M + 1 represents the amount of sigmoid curves. Considering the detection ranges of on-board sensors [32], the planning horizon is limited to 200 m.

3.3.2. Parameter Configuration

Some key way-points of the collision-free path can be obtained using Equations (7) and (8). Since the amplitude of sigmoid curve is related to the lateral coordinates of the target lane ( Y TrgL ) and the key waypoints ( y obs ) , the amplitude of the curve is determined in Equation (10):
P b , i = y obs i Y TrgL i = 1 y obs i y obs i 1 i ( 1 , n ) Y TrgL y obs i 1 i = n .
The slope parameter can be determined using Equation (11):
P a , i = k 1 , i · s i g n P b , i ,
where k 1 , i denotes the maximum slope at the centrosymmetric point and s i g n is the sign function.
The centrosymmetric point of the sigmoid curve is defined in Equation (12):
P c , i = x obs i k 2 , i X s i = 1 x obs i 1 + k 2 , i x obs i x obs i 1 2 i ( 1 , n ) x obs i 1 + k 2 , i X s i = n ,
where k 2 , i 1 is a tunable coefficient.
When the above three parameters and the bias have been obtained in the definition domain Ω x , i , the sigmoid curve can be determined uniquely using Equation (13):
f s i g , i = P b , i · s i g m o i d ( x , P c , i , P a , i ) + b i ,
x Ω x , i , b i = Y TrgL i = 1 y obs i 1 i 1 ,
where f s i g , i denotes the ith sigmoid curve function, b i is the corresponding bias. Figure 8 shows the parameters that shape the sigmoid curve in detail.

3.4. Trajectory Optimization with Sigmoid Curves

Since the coefficients of k 1 , i and k 2 , i are not determined yet, a series of sigmoid curves can be generated by the above configurations. An optimization objective function is designed to obtain the shortest path subject to the constraints of the lateral acceleration and the yaw rate to ensure collision avoidance and to improve the vehicle stability of the autonomous driving. The distance of sigmoid curve is calculated according to Equation (14):
S s i g , i = x start i x end i 1 + f ˙ s i g , i 2 ( x ) d x .

3.4.1. Collision Avoidance Constraint

The planned path generated by PFBM is collision-free, which can be used as the constraints of collision avoidance to assist configuring the collision-free sigmoid curves. The collision-free feature can be determined if the sigmoid curves are always farther to the obstacle than that of the collision-free path of PFBM. As Figure 9a indicates, the collision feature cannot be deduced directly and an additional check is required. Therefore, the constraints of collision avoidance should be considered to ensure the collision-free feature of the candidate sigmoid curves.
Instead of combining the geometric information of obstacles [33], the collision avoidance can be ensured by comparing the lateral positions of the candidate paths to that of the PFBM. As illustrated in Figure 9b, collision avoidance is ensured when the red line is completely above the blue line under this situation.
The constraints to ensure collision avoidance based on the path of PFBM are shown in Equation (15):
K I n e q , i C o n s ( 1 ) : = f s i g , i x i Y min , y obs i Y obs f s i g , i x i Y min , y obs i < Y obs ,
where x i Ω x , i denotes the longitudinal range of the road, and K I n e q , i C o n s denotes the inequality constraints of k 1 , i and k 2 , i .

3.4.2. The Constraints of Vehicle Dynamics

The constraints of vehicle dynamics should also be considered in path planning module to improve the vehicle stability [34,35] during path tracking. The vehicle stability and ride comfort can be well evaluated based on the lateral acceleration and yaw rate during the path tracking. Assuming that the target velocity is invariant during path tracking, the yaw rate is considered as shown in Equation (16):
ω v , i = ρ i V | ω v , i | ω s ,
where ω v , i (rad/s) is the yaw rate of the ith curve at a speed of V (m/s), ρ i is the curvature of the ith curve and ω s (rad/s) denotes the yaw rate constraint to ensure path tracking stability.
The lateral acceleration is considered as follows in Equation (17):
a y , i = V c o s θ i ω v , i | a y , i ) | a s ,
where V (m/s) denotes the target speed for path tracking, a s (m/s 2 ) denotes the constraints of lateral acceleration in path planning module, a y , i is the lateral acceleration of the ith curve.
The constraints of vehicle dynamics can be transformed into a constraint of path curvature in Equation (18):
K I n e q , i C o n s ( 2 ) : = ρ i = | f ¨ s i g , i ( x ) | 1 + f ˙ s i g , i ( x ) 2 3 / 2 | ρ i | ρ cos ρ cos = m i n ( a s V 2 , w s V ) ,
where ρ cos denotes the curvature constraint of planned path considering the ride comfort and vehicle stability in path planning module.

3.4.3. Geometric Constraints

The geometric constraints include amplitude, start point, endpoint and central symmetric point constraints. The end point constraint is defined as:
K E q , i C o n s ( 1 ) : = x i end = Ω x , i ( e n d ) y i end = i n t e r p 1 X min , Y min , x i end f s i g , i x i end = y i end 0 < f ˙ s i g , i x i end ϵ ,
where ϵ denotes the infinitesimal value, and K E q , i C o n s denotes the equality constraints of k 1 , i and k 2 , i .
The start point constraint is defined as:
K E q , i C o n s ( 2 ) : = x i start = Ω x , i ( s t a r t ) y i end f s i g , i x i start = P b , i 0 < f ˙ s i g , i x i start ϵ .
The constraint of the centrosymmetric point P c , i is defined as:
K I n e q , i C o n s ( 3 ) : = x i end P c , i X s x i start < P c , i < x i end .
The inequality constraints are thus summarized as:
K Ineq i = K I n e q , i C o n s ( 1 ) , K I n e q , i C o n s ( 2 ) , K I n e q , i C o n s ( 3 ) ,
where K I n e q i refers to the inequality constraints of the ith curve, including the constraints of the collision avoidance, the constraints of the lateral acceleration, the constraints of the yaw rate and the constraints of the geometric.
The constrained nonlinear optimization problem is formulated as:
min k 1 , i , k 2 , i x start i x end i 1 + f ˙ s i g , i 2 ( x ) d x
s . t . x i end = Ω x , i ( e n d ) y i end = i n t e r p 1 X min , Y min , x i end f s i g , i x i end = y i end x i start = Ω x , i ( s t a r t ) y i end f s i g , i x i start = P b , i 0 < f ˙ s i g , i x i end ϵ 0 < f ˙ s i g , i x i start ϵ , ϵ > 0 k 1 , i , k 2 , i K Ineq i
A driving scenario with one static obstacle is proposed to analyze the planned path of HPFSM. The relevant parameters for realizing HPFSM are described in Table 2. Figure 10 shows that there are several trajectories satisfying the collision-free constraints, e.g., the blue solid and dotted curves. With a target speed of 20 m/s, the optimal trajectory among the candidate curves is the shortest trajectory (composed with the red and black curves) satisfying the constraints of vehicle dynamics, which require the yaw rate and lateral acceleration are within 25 deg/s and 2 m/s 2 , respectively.
Figure 11a shows the curvature of the optimal trajectory generated using HPFSM. It shows the curvature is continuous, which means the optimal trajectory is drivable. Figure 11b shows the yaw rate and lateral acceleration calculated under the target tracking speed of 20 m/s. It indicates that both the constraints of the lateral acceleration and the yaw rate are effectiveness during the path planning. The results of Figure 11 illustrate that the trajectory can be optimized to satisfy the constraints of vehicle dynamics with the parameters optimization of sigmoid curves.

4. Verification and Discussion

To further examine and evaluate the proposed approach, a static and a dynamic driving scenario are designed for simulation, respectively. The parked vehicles are considered as the obstacles in the static scenario, and vehicles with short intervals are introduced as the overtaking objects in the dynamic scenario.

4.1. Driving Scenarios for Simulation and Evaluation

A static scenario is with three cars parked on the roadsides as shown in Figure 12. There are two parked cars located in the target lane, while the ego vehicle is approaching to the parked car with a speed of 20 m/s. The positions of the three parked vehicles are ( X obs , 1 = 80 m, Y obs , 1 = 1.5 m ), ( X obs , 2 = 180 m, Y obs , 2 = 6.2 m) and ( X obs , 3 = 280 m, Y obs , 3 = 1.5 m), respectively. The constraints of the lateral acceleration and yaw rate are designed within 2 m/s 2 and 25 deg/s, respectively.
A dynamic overtaking scenario is designed with three leading vehicles located with short distances, as shown in Figure 13. The red dotted line denotes the target lateral position, i.e., the center line of the target lane. Three leading vehicles are driving with a constant speed ( V obs , 1 = V obs , 2 = V obs , 3 = 15 m/s) from different initial positions ( X obs , 1 = 50 m, X obs , 2 = 70 m, X obs , 3 = 85 m). The initial position and speed of the ego vehicle are set as X ego = 0 m and V ego = 15 m/s, respectively. The target speed and lateral position of the ego vehicle are set as 20 m/s and 1.75 m, respectively. Meanwhile, the constraints of yaw rate and lateral acceleration are designed within 2 m/s 2 and 25 deg/s, respectively.

4.2. Path Tracking Controller for Validation

Since the main purpose of path planning is to provide an expected reference trajectory for path tracking, it is more meaningful to evaluate the proposed path planning method with the combination of a path tracking controller. Based on these, a linear time-varying model predictive tracking controller (LTV-MPC) [20] is used to evaluate the HPFSM by comparing with PFBM. The 3-DOF bicycle model, including the longitudinal, lateral and yaw directions, is used as the prediction model of the LTV-MPC.
The dynamics equations of the 3-DOF dynamics model are presented in Equation (24):
m v ˙ x ω v y = F x cos δ m v ˙ y + ω v x = F y , r + F y , f cos δ I z ω ˙ = F y , f L f cos δ F y , r L r .
The motion equations of the vehicle are shown in Equation (25):
X ˙ = v x cos φ v y sin φ Y ˙ = v x sin φ + v y cos φ ,
where v x , v y and ω are the longitudinal velocity, lateral velocity and yaw rate of the vehicle, respectively; X, Y and φ denote the vehicle longitudinal, lateral position and the heading angle; m and F x represent the vehicle mass and longitudinal force of the front-driving tire; F y , f and F y , r denote the lateral force of front and rear tires; L f , L r and I z represent the front, rear wheelbase and the vehicle inertia around vertical axis, respectively; δ is the steering angle of the front wheel. The relevant vehicle parameters are the same as Table I in [17]. The configuration parameters of the LTV-MPC are presented in Table 3.

4.3. Results and Discussion

4.3.1. Static Scenario

The comparisons of trajectories between HPFSM and PFBM are shown in Figure 14a, respectively. The green and red trajectories are the generated paths of PFBM and HPFSM, respectively. It shows that the optimized path by HPFSM is more feasible to be an expected driving trajectory, because the path is smoother than that of PFBM without increasing in length ( 400.87 m vs. 403.88 m). The shaded part illustrates that the red trajectory is collision-free by comparing the lateral positions of the two paths. The comparison of the curvatures between the two trajectories is shown in Figure 14b, which further illustrates the red path is smoother than the green one.
The planned paths of HPFSM and PFBM are tracked by the LTV-MPC with a target speed of 20 m/s, respectively. The comparisons of the yaw rate and lateral acceleration between the two methods are shown in Figure 15. The comparison of lateral acceleration shows that the instantaneous and average values of HPFSM are smaller than that of PFBM in Figure 15a, which illustrates the ride comfort is improved with HPFSM. Meanwhile, Figure 15b shows the comparison of yaw rate, which illustrates that the yaw rate based on PFBM does not satisfy the designed constraint of 25 deg/s; however, the yaw rate based on HPFSM can be well constrained. This implies that the stability of the ego vehicle is also better while tracking the path of HPFSM.
The improvements with HPFSM in the static scenario is analyzed in Table 4. It shows that the maximum and average lateral accelerations are decreased almost 60% (6.254 m/s 2 v s . 2.504 m/s 2 ) and 40.6% (0.475 m/s 2 v s . 0.282 m/s 2 ) comparing to PFBM, respectively. Meanwhile, the yaw rate is also optimized in the maximum and average values, respectively. The maximum and average yaw rates with HPFSM are improved 60.47% (44.17 deg/s vs. 17.459 deg/s) and 28.2% (3.517 deg/s vs. 2.524 deg/s), respectively.

4.3.2. Dynamic Scenario

The tracking velocities of HPFSM and PFBM are shown in Figure 16a to ensure a consistent speed environment during the overtaking task. The trajectories of the two methods are shown in Figure 16b; they show that the ego vehicle can finish the overtaking task with both of these two methods. However, the trajectory with PFBM shows an sudden fluctuation at the position around X = 300 m, which will result in sharp steering maneuvers as shown in Figure 16c. These unexpected steering maneuvers will further affect both the driving safety and stability.
The yaw rate and the lateral acceleration of the two methods are compared in Figure 17. The yaw rate is constrained within 10 deg/s while tracking the path of HPFSM; however, the yaw rate is beyond the designed constraint of 25 deg/s while tracking the path of PFBM, as shown in Figure 17a. Meanwhile, the comparison of the lateral acceleration in Figure 17b shows the lateral acceleration based on HPFSM is much smaller than that of PFBM during tracking. These illustrate that both the vehicle stability and the ride comfort of the ego vehicle are improved with the proposed HPFSM comparing to the PFBM. The improvements with HPFSM in the dynamic scenario are shown in Table 5. This indicates that the maximum and average lateral accelerations with HPFSM are decreased 87.8% (2.4 m/s 2 v s . 0.29 m/s 2 ) and 83.9% (0.18 m/s 2 v s . 0.029 m/s 2 ), respectively. Meanwhile, the yaw rate is also optimized in the maximum and average values compared to the PFBM. The maximum and average yaw rates are improved 82.8% (20.4 deg/s v s . 3.5 deg/s) and 72.2% (1.7 deg/s v s . 0.47 deg/s), respectively.

5. Conclusions

A hybrid path planning is proposed to achieve an expected path generation and to improve the vehicle stability and the ride comfort during autonomous driving by combining the potential field with the sigmoid curve. The collision avoidance and the vehicle dynamics are considered to obtain the shortest collision-free trajectory composed by sigmoid curves. The multiobstacle static and dynamic scenarios are designed to examine the effectiveness of HPFSM, respectively. To evaluate the performance of autonomous driving with HPFSM, an LTV-MPC is used to track the planned paths of HPFSM and PFBM, respectively. The simulation results of the static scenario show that the maximum and average lateral accelerations are decreased 60% and 40%, and the maximum and average yaw rates are decreased almost 60.47% and 28.2%, respectively. The results of the simulated dynamic scenario show the same trend as the static scenario with a decrease of almost 80% in the indexes of both the lateral acceleration and the yaw rate. However, these improvements are achieved on the basis of the analysis of the simulation results; the figures are likely to be more modest in the practical application. These simulation results indicate that the vehicle stability and the ride comfort are well improved with the proposed method during autonomous driving. How the local minima problem can be completely or sufficiently avoided in more complex and unknown driving scenarios with more traffic participants is still a challenging task and should be further addressed in the future work. Meanwhile, our future work will present experimental applications of the proposed method under real driving scenarios.

Author Contributions

The presented work was carried out in collaboration with all authors. B.L. conceived the idea, realized the algorithms and wrote the manuscript. H.H. and D.C. reviewed the manuscript and provided important suggestions. H.Y., H.W. and G.L. gave some useful advice to organize the work. M.S. organized the figures. All authors have read and agreed to the published version of the manuscript.

Funding

This work was supported by the National key R&D program of China (2018YFB0106200) in part, and by the National Science Foundation of China Joint Fund Project (U1864205).

Conflicts of Interest

The authors declare no conflict of interest.

Abbreviations

The following abbreviations are used in this manuscript:
AVsAutonomous Vehicles
PFPotential Field
OPFObstacle Potential Field
PFBMPotential Field-based Path Planning Method
HPFSMHybrid Potential Field Sigmoid Curve Method
LTV-MPCLinear Time-varying Model Predictive Tracking Controller

References

  1. Rimon, E.; Koditschek, D.E. Exact robot navigation using artificial potential functions. IEEE Trans. Robot. Autom. 1992, 8, 501–518. [Google Scholar] [CrossRef] [Green Version]
  2. Yu, X.; Liu, L. Distributed formation control of nonholonomic vehicles subject to velocity constraints. IEEE Trans. Ind. Electron. 2016, 63, 1289–1298. [Google Scholar] [CrossRef]
  3. Huang, Y.; Wang, H.; Khajepour, A.; Ding, H.; Yuan, K.; Qin, Y. A Novel Local Motion Planning Framework for Autonomous Vehicles Based on Resistance Network and Model Predictive Control. IEEE Trans. Veh. Technol. 2020, 69, 55–66. [Google Scholar] [CrossRef]
  4. Wang, H.; Huang, Y.; Khajepour, A.; Zhang, Y.; Rasekhipour, Y.; Cao, D. Crash mitigation in motion planning for autonomous vehicles. IEEE Trans. Intell. Transp. Syst. 2019, 20, 3313–3323. [Google Scholar] [CrossRef]
  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. 2016, 17, 1135–1145. [Google Scholar] [CrossRef]
  6. Anderson, S.J.; Karumanchi, S.B.; Iagnemma, K. Constraint-based planning and control for safe, semi-autonomous operation of vehicles. In Proceedings of the 2012 IEEE Intelligent Vehicles Symposium, Alcala de Henares, Spain, 3–7 June 2012; pp. 383–388. [Google Scholar]
  7. Hwang, J.Y.; Kim, J.S.; Lim, S.S.; Park, K.H. A fast path planning by path graph optimization. IEEE Trans. Syst. Man Cybern. Part A Syst. Hum. 2003, 33, 121–128. [Google Scholar] [CrossRef]
  8. Ziegler, J.; Werling, M.; Schröder, J. Navigating car-like robots in unstructured environments using an obstacle sensitive cost function. In Proceedings of the 2008 IEEE Intelligent Vehicles Symposium, Eindhoven, The Netherlands, 4–6 June 2008; pp. 787–791. [Google Scholar]
  9. Ziegler, J.; Stiller, C. Spatiotemporal state lattices for fast trajectory planning in dynamic on-road driving scenarios. In Proceedings of the IEEE/RSJ International Conference on Intelligent Robots and Systems, St. Louis, MO, USA, 11–15 October 2009; pp. 1879–1884. [Google Scholar]
  10. Chen, L.; Shan, Y.; Tian, W.; Li, B.; Cao, D. A fast and efficient double-tree RRT*-like sampling-based planner applying on mobile robotic systems. IEEE/Asme Trans. Mechatron. 2018, 23, 2568–2578. [Google Scholar] [CrossRef]
  11. Kavraki, L.E.; Švestka, P.; Latombe, J.C.; Overmars, M.H. Probabilistic roadmaps for path planning in high-dimensional configuration spaces. IEEE Trans. Robot. Autom. 1996, 12, 566–580. [Google Scholar] [CrossRef] [Green Version]
  12. Zhang, Y.; Chen, H.; Waslander, S.L.; Gong, J.; Xiong, G.; Yang, T.; Liu, K. Hybrid trajectory planning for autonomous driving in highly constrained environments. IEEE Access 2018, 6, 32800–32819. [Google Scholar] [CrossRef]
  13. Mercy, T.; Van Parys, R.; Pipeleers, G. Spline-based motion planning for autonomous guided vehicles in a dynamic environment. IEEE Trans. Control Syst. Technol. 2018, 26, 2182–2189. [Google Scholar] [CrossRef]
  14. Brezak, M.; Petrovic, I. Real-time approximation of clothoids with bounded error for path planning applications. IEEE Trans. Robot. 2014, 30, 507–515. [Google Scholar] [CrossRef]
  15. Li, X.; Sun, Z.; Cao, D.; He, Z.; Zhu, Q. Real-Time Trajectory Planning for Autonomous Urban Driving: Framework, Algorithms, and Verifications. IEEE/ASME Trans. Mechatron. 2016, 21, 740–753. [Google Scholar] [CrossRef]
  16. Khatib, O. The Potential Field Approach And Operational Space Formulation In Robot Control. In Adaptive and Learning Systems: Theory and Applications; Narendra, K.S., Ed.; Springer: Boston, MA, USA, 1986; pp. 367–377. [Google Scholar]
  17. Ji, J.; Khajepour, A.; Melek, W.W.; Huang, Y. Path planning and tracking for vehicle collision avoidance based on model predictive control with multiconstraints. IEEE Trans. Veh. Technol. 2017, 66, 952–964. [Google Scholar] [CrossRef]
  18. Rasekhipour, Y.; Khajepour, A.; Chen, S.K.; Litkouhi, B. A potential field-based model predictive path-planning controller for autonomous road vehicles. IEEE Trans. Intell. Transp. Syst. 2017, 18, 1255–1267. [Google Scholar] [CrossRef]
  19. Krogh, B.H.; Thorpe, C.E. Integrated path planning and dynamic steering control for autonomous vehicles. In Proceedings of the IEEE International Conference on Robotics and Automation, San Francisco, CA, USA, 7–10 April 1986; pp. 1664–1669. [Google Scholar]
  20. Li, M.; Song, X.; Cao, H.; Wang, J.; Huang, Y.; Hu, C.; Wang, H. Shared control with a novel dynamic authority allocation strategy based on game theory and driving safety field. Mech. Syst. Signal Proc. 2019, 124, 199–216. [Google Scholar] [CrossRef]
  21. Park, D.H.; Hoffmann, H.; Pastor, P.; Schaal, S. Movement reproduction and obstacle avoidance with dynamic movement primitives and potential fields. In Proceedings of the IEEE-RAS International Conference on Humanoid Robots, Daejeon, Korea, 1–3 December 2008; pp. 91–98. [Google Scholar]
  22. Li, G.; Yang, Y.; Zhang, T.; Qu, X.; Cao, D.; Cheng, B.; Li, K. Risk assessment based collision avoidance decision-making for autonomous vehicles in multi-scenarios. Transp. Res. Part C Emerg. Technol. 2021, 122, 102820. [Google Scholar]
  23. Lee, J.; Nam, Y.; Hong, S. Random force based algorithm for local minima escape of potential field method. In Proceedings of the 2010 11th International Conference on Control Automation Robotics and Vision, Singapore, 7–10 December 2010; pp. 827–832. [Google Scholar]
  24. Li, G.; Yang, Y.; Qu, X. Deep learning approaches on pedestrian detection in hazy weather. IEEE Trans. Ind. Electron. 2020, 67, 8889–8899. [Google Scholar] [CrossRef]
  25. Montiel, O.; Orozco-Rosas, U.; Sepúlveda, R. Path planning for mobile robots using bacterial potential field for avoiding static and dynamic obstacles. Expert Syst. Appl. 2015, 42, 5177–5191. [Google Scholar] [CrossRef]
  26. Kovács, B.; Szayer, G.; Tajti, F.; Burdelis, M.; Korondi, P. A novel potential field method for path planning of mobile robots by adapting animal motion attributes. Robot. Auton. Syst. 2016, 82, 24–34. [Google Scholar] [CrossRef]
  27. Hwang, Y.K.; Ahuja, N. A potential field approach to path planning. IEEE Trans. Robot. Autom. 1992, 8, 23–32. [Google Scholar] [CrossRef] [Green Version]
  28. Elbanhawi, M.; Simic, M.; Jazar, R. Randomized bidirectional B-spline parameterization motion planning. IEEE Trans. Intell. Transp. Syst. 2016, 17, 406–419. [Google Scholar] [CrossRef]
  29. Resende, P.; Nashashibi, F. Real-time dynamic trajectory planning for highly automated driving in highways. In Proceedings of the International IEEE Conference on Intelligent Transportation Systems, Funchal, Portugal, 19–22 September 2010; pp. 653–658. [Google Scholar]
  30. Finney, D.J. Probit Analysis: A Statistical Treatment of the Sigmoid Response Curve; Cambridge University Press: Cambridge, UK, 1952. [Google Scholar]
  31. You, F.; Zhang, R.; Lie, G.; Wang, H.; Wen, H.; Xu, J. Trajectory planning and tracking control for autonomous lane change maneuver based on the cooperative vehicle infrastructure system. Expert Syst. Appl. 2015, 42, 5932–5946. [Google Scholar] [CrossRef]
  32. Li, S.E.; Li, G.; Yu, J.; Liu, C.; Cheng, B.; Wang, J.; Li, K. Kalman filter-based tracking of moving objects using linear ultrasonic sensor array for road vehicles. Mech. Syst. Signal Proc. 2017, 98, 173–189. [Google Scholar] [CrossRef]
  33. Bialkowski, J.; Otte, M.; Karaman, S.; Frazzoli, E. Efficient collision checking in sampling-based motion planning via safety certificates. Int. J. Robot. Res. 2016, 35, 767–796. [Google Scholar] [CrossRef]
  34. Liu, W.; He, H.; Sun, F.; Lv, J. Integrated chassis control for a three-axle electric bus with distributed driving motors and active rear steering system. Veh. Syst. Dyn. 2017, 55, 601–625. [Google Scholar] [CrossRef]
  35. Ataei, M.; Khajepour, A.; Jeon, S. Reconfigurable Integrated Stability Control for Four- and Three-wheeled Urban Vehicles With Flexible Combinations of Actuation Systems. IEEE/ASME Trans. Mechatron. 2018, 23, 2031–2041. [Google Scholar] [CrossRef]
Figure 1. Framework of the hybrid path planning method by combining potential fields with sigmoid curves.
Figure 1. Framework of the hybrid path planning method by combining potential fields with sigmoid curves.
Sensors 20 07197 g001
Figure 2. Examples without trapping into local minima: (a) scenario without obstacle vehicle; (b) scenario with an obstacle vehicle.
Figure 2. Examples without trapping into local minima: (a) scenario without obstacle vehicle; (b) scenario with an obstacle vehicle.
Sensors 20 07197 g002
Figure 3. Potential fields with different longitudinal and lateral safe distances.
Figure 3. Potential fields with different longitudinal and lateral safe distances.
Sensors 20 07197 g003
Figure 4. PFBM path planning for collision avoidance.
Figure 4. PFBM path planning for collision avoidance.
Sensors 20 07197 g004
Figure 5. A driving scenario with two obstacle vehicles.
Figure 5. A driving scenario with two obstacle vehicles.
Sensors 20 07197 g005
Figure 6. A driving scenario with multivehicle.
Figure 6. A driving scenario with multivehicle.
Sensors 20 07197 g006
Figure 7. Tunable features of the sigmoid curve: (a) Sigmoid curves with different central point; (b) Sigmoid curves with different central point; (c) Sigmoid curves with different maximum slope.
Figure 7. Tunable features of the sigmoid curve: (a) Sigmoid curves with different central point; (b) Sigmoid curves with different central point; (c) Sigmoid curves with different maximum slope.
Sensors 20 07197 g007
Figure 8. The parameters of sigmoid curve.
Figure 8. The parameters of sigmoid curve.
Sensors 20 07197 g008
Figure 9. Collision-free checking: (a) Collision avoidance is not ensured; (b) Collision avoidance is ensured.
Figure 9. Collision-free checking: (a) Collision avoidance is not ensured; (b) Collision avoidance is ensured.
Sensors 20 07197 g009
Figure 10. The optimal trajectory with sigmoid curves in a static scenario.
Figure 10. The optimal trajectory with sigmoid curves in a static scenario.
Sensors 20 07197 g010
Figure 11. HPFSM path planning with constraints: (a) curvature of the planned trajectory; (b) yaw rate and lateral acceleration.
Figure 11. HPFSM path planning with constraints: (a) curvature of the planned trajectory; (b) yaw rate and lateral acceleration.
Sensors 20 07197 g011
Figure 12. A static driving scenario with three vehicles parked on roadsides.
Figure 12. A static driving scenario with three vehicles parked on roadsides.
Sensors 20 07197 g012
Figure 13. Leading vehicles driving with short interval distance.
Figure 13. Leading vehicles driving with short interval distance.
Sensors 20 07197 g013
Figure 14. The path comparisons between HPFSM and PFBM in a static scenario: (a) Trajectory comparison: HPFSM vs PFBM; (b) Curvature comparison: HPFSM vs PFBM.
Figure 14. The path comparisons between HPFSM and PFBM in a static scenario: (a) Trajectory comparison: HPFSM vs PFBM; (b) Curvature comparison: HPFSM vs PFBM.
Sensors 20 07197 g014
Figure 15. Path tracking comparisons between the two methods in a static scenario: (a) LTV-MPC tracking: Lateral acceleration comparison; (b) LTV-MPC tracking: Yaw rate comparison.
Figure 15. Path tracking comparisons between the two methods in a static scenario: (a) LTV-MPC tracking: Lateral acceleration comparison; (b) LTV-MPC tracking: Yaw rate comparison.
Sensors 20 07197 g015
Figure 16. An overtaking scenario with multivehicle distributed in short interval distance: (a) HPFSM vs. PFBM: Tracking velocity; (b) HPFSM vs. PFBM: Tracking trajectory; (c) HPFSM vs. PFBM: Steering angle of front wheel.
Figure 16. An overtaking scenario with multivehicle distributed in short interval distance: (a) HPFSM vs. PFBM: Tracking velocity; (b) HPFSM vs. PFBM: Tracking trajectory; (c) HPFSM vs. PFBM: Steering angle of front wheel.
Sensors 20 07197 g016
Figure 17. The comparisons of yaw rate and lateral acceleration: (a) HPFSM vs. PFBM: Yaw rate; (b) HPFSM vs. PFBM: Lateral acceleration.
Figure 17. The comparisons of yaw rate and lateral acceleration: (a) HPFSM vs. PFBM: Yaw rate; (b) HPFSM vs. PFBM: Lateral acceleration.
Sensors 20 07197 g017
Table 1. Parameters for PF construction.
Table 1. Parameters for PF construction.
ParameterValueParameterValueParameterValue
X (m)0∼200 Y TrgL (m)1.75 Y obs (m)1.5
Y (m)0∼7 Y Bl (m)6 X s (m)20
a0.5 Y Br (m)1 Y s (m)1.5
b100 X obs (m)50 a sta 1 × 10 4
Table 2. Initialization parameters.
Table 2. Initialization parameters.
ParameterValueParameterValueParameterValue
μ ( 75 , 1.5 ) b 1 0 x 2 [ 75 , 150 ]
Σ d i a g ( [ 10 , 1.5 ] ) P c , 1 [ 0 , 75 ] b 2 3.5
P b , 1 3.5 P a , 1 [ 0 , 1 ] P c , 2 [ 75 , 150 ]
x 1 [ 0 , 75 ] P b , 2 −3.5 P a , 2 [ 1 , 0 ]
V20 (m/s) a s 2 (m/s 2 ) ω s 25 (deg/s)
Table 3. Parameters of the MPC Controller.
Table 3. Parameters of the MPC Controller.
SymbolDescriptionValue [Units]
N p Prediction horizon20 [unitless]
N u Control variable’s number2 [unitless]
N s State variable’s number6 [unitless]
T s Sampling period0.05 [s]
δ w Limitation of steering wheel angle [ 540 , 540 ] [ ]
Δ δ w Steering wheel angle rate [ 5 , 5 ] [ ]
F x Longitudinal tire force limitation [ 2000 , 2000 ] [ N ]
Δ F x Tire force rate limitation [ 50 , 50 ] [ N ]
Q Weights matrix of states tracking d i a g ( [ 1 × 10 7 , 1 × 10 2 , 1 × 10 7 , 0, 1 × 10 7 , 0 ] )
R Weights matrix of control variables d i a g ( [ 1 × 10 7 , 1 × 10 5 ] )
Table 4. Results comparisons in the static scenario.
Table 4. Results comparisons in the static scenario.
SymbolDescriptionHPFSMPFBM ( % )
a y , max (m/s 2 )Maximum lateral acceleration2.5046.25459.9
a y , mean (m/s 2 )Average lateral acceleration0.2820.47540.6
ω max (deg/s)Maximum yaw rate17.45944.17060.47
ω mean (deg/s)Average yaw rate2.5243.51728.2
Table 5. Results comparisons in the dynamic scenario.
Table 5. Results comparisons in the dynamic scenario.
SymbolDescriptionHPFSMPFBM ( % )
a y , max (m/s 2 )Maximum lateral acceleration0.2932.41087.8
a y , mean (m/s 2 )Average lateral acceleration0.0290.18083.9
ω max (deg/s)Maximum yaw rate3.50820.43082.8
ω mean (deg/s)Average yaw rate0.4771.71372.2
Publisher’s Note: MDPI stays neutral with regard to jurisdictional claims in published maps and institutional affiliations.

Share and Cite

MDPI and ACS Style

Lu, B.; He, H.; Yu, H.; Wang, H.; Li, G.; Shi, M.; Cao, D. Hybrid Path Planning Combining Potential Field with Sigmoid Curve for Autonomous Driving. Sensors 2020, 20, 7197. https://doi.org/10.3390/s20247197

AMA Style

Lu B, He H, Yu H, Wang H, Li G, Shi M, Cao D. Hybrid Path Planning Combining Potential Field with Sigmoid Curve for Autonomous Driving. Sensors. 2020; 20(24):7197. https://doi.org/10.3390/s20247197

Chicago/Turabian Style

Lu, Bing, Hongwen He, Huilong Yu, Hong Wang, Guofa Li, Man Shi, and Dongpu Cao. 2020. "Hybrid Path Planning Combining Potential Field with Sigmoid Curve for Autonomous Driving" Sensors 20, no. 24: 7197. https://doi.org/10.3390/s20247197

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