2.3. Resolving Localized Oscillations Caused by U-Shaped Obstacles
Map preprocessing can only address known obstacles, but when the algorithm is run, the method is not applicable to obstacles that appear suddenly, because map preprocessing requires real-time modeling of the environment, which can lead to inefficiency in path planning if it is used during the planning process, and the appearance of these obstacles is unpredictable and their morphology may change. When a U-shaped obstacle suddenly appears on the trajectory of the APF, a phenomenon of local oscillation occurs, and this phenomenon with its repulsive potential field energy is shown in
Figure 6.
From the figure, it can be seen that the traditional APF, when faced with the sudden appearance of a U-shaped obstacle, will experience the phenomenon of localized oscillation, i.e., the current point will stall at a certain position and reach a force equilibrium point near the U-shaped obstacle, thus being unable to exit the area. In real vehicle navigation, the vehicle may be trapped by the repulsive force of the obstacle and fall into a localized region of minimum potential field, which makes it difficult to continue driving towards the target, while the U-shaped obstacle causes the computation of the potential field to become more complicated and the computational efficiency of the vehicle controller to increase linearly.
Therefore, this paper solves this problem by integrating global and local path planning strategies. The Dijkstra algorithm is used to generate the approximate target path for the APF algorithm, and then the APF algorithm is used to adjust the robot’s traveling route in real time to avoid the local optimal trap. However, the global path planned by the optimized Dijkstra’s algorithm can guarantee the distance to the obstacles, but there are more inflection points in the path, which will lead to the APF algorithm showing an increase in the computational complexity as well as a decrease in the algorithm’s real-time performance.
This paper optimizes the global path, removes redundant path points, and ensures that the distance from the remaining path points to the center point of the obstacle is not less than the distance to the grid, as shown in Equation (5).
where
t is the projection scale.
p1 is the first point of the selected path.
p3 is the third point, and
is the center of the obstacle.
The relative position of the center point in this line segment is represented by the projection scale
t while restricting it to the range (0,1), and then the distance
dist is calculated by Equation (6).
The steps to implement the method are shown below:
- (1)
The start point of the path is taken as the first point of the optimization step, called p1, and the subsequent two points, p2 and p3, of this point are selected to connect the path point p1 and the path point p3 and to check whether the connecting line intersects with the obstacle.
- (2)
If they intersect, the intermediate point p2 is retained, and points like p2 are called necessary points; then the next test starts directly from p2, and the three points are selected in turn for the cycle.
- (3)
If they do not intersect, then calculate the shortest distance dist between the center point of the obstacle and p1p3. If the distance of dist is less than the distance of a grid, then p2 is retained for the cycle of step 2, and vice versa, p2 is removed, and p4 is selected at this time as the intermediate point, and the algorithm cycles through the judgments until the last point is the target point.
The necessary points of the paths calculated by Formulas (5) and (6) are taken as the temporary target points of the APF algorithm to provide attraction. Use the final target point and the temporary target point, respectively, to exert gravitational force on the current point. Compare the two ways and calculate the combined potential energy. The comparison graph and the combined potential energy graph are shown in
Figure 7.
It can be observed that the paths planned by the traditional APF algorithm show a greater variation in the resultant force and a poorer match with the global path than the APF using temporary target points. Due to the existence of obstacles near the target point, there is a large difference between the combined potential energy and the zero potential energy point. This will lead to not accurately reaching the target point, so in this paper, the potential energy function of the APF is improved. Based on Equation (2), the improved potential energy function is shown in Equation (7).
Split the original repulsive force
into two repulsive forces,
and
.
is still pointing from the obstacle to the current point, and
is pointing from the current point to the target point. Solve for the negative gradient for
and
, respectively, as shown in Equations (8)–(10).
A distance-dependent target distance factor is introduced into the potential energy function
, After performing the square operation on the distance result, it is proportionally magnified to emphasize the influence of distance change on the potential energy value. At the same time in the function introduced Gaussian function, the repulsive potential energy will gradually equal the original potential energy, and the change of the total potential energy field will be smoother. If the current position is near the final arrival point, the value of the Gaussian function tends to 0, which ensures that the final point is the lowest point of the total potential energy of the entire field. The combined potential energy of the APF with the modified repulsion function is compared with that of the APF, and the comparison plot is shown in
Figure 8, and the path comparison with the lowest combined potential energy is shown in
Figure 9.
It can be observed that the paths planned by the APF using the improved repulsion function have less variation, fit the global path better, incorporate the distances between the target and the obstacles well, and pass the distance factor as well as the Gaussian decay term so as to realize a nonlinear and adaptive potential field, and the minimum value of the combined potential energy point is 0.0006, which is almost converging to 0, which will provide a basis for the subsequent localized paths for the APF.
The APF with the above modified repulsion function is fused with the optimized Dijkstra’s algorithm, and the simulation is shown in
Figure 10 when facing a U-shaped obstacle.
As can be seen from the figure, when facing the appearing U-shaped obstacles, the fusion algorithm of APF can provide the path inflection point as a temporary target point with the help of Dijkstra’s algorithm, which avoids the local oscillation phenomenon caused by the force balance due to the U-shaped obstacles.
However, this type of approach is not applicable to all cases. If the U-shaped obstacle suddenly appears after the global algorithm has finished planning, and it happens to appear in the path of Dijkstra’s planning, it will still cause the phenomenon of local oscillation. Therefore, the algorithm can not always rely on Dijkstra’s path inflection points but directly in the vicinity of the U-shaped obstacles directly form a gravitational point to guide the APF algorithm to “escape.” Based on the above situation, this paper continues to improve.
Since U-shaped obstacles usually have complex shapes and may lead to unstable potential fields, in this paper, U-shaped obstacles are ellipticized because ellipses have better mathematical descriptions for obstacles with different sizes and shapes (e.g., U- or L-shaped obstacles), which can be adapted to different obstacles by ellipticization and can be more easily dealt with when dealing with the ensemble potential field by constructing the ellipticization formula shown in Equation (11).
where
,
,
, and
are the U-shaped obstacle boundary coordinates.
is the angle in polar coordinates, and
is the vehicle width, respectively.
The approach begins by determining the center of the U-shaped obstacle,
, as the center of the ellipse and then determines the long and short axes of the ellipse based on the length of the boundary of the U-shaped obstacle plus the width of the vehicle. The long and short axes of the ellipse are determined by adding the width of the vehicle to the length of the boundary of the U-shaped obstacle, which is the “dilated” half-axis of the x- and y-directions, respectively, and taking the width of the vehicle (
) into account. The
is used for reorientation when the obstacle is not directly in the Cartesian coordinate system. Secondly, the two endpoints of the long axis are selected as the temporary virtual target points. At this time, the size of the combined potential energy of the two virtual target points is calculated, and the temporary virtual target point with the smallest combined potential energy is selected as the final virtual target point. According to Equation (3), the virtual target point
is used as the attraction for the APF algorithm to provide the improvement of the simulation, as shown in
Figure 11.
As can be seen from the figure, the U-shaped obstacle is ellipticized, and two temporary virtual target points are found through the elliptic function. Finally, the green point with the lowest potential energy is selected as the final virtual target point to provide attraction. When facing U-shaped obstacles, it can be directly bypassed, avoiding the occurrence of local oscillation phenomena. And based on the improved repulsive force function, the local path can basically fit the path planned by the Dijkstra algorithm. The improvements in
Section 2.3 are shown in
Figure 12.
2.4. Path Optimization Based on Steering Model
Since the APF algorithm essentially calculates the location of the next path point by using the combined force, if the parameters of the force field are not set appropriately, it may lead to discontinuous changes in the path. Meanwhile, if there are multiple obstacles in the environment, cusps or sharp turns in the path can be formed since the formulas for the calculation of the attraction and repulsion forces usually use forms such as the inverse square or the exponential function. Paths are too tortuous, and path cusps occur. It can lead to frequent steering in real-world situations, as well as not meeting the mechanical constraints of the vehicle and leading to very poor comfort. Moreover, the overly zigzag path cannot be used as a reference path for subsequent tracking control studies.
Therefore, according to the above problems, this paper adopts the three-point arc method based on the steering model to make the APF algorithm able to make the path more continuous and smooth when performing local obstacle avoidance and path planning. Since the application carrier of the algorithm is a vehicle model, and the vehicle model has the characteristic of a minimum turning radius, in order to comply with the vehicle kinematics constraints, not only are curvature limitations needed on the planned paths, but also the planned paths cannot be less than the minimum turning radius of the vehicle radius, so it is necessary to add the corner constraints in the algorithm.
Steering sensitivity is an important index for evaluating the steady-state effect of the vehicle [
22], and its formula is shown in Equation (12).
where
is the angular velocity of the pendulum.
is the angular velocity of the pendulum.
s represents the current state.
is the component of velocity in the
x-axis.
L is the vehicle wheelbase.
m is the mass.
a is the front wheelbase, and
b is the rear wheelbase.
In the case of not considering the tire side deflection, and at the same time the speed state in the obstacle avoidance process is low speed, the vehicle is considered to be in the neutral steering state, so the maximum front wheel angle and the minimum turning radius relationship formula is shown in Equation (13), and the path curvature is shown in Equation (14).
The three-point arc method used in this paper will first determine whether the turning radius meets the requirements. According to the coordinates of the previous point
, the current point
and the coordinates of the predicted point
planned by the APF algorithm to calculate the distance between the three points, the calculation formula is shown in Equation (15).
where
,
,
are the Euclidean distance between the current point and the previous point, the Euclidean distance between the predicted point and the current point and the Euclidean distance between the predicted point and the previous point, respectively.
After obtaining the Euclidean distances of the three points, the angle formed by the three points is calculated using the cosine theorem, and the angle is restricted to [−1,1] as shown in Equation (16).
Based on the angle formed by the three points and the distance between the three points, the radius
R of the three-point arc can be found, and the formula is shown in Equation (17).
The path planned by the APF algorithm using the theory of the three-point arc method is shown in
Figure 13, and the curvature of this smooth path segment is derived and represented in
Figure 14.
As can be seen from
Figure 11 and
Figure 12, the use of the three-point arc method reduces the path cusp situation while making the path very smooth. However, the path curvature varies greatly, and there are cases of abrupt changes in curvature over a wide range. The curvature reflects the degree of curvature of the path, and the greater the curvature, the sharper the turn of the path. If the curvature of the path is too large, it means that the vehicle needs a smaller turning radius, which is not possible to drive on this path because the vehicle model has the limitations of steering angle and minimum turning radius; therefore, this paper proposes a three-point arc method based on the steering model for path optimization.
Firstly, according to the vehicle’s three-point arc radius
R and vehicle wheelbase
L, and ignoring the steering difference between the left and right wheels and mechanical factors. Based on the simplified steering model, to find out the steering angle, the formula is shown in Equation (18).
where
L is the wheelbase of the vehicle, and
R is the turning radius found by the three-point arc method.
When the APF algorithm plans the location of the predicted points, the coordinates of the three points are used with other parameters of the vehicle model to calculate the arc radius
R. If
also calculates the steering angle based on the steering model, then it means that the planned path angle
, meets the front wheel angle constraints, and the position of the next point can be planned in accordance with the ensemble of the APF algorithm; If
also calculates the steering angle
, based on the steering model, that is, if the corner change caused by the resultant force direction is not within the angle constraint range, then the driving direction is re-determined according to Equation (19).
Equation (18) is based on the geometric characteristics of the vehicle and is used to calculate the front wheel angle of the vehicle for a given turning radius
R. The front wheel angle is calculated based on the geometric characteristics of the vehicle. If the calculated front wheel angle does not meet the actual constraints of the vehicle, the limit angle of the vehicle is calculated based on Equation (19), the minimum turning radius of the vehicle,
Rmin, and the Euclidean distance between the first two points. The direction of travel at the limit is shown in
Figure 15.
The three-point arc method using the steering model-based method will be compared with the APF algorithm, and the comparison plot is shown in
Figure 16, while the curvature and steering angle of the path will be calculated and plotted as shown in
Figure 17 and
Figure 18.
From the figure, we can see that the three-point arc method based on the steering model can well smooth the path planned by APF, and the maximum value of the curvature of the smoothed path is not more than 0.4, and there is no curvature mutation phenomenon, which indicates that the path curvature is not particularly drastic at any point, and it is relatively smooth, and at the same time, the maximum value of the steering angle is 37.7°, and the average value is 7.5°, which is all in the range of the steering angle limitation.
Therefore, the three-point arc method based on the steering model proposed in this paper can largely improve the phenomenon of path cusps produced by APF due to the uneven ensemble force and, at the same time, limit the steering angles to the steering constraints of the vehicle.
Since the traditional step size is too small, the step size is optimized according to the density of obstacles in order to improve the efficiency and accuracy of path planning, as well as to ensure smooth paths and avoid large turns. The optimization used in this paper is shown below:
- (1)
The base step length is set, and a threshold for the number of obstacles is set. When the number of obstacles in a certain range is less than the current threshold, the base step is enlarged, and in this paper, we choose to directly enlarge it 4 times. When the number of obstacles is greater than the threshold, directly shrink 0.8 times.
- (2)
When the number of obstacles is between the maximum and minimum number, a linear difference is calculated for the step size so that the step size can be dynamically adjusted.
In this paper, the maximum number of obstacles is set to 6, the minimum number of obstacles is set to 1, and the basic step size in this paper is set to 1. A dynamic step size is used to balance speed and obstacle avoidance. These values are based on many experiments. If the step size is fixed and too large, the algorithm may skip local details, resulting in an unsmooth path, especially in complex environments with many obstacles.
Through the adaptive step size, the algorithm can dynamically adjust the step size according to the actual situation to ensure a smoother path and avoid generating large turns or unnatural paths; meanwhile, in the more open area, the gradient change of the potential field is small, and the step size can be increased appropriately to accelerate the search speed, while in the complex environment, the gradient change of the potential field is large, and the step size is reduced to precisely adjust the position to avoid collision or path deviation from the target.
Simulation is carried out using MATLAB to add randomly appearing static U-shaped obstacles on the path and two reciprocating dynamic circular obstacles, and the improved algorithm in this paper is compared with the fusion algorithms of A* and DWA, and the comparison graph is shown in
Figure 19, and the steering angle is shown in
Figure 20.
In the figure, the gray grid is the grid after the expansion process. The purpose is to expand the range of obstacles to provide a safe distance for the global path and does not provide repulsive force. The green curve is the path after the APF planning, and the blue curve is the path after the planning of A* and DWA algorithms. When static U-shaped obstacles and dynamic obstacles suddenly appear on the map, the improved APF algorithm can avoid the local oscillation phenomenon by virtue of the virtual target point to bypass the U-shaped obstacles, and at the same time, it can smoothly avoid dynamic obstacles, and the curvature of the planned path meets the requirements, and the steering angle is within the limitation; while the combination of A* and DWA algorithms is directly trapped in the local optimal phenomenon when facing the U-shaped obstacles.
The three-point arc method based on the steering model used in this paper can realize the smoothing of the generated paths in real time during the path planning process, changing the predicted point positions according to random and dynamic obstacles and adjusting the direction angle based on the vehicle model parameters. The real-time smoothed path is compared with the three-times B-spline smoothing, and the comparison graph is shown in
Figure 21. The rate of change of curvature of the two will also be compared, as shown in
Figure 22.
As can be seen from the figure, the path planned by APF is smoothed by using three times B-spline in path post-processing, and its effect is not good at the corners of the path and in avoiding dynamic obstacles, and there are sharp points in the path and the corners are not silky smooth, while the three-point arc method based on the steering model adopted in this paper still has a very good smoothing effect at the corners, and the angle meets the requirements.
Meanwhile, the curvature change of the smoothing method used in this paper is better than the three-times B-spline smoothing. In the use of B-spline for smoothing, if the number of path points is too many, it will lead to unstable curvature calculation, very sensitive to small perturbations, while the smoothing method used in this paper is essentially based on the steering model, which can ensure that the vehicle will not have a drastic steering change, and the front wheel steering angle is continuous, which ensures that the curvature change on the path is smooth.
Several papers consider the carrier of the algorithm as a mass, which is unrealistic, because the vehicle carrier usually exists in volume when avoiding obstacles. Although the mass was successfully avoided, if the volume exists, it will also collide, so this paper continues to optimize the algorithm to incorporate the vehicle volume into the algorithm and take into account the volume constraints of the vehicle in performing the obstacle avoidance process. The flowchart of the algorithm in
Section 2.4 is shown in
Figure 23.
2.5. Vehicle Collision Detection Model
When planning the APF algorithm, the center point of the rear axle of the vehicle, i.e., the prime point , is usually chosen to represent the current position of the vehicle. Therefore, the planned paths are paths consisting of a series of rear axle centers, and it is not possible to determine whether a vehicle is in a collision only at the rear axle center point, because vehicles have volume and width, and collision detection with obstacles usually uses the outer contour of the vehicle as a reference. Since the surface of the vehicle has bumps and also the vehicle itself is irregularly shaped, the outer contour of the vehicle is simplified to a rectangle, and a plurality of envelope circles are used to cover the surface of the rectangle in response to the presence of bumps.
Given that the APF algorithm is more sensitive to the combined force, in order to improve the safety of the planned path, and at the same time, in order to approximate the expansion of each contour of the vehicle body, to ensure that the vehicle still has enough expansion circle area when avoiding obstacles. If fewer expansion circles are used, it will lead to the model area not being expanded. At the same time, if the number of expansion circles is too high, it will lead to an increase in the computational complexity, so this paper selects three rows of a total of 14 envelope circles to cover the body. In order to improve the accuracy of the vehicle collision detection, the vehicle collision detection model is shown in
Figure 24.
From
Figure 17, Or is the center of the rear axle, L1, the rear axle, L2, the front axle, d1, the distance from the rear axle to the edge of the vehicle, d2, the distance from the front axle to the edge of the vehicle, W, the width of the vehicle,
the radius of the collision detection, and the radius of each envelope the same as that of the center of the two envelope circles. By using the envelope circle, the vehicle collision problem can be converted into a problem of the distance between the 14 envelope circles and the surrounding obstacles, so it is only necessary to calculate the distance between the center of each envelope circle and the obstacles and compare it with the collision detection radius
to determine whether a collision occurs or not. The formula for calculating the collision detection radius
and the distance between the center of the envelope circle is shown in Equations (20) and (21).
where
n is the maximum number of envelope circles in a row, which is 6 in this paper.
L is the axis distance, and
k is the envelope circle radius expansion factor.
According to the coordinates of the center point of the rear axis
, to calculate the center coordinates of the 14 envelope circles, collision detection can be carried out. In this paper, we give the eight center coordinates of
O1,
O2,
O3,
O4,
O10,
O12,
O13, and
O14, and the calculation formula of the other center coordinates is similar. The calculation formula is shown in Equations (22)–(29).
According to the above formula to establish a good vehicle collision detection model, in the collision detection, you only need to judge the center of each envelope circle, and the distance between the obstacle and the obstacle is greater than that is to say, when the obstacle in the environment is denser, the passable area is narrower, and if there is also a random emergence of dynamic obstacles near the passable area, it will lead to the distance between the vehicle and obstacle being smaller, which is not conducive to the vehicle’s passage. Therefore, this paper adopts the temporary target point bias strategy, which combines the temporary target point provided by the Dijkstra algorithm with the combined potential energy in the APF algorithm and selects a safer temporary target point to attract vehicles to move. The temporary target point bias strategy is shown in
Figure 25.
The red dashed line in the figure is the global path planned by Dijkstra’s algorithm, the blue circle is the temporary target point, and its distance from the gray grid is dist = 1. The calculation formula is shown in Equation (6). The red dashed circle is the target point bias circle used to test the distance between the obstacles to ensure that there is enough safe distance. R is the test radius of the bias circle; its size is equal to the width of a grid. is the bias circle within the range of the smallest point of the combined potential energy. The bias strategy process is shown below:
- (1)
Iterate over all temporary target points, calculate the distance dist between them and the gray grid, and generate a target point bias circle with the temporary target point as the center and as the radius.
- (2)
If , the point is moved in all four directions, up, down, left, and right.
- (3)
The final direction of movement is selected based on the combined potential energy values of the four directions, and the direction with the lowest combined potential energy is chosen as the target bias point.
- (4)
The move distance is d. If after the move it is found that its bias circle still intersects with the gray grid’s, recalculate the combined potential energy and continue to choose the optimal direction for the move until to satisfy .
The above improvements are simulated, and the simulation is shown in
Figure 26, and the steering angle plots and smoothing comparison plots are shown in
Figure 27 and
Figure 28.
As can be seen from the figure, the vehicle collision detection model ensures the distance between the vehicle model and the dynamic and static obstacles and has good results in avoiding the dynamic obstacles.
The gray grid in the figure is the expanded obstacle, but there is a phenomenon that the vehicle carrier covers the gray grid because this type of obstacle does not provide repulsive force, and if the same size of repulsive force is still applied to the carrier, it will cause the vehicle carrier to be overstressed and the steering effect will not be obvious, so the grid is only for expanding the distance with the original obstacle to provide a certain safe distance base for local path planning; at the same time, the target point bias strategy further expands the distance between the temporary target point and the obstacles to prevent the vehicle from colliding with the obstacles when steering; the steering angles of the vehicles are all limited to ±40°, the maximum angle of the left turn is 28.35°, the maximum angle of the right turn is 36.98°, and the average steering angle is 8.38°; comparing the planned paths with the three-times B-spline, the three-times B-spline curves cannot deal well with the phenomenon of sudden corner change caused by vehicle turning, while the three-point arc method based on the steering model used in this paper is still smooth in the turning stage.
The APF algorithm with the added collision detection model is compared with the unadded collision detection model, and the comparison results are shown in
Table 1.
As can be seen from
Table 1, the APF algorithm with the addition of three rows of 14 envelope circles improves the minimum distance between the planned path and the obstacle by 66.67%, although the algorithm running time increases slightly (by 12.23%). This is because too close a distance triggers the safety mechanism of the expansion detection model, and the obstacle provides repulsive force in advance to ensure that it will not touch the obstacle, so the relative increase in time to improve the safety of the path is tolerable.
Although the comparison of the algorithm running time was conducted, the improved method still needs to be analyzed for theoretical cost complexity, including time complexity and space complexity.
After theoretical analysis, the time complexity of the method is O(N), where N is the number of obstacles in the environment. Although the introduction of the multi-envelope circle model increases the computation of the constant factor, the method improves the accuracy of vehicle collision detection and demonstrates a good balance of performance and accuracy. In each iteration, we compute 14 fixed-position envelope circle centers. These circle centers are distributed in three alignments to form a comprehensive coverage of the vehicle body. The computation is independent of the number of obstacles and has a time complexity of O(1).
For each envelope circle, we need to calculate its distance to each obstacle in the environment, and a total of 14 × N distance calculations are performed. Although the computation is 14 times more than the single-point model, the constant coefficient can be ignored from the asymptotic analysis point of view, and the complexity is still O(N). When an obstacle enters the detection range, we compute the distance-based repulsive potential field. This process has O(N) complexity for the worst case. The space complexity, also O(N), is mainly used to store the distance and force value information associated with the N obstacles. 14 The storage requirement for the circle center coordinates is a fixed value and has a negligible effect on the space complexity.
The envelope circle model does not change the asymptotic complexity O(N) of the algorithm, although it increases the computational effort by a constant factor. This increase in computational cost is fully justified considering that the method significantly improves the accuracy of collision detection by meticulously modeling the vehicle shape, especially in complex environments and narrow passages.
In summary, the improvement of this paper for the APF algorithm is shown below:
- (1)
Firstly, in order to circumvent the planned trajectory from intersecting with any obstacles and thereby mitigate the risk of a collision, the obstacles are augmented by one raster width for the purpose of collision detection.
- (2)
Secondly, the optimal path planned by Dijkstra’s algorithm is used as the global path of the APF algorithm, and the search direction of Dijkstra’s algorithm is improved due to the fact that there will be a situation where the distance to the obstacle is too close, and the path is optimized for the more inflection points of the global path in order to reduce the computational complexity and ensure that the distance between the path and the obstacle is not less than dist.
- (3)
Again, in order to ensure that the combined potential energy is not equal to zero when the final point is reached, the APF is augmented by adding a Gaussian function and a distance factor, and it can be ascertained that the final value of the combined potential energy tends to 0. In addition, for the localized oscillation phenomenon induced by U-shaped obstacles, these are configured as ellipticals, and coupled with the gravitational force provided by the virtual target point, it is possible for the vehicle to bypass the U-shaped obstacles voluntarily.
- (4)
In order to conform the local paths to the kinematic constraints of the vehicle, we use a three-point arc method based on the steering model. This method smoothes the path in real time, and the steering angles are all in compliance with the requirements. In addition, the planning step size is optimized based on the number of obstacles in order to improve efficiency.
- (5)
Finally, the prime is instantiated as a vehicle model, and the vehicle collision detection model is used to wrap the vehicle with an envelope circle, which can be used to further improve the path safety by considering the vehicle volume constraints when performing collision detection and by using the target point bias strategy.