Next Article in Journal
Fuzzy Clustering Algorithm Based on Improved Global Best-Guided Artificial Bee Colony with New Search Probability Model for Image Segmentation
Previous Article in Journal
Microvalves for Applications in Centrifugal Microfluidics
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Article

An Optimization-Based Motion Planner for Car-like Logistics Robots on Narrow Roads

1
School of Automation, Central South University, Changsha 410083, China
2
Beijing Institute of Automation Equipment, Beijing 100074, China
*
Author to whom correspondence should be addressed.
Sensors 2022, 22(22), 8948; https://doi.org/10.3390/s22228948
Submission received: 13 October 2022 / Revised: 7 November 2022 / Accepted: 17 November 2022 / Published: 18 November 2022
(This article belongs to the Section Sensors and Robotics)

Abstract

:
Thanks to their strong maneuverability and high load capacity, car-like robots with non-holonomic constraints are often used in logistics to improve efficiency. However, it is difficult to plan a safe and smooth optimal path in real time on the restricted narrow roads of the logistics park. To solve this problem, an optimization-based motion planning method inspired by the Timed-Elastic-Band algorithm is proposed, called Narrow-Roads-Timed-Elastic-Band (NRTEB). Three optimization modules are added to the inner and outer workflow of the Timed-Elastic-Band framework. The simulation results show that the proposed method achieves safe reversing planning on narrow roads while the jerk of the trajectory is reduced by 72.11% compared to the original method. Real-world experiments reveal that the proposed method safely and smoothly avoids dynamic obstacles in real time when navigating forward and backward. The motion planner provides a safer and smoother trajectory for car-like robots on narrow roads in real time, which greatly enhances the safety, robustness and reliability of the Timed-Elastic-Band planner in logistics parks.

1. Introduction

With the continuous development of service robot technology, the logistics industry is gradually transforming and upgrading. The traditional manual handling and logistics management model is being eliminated. The automation mode with logistics robots is widely used at the core of factories and production enterprises [1,2]. The intelligent operation of logistics handling has become the trend of industry development. Among them, motion planning is the key technology of autonomous navigation, which determines whether the robot can safely and efficiently reach the target. Motion planning is the search for a collision-free optimal trajectory from the current position to a local target in the dynamic environment around the robot [3]. Assuming that the localization [4], mapping [5], perception [6], and routing [7] modules perform well while the robot navigates on the wide-structured roads, this type of general motion planning approach has been well studied [8,9,10,11]. However, in logistics parks, robots travel on diverse and complex roads. Due to the size limitation of the park, the environment is mostly unstructured roads and presents a network or ring shape [12]. Unlike structured roads, unstructured roads generally do not have lane lines. Therefore, the sensors cannot recognize lane information. The drivable area cannot be determined based on the lane lines [13]. A safe path can only be reasonably planned based on the location of obstacles. To make matters worse, the park inevitably contains some narrow curves and straights. Due to the narrow exploration space, higher demands are placed on the robot motion planning capability. First, the robot needs to track the global path smoothly. To ensure the integrity of the goods, the robot’s speed during transport needs to be as smooth as possible. Second, the transportation process has the potential to involve reversing conditions. Non-holonomic constrained car-like robots also present a challenge in reversing on narrow roads. Finally, the robot often needs to interact with dynamic obstacles such as pedestrians and vehicles in the park during navigation. Ensuring collision-free transportation is the basis for realizing motion planning in the park. Various types of algorithms have been made available with poor applicability in this type of scenario [14]. Although the Timed-Elastic-Band algorithm is widely used in various mobile robot navigation systems for its advantages such as rapid solution and high applicability, it is still not sufficient to fully cope with these problems. Based on the above motivation, this paper proposes the Narrow-Roads-Timed-Elastic-Band (NRTEB) method for narrow space planning. This aims to improve the safety, stability and robustness of car-like logistics robots for motion planning on narrow roads. The main contributions of this paper are:
(1) We reconstruct the inner and outer workflow of the Timed-Elastic-Band algorithm to improve its motion planning performance on narrow roads.
(2) The jerk is added to the objective function in the form of a soft constraint, which improves the smoothness of the speed profile without significantly increasing the computation time.
(3) A strategy is designed to enhance safety when navigating in reverse, thereby reducing the risk of collision with narrow-road edges.
(4) A sampling-based obstacle avoidance strategy is proposed for the presence of obstacles on local targets to improve the safety and stability of narrow-road obstacle avoidance.
A comparison of the method in this paper with the framework of the TEB is shown in Figure 1.

2. Literature Review

2.1. Researches on Point-to-Point Motion Planning Methods

For autonomous mobile robots that need to accomplish specific tasks, their operation process can be divided into segments of point-to-point motion planning [15]. For example, logistics robots continuously move from the current target to the next target in a set of freight handling processes. For point-to-point motion planning methods, they can be broadly classified into graph search-based ones, sampling-based ones, curve-interpolation-based ones, optimization-based ones and deep reinforcement learning-based ones [16]. One of the earliest point-to-point path planning methods is the graph search method. A well-known method is the shortest path algorithm proposed by Dijkstra [17]. In order to improve the search efficiency, the A* algorithm was proposed later [18]. This algorithm significantly reduces the search time by estimating the cost from the current location to the target through a heuristic function. The graph search algorithm is the most mature global path planning method, of which the A* algorithm has been widely used in the fields of autonomous driving and robotics. However, it only considers static obstacles and the path does not contain time information, so it is not applicable to dynamic local trajectory planning. Sampling-based schemes were initially studied to deal with pathfinding problems in high-dimensional spaces. One of the most representative is the rapid-exploration random tree (RRT) [19] method. A series of sampling-based studies were then enriched, such as RRT* [20] and informed-RRT* [21]. These both aim to improve the sampling efficiency and thus speed up the pathfinding process, but the paths are usually not smooth enough and optimality is not guaranteed. Curve interpolation methods are often used to generate smooth, comfortable trajectories. Common interpolated curves are polynomial [22], Bezier [23], and spline curves [24]. Since they are interpolation operations based on waypoints, the quality of local trajectory planning results depends on the quality of global path planning. In recent years, numerical optimization-based methods have attracted a great deal of attention [25]. This class of methods models the search problem as an optimization problem. Various constraints such as velocity, acceleration, minimum steering radius, etc. are incorporated into a unified model for solving the problem. Because of its ability to explicitly handle dynamic obstacles and various types of constraints, it is widely used in various autonomous driving and robotic systems. For example, Baidu’s motion planning module for unmanned vehicles extensively uses this type of approach to generate a short trajectory that is safe, comfortable, and collision-free [26]. In the field of robotics, the most popular one belonging to this category is the TEB local trajectory planner [27]. However, the TEB method ignores the comfort of speed change [28], which is detrimental to logistics handling robots. Although deep reinforcement learning-based motion planning methods are becoming a hot research topic, most of the work is still in the simulation stage. Such methods have not been adopted in the industry for the direct control of robots because safety and stability cannot be guaranteed [29].

2.2. Studies on Narrow Road Motion Planning Methods

A small amount of literature exists in the area of intelligent driving in narrow-road scenarios. The “narrow road assistant” proposed in [30] provided drivers with collision warning and steering support for driving on narrow roads. The driver-adapted ADAS proposed in [31] matched the driver’s driving style to provide appropriate steering assistance. Sato, T. et al. [32] presented two driving assistance system models based on drivers’ cognitive processes that are useful for achieving smooth passage on narrow roads and improving driver performance. In addition to advanced driver assistance systems applied on structured roads, some researchers have explored methods for the motion planning of mobile robots in narrow, unstructured road environments. Tian et al. [33] proposed a local path planning method for turning around in a narrow environment which combines Bezier curve and the minimum turning radius arc. The safety of planning in narrow roads is improved, but the real-time performance is poor. Li et al. [34] improved the planning performance of RRT in narrow roads or cluttered environments by fusing bidirectional RRT and rapidly exploring random vines. However, these paths are not smooth. Therefore, they cannot be provided to car-like robots for execution.

2.3. Studies on Timed-Elastic-Band Methods

In the scope of the TEB method, a variety of improved algorithms have successively been proposed. TEB adopts a strategy of predictive control to guide the robot to accomplish online trajectory planning tasks in a dynamic environment [35]. The first control action is finally adopted as the robot’s command [36]. The TEB planning algorithm proposed by C. Rösmann [37] is an evolution of the elastic band (EB) [38], which explicitly adds the time intervals to its optimization. The original TEB planner might cause a trajectory across obstacles which are owed to the optimization being trapped in local minima. Subsequently, C. Rösmann proposed an improved method for generating alternative suboptimal trajectory clusters based on distinctive topologies [39]. After the TEB algorithm was adopted by the ROS navigation stack [40], it has gradually become a hot topic of study among scholars. Keller et al. [41] studied the optimal obstacle avoidance trajectory generation method with the TEB framework. Their approach improves the obstacle avoidance capability of the TEB, but does not talk about the real-time planning problem. Ulbrich et al. [42] proposed a variant of TEB that uses loose ends in planning to produce more human-like paths. However, the authors admit that the method still has the probability of falling into local minima and failing to provide safe trajectories. S. Smith et al. [43] presented an egocentric map representation for TEB in an uncertain environment to solve the problem of mismatch between optimization graph and grid-based map. This reduces the planning time but is only validated in a simulated environment, so it is not sufficiently convincing to provide guidance for a real robot. A car-like sweeping robot system based on TEB local trajectory planning is proposed in [15]. The method improves the sweeping coverage, but the speed change during navigation is not smooth. The previous works have more or less improved the trajectory smoothness, solution stability, and obstacle avoidance safety of TEB. However, none of them can perfectly solve all the problems of TEB in narrow-road planning, especially the reverse planning and reverse obstacle avoidance scenarios that logistics robots often encounter. In addition, most of the studies only show the optimization effect of a certain aspect. There is a lack of real-time results presentation, which is very important for motion planning. Therefore, this paper intends to comprehensively address the problems arising from TEB in narrow-road planning. The effectiveness and superiority of the method is verified by simulation experiments and real-world experiments. This will provide good guidance for car-like robots driving on the narrow roads of logistics parks.
There are several reasons why the TEB algorithm can be widely used in robot motion planning: (1) Strong solving ability: To reduce costs, logistics robots usually have limited computational resources. TEB is able to solve optimization problems very quickly. In the objective function of TEB optimization, many error terms are partial [37]. As such, the Hessian matrix is sparse so that the solution is rapid. (2) Wide applicability: TEB is not only applicable to differential wheels but also the chassis of the Ackermann structure [44]. This makes a lot of sense for ROS [45] because, in the early stage of development, ROS studied mostly round universal wheel robots and rarely considered car-like robots [46]. In addition, TEB considered different vehicle chassis contour models, different obstacle types, and whether the obstacles are dynamic, so it is more adaptable to obstacle avoidance in dynamic environments. (3) Insensitive to the smoothness of global reference path: TEB selects the farthest point of the global path within the local sensing range as the local planning terminal. The shape of the trajectory is adjusted by various constraints, so it does not require the global path to conform to the kinematic constraints of the robot. Unlike Baidu Apollo’s local planner [26], it heavily relies on global path smoothing, so it reduces the overhead time of path smoothing. However, there are still the following problems that limit its application to car-like robots on narrow roads. (1) Speed planning results are not smooth: Although the non-holonomic constraint ensures smooth paths, both angular and linear speed profiles are not smooth. This is due to the fact that the TEB does not constrain the jerk of the entire trajectory. The unsmoothed speed planning results mean that there is a possibility of unstable control, which is contrary to the need for the robot motion and steering to be as smooth as possible in narrow-road scenarios. (2) Narrow road reversing planning is flawed: At the beginning of a new planning cycle, the TEB method selects a waypoint from the global path as a local target based on the forward-looking distance. When the global path is behind the robot, the heading of the local target is opposite the robot heading, because the global planning starts from the robot and points to the target. Based on this problem, TEB generates a parking trajectory, which is unacceptable for reversing behavior in confined environments. The robot is highly susceptible to collisions with road edges or cannot turn around due to the minimum turning radius. (3) Planning fails when obstacles fall on the local target: A local target is a waypoint obtained from the global path. Its position is fixed at the beginning of the planning cycle. If at this point the sensors detect a dynamic obstacle moving to the position of the local target, it will cause the planning to fail because the target is unreachable. This can be solved by updating the global path, however, global planning is unreliable as the module with the slowest update frequency and computation takes a long time. Additionally, the introduction of dynamic obstacles makes the search space non-convex and may lead the optimization into local minima.

3. Materials and Methods

For the above-mentioned problems arising in narrow road environments, we reconstruct the inner and outer workflow of the TEB algorithm. The improvements in the internal optimization loop are presented first, corresponding to the orange module in Figure 1. Then, the two working modules in the external working loop are introduced, corresponding to the blue modules in Figure 1.

3.1. Motion Smoothing

3.1.1. Motion Planning Modeling

Car-like robots with an Ackermann structure traveling on the configuration space, which is shown in Figure 2. This paper adopts the kinematic model [47] for the Ackermann chassis.
x ˙ = v cos θ y ˙ = v sin θ θ ˙ = v tan δ f L
where ( x , y , θ ) is the configuration space state, ( x , y ) is a two-dimensional Cartesian coordinate, θ denotes the heading angle of the robot, v is the longitudinal speed, δ f is the front steering angle, and L is the wheelbase of the vehicle.
The time intervals between poses are added to the optimization variables. Therefore, TEB not only modifies the geometry of the trajectory but also optimizes the velocity and acceleration, thus solving the high-dimensional search problem of motion planning. The sequence of poses in configuration space is expressed as:
Q = { q i } i = 0 n 1 n N
where q i = ( x i , y i , θ i ) . This denotes a robot pose in the configuration space.
The time interval between each two poses is denoted by Δ T , and the set of time interval vertices is expressed as:
τ = { Δ T i } i = 0 n 2 n N
where Δ T i is the time interval between q i and q i + 1 .
Thus, the TEB trajectory is represented as a combination of a sequence of poses and a sequence of time intervals, which are the optimization variables of the subsequent solution:
S = { Q , τ }
To facilitate the transformation of multi-objective optimization problems into graph optimization problems, the TEB algorithm transforms the hard constraint into a soft one. Therefore, this paper adopts the piecewise continuous, differentiable uniform cost function described in [27] to penalize the violation of constraints:
e ( x , x r , ϵ , R , n ) ( x ( x r ϵ ) R ) n i f x > x r ϵ 0 o t h e r w i s e
where x r presents the bound value. n is the polynomial order, R is the scaling, and  ϵ expresses the safety margin. In this paper, we choose x r = 0.5, ϵ = 0.05, R = 0.25, n = 6.
The multi-objective function of TEB can be expressed as:
f T E B ( S ) = k γ k · f k ( S )
where f k ( S ) represents the deviation of each constraint from the desired value, and  γ k denotes the corresponding weights. f v = e ( v i , v m a x , ϵ , R , n ) represents the velocity constraint of the trajectory, where v i is obtained by differentiating the adjacent pose q i , q i + 1 from their time intervals Δ T i . f a = e ( a i , a m a x , ϵ , R , n ) represents the acceleration limitation of the trajectory, where a i is obtained from the three adjacent poses q i , q i + 1 , q i + 2 with their two time intervals Δ T i , Δ T i + 1 . f p a t h = e ( q i , p i , ϵ , R , n ) is the target-following constraint. f o b s = e ( d m i n , j , r m i n , ϵ , R , n ) indicates that the obstacle constraint for those poses that are less than the minimum safe distance r m i n . f t i m e = ( i = 1 n Δ T i ) 2 is the shortest time constraint. f n h represents a nonholonomic constraint between two adjacent poses which guarantees the generation of a trajectory that conforms to the vehicle kinematics. We refer to [39] for more details on constraint modeling.
Finally, Equation (6) is transformed into a graph optimization problem, as shown in Figure 3b. It is solved with the optimization framework of G2O [48] to obtain the optimal motion:
S * = arg min S f T E B ( S )
where S * is the optimal TEB trajectory obtained from the optimal solution.

3.1.2. Jerk Limitation

The linear jerk is the derivative of linear acceleration while the angular jerk is the derivative of angular acceleration. Constraining the jerk smooths out the speed profile of the trajectory, thus increasing the stability of the motion on narrow roads. A linear jerk is derived by the difference method from the four adjacent poses of S and the three time intervals between them, as shown in Figure 3a. The linear velocity is first represented by the sequence of poses q:
v i = q i + 1 q i Δ T i = ( x i + 1 x i ) 2 + ( y i + 1 y i ) 2 Δ T i
The linear acceleration is obtained from the three adjacent poses with their two time intervals, and thus the linear acceleration is represented by the linear velocity v i , v i + 1 and the time interval Δ T , Δ T i + 1 :
a v i = 2 ( v i + 1 v i ) Δ T i + Δ T i + 1
Finally, the linear jerk is represented by the acceleration a v i , a v i + 1 with their three adjacent time intervals Δ T , Δ T i + 1 , Δ T i + 2 as follows:
J v i = a v i + 1 a v i α Δ T i + β Δ T i + 1 + γ Δ T i + 2
In order to obtain the exact difference result, it is necessary to ensure that α + β + γ = 1 . Δ T i + 1 is correlated with both a v i and a v i + 1 , as seen from Figure 3. Δ T i and Δ T i + 2 are only correlated with a v i , a v i + 1 , respectively. Thus, Δ T i + 1 is given greater weight. This paper let α = γ = 0.25 , β = 0.50 .
Similarly, the angular jerk can be obtained as follows:
J ω i = a ω i + 1 a ω i α Δ T i + β Δ T i + 1 + γ Δ T i + 2
where a ω indicates the angular acceleration of the robot.
The constraint function of the linear jerk and angular jerk is expressed as:
f J v = e ( J v i , J v m a x , ϵ , R , n ) f J ω = e ( J ω i , J ω m a x , ϵ , R , n )
where J v m a x is the threshold of the linear jerk and J ω m a x is the threshold of the angular jerk.
Therefore, the multi-objective function of NRTEB can be expressed as:
f N R T E B ( S ) = f T E B ( S ) + γ J v f J v + γ J ω f J ω
where γ J v is the optimization weight of the linear jerk constraint and γ J ω is the optimization weight of the angular jerk constraint.
With the above definition, the multi-objective problem is transformed into a graph optimization problem, where four poses and three time intervals constitute the minimum hyper-graph considering jerk, as shown in Figure 3a. A simplified example structure of the NRTEB hyper-graph is shown in Figure 3b.

3.2. Reverse Planning Enhancement

This paper has already explained the shortcomings of the original TEB in reverse planning in Section 2.3. Due to the problem of local target reference heading, TEB always tries to generate a parking trajectory when the global path is behind the vehicle, as shown in Figure 4a. This reversing strategy is extremely unsafe in narrow roads. To enhance the safety and robustness of reversing planning, this paper intends to solve the problem from local trajectory planning cycle instead of the global planning module. When the global path is behind the vehicle and the robot is far from the global target, NRTEB is able to generate a direct reversing trajectory, as shown in Figure 4b. When the robot approaches the global target, it takes this goal as the end point of optimization. As such, the robot’s terminating heading problem is also solved.
A vector product is used to represent the position of a point in relation to the robot. If the vector product of the body direction vector and vector formed by the selected point and the robot center of mass is negative, the picked point is considered to be behind the robot, i.e., Point b in Figure 5. The reference heading of the local target is corrected by judging this condition, so as to keep the heading of the planning start and the planning end consistent. The workflow for handling reversing is shown in Algorithm A1 in Appendix A, which indicates the corresponding processBackward module in Figure 1.

3.3. Obstacle Avoidance Strategy

The essence of TEB planning is to periodically solve an optimization problem. The search space becomes non-convex when dynamic obstacles appear on the local targets, which leads to an optimization that may fall into local minima. In order to make the local target reachable and convexize the search space, an obstacle avoidance strategy that samples first and searches later to determine the local target location is proposed as shown in Figure 6.
Firstly, as shown in Figure 6a, the NRTEB planner calculates the direction vector from the robot to the local target v d i r , then make a vertical line of the direction vector across the local target, finds the location of the possible guided turning point on the vertical line based on the amount of lateral displacement change l and angle change Δ θ . The green dashed line is the expected obstacle avoidance trajectory after updating the local target. The coordinates of the old local target are known: ( x l t , y l t ) , the pose of the left guided turning point is obtained from the geometric relationship as:
x g t l = x l t l sin θ y g t l = y l t + l cos θ θ g t l = θ + Δ θ
where Δ θ and l are the parameters determined by the working environment. From the symmetry relationship, the pose of the right-guided turning point is:
x g t r = x l t + l sin θ y g t r = y l t l cos θ θ g t r = θ Δ θ
Secondly, on the basis of guided turning points, the set of obstacle avoidance points is sampled according to the preset parameters and geometric relationships, as shown in Figure 6b. Then, the set of sampling points is traversed until a point that meets the collision constraint is found as the new local target for the current planning cycle.
To obtain the sampling point, the assist point is first calculated according to Equation (16):
x a s = x g t + Δ l cos ( π 2 θ ) y a s = y g t Δ l sin ( π 2 θ )
where ( x g t , y g t ) is the position of guided turning point and Δ l denotes the determined lateral variation.
With the help of an assist point, the sampling point is then calculated by Equation (17):
x s p = x a s Δ s cos θ y s p = y a s Δ s sin θ θ s p = θ + Δ θ Δ ϕ
where ( x s p , y s p , θ s p ) is the pose of sampling point, Δ s denotes the determined longitudinal variation, and Δ ϕ denotes the determined angular variation. The decision process for the local target is shown in Algorithm A2 in Appendix A, which indicates the corresponding processObstacleOnLocalTarget function in Figure 1.
Finally, the algorithm introduces two hyperparameters, l and Δ θ , which represent the amount of lateral distance and angle change, respectively. There is a relationship between the choice of these two parameters and the minimum turning radius because the car-like robot is subject to non-holonomic constraints. A simple proof is as follows:
Assume that the distance between the robot and the local target is s, according to the Pythagorean theorem:
e = l 2 + s 2
The robot kinematics are geometrically related as shown in Figure 7, so the relationship between Δ θ and the vehicle turning radius R is given by:
tan Δ θ e R
Bringing Equation (18) into Equation (19), when the value of l is determined, the range of values of Δ θ is:
Δ θ arctan l 2 + s 2 R m i n
where R m i n represents the minimum turning radius of the robot. Therefore, the value of Δ θ needs to be determined according to the constraint range of Equation (20), while l needs to be selected as appropriate according to the road width. s depends on the lookahead distance which can be set as a hyperparameter in NRTEB.

4. Results and Discussion

In this section, firstly, the trajectory of our method is compared with the advanced motion planning method in a constrained environment. Then, a simulation environment containing narrow corridors is built in Gazebo (https://github.com/osrf/gazebo, accessed on 15 January 2010) to compare the motion performance, reversing performance, and real-time performance of each method. Finally, we evaluate the reversing and obstacle avoidance performance of the proposed method in the narrow-road scenario on a real car-like robot platform. The experimental results of the article are reproducible with the same robot structure and the same experimental parameters. However, note that it needs to be assumed that the localization, perception, and global path planning modules work properly during the experiment.

4.1. Simulation and Analysis

The method of this paper is compared with the original TEB and MPC applied to the car-like robot model. The simulation experiments were conducted on a laptop with an Intel Core i5-6300HQ CPU 2.30 GHz × 4. The influence of algorithm parameters on the trajectory is also discussed.

4.1.1. Trajectory Motion Performance Comparison

The motion planner usually updates the trajectory according to a certain frequency, so the trajectory has been dynamically varying as the robot moves and the environment changes. In order to accurately compare the motion performance of trajectories generated by different motion planners in the same environment, the start and end point are fixed to simulate the robot position and local target. Furthermore, three static obstacles are added in the direction of their motion. The posture of the planning start is ( 4 , 0 , 0 ) T . The posture of the planning end is ( 4 , 0 , 0 ) T . All three obstacles are 0.2 m × 0.2 m × 0.2 m cubes, which are located at ( 3 , 0.1 ) T , ( 1.5 , 0.1 ) T , and  ( 2 , 0.1 ) T , respectively. The planning parameters of the motion planners are shown in Table 1. The trajectory generated by NRTEB is shown in Figure 8.
The motion performance of the trajectories generated by the three planners is shown in Figure 9. All three methods generate the correct obstacle avoidance path where MPC has the closest distance to the obstacle and the highest collision risk, but can reach the end point faster. While the paths generated by TEB and NRTEB are relatively safer. The speed profile of TEB and MPC is steeper and the yaw change is more rapid, which poses a more stringent challenge to the tracking stability. In contrast, the NRTEB has the smoothest speed profile, which significantly reduces jitter and oscillation during travel. This is important for logistics robots to avoid shaking and thus ensure the integrity of the products.
This paper also explores the effect of planning parameters on the performance of the NRTEB planner for trajectories. The different jerk bounds or optimization weights are set to compare the planning performance in the same environment, respectively. The results are shown in Figure 10. The tighter the jerk constraint, the greater the fluctuation of the planning path. It can be seen from the heading angle, linear velocity, and angular velocity curves that the tighter the jerk limit, the smoother the curve, and the longer the motion time at the same time, where the motion curve is smoothest for a jerk threshold of 0.1 and steepest for a jerk threshold of 4. An increase in the optimization weight of jerk further improves the motion smoothness and motion time. In this paper, we suggest that the constraint range of jerk is between 0.1 and 5, and the optimization weight of jerk is between 1 and 10. If there is a higher requirement for the motion time, the optimization weight of the trajectory motion duration can be further adjusted upward, thus making a balanced trade-off between motion smoothness and motion time.

4.1.2. Tracking Performance Comparison

Tracking the global path is an important goal of motion planning. The tracking error between the actual vehicle trajectory and the global path is an important indicator of planning performance when there is no obstacle interaction during navigation. A car-like robot model developed by MIT named racecar (https://github.com/mit-racecar/racecar, accessed on 28 February 2017) and a simulation environment built using Gazebo (https://github.com/osrf/gazebo, accessed on 15 January 2010) were used to conduct comparative experiments on tracking performance under Robot Operating System (ROS) (https://www.ros.org/, accessed on 23 May 2018). The vehicle is equipped with a single-line LIDAR on top to sense the surrounding environment obstacles. The environment size is 10 m × 10 m. The real-time motion state of the robot is feedback by the gazebo simulator. The global path is provided and recorded using the A* algorithm, and the same global path is kept published during the experiments. The simulation environment containing narrow corridors is shown in Figure 11. The key parameters for the simulation experiments are shown in Table 2. All parameters do not exceed the kino-dynamic constraints of the car-like robot model.
Firstly, the pre-recorded global path is published, and different motion planning algorithms are used to generate local motion trajectories. Then, the motion state of the robot is recorded in real-time from the starting point to the global target with a frequency of 2 Hz. The traces of the robot’s odometry are shown in Figure 12. The results of the actual robot path length and average lateral tracking error are shown in Table 3. Among them, MPC generates the shortest tracking path but has the largest tracking error, which makes it significantly riskier to collide with walls at the corners of narrow roads. TEB and NRTEB have a smaller tracking error, which allows the robot to stay in the middle of the narrow road. NRTEB requires a larger turning radius because it limits the jerk, but does not significantly affect the tracking performance.
The robot status data during navigation is shown in Table 4. It should be noted that, to reflect the degree of change in motion, the average values in Table 4 need to be averaged after taking the absolute values of the jerk data first. The motion of MPC took 117.495 s, the motion of TEB took 124.516 s, and the motion of NRTEB took 137.017 s. The results again verified that NRTEB can improve the speed smoothness by constraining the jerk of the trajectory. However, the side effect is to increase the steering radius and motion duration. It can be solved by adjusting the constraint range of jerk, the magnitude of jerk optimization weight and the weight of the trajectory motion duration, as described in the previous section. The average planning time consumption of MPC is 154 ms, which cannot guarantee real-time planning when the CPU computing power is limited, while the planning efficiency of TEB and NRTEB is significantly improved. It is further demonstrated that adding the jerk to the objective function for optimization does not significantly increase the planning time consumption since the jerk term is partial with respect to the whole trajectory, thus ensuring real-time planning.

4.1.3. Comparison of Reversing Trajectory

When the global path is behind the robot, TEB generates the parking trajectory for turning around, but this does not work on narrow roads, as shown in Figure 13a,b.
Due to the minimum steering radius constraint of the car-like robot, the trajectory is very likely to cause the robot to collide with the boundary or unable to turn around, thus leading to planning failure. MPC is even unable to generate a trajectory. NRTEB generates a straight reversing trajectory by modifying the reference heading of the local target, as shown in Figure 13c, which solves the problem of robot oscillation due to a minimum turning radius constraint when reversing on narrow roads. The initial state of the robot in this part of the experiment is the terminal state of the previous part, i.e., the robot pose is [ 1 , 9 , π ] T and the global target is set to [ 1.5 , 7 , π 4 ] T . The global reference path generated by the A* algorithm located behind the robot is shown in Figure 13d. The diagram shows that NRTEB guides the robot out of the narrow dead zone and eventually reaches a new global target, which is not possible with the other two methods.

4.2. Realistic Obstacle Avoidance Scenarios

Given that the simulation environment ignores the data transmission time delay and does not reflect the obstacle information of the robot in real narrow-road environments, the obstacle avoidance performance of NRTEB and TEB is compared through our self-developed car-like logistics robot platform, as shown in Figure 14. The components of the automated guided vehicle (AGV) are shown in Table 5. Vehicle chassis parameters are shown in Table 6.
The AGV is tested on a 2.75 m-wide road with traffic guardrails. The planning parameters of NRTEB are shown in Table 7. When the vehicle is driving in the middle of the road, its distance from the edge of the road is 1.375 m, so set l to 1.0. According to Equation (20), the maximum value of Δ θ is 67.59 , so choose Δ θ as 60. Our system integrates with the global road network planning module in Autoware (https://www.autoware.org/, accessed on 1 August 2015) to provide a global reference path. Figure 15a shows the real environment captured by the camera, while Figure 15b shows the visualization of the AGV in Rviz.
To validate our planner, it is tested repeatedly on the loop road as shown in Figure 15. During navigation, pedestrians pass through the global reference path with irregular motion. A global target behind the robot is also set to test its reversal planning capabilities. The comparison experiments are conducted on the same narrow roads while keeping the same parameters. The results are shown in Figure 16.
When an obstacle appears on the global reference path of the AGV, as shown in Figure 16a, the TEB planner suffers from planning confusion which is caused by the fact that the search space becomes non-convex due to the intervention of dynamic obstacles, so that the TEB planning falls into local minima, as shown in Figure 16e, while NRTEB updates the optimization endpoint by sampling search to make the non-convex problem convex so it can avoid falling into local minima and generate optimal trajectories, as shown in Figure 16i. When the AGV has enough lateral displacement after following the first few points, the trajectory following the global reference path is generated again after the local target leaves obstacles at the next moment, as shown in Figure 16b,f,j, and at the current time, the TEB planner also generates the correct trajectory but closer to the obstacle, causing tracking to be more difficult. When the global target is behind the AGV and in the same direction as the AGV, the TEB planner generates a parking trajectory, which leads the vehicle to becoming trapped at the edge of the road by not being able to turn around on narrow roads, as shown in Figure 16g, and the NRTEB planner generates a reasonable reversing trajectory, as shown in Figure 16k. In addition, our improvement in obstacle avoidance is also applicable to the reversing scenario. If there are obstacles on the local target in the reversing process, as shown in Figure 16d, the TEB planner also does not generate a reasonable trajectory, as shown in Figure 16h, and the NRTEB planner looks for a new local target without obstacles as the endpoint of the current planning cycle to generate a correct trajectory, as shown in Figure 16l.
The planning performance of the real-world navigation is shown in Table 8. The results show that NRTEB significantly improves the smoothness of speed changes, although it increases some navigation elapsed time. When collision detection is performed, the planning time consumption is approximately 100 milliseconds and no more than 50 milliseconds during normal driving. If the computational power of IPC is insufficient, the size of the local cost map can be reduced appropriately and the maximum frequency of motion planning can be decreased at the same time. It should be noted that the NRTEB solution can be performed under the current parameters, but when the planning frequency and the local cost map update frequency are too high—causing the computational capacity of the IPC to be exceeded—the motion planning solution no longer converges, which can be solved by replacing the CPU with a more computationally powerful one.

5. Conclusions

In this paper, a motion planning algorithm for logistics car-like robots was proposed. It greatly improves the planning capability of a TEB algorithm in a narrow-road environment. It makes up for the shortcomings of TEB in terms of an unsmooth speed profile, unsafe reverse planning, and unstable dynamic obstacle avoidance. Compared with TEB, NRTEB plans a smoother speed profile. The linear jerk of the trajectory is 55.48% smaller and the angular jerk is 72.11% smaller than that of TEB. This improves the comfort of robot motion and greatly reduces the probability of good being damaged due to sudden speed changes. When navigating without obstacles, NRTEB tracks the global path in real time and stably. NRTEB’s tracking error is 24.46% smaller than MPC, and the planning time is reduced by 98.66%. In addition, NRTEB enables safe reverse navigation on narrow roads, which is not possible with the other two comparison methods. More significantly, real-world experiments demonstrate that NRTEB safely avoids dynamic obstacles in real time. It even achieves narrow-road obstacle avoidance whilst reversing.
NRTEB’s planning efficiency can be further improved. Future work will deploy local map update modules on GPU for parallel processing. We recommend applying this method to car-like robots that need to work frequently in narrow-road environments, including but not limited to logistics, inspection, search, and rescue, etc.

Author Contributions

Conceptualization, L.Y. and H.W.; methodology, H.W.; software, H.W.; validation, L.Y. and C.L.; formal analysis, L.Y.; investigation, H.W.; resources, L.Y. and C.L.; data curation, C.L.; writing—original draft preparation, H.W.; writing—review and editing, L.Y.; visualization, H.W. and H.J.; supervision, H.J.; project administration, H.W.; funding acquisition, L.Y. All authors have read and agreed to the published version of the manuscript.

Funding

This work was supported by the National Natural Science Foundation of China (61976224, 61976088) and the Natural Science Foundation of Hunan Province (2022JJ30758).

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Conflicts of Interest

The authors declare no conflict of interest.

Appendix A

Algorithm A1 processBackward
Input: P r o b o t : the robot current position; l o c a l _ p a t h : A local path intercepted from the global path; g l o b a l _ t a r g e t : the global target
Output: θ l o c a l _ t a r g e t
1:
D g l o b a l E u c l i d e a n _ d i s t a n c e ( P g l o b a l _ t a r g e t , P r o b o t )
2:
Set the reachable distance of the global target D g l o b a l _ n e a r
3:
if D g l o b a l > D g l o b a l _ n e a r then
4:
    Get the l o c a l _ t a r g e t ( x , y , θ ) from the last point of l o c a l _ p a t h l o c a l _ t a r g e t
5:
     D l o c a l E u c l i d e a n _ d i s t a n c e ( P l o c a l _ t a r g e t , P r o b o t )
6:
    Calculate the direction vector between the robot and the local target V lt
7:
    Calculate the direction vector of the robot V robot
8:
     d o t p r o d u c t V lt · V robot
9:
    if  d o t p r o d u c t < 0  then
10:
       θ l o c a l _ t a r g e t θ l o c a l _ t a r g e t + π
11:
   else
12:
       θ l o c a l _ t a r g e t θ l o c a l _ t a r g e t
13:
   end if
14:
else
15:
    θ l o c a l _ t a r g e t θ g l o b a l _ t a r g e t
16:
end if
Algorithm A2 processObstalcesOnLocalTarget
Input: l o c a l _ t a r g e t = ( x r p , y r p ) , l o c a l _ c o s t m a p , l, Δ θ , Δ l , Δ s , Δ ϕ
Output: n e w _ l o c a l _ t a r g e t
1:
Get the cost of local target from l o c a l _ c o s t m a p C l o c a l
2:
if C l o c a l > 0 then
3:
     V dir = ( v x , v y )
4:
     θ arctan v y v x
5:
     x g t x l t l sin θ
6:
     y g t y l t + l cos θ
7:
     θ g t θ + Δ θ
8:
    if  C g t > 0  then
9:
         s E u c l i d e a n _ d i s t a n c e ( r o b o t , l o c a l _ t a r g e t )
10:
       s e t i = 1
11:
      while  Δ θ i Δ ϕ > 0 and l i Δ l > 0 and s i Δ s > 0  do
12:
          x a s x g t + i Δ l cos ( π 2 θ )
13:
          y a s y g t i Δ l sin ( π 2 θ )
14:
          x s p x a s i Δ s cos θ
15:
          y s p y a s i Δ s sin θ
16:
          θ s p θ + Δ θ i Δ ϕ
17:
         if  C s p = = 0 then
18:
          return n e w _ l o c a l _ t a r g e t = ( x s p , y s p , θ s p )
19:
         end if
20:
          i = i + 1
21:
    end while
22:
  else
23:
     return g u i d e d _ t u r n i n g _ p o i n t = ( x g t , y g t , θ g t )
24:
   end if
25:
else
26:
   return l o c a l _ t a r g e t = ( x l t , y l t , θ l t )
27:
 end if

References

  1. Pikner, H.; Sell, R.; Karjust, K.; Malayjerdi, E.; Velsker, T. Cyber-physical control system for autonomous logistic robot. In Proceedings of the 2021 IEEE 19th International Power Electronics and Motion Control Conference (PEMC), Gliwice, Poland, 25–29 April 2021; pp. 699–704. [Google Scholar]
  2. Samaniego, R.; Rodríguez, R.; Vázquez, F.; López, J. Efficient path planing for articulated vehicles in cluttered environments. Sensors 2020, 20, 6821. [Google Scholar] [CrossRef] [PubMed]
  3. Mohanan, M.; Salgoankar, A. A survey of robotic motion planning in dynamic environments. Robot. Auton. Syst. 2018, 100, 171–185. [Google Scholar] [CrossRef]
  4. Mur-Artal, R.; Tardós, J.D. Orb-slam2: An open-source slam system for monocular, stereo, and rgb-d cameras. IEEE Trans. Robot. 2017, 33, 1255–1262. [Google Scholar] [CrossRef] [Green Version]
  5. Henry, P.; Krainin, M.; Herbst, E.; Ren, X.; Fox, D. RGB-D mapping: Using Kinect-style depth cameras for dense 3D modeling of indoor environments. Int. J. Robot. Res. 2012, 31, 647–663. [Google Scholar] [CrossRef] [Green Version]
  6. Thuruthel, T.G.; Shih, B.; Laschi, C.; Tolley, M.T. Soft robot perception using embedded soft sensors and recurrent neural networks. Sci. Robot. 2019, 4, eaav1488. [Google Scholar] [CrossRef]
  7. Pan, H.; Guo, C.; Wang, Z. Research for path planning based on improved astart algorithm. In Proceedings of the 2017 4th International Conference on Information, Cybernetics and Computational Social Systems (ICCSS), Dalian, China, 24–26 July 2017; pp. 225–230. [Google Scholar]
  8. Claussmann, L.; Revilloud, M.; Gruyer, D.; Glaser, S. A review of motion planning for highway autonomous driving. IEEE Trans. Intell. Transp. Syst. 2019, 21, 1826–1848. [Google Scholar] [CrossRef] [Green Version]
  9. Elbanhawi, M.; Simic, M. Sampling-based robot motion planning: A review. IEEE Access 2014, 2, 56–77. [Google Scholar] [CrossRef]
  10. Paden, B.; Čáp, M.; Yong, S.Z.; Yershov, D.; Frazzoli, E. A survey of motion planning and control techniques for self-driving urban vehicles. IEEE Trans. Intell. Veh. 2016, 1, 33–55. [Google Scholar] [CrossRef] [Green Version]
  11. Chi, W.; Ding, Z.; Wang, J.; Chen, G.; Sun, L. A Generalized Voronoi Diagram-Based Efficient Heuristic Path Planning Method for RRTs in Mobile Robots. IEEE Trans. Ind. Electron. 2021, 69, 4926–4937. [Google Scholar] [CrossRef]
  12. Liu, X.; Jing, Q.; Fang, L.; Jin, C.; Zhao, X. The planning of modern logistics park in Jilin city. In Proceedings of the 2011 Chinese Control and Decision Conference (CCDC), Mianyang, China, 23–25 May 2011; pp. 1757–1761. [Google Scholar]
  13. Guastella, D.C.; Muscato, G. Learning-based methods of perception and navigation for ground vehicles in unstructured environments: A review. Sensors 2020, 21, 73. [Google Scholar] [CrossRef]
  14. Nowakiewicz, M. MST-Based method for 6DOF rigid body motion planning in narrow passages. In Proceedings of the 2010 IEEE/RSJ International Conference on Intelligent Robots and Systems, Taipei, Taiwan, 18–22 October 2010; pp. 5380–5385. [Google Scholar]
  15. Wang, Z.; Shen, Y.; Zhang, L.; Zhang, S.; Zhou, Y. Towards Robust Autonomous Coverage Navigation for Carlike Robots. IEEE Robot. Autom. Lett. 2021, 6, 8742–8749. [Google Scholar] [CrossRef]
  16. 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. [Google Scholar] [CrossRef]
  17. 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–129. [Google Scholar] [CrossRef]
  18. Ferguson, D.; Howard, T.M.; Likhachev, M. Motion planning in urban environments. J. Field Robot. 2008, 25, 939–960. [Google Scholar] [CrossRef]
  19. LaValle, S.M. Rapidly-exploring random trees: A new tool for path planning. Mathematics 1998, 98, 303–307. [Google Scholar]
  20. Karaman, S.; Walter, M.R.; Perez, A.; Frazzoli, E.; Teller, S. Anytime motion planning using the RRT. In Proceedings of the 2011 IEEE International Conference on Robotics and Automation, Shanghai, China, 9–13 May 2011; pp. 1478–1483. [Google Scholar]
  21. Gammell, J.D.; Srinivasa, S.S.; Barfoot, T.D. Informed RRT*: Optimal sampling-based path planning focused via direct sampling of an admissible ellipsoidal heuristic. In Proceedings of the 2014 IEEE/RSJ International Conference on Intelligent Robots and Systems, Chicago, IL, USA, 14–18 September 2014; pp. 2997–3004. [Google Scholar]
  22. Xu, W.; Wei, J.; Dolan, J.M.; Zhao, H.; Zha, H. A real-time motion planner with trajectory optimization for autonomous vehicles. In Proceedings of the 2012 IEEE International Conference on Robotics and Automation, St. Paul, MN, USA, 14–18 May 2012; pp. 2061–2067. [Google Scholar]
  23. González, D.; Pérez, J.; Lattarulo, R.; Milanés, V.; Nashashibi, F. Continuous curvature planning with obstacle avoidance capabilities in urban scenarios. In Proceedings of the 17th International IEEE Conference on Intelligent Transportation Systems (ITSC), Qingdao, China, 8–11 October 2014; pp. 1430–1435. [Google Scholar]
  24. Farouki, R.T. Pythagorean—Hodograph Curves; Springer: Berlin/Heidelberg, Germany, 2008. [Google Scholar]
  25. Xiong, L.; Fu, Z.; Zeng, D.; Leng, B. An Optimized Trajectory Planner and Motion Controller Framework for Autonomous Driving in Unstructured Environments. Sensors 2021, 21, 4409. [Google Scholar] [CrossRef]
  26. Fan, H.; Zhu, F.; Liu, C.; Zhang, L.; Zhuang, L.; Li, D.; Zhu, W.; Hu, J.; Li, H.; Kong, Q. Baidu apollo em motion planner. arXiv 2018, arXiv:1807.08048. [Google Scholar]
  27. Rösmann, C.; Feiten, W.; Wösch, T.; Hoffmann, F.; Bertram, T. Trajectory modification considering dynamic constraints of autonomous robots. In Proceedings of the ROBOTIK 2012, 7th German Conference on Robotics, Munich, Germany, 21–22 May 2012; pp. 74–79. [Google Scholar]
  28. Sun, X.; Deng, S.; Tong, B. Trajectory Planning Approach of Mobile Robot Dynamic Obstacle Avoidance with Multiple Constraints. In Proceedings of the 2021 6th IEEE International Conference on Advanced Robotics and Mechatronics (ICARM), Chongqing, China, 3–5 July 2021; pp. 829–834. [Google Scholar]
  29. Wang, J.; Zhang, T.; Ma, N.; Li, Z.; Ma, H.; Meng, F.; Meng, M.Q.H. A survey of learning-based robot motion planning. IET Cyber-Syst. Robot. 2021, 3, 302–314. [Google Scholar] [CrossRef]
  30. Michalke, T.P.; Gläser, C.; Bürkle, L.; Niewels, F. The narrow road assistant-next generation advanced driver assistance in inner-city. In Proceedings of the 16th International IEEE Conference on Intelligent Transportation Systems (ITSC 2013), The Hague, The Netherlands, 6–9 October 2013; pp. 2173–2180. [Google Scholar]
  31. Takamatsu, Y.; Takada, Y.; Kishi, N. A narrow road driving assistance system based on driving style. In Proceedings of the 2017 IEEE International Conference on Systems, Man, and Cybernetics (SMC), Banff, AB, Canada, 5–8 October 2017; pp. 1669–1674. [Google Scholar]
  32. Sato, T.; Daimon, T.; Kawashima, H.; Kinoshita, M.; Ikeda, A. Fundamental study on human interface of narrow road drive assist system based on drivers’ cognitive process. JSAE Rev. 2003, 24, 189–196. [Google Scholar] [CrossRef]
  33. Tian, X.; Fu, M.; Yang, Y.; Wang, M.; Liu, D. Local Smooth Path Planning for Turning Around in Narrow Environment. In Proceedings of the 2019 IEEE 28th International Symposium on Industrial Electronics (ISIE), Vancouver, BC, Canada, 12–14 June 2019; pp. 1924–1929. [Google Scholar]
  34. Li, B.; Chen, B. An Adaptive Rapidly-Exploring Random Tree. IEEE/CAA J. Autom. Sin. 2021, 9, 283–294. [Google Scholar] [CrossRef]
  35. Rösmann, C.; Hoffmann, F.; Bertram, T. Timed-elastic-bands for time-optimal point-to-point nonlinear model predictive control. In Proceedings of the 2015 European Control Conference (ECC), Linz, Austria, 15–17 July 2015; pp. 3352–3357. [Google Scholar]
  36. Morari, M.; Lee, J.H. Model predictive control: Past, present and future. Comput. Chem. Eng. 1999, 23, 667–682. [Google Scholar] [CrossRef]
  37. Rösmann, C.; Feiten, W.; Wösch, T.; Hoffmann, F.; Bertram, T. Efficient trajectory optimization using a sparse model. In Proceedings of the 2013 European Conference on Mobile Robots, Barcelona, Spain, 25–27 September 2013; pp. 138–143. [Google Scholar]
  38. Quinlan, S. Real-Time Modification of Collision-Free Paths. Ph.D. Thesis, Stanford University, Stanford, CA, USA, 1995. [Google Scholar]
  39. Rösmann, C.; Hoffmann, F.; Bertram, T. Integrated online trajectory planning and optimization in distinctive topologies. Robot. Auton. Syst. 2017, 88, 142–153. [Google Scholar] [CrossRef]
  40. Marin-Plaza, P.; Hussein, A.; Martin, D.; de la Escalera, A. Global and local path planning study in a ROS-based research platform for autonomous vehicles. J. Adv. Transp. 2018, 2018, 6392697. [Google Scholar] [CrossRef]
  41. Keller, M.; Hoffmann, F.; Hass, C.; Bertram, T.; Seewald, A. Planning of optimal collision avoidance trajectories with timed elastic bands. IFAC Proc. Vol. 2014, 47, 9822–9827. [Google Scholar] [CrossRef]
  42. Ulbrich, F.; Goehring, D.; Langner, T.; Boroujeni, Z.; Rojas, R. Stable timed elastic bands with loose ends. In Proceedings of the 2017 IEEE Intelligent Vehicles Symposium (IV), Los Angeles, CA, USA, 11–14 June 2017; pp. 186–192. [Google Scholar]
  43. Smith, J.S.; Xu, R.; Vela, P. egoTEB: Egocentric, Perception Space Navigation Using Timed-Elastic-Bands. In Proceedings of the 2020 IEEE International Conference on Robotics and Automation (ICRA), Paris, France, 31 May–31 August 2020; pp. 2703–2709. [Google Scholar]
  44. Rösmann, C.; Hoffmann, F.; Bertram, T. Kinodynamic trajectory optimization and control for car-like robots. In Proceedings of the 2017 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Vancouver, BC, Canada, 24–28 September 2017; pp. 5681–5686. [Google Scholar]
  45. Quigley, M.; Conley, K.; Gerkey, B.; Faust, J.; Foote, T.; Leibs, J.; Wheeler, R.; Ng, A.Y. ROS: An open-source Robot Operating System. In Proceedings of the ICRA Workshop on Open Source Software, Kobe, Japan, 12–17 May 2009; p. 5. [Google Scholar]
  46. Rosmann, C.; Hoffmann, F.; Bertram, T. Online Trajectory Planning in ROS under Kinodynamic Constraints with Timed-Elastic-Bands. In Robot Operating System (ROS); Koubaa, A., Ed.; Studies in Computational Intelligence; Springer: Cham, Switzerland, 2017; Volume 707, pp. 231–261. [Google Scholar]
  47. LaValle, S.M. Planning Algorithms; Cambridge University Press: Cambridge, UK, 2006. [Google Scholar]
  48. Kümmerle, R.; Grisetti, G.; Strasdat, H.; Konolige, K.; Burgard, W. G2o: A general framework for graph optimization. In Proceedings of the 2011 IEEE International Conference on Robotics and Automation, Shanghai, China, 9–13 May 2011; pp. 3607–3613. [Google Scholar]
Figure 1. Workflow comparison. (a) is the workflow of the TEB method. (b) is the NRTEB workflow. The two modules in blue represent improvements in the outer planning loop, corresponding to contributions 3 and 4. The orange module represents improvements in the inner planning loop, corresponding to contribution 2.
Figure 1. Workflow comparison. (a) is the workflow of the TEB method. (b) is the NRTEB workflow. The two modules in blue represent improvements in the outer planning loop, corresponding to contributions 3 and 4. The orange module represents improvements in the inner planning loop, corresponding to contribution 2.
Sensors 22 08948 g001
Figure 2. Robot kinematic model.
Figure 2. Robot kinematic model.
Sensors 22 08948 g002
Figure 3. (a) A minimum hyper-graph considering jerk. (b) A simplified structure of the NRTEB hyper-graph. Circles represent optimized vertices and rectangles represent constrained hyperedges. Every seven adjacent vertices have a jerk super-edge, thus limiting the jerk of the whole trajectory.
Figure 3. (a) A minimum hyper-graph considering jerk. (b) A simplified structure of the NRTEB hyper-graph. Circles represent optimized vertices and rectangles represent constrained hyperedges. Every seven adjacent vertices have a jerk super-edge, thus limiting the jerk of the whole trajectory.
Sensors 22 08948 g003
Figure 4. Reverse trajectory comparison. The blue dashed line indicates the global path. The red dashed line is the parking trajectory of the TEB. The green dashed line is the direct reversing trajectory of NRTEB. The arrow indicates the heading of the path point.
Figure 4. Reverse trajectory comparison. The blue dashed line indicates the global path. The red dashed line is the parking trajectory of the TEB. The green dashed line is the direct reversing trajectory of NRTEB. The arrow indicates the heading of the path point.
Sensors 22 08948 g004
Figure 5. Relationship between the location of given points and the robot.
Figure 5. Relationship between the location of given points and the robot.
Sensors 22 08948 g005
Figure 6. An obstacle avoidance strategy to cope with dynamic obstacles falling on local targets.
Figure 6. An obstacle avoidance strategy to cope with dynamic obstacles falling on local targets.
Sensors 22 08948 g006
Figure 7. The geometric relationship between the obstacle avoidance parameters and the robot turning radius.
Figure 7. The geometric relationship between the obstacle avoidance parameters and the robot turning radius.
Sensors 22 08948 g007
Figure 8. The trajectory generated by NRTEB. The curve is the motion trajectory and the arrows represent the heading angle of the planning state.
Figure 8. The trajectory generated by NRTEB. The curve is the motion trajectory and the arrows represent the heading angle of the planning state.
Sensors 22 08948 g008
Figure 9. Comparison of MPC, TEB, and NRTEB in the path, heading angle, linear velocity, and angular velocity.
Figure 9. Comparison of MPC, TEB, and NRTEB in the path, heading angle, linear velocity, and angular velocity.
Sensors 22 08948 g009
Figure 10. Motion curves with different planning parameters.
Figure 10. Motion curves with different planning parameters.
Sensors 22 08948 g010
Figure 11. The simulation environment. The green curve represents the global path recorded in advance. The red curve with arrows represents the motion trajectory and the blue arrow indicates the local target.
Figure 11. The simulation environment. The green curve represents the global path recorded in advance. The red curve with arrows represents the motion trajectory and the blue arrow indicates the local target.
Sensors 22 08948 g011
Figure 12. The traces of the robot’s odometry. The gray dashed line is the global reference path that was pre-recorded and published in the experiment. The starting pose is ( 1 , 1 , 0 ) T and the ending pose is ( 1 , 9 , π ) T .
Figure 12. The traces of the robot’s odometry. The gray dashed line is the global reference path that was pre-recorded and published in the experiment. The starting pose is ( 1 , 1 , 0 ) T and the ending pose is ( 1 , 9 , π ) T .
Sensors 22 08948 g012
Figure 13. (a) Reversing trajectory generated by TEB. The red arrow represents the pose of the trajectory point and the blue arrow indicates the local target. (b) TEB’s reversing planning results in a narrow corner. (c) The straight reversing trajectory generated by NRTEB. (d) The comparison of the global path generated by A* algorithm and the reversing path with the NRTEB.
Figure 13. (a) Reversing trajectory generated by TEB. The red arrow represents the pose of the trajectory point and the blue arrow indicates the local target. (b) TEB’s reversing planning results in a narrow corner. (c) The straight reversing trajectory generated by NRTEB. (d) The comparison of the global path generated by A* algorithm and the reversing path with the NRTEB.
Sensors 22 08948 g013
Figure 14. Self-developed autonomous ground vehicle.
Figure 14. Self-developed autonomous ground vehicle.
Sensors 22 08948 g014
Figure 15. The real-world experiment. The blue line is the global reference path. The curve composed of red arrows is the result of the motion trajectory. The blue arrow represents the local target generated by NRTEB planner. The green sphere represents the tracking point selected in the local trajectory for the controller.
Figure 15. The real-world experiment. The blue line is the global reference path. The curve composed of red arrows is the result of the motion trajectory. The blue arrow represents the local target generated by NRTEB planner. The green sphere represents the tracking point selected in the local trajectory for the controller.
Sensors 22 08948 g015
Figure 16. Real-world experimental results. (ad) Are the pictures captured by the camera, (a,b) perform obstacle avoidance tests with pedestrians. (c,d) Are taken by the camera fixed on the back of the AGV. (d) Is used to test reverse obstacle avoidance. (eh) Are the screenshots taken from Rviz when running TEB planner. (il) Are the screenshots when running the NRTEB planner.
Figure 16. Real-world experimental results. (ad) Are the pictures captured by the camera, (a,b) perform obstacle avoidance tests with pedestrians. (c,d) Are taken by the camera fixed on the back of the AGV. (d) Is used to test reverse obstacle avoidance. (eh) Are the screenshots taken from Rviz when running TEB planner. (il) Are the screenshots when running the NRTEB planner.
Sensors 22 08948 g016
Table 1. Kino-dynamic parameters and optimization parameters.
Table 1. Kino-dynamic parameters and optimization parameters.
Constraint ParametersValuesApplication Scope
Maximum linear velocity (m/s)0.4MPC, TEB, NRTEB
Maximum angular velocity (m/s)0.3MPC, TEB, NRTEB
Maximum linear acc (m/s 2 )0.5MPC, TEB, NRTEB
Maximum angular acc (rad/s 2 )0.5MPC, TEB, NRTEB
Minimum distance to obstacle (m)0.5MPC, TEB, NRTEB
Maximum linear jerk (m/s 3 )0.1NRTEB
Maximum angular jerk (rad/s 3 )0.1NRTEB
The weight of linear velocity ( γ v )1.0TEB, NRTEB
The weight of angular vel ( γ ω )1.0TEB, NRTEB
The weight of linear acc ( γ a v )1.0TEB, NRTEB
The weight of angular acc ( γ a ω )1.0TEB, NRTEB
The weight of linear jerk ( γ J v )1.0NRTEB
The weight of angular jerk ( γ J ω )1.0NRTEB
The weight of states [ 2.0 , 2.0 , 2.0 ] MPC
The weight of controls [ 1.0 , 1.0 ] MPC
Table 2. Simulation Parameters.
Table 2. Simulation Parameters.
Constraint ParametersValues
Maximum linear velocity (m/s)0.5
Maximum angular velocity (m/s)0.5
Maximum linear acc (m/s 2 )1.0
Maximum angular acc (rad/s 2 )1.0
Maximum linear jerk (m/s 3 )2.0
Maximum angular jerk (rad/s 3 )2.0
Local costmap size (m 2 )5 × 5
Local costmap update frequency (Hz)10.0
robot footprint size (m 2 )0.4 × 0.2
Maximum steering angle (rad)0.785
Motion planning frequency (Hz)10.0
Table 3. Path length and average lateral tracking error.
Table 3. Path length and average lateral tracking error.
MPCTEBNRTEB
Path length (m)23.18623.50723.644
Average lateral tracking error (m)0.0940.0620.071
Table 4. Planning performance statistics.
Table 4. Planning performance statistics.
MinMaxAverage (abs)
MPC J v −1.0011.0040.072
J ω −2.5901.4860.197
T0.041488.954154.117
TEB J v −1.0921.0900.146
J ω −2.3312.7970.251
T0.04515.5081.488
NRTEB J v −0.2950.3090.065
J ω −0.5620.7380.070
T0.05018.9202.069
J v (m/s3): The linear jerk. J ω (rad/s3): The angular jerk. T (ms): Planning time consumption.
Table 5. Electronic components.
Table 5. Electronic components.
ComponentsProduct Model
IPCNVIDIA Jetson Xavier NX
GNSSCHCNAV CGI410
LiDAR (front)RoboSense-RS-LiDAR-16
LiDAR (back)LEME-02A
CameraNetcan 1080p
4G wirelessQUECTEL
Vehicle control unitself-developed
Table 6. Vehicle chassis parameters.
Table 6. Vehicle chassis parameters.
Chassis ParametersValues
Track (m)0.60
Wheelbase (m)0.98
Maximum steering angle (rad)0.52
Minimum turning radius (m)1.70
Rated load (kg)200
Maximum velocity (m/s)2.80
Maximum acceleration (no load) (m/s 2 )2.5
Rated acceleration (m/s 2 )0.77
Envelope size (m 3 ) 1.30 × 0.70 × 0.46
Table 7. NRTEB parameters.
Table 7. NRTEB parameters.
Planner ParametersValues
γ J v 1.0
γ J ω 1.0
l (m)1.0
Δ θ ( )60
Lookahead_dist (m)4.0
Maximum linear velocity (forward) (m/s)2.50
Maximum linear velocity (backward) (m/s)1.50
Maximum angular velocity (rad/s)0.50
Maximum acceleration (m/s 2 )0.75
Maximum linear jerk (m/s 3 )1.0
Maximum angular jerk (rad/s 3 )0.5
Minimum turning radius (m)1.70
Minimum distance to obstacle (m)0.5
Local costmap size (m 2 ) 4 × 4
Local costmap update frequency (Hz)10.0
Motion planning frequency (Hz)10.0
γ J v : The weight of linear jerk. γ J ω : The weight of angular jerk. l: The lateral obstacle avoidance distance. Δ θ : The amount of angle change.
Table 8. Planning performance statistics.
Table 8. Planning performance statistics.
MinMaxAverage (abs)
TEB J v −1.3681.1730.154
J ω −2.5652.6570.362
T10.854117.14250.627
Δ T 217.514
NRTEB J v −0.2740.2980.062
J ω −0.5750.7430.071
T11.947120.62053.613
Δ T 239.265
J v (m/s3): The linear jerk. J ω (rad/s3): The angular jerk. T (ms): Planning time consumption. Δ T (s): Time taken to run a complete navigation process.
Publisher’s Note: MDPI stays neutral with regard to jurisdictional claims in published maps and institutional affiliations.

Share and Cite

MDPI and ACS Style

Yu, L.; Wu, H.; Liu, C.; Jiao, H. An Optimization-Based Motion Planner for Car-like Logistics Robots on Narrow Roads. Sensors 2022, 22, 8948. https://doi.org/10.3390/s22228948

AMA Style

Yu L, Wu H, Liu C, Jiao H. An Optimization-Based Motion Planner for Car-like Logistics Robots on Narrow Roads. Sensors. 2022; 22(22):8948. https://doi.org/10.3390/s22228948

Chicago/Turabian Style

Yu, Lingli, Hanzhao Wu, Chongliang Liu, and Hao Jiao. 2022. "An Optimization-Based Motion Planner for Car-like Logistics Robots on Narrow Roads" Sensors 22, no. 22: 8948. https://doi.org/10.3390/s22228948

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