Next Article in Journal
Field Representation Microwave Thermography Utilizing Lossy Microwave Design Materials
Next Article in Special Issue
Optimal Deployment of Charging Stations for Aerial Surveillance by UAVs with the Assistance of Public Transportation Vehicles
Previous Article in Journal
Janus Hydrogel Microbeads for Glucose Sensing with pH Calibration
Previous Article in Special Issue
General Purpose Low-Level Reinforcement Learning Control for Multi-Axis Rotor Aerial Vehicles
 
 
Font Type:
Arial Georgia Verdana
Font Size:
Aa Aa Aa
Line Spacing:
Column Width:
Background:
Communication

Trajectory Planner CDT-RRT* for Car-Like Mobile Robots toward Narrow and Cluttered Environments

School of Mechanical Engineering, Korea University, Seoul 02841, Korea
*
Author to whom correspondence should be addressed.
Sensors 2021, 21(14), 4828; https://doi.org/10.3390/s21144828
Submission received: 11 May 2021 / Revised: 9 July 2021 / Accepted: 12 July 2021 / Published: 15 July 2021

Abstract

:
In order to achieve the safe and efficient navigation of mobile robots, it is essential to consider both the environmental geometry and kinodynamic constraints of robots. We propose a trajectory planner for car-like robots on the basis of the Dual-Tree RRT (DT-RRT). DT-RRT utilizes two tree structures in order to generate fast-growing trajectories under the kinodynamic constraints of robots. A local trajectory generator has been newly designed for car-like robots. The proposed scheme of searching a parent node enables the efficient generation of safe trajectories in cluttered environments. The presented simulation results clearly show the usefulness and the advantage of the proposed trajectory planner in various environments.

1. Introduction

Recently, outdoor mobile robots have been receiving much attention because of the increased demand in the field of delivery and transportation. There are various wheel structures built according to target applications and environments. Two-wheel differential robots have been widely used owing to their simple structures. However, two-wheel robots have a lot of limitations in outdoor applications because it is difficult to overcome uneven ground conditions. Car-like robots are preferred in outdoor applications. The major drawback of car-like robots is that control problems become difficult due to nonholonomic constraints.
Path planning schemes are divided into two major groups. The first group includes search-based schemes and the second group includes sampling-based approaches. The search-based planner divides a space into small units such as grid-like graph structures or state lattice space as presented in [1]. Then, various search algorithms, including the Dijkstra’s algorithm, A* in [2] and D* in [3], can be applied to find solutions. Optimality can be obtained at the price of high computational cost. The search-based planner for various types of robots was proposed in [4,5]. The state lattice-based motion planning was applied not only to ground vehicles in [6], but also to aerial vehicles in [7].
The sampling-based planner extends trees or graph structures as shown in [8,9], respectively. Rapidly exploring Random Tree (RRT), shown in [10], is widely used because RRT may efficiently find feasible paths in high dimensional spaces with low computational cost as shown in [11,12,13]. Recently, RRT solutions in high dimensional spaces, such as temporal logic specifications, were proposed in [14].
Conventional RRTs showed many limitations mainly because the resultant RRT paths were generated without reflecting nonholonomic constraints. Recently, RRTs under the consideration of kinodynamic constraints have been proposed, as in [15,16,17,18,19].
There are two main issues in kinodynamic planning on the basis of RRTs. The first issue is to design proper sampling methods for the fast extension of random trees. In [20,21], sampling methods for RRT were proposed. The second issue is to define an appropriate distance metric for evaluating candidate paths. As Lavalle pointed out in [22], the distance metric considerably affects the performance of RRT planners. Euclidian distances in planes are commonly used when the fast expansion of the tree is significant. However, the consideration of kinodynamic constraints is essential in order to obtain efficient and feasible paths. Sampling in the control input space in [23] is one useful candidate. The planner in [23] requires an additional search algorithm in order to find the nearest neighbor nodes. The cost metric for informed RRT was proposed in [24].
As one of the outcomes of the Defense Advanced Research Projects Agency Urban Challenge, the closed loop Rapidly exploring Random Tree (CL-RRT) [25] was proposed. The CL-RRT generated reference guidelines through random sampling. CL-RRT generated feasible trajectories in the finite road region with the guidelines. CL-RRT mainly focused on autonomous vehicles in the road environment. A sampling technique was especially designed for roadways and parking lots.
The RRT* algorithm in [26] was proposed towards optimal path planning. A rewiring procedure of RRT* guaranteed asymptotic convergence to optimal solutions with a proper nearest range limit. Various planners based on RRT* were proposed in [27,28]. An RRT*-based planner was proposed for the high-speed maneuvering of autonomous vehicles in [23]. The scheme in [23] considered dynamic constraints including slip conditions. The distance metrics in [23] were designed for a relatively simple roadway without obstacles.
The Dual-Tree Rapidly exploring Random Tree (DT-RRT) was proposed for two-wheel differential mobile robots in [29]. DT-RRT utilized two separate trees with different distance metrics. DT-RRT efficiently generated feasible trajectories and local control inputs. A re-planning algorithm and tree updating process support real-time trajectory generation by reflecting the latest sensor information.
This paper aims to generate a feasible trajectory for car-like mobile robots in cluttered environments. Various planners were proposed for handling kinodynamic constraints or the fast extension of RRT. However, it is difficult to find the existing controller that is appropriate for a car-like robot in cluttered environments. Since the target application is the outdoor delivery robots, target environments are different from the environments of autonomous vehicles. Therefore, we propose the new path planning and motion control scheme CDT-RRT*, which is especially designed for car-like mobile robots. CDT-RRT* provides feasible trajectories and control inputs. CDT-RRT* can generate a kinodynamically feasible and goal-reachable trajectory with low computational cost. We propose a new parent searching algorithm of the dual-tree structure. The proposed replanning procedure includes re-propagation and tree-branching. Owing to the new searching algorithm, CDT-RRT* shows an outstanding performance in cluttered and narrow environments. The presented simulation results clearly demonstrate advantages over prior works.
The rest of this paper is organized as follows: Section 2 introduces the kinematic model and DT-RRT in [29]. The proposed CDT-RRT* scheme is presented in Section 3. The simulation results are presented in Section 4. Some concluding remarks are illustrated in Section 5.

2. The Kinematic Model and Dual-Tree RRT

2.1. Kinematic Model of a Car-Like Robot

The kinematic model of a car-like robot is shown in Figure 1. The reference point of the robot pose is on the center of the rear axle.
x ˙ = x ˙ y ˙ θ ˙ δ ˙ v ˙ = v c o s ( θ ) v s i n ( θ ) v L t a n ( δ ) 0 0 + 0 0 0 0 1 u 1 + 0 0 0 1 0 u 2
Equation (1) is the kinematic model of car-like robots. The state vector x = ( x , y , θ , δ , v ) T is a five-tuple that is composed of a robot pose, steering angle δ and translational velocity v. Control inputs are subject to the conditions u 1 [ a m a x , a m a x ] and u 2 [ δ m a x , δ m a x ] .
The workspace is defined by q R 2 where q = ( x , y ) . It is assumed that maps and obstacles are updated in real-time. The objective of the controller is to generate feasible trajectories τ : [ 0 , T ] C f r e e in finite time. The initial and goal conditions are given by τ ( 0 ) = x ( 0 ) and τ ( T ) B g o a l , respectively, whereas B g o a l = { x | q g o a l x < ϵ } . L f w , l fw and η are control parameters that will be explained in Section 3.1. The target point implies the desired target point for forward simulations.

2.2. Dual-Tree RRT

The Dual-Tree RRT (DT-RRT) was proposed in [29]. The dual-tree signifies the workspace tree and the state tree. The workspace tree is generated in 2D space q = ( x , y ) . The distance metric is the Euclidean distance in a 2D plane. The workspace tree can be quickly extended by the node sampling technique that is similar to the conventional RRT. The state tree is generated in the state space x = ( x , y , θ , δ , v ) T . The cost is defined as the travel time of a candidate trajectory that is generated by reflecting the kinodynamic constraints of a robot. Therefore, smooth trajectories can be quickly generated by DT-RRT.
The workspace tree is extended by sampling new nodes. The state tree is extended by the utilization of newly created workspace tree nodes. During the extension, the lowest cost trajectory is selected out of many candidates. The quality of a trajectory is remarkably improved through the proposed parent node search and the reconnecting process.
The state node of DT-RRT has two node types including a stop state and a moving state. The stop state represents the state in which the robot has zero velocity, and a moving state represents the non-zero velocity. Four edge types of state trees generate a sequence of discrete motions, including turn-on-the-spot in cluttered environments. With the four edge types of DT-RRT, holonomic trajectories can be generated, and the probabilistic completeness of DT-RRT is guaranteed.

3. Car-like DT-RRT* (CDT-RRT*)

3.1. Motion Controller for Trajectory Generations

The major scope of this paper is to propose CDT-RRT* (Car-like DT-RRT*), which computes the control inputs of car-like mobile robots towards smooth and efficient motions. Two motion controllers in [30,31] were adopted in DT-RRT. Since the kinodynamic characteristics of car-like robots are completely different, motion controllers should be carefully redesigned.
The Pure-Pursuit Controller (PPC) in [32] was exploited as a local motion controller for CDT-RRT*. PPC has been widely used for the trajectory tracking of car-like robots and vehicles as shown in [25]. PPC does not guarantee that a robot can be steered to the desired target pose. Therefore, it is important to investigate whether PPC can be a useful local controller when target positions are given from the workspace tree. The control input of PPC in CDT-RRT* is redesigned as follows.
δ = t a n 1 L s i n η L f w 2 + l fw c o s η
v = m i n ( v r e f v c , a m a x · t c y c l e )
δ denotes a steering angle input. L f w is a look ahead distance. l fw is the distance from the rear axle to the forward anchor point. η is the heading of the look-ahead point from the forward anchor point [25].
v denotes a velocity input of car-like robots. v r e f is a reference linear velocity. Maximum speed trajectories will be generated when v r e f = v m a x . t c y c l e is the cycle time of the controller.
The local controller computes control inputs through forward simulations. A local controller should satisfy three requirements. Firstly, the local controller should be able to cope with the changes in path length and velocity through appropriate parameter adjustment. The second requirement is that the final positioning error should be acceptably small. Finally, the positioning errors should converge through iterations.
In order to investigate whether PPC satisfies three requirements, simulations are carried out. Figure 2 shows the simulation results. The robot is driven to 35 target positions from the origin through the PPC. If the final positioning error is smaller than 10 cm, then the positioning is successful. We assume that the proposed method will be applied to outdoor delivery robots. The positioning accuracy of 10 cm is sufficient for an outdoor delivery robot because the human will handle the loading and unloading procedures. From Figure 2, it is clear that smooth trajectories are generated with small final positioning errors. Final positioning errors at all positions did not exceed 10 cm. The mean of the final positioning errors was 8.58 cm.
The state node of CDT-RRT* has two node types including a stop node and a moving node. The stop node is generated around the neighborhood of obstacles. The move node is generated in collision-free space. An edge type between two nodes is defined by the node type of a parent node and a child node.
There are four edge types in CDT-RRT*, including stop-move, stop-stop, move-move and move-stop. At each node, various different motion primitives can be selected according to the node types. By the selection of stop-move or stop-stop, CDT-RRT* generates a variety of trajectories that include stopping motions. This fact implies that rich behavior can be obtained by the sequential combination of piecewise smooth motions.

3.2. Dual-Tree Structure of CDT-RRT*

Tree extension puts an emphasis on fast-growing and tree restructuring plays a significant role in improving performance. Restructuring is composed of the parent node search and reconnect processes. The parent node search of the conventional DT-RRT started from the closest node to the newly created node q n e w . Then the least cost trajectory was selected out of multiple candidate trajectories that were generated from parent nodes to q n e w .
Figure 3 illustrates the difference between the conventional DT-RRT and the proposed CDT-RRT*. Black trees are workspace trees. Dashed red lines show state trees. Once new node q n e w is created, the conventional DT-RRT connects between q n e w and parent nodes of closest node q n 1 as shown in Figure 3a. Nodes with blue circles in Figure 3a correspond to parent nodes. Figure 3b shows that the trajectory from q n 3 to q n e w was selected because of the lowest cost.
Although DT-RRT showed excellent performances in many practical applications, there are also limitations. One of the drawbacks is its limited restructuring capability. Since DT-RRT only selects the closest parent node, a better solution can be found according to the strategy of the parent node selection.
The proposed CDT-RRT* adopts multiple parent node candidates. As shown in Figure 3c, Q n e a r l i s t is defined as the close neighborhood of q n e w in the range of B r . Then all nodes Q n e a r l i s t = { q n 1 , q n 2 } in Figure 3c become parent node candidates. Finally, the minimum cost trajectory is selected out of all candidate trajectories from all parent nodes to q n e w .
Algorithm 1 shows the proposed tree extension scheme. TW and TX are the workspace tree and the state tree. RandomSample() randomly picks a single point in 2D workspace (x,y). ExtWorkSpace ( TW , q r a n d ) finds Q n e a r , which is a nearest neighbor of q r a n d . ExtWorkSpace ( TW , q r a n d ) connects Q n e a r to Q n e w . Q n e w is generated by q r a n d and has a position q n e w = ( x n e w , y n e w ) . The position of q n e w can be different from q r a n d , because q n e w moved towards Q n e a r by the maximum length of the tree extension. The subroutine NearNodeList ( Q n e w , B r ) finds the near nodes of Q n e w in the range of B r . TW . Add ( Q n e a r , Q n e w ) implies that the workspace tree obtains a new child node Q n e w . The parent node of Q n e w is Q n e a r . TX . Add ( X p , X m i n ) implies that the state tree acquires new child node X m i n . The parent node of X m i n is X p . ReConnectTrees ( Q n e w , X m i n ) restructures the state tree after the addition of new nodes. Existing state nodes nearby X m i n are temporarily connected from X m i n , while ReConnectTrees ( Q n e w , X m i n ) operates. If the cost of a temporarily connected path is lower than the original cost, the existing state node will be reconnected as a child of X m i n .
Algorithm 2 describes the proposed strategy of selecting parent nodes for restructuring. Algorithm 2 returns minimum cost parent node X p after computing all trajectory costs from candidate nodes to q n e w . GetStateNode ( Q n e a r ) returns the state node that is derived from the workspace node Q n e a r . ExtendState ( q new , X cur , type ) generates a trajectory from X c u r to q n e w in the range of e r . The proposed motion controller in Section 3.1 is employed for trajectory generation. q n e w is the target point of the forward simulation in Figure 1.
Algorithm 1 BuildTree* ( q 0 , x 0 , g o a l )
TW . INIT ( q 0 , g o a l ) ;
TX . INIT ( x 0 , g o a l ) ;
while  t l i m i t  do
   q r a n d  RandomSample();
   [ Q n e w , Q n e a r , t y p e ]  ExtWorkSpace ( TW , q r a n d ) ;
   Q n e a r l i s t  NearNodeList ( Q n e w , B r )
   [ X p , X m i n ]  FindParentState* ( Q n e a r l i s t , q n e w , t y p e ) ;
  if  X p = n i l  then
    continue ;
  end if
   TW . Add ( Q n e a r , Q n e w ) ;
   TX . Add ( X p , X m i n ) ;
  ReConnectTrees ( Q n e w , X m i n ) ;
end while
return ;
B r is a boundary of near nodes. It affects path quality and planning time. Large B r increases the number of candidate nodes. Therefore, the path quality can be improved and the computational cost of planning increases with the increase of B r . Small B r may save planning time at the sacrifice of the path quality. In RRT* [26], a scheme that dynamically decreased B r was proposed. The asymptotic optimality of RRT-based planning with decreasing B r was shown in [26]. The determination of B r in CDT-RRT* exploited a similar approach of the conventional RRT*.
B r = m i n { γ R R T * ( l o g ( c a r d ( V ) ) / c a r d ( V ) ) 1 / d , η } γ R R T * = 2 ( 1 + 1 / d ) 1 / d ( μ ( X f r e e ) / ζ d ) 1 / d
Algorithm 2 FindingParentState* { Q n e a r l i s t , q n e w , t y p e }
X p , X m i n n i l ;
c o s t m i n i n f ;
for all  Q n e a r Q n e a r l i s t  do
   X c u r  GetStateNode ( Q n e a r ) ;
   [ X n e w , e r , c o s t ]  ExtendState ( q new , X cur , type )
  if  e r B r and c o s t c o s t m i n  then
    [ X p , X m i n , c o s t m i n ] [ X c u r , X n e w , c o s t ] ;
  end if
end for
return X p , X m i n ;
As described in [26], c a r d ( V ) is a cardinal number of workspace tree size. d is a dimension of the workspace, which is two in CDT-RRT*. μ ( X f r e e ) denotes the Lebesgue measure of the obstacle-free space, and ζ d is the volume of the unit ball in the d-dimensional Euclidean space. η is provided by the local steering function, which is ExtendState in CDT-RRT*. η of CDT-RRT* is 3 × the maximum length of the tree extension (which is 3 m).
In Figure 3c, the proposed CDT-RRT* selects q n 2 in addition to q n 1 as the parent node candidates. DT-RRT selected only q n 1 and parent nodes of q n 1 under the same condition as shown in Figure 3a. Figure 3d shows the completely different trajectory of the proposed CDT-RRT*. The resultant trajectory cost of CDT-RRT* is significantly lower than the cost of the DT-RRT trajectory in Figure 3b. The major advantage of CDT-RRT* is that restructuring is carried out with a wide variety of diverse candidate trajectories. Therefore, CDT-RRT* shows superior performances over prior works, especially in narrow and cluttered environments, because the minimum cost trajectory can be efficiently found from many trajectories with different homotopy.
CDT-RRT* includes replanning procedures for practical trajectory following. The replanning algorithm carries out translation of the existing tree to deal with localization error and disturbance of the controller. After translation of the whole tree, the lowest cost trajectory to the goal is selected. Then, collision checking for the lowest cost trajectory is carried out. If any collision occurs due to a map update or translation of the tree, unreachable nodes due to the collision are deleted. Then, the remaining orphan nodes are reconstructed based on the workspace tree. This reconstruction possibly saves planning time owing to the conservation of orphan nodes. The branching tree sequence is carried out after reconstruction. While branching the tree, the root node of the tree is generated as the robot moves forward.
Table 1 shows the qualitative comparison among kinodynamic planners. Six significant considerations are summarized towards kinodynamic planning in cluttered environments. Table 1 clearly visualizes unsolved problems and the differences among controllers. It is clear that the proposed CDT-RRT* is advantageous from a variety of aspects. CDT-RRT* can handle the kinodynamic constraints of car-like robots and generate piecewise smooth motions. By sampling in the R 2 configuration space, CDT-RRT* could extend the tree rapidly with goal bias. The proposed parent node selection and re-connect scheme greatly contribute to finding asymptotic optimal trajectories in cluttered environments. The proposed replanning scheme can maintain the dual-tree structure by conserving orphan nodes while robots keep moving and updating sensor information.

4. Simulation Results

Seven simulations are carried out for verification. Simulation conditions are listed in Table 2.
Figure 4 shows the result of simulation 1. Boundary conditions of simulation 1 were initial condition x s = ( 10 , 10 , 0 , 0 , 0 ) and goal q g = ( 40 , 40 ) . The environment was free of obstacles. Three schemes were tested for comparison. One was the conventional RRT, the second was the conventional DT-RRT and the third was the proposed CDT-RRT*. Each scheme tried to generate 100 trajectories. If a trajectory could not be generated in 30 s, the trial was counted as a failure. In Table 3, the computing time indicates the required time to compute a single trajectory. The travel time indicates the moving time along the trajectory from the start to the goal. The failure count signifies the number of the failed trials out of 100 trajectory generations.
The conventional RRT was implemented for comparison. The conventional RRT sampled a random point in the 2-dimensional configuration space. The sampled point and the nearest node of the sampled point were connected by ExtendState of CDT-RRT*. If the connection fails, the conventional RRT samples another point until finding a feasible path. The conventional RRT showed a significantly low success rate of node extension.
From Table 3, it can be seen that the success rate of RRT trajectory generation was only 34%. The travel time and computing time were much longer than those of DT-RRT or CDT-RRT*. In the case of a car-like robot, the limitation of steering angles limits the motion of the robot. Therefore, most of the newly created RRT nodes become infeasible because new nodes were generated without consideration of kinematic constraints. It is desirable to obtain smooth and efficient trajectories from the viewpoint of quality. From Figure 4a, it is clear that the quality of RRT trajectories is poor. The poor performance of RRT was caused by the lack of restructuring processes.
Table 3 shows that DT-RRT and CDT-RRT* successfully generated 100 trajectories without any failure. This result was made possible owing to the application of local controllers where kinodynamic constraints were considered. From the viewpoint of trajectory quality, there were no significant differences between DT-RRT and CDT-RRT* in the obstacle-free environment. Figure 4b,c show that the two schemes have similar performances and provide satisfactory results.
Simulation 2 was carried out to investigate the trajectory expansion of CDT-RRT*. Figure 5 shows the planning result of CDT-RRT* in simulation 2. The blue lines show the state tree of CDT-RRT*. The thick red line indicates the solution path. The grey circle describes the goal region. CDT-RRT* returns the path nearest to the goal until securing a goal-reachable path as shown in Figure 5a,b. The cost of the solution path increased during that period as shown in zone (A) of Figure 6. After securing a goal-reachable path as in Figure 5c, the tree of CDT-RRT* kept extending and searching for a better solution, as shown in zone (B). If CDT-RRT* finds a lower-cost solution, the cost decreases as shown in zone (C).
Simulation 3 was carried out in the consecutive U-shaped corridor environment as shown in Figure 7. In simulation 2, the robot was driven from x s = ( 3 , 40 , 0 , 0 , 0 ) to q g = ( 95 , 20 ) . Table 4 shows the quantitative results of the comparison. It can be seen that RRT could not generate trajectories in most cases. Therefore, RRT is inapplicable in the cluttered environment, as in Figure 7. It is noteworthy that the success rate of CDT-RRT* trajectory generation was 100%, while the success rate of DT-RRT was only 74%. In addition, the computing time of the trajectories can be remarkably saved by the use of CDT-RRT*. The mean computing time of CDT-RRT* is only 23% of DT-RRT’s computing time. Figure 8 shows the histograms of the computing times for DT-RRT and CDT-RRT*. It can be seen that solutions can be obtained in a short time for the case of CDT-RRT*. From the result, it is evident that the proposed CDT-RRT* shows superior performances in a cluttered environment owing to its excellent restructuring capability. The high success rate of trajectory generation and reduced computing cost enable real-time computation and high-speed obstacle avoidance motions.
Simulation 4 was carried out in the cluttered narrow environment as shown in Figure 9. The robot was driven from x s = ( 10 , 25 , 0 , 0 , 0 ) to q g = ( 85 , 25 ) . Table 5 shows the result of a quantitative comparison among the three schemes. It is obvious that RRT fails to generate feasible trajectories because the success rate of trajectory generation is only 1%. The failure rate of DT-RRT is 23% and it is much higher than the 3% failure rate of CDT-RRT*. The computing time of DT-RRT was 50% longer than that of CDT-RRT*. Figure 10 shows the histograms of the computing times for DT-RRT and CDT-RRT*. It can be seen that we can expect quick and stable performances for CDT-RRT* in most trials. Although the travel time of the two schemes did not show a significant difference, the difference in terms of the computing time and the success rate greatly affects the real-time performance of robot navigation.
Simulation 5 was carried out in the maze environment as shown in Figure 11. The robot was driven from x s = ( 5 , 55 , 0 , 0 , 0 ) to q g = ( 85 , 5 ) . Table 6 shows the comparative results among the three schemes. RRT showed complete failure in the long cluttered environment. The proposed CDT-RRT* did not fail to find the trajectory in any trial, while the failure rate of DT-RRT was 36%. The mean computing time of DT-RRT was 2.2 times longer than that of CDT-RRT*. Figure 12 shows the histograms of the computing times for DT-RRT and CDT-RRT*. It is evident that all CDT-RRT* trajectories were obtained in a short time, while DT-RRT showed excessive computing time and unstable performances in many trials. From the viewpoint of the mean travel time, CDT-RRT* took only 66 s, while DT-RRT took 72 s—10% longer than that of the proposed method.
Simulation 6 was carried out in a cluttered environment as shown in Figure 13. The robot was driven from x s = ( 5 , 25 , 0 , 0 , 0 ) to q g = ( 85 , 25 ) . Table 7 shows the comparative results among the three schemes. RRT showed complete failure in the long cluttered environment. The proposed CDT-RRT* did not fail to find the trajectory at any trial, while the failure rate of DT-RRT was 14%. The mean computing time of DT-RRT was 1.4 times longer than that of CDT-RRT*. Figure 14 shows the histograms of the computing times for DT-RRT and CDT-RRT*. It is evident that all CDT-RRT* trajectories were obtained in a short time, while DT-RRT showed excessive computing time and unstable performances in many trials. From the viewpoint of the mean travel time, CDT-RRT* took only 61 s, while DT-RRT took 62 s. Although the travel time of the two schemes did not show a significant difference, the difference in terms of the computing time and the success rate greatly affects the real-time performance of robot navigation.
Simulation 7 was carried out in a narrow environment as shown in Figure 15. The robot was driven from x s = ( 5 , 25 , 0 , 0 , 0 ) to q g = ( 90 , 25 ) . Table 8 shows the comparative results among the three schemes. RRT showed complete failure in the long cluttered environment. The proposed CDT-RRT* did not fail to find the trajectory in any trial, while the failure rate of DT-RRT was 1%. The mean computing time of DT-RRT was 2.0 times longer than that of CDT-RRT*. Figure 16 shows the histograms of the computing times for DT-RRT and CDT-RRT*. It is evident that all CDT-RRT* trajectories were obtained in a short time, while DT-RRT showed excessive computing time and unstable performances in many trials. From the viewpoint of the mean travel time, CDT-RRT* took 46 s, while DT-RRT took 47 s. Although the travel time of the two schemes did not show a significant difference, the difference in terms of the computing time and the success rate greatly affects the real-time performance of robot navigation.
Therefore, it can be concluded that the proposed CDT-RRT* generates feasible trajectories with short travel times. In addition, the proposed parent search algorithm shows outstanding performances especially in narrow cluttered environments where conventional schemes show limited performances.

5. Conclusions

This paper proposed a new trajectory planner, CDT-RRT*, for car-like mobile robots. CDT-RRT* utilizes the workspace tree and the state tree for the fast-growing of trees as well as for kinodynamically feasible trajectory generation. The proposed restructuring scheme provides outstanding performances over prior works owing to its superior search capability out of diverse candidate trajectories. CDT-RRT* is especially useful when the robot moves in narrow cluttered environments. Owing to the appropriate design of the tree search algorithm, a high success rate of trajectory generation and a reduced computing time have been achieved. Those two advantages greatly contribute to real-time applications. The presented simulation results clearly show the advantage of the proposed CDT-RRT* in various environments.
Although it is possible to generate the maneuvering, including both forward and backward motions, CDT-RRT* may fail to generate feasible trajectories in extremely narrow and cluttered environments. Future works will include the development of different local controllers or improved node sampling strategies in order to overcome extreme situations.

Author Contributions

Conceptualization, H.K. and W.C.; methodology, H.K.; software, H.K. and D.C.; formal analysis, H.K. and J.S.; investigation, H.K.; data curation, H.K.; writing—original draft preparation, H.K. and W.C.; writing—review and editing, H.K.; visualization, H.K. and J.L.; supervision, W.C. All authors have read and agreed to the published version of the manuscript.

Funding

This work was supported in part by the NRF, MSIP(NRF-2021R1A2C2007908), the Industry Core Technology Development Project (20005062) by MOTIE, and was also supported by the Agriculture, Food and Rural Affairs Research Center Support Program (714002-07) by MAFRA.

Institutional Review Board Statement

Not applicable.

Informed Consent Statement

Not applicable.

Conflicts of Interest

The authors declare no conflict of interest.

References

  1. McNaughton, M.; Urmson, C.; Dolan, J.M.; Lee, J.W. Motion planning for autonomous driving with a conformal spatiotemporal lattice. In Proceedings of the 2011 IEEE International Conference on Robotics and Automation (ICRA), Shanghai, China, 9–13 May 2011; pp. 4889–4895. [Google Scholar]
  2. Hart, P.E.; Nilsson, N.J.; Raphael, B. A formal basis for the heuristic determination of minimum cost paths. IEEE Trans. Syst. Sci. Cybern. 1968, 4, 100–107. [Google Scholar] [CrossRef]
  3. Stentz, A. The focussed d^* algorithm for real-time replanning. IJCAI 1995, 95, 1652–1659. [Google Scholar]
  4. Ding, W.; Gao, W.; Wang, K.; Shen, S. An Efficient B-Spline-Based Kinodynamic Replanning Framework for Quadrotors. IEEE Trans. Robot. 2019, 35, 1287–1306. [Google Scholar] [CrossRef] [Green Version]
  5. Artuñedo, A.; Villagra, J.; Godoy, J. Real-Time Motion Planning Approach for Automated Driving in Urban Environments. IEEE Access 2019, 7, 180039–180053. [Google Scholar] [CrossRef]
  6. Lin, J.; Zhou, T.; Zhu, D.; Liu, J.; Meng, M.Q.H. Search-Based Online Trajectory Planning for Car-like Robots in Highly Dynamic Environments. arXiv 2020, arXiv:2011.03664. [Google Scholar]
  7. Schleich, D.; Behnke, S. Search-based planning of dynamic MAV trajectories using local multiresolution state lattices. arXiv 2021, arXiv:2103.14607. [Google Scholar]
  8. Yang, S.; Lin, Y. Development of an Improved Rapidly Exploring Random Trees Algorithm for Static Obstacle Avoidance in Autonomous Vehicles. Sensors 2021, 21, 2244. [Google Scholar] [CrossRef] [PubMed]
  9. Shome, R.; Kavraki, L.E. Asymptotically Optimal Kinodynamic Planning Using Bundles of Edges. In Proceedings of the 2021 International Conference on Robotics and Automation (ICRA), Xian, China, 30 May–5 June 2021. [Google Scholar]
  10. LaValle, S.M. Rapidly-Exploring Random Trees: A New Tool for Path Planning; TR 98-11; Computer Science Department, Iowa State University: Ames, IA, USA, 1998; Available online: http://janowiec.cs.iastate.edu/papers/rrt.ps (accessed on 11 May 2021).
  11. Hauser, K.; Zhou, Y. Asymptotically optimal planning by feasible kinodynamic planning in a state–cost space. IEEE Trans. Robot. 2016, 32, 1431–1443. [Google Scholar] [CrossRef]
  12. Verginis, C.K.; Dimarogonas, D.V.; Kavraki, L.E. Sampling-Based Motion Planning for Uncertain High-Dimensional Systems via Adaptive Control. In Algorithmic Foundations of Robotics XIV, Proceedings of the Fourteenth Workshop on the Algorithmic Foundations of Robotics 14, Oulu, Finland, 21–23 June 2021; Springer: Basingstoke, UK, 2021; pp. 159–175. [Google Scholar]
  13. Kingston, Z.; Moll, M.; Kavraki, L.E. Sampling-based methods for motion planning with constraints. Annu. Rev. Control. Robot. Auton. Syst. 2018, 1, 159–185. [Google Scholar] [CrossRef] [Green Version]
  14. Vasile, C.I.; Li, X.; Belta, C. Reactive sampling-based path planning with temporal logic specifications. Int. J. Robot. Res. 2020, 39, 1002–1028. [Google Scholar] [CrossRef]
  15. Ghosh, D.; Nandakumar, G.; Narayanan, K.; Honkote, V.; Sharma, S. Kinematic constraints based Bi-directional RRT (KB-RRT) with parameterized trajectories for robot path planning in cluttered environment. In Proceedings of the 2019 International Conference on Robotics and Automation (ICRA), Montreal, QC, Canada, 20–24 May 2019; pp. 8627–8633. [Google Scholar]
  16. Webb, D.J.; van den Berg, J. Kinodynamic RRT*: Asymptotically optimal motion planning for robots with linear dynamics. In Proceedings of the 2013 IEEE International Conference on Robotics and Automation (ICRA), Karlsruhe, Germany, 6–10 May 2013; pp. 5054–5061. [Google Scholar]
  17. Hu, B.; Cao, Z.; Zhou, M. An Efficient RRT-Based Framework for Planning Short and Smooth Wheeled Robot Motion Under Kinodynamic Constraints. IEEE Trans. Ind. Electron. 2021, 68, 3292–3302. [Google Scholar] [CrossRef]
  18. Westbrook, M.G.; Ruml, W. Anytime Kinodynamic Motion Planning using Region-Guided Search. In Proceedings of the 2020 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Las Vegas, NV, USA, 24 October 2020–24 January 2021; pp. 6789–6796. [Google Scholar]
  19. Schmerling, E.; Janson, L.; Pavone, M. Optimal sampling-based motion planning under differential constraints: The driftless case. In Proceedings of the 2015 IEEE International Conference on Robotics and Automation (ICRA), Seattle, WA, USA, 26–30 May 2015; pp. 2368–2375. [Google Scholar]
  20. Thakar, S.; Rajendran, P.; Kim, H.; Kabir, A.M.; Gupta, S.K. Accelerating Bi-Directional Sampling-Based Search for Motion Planning of Non-Holonomic Mobile Manipulators. In Proceedings of the 2020 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Las Vegas, NV, USA, 24 October 2020–24 January 2021; pp. 6711–6717. [Google Scholar] [CrossRef]
  21. Joshi, S.S.; Tsiotras, P. Relevant Region Exploration On General Cost-maps For Sampling-Based Motion Planning. In Proceedings of the 2020 IEEE/RSJ International Conference on Intelligent Robots and Systems (IROS), Las Vegas, NV, USA, 24 October 2020–24 January 2021; pp. 6689–6695. [Google Scholar] [CrossRef]
  22. LaValle, S.M. From dynamic programming to RRTs: Algorithmic design of feasible trajectories. In Control Problems in Robotics; Springer: Berlin/Heidelberg, Germany, 2003; pp. 19–37. [Google Scholar]
  23. hwan Jeon, J.; Cowlagi, R.V.; Peters, S.C.; Karaman, S.; Frazzoli, E.; Tsiotras, P.; Iagnemma, K. Optimal motion planning with the half-car dynamical model for autonomous high-speed driving. In Proceedings of the 2013 American Control Conference, Washington, DC, USA, 17–19 June 2013; pp. 188–193. [Google Scholar]
  24. Armstrong, D.; Jonasson, A. AM-RRT*: Informed Sampling-based Planning with Assisting Metric. arXiv 2020, arXiv:2010.14693. [Google Scholar]
  25. Luders, B.D.; Karaman, S.; Frazzoli, E.; How, J.P. Bounds on tracking error using closed-loop rapidly-exploring random trees. In Proceedings of the 2010 American Control Conference, Baltimore, MD, USA, 30 June–2 July 2010; pp. 5406–5412. [Google Scholar]
  26. Karaman, S.; Frazzoli, E. Sampling-based algorithms for optimal motion planning. Int. J. Robot. Res. 2011, 30, 846–894. [Google Scholar] [CrossRef]
  27. 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]
  28. Schmid, L.; Pantic, M.; Khanna, R.; Ott, L.; Siegwart, R.; Nieto, J. An Efficient Sampling-Based Method for Online Informative Path Planning in Unknown Environments. IEEE Robot. Autom. Lett. 2020, 5, 1500–1507. [Google Scholar] [CrossRef] [Green Version]
  29. Moon, C.; Chung, W. Kinodynamic Planner Dual-Tree RRT (DT-RRT) for Two-Wheeled Mobile Robots Using the Rapidly Exploring Random Tree. IEEE Trans. Ind. Electron. 2015, 62, 1080–1090. [Google Scholar] [CrossRef]
  30. Kanayama, Y.; Kimura, Y.; Miyazaki, F.; Noguchi, T. A stable tracking control method for an autonomous mobile robot. In Proceedings of the IEEE International Conference on Robotics and Automation (ICRA), Cincinnati, OH, USA, 13–18 May 1990; pp. 384–389. [Google Scholar]
  31. De Luca, A.; Oriolo, G.; Vendittelli, M. Control of wheeled mobile robots: An experimental overview. Ramsete 2001, 270, 181–226. [Google Scholar]
  32. Amidi, O.; Thorpe, C.E. Integrated mobile robot control. In Proceedings of the SPIE, The International Society for Optical Engineering, Boston, MA, USA, 1 March 1991; Volume 1388, pp. 504–523. [Google Scholar]
Figure 1. Geometry of the car-like mobile robot model.
Figure 1. Geometry of the car-like mobile robot model.
Sensors 21 04828 g001
Figure 2. Trajectory generation results using Pure-pursuit controller.
Figure 2. Trajectory generation results using Pure-pursuit controller.
Sensors 21 04828 g002
Figure 3. Finding parent node process in tree expansion.
Figure 3. Finding parent node process in tree expansion.
Sensors 21 04828 g003
Figure 4. Resultant trajectories from simulation 1.
Figure 4. Resultant trajectories from simulation 1.
Sensors 21 04828 g004
Figure 5. Resultant trajectories of CDT-RRT* from simulation 2.
Figure 5. Resultant trajectories of CDT-RRT* from simulation 2.
Sensors 21 04828 g005
Figure 6. The cost of the solution path by CDT-RRT* in simulation 2.
Figure 6. The cost of the solution path by CDT-RRT* in simulation 2.
Sensors 21 04828 g006
Figure 7. Resultant trajectories from simulation 3. Red lines: DT-RRT, Blue lines: CDT-RRT*.
Figure 7. Resultant trajectories from simulation 3. Red lines: DT-RRT, Blue lines: CDT-RRT*.
Sensors 21 04828 g007
Figure 8. Histogram of the computing time for the results from simulation 3.
Figure 8. Histogram of the computing time for the results from simulation 3.
Sensors 21 04828 g008
Figure 9. Resultant trajectories from simulation 4. Red lines: DT-RRT, Blue lines: CDT-RRT*.
Figure 9. Resultant trajectories from simulation 4. Red lines: DT-RRT, Blue lines: CDT-RRT*.
Sensors 21 04828 g009
Figure 10. Histogram of the computing time for the results from simulation 4.
Figure 10. Histogram of the computing time for the results from simulation 4.
Sensors 21 04828 g010
Figure 11. Resultant trajectories from simulation 5. Red lines: DT-RRT, Blue lines: CDT-RRT*.
Figure 11. Resultant trajectories from simulation 5. Red lines: DT-RRT, Blue lines: CDT-RRT*.
Sensors 21 04828 g011
Figure 12. Histogram of the computing time for the results from simulation 5.
Figure 12. Histogram of the computing time for the results from simulation 5.
Sensors 21 04828 g012
Figure 13. Resultant trajectories from simulation 6. Red lines: DT-RRT, Blue lines: CDT-RRT*.
Figure 13. Resultant trajectories from simulation 6. Red lines: DT-RRT, Blue lines: CDT-RRT*.
Sensors 21 04828 g013
Figure 14. Histogram of the computing time for the results from simulation 6.
Figure 14. Histogram of the computing time for the results from simulation 6.
Sensors 21 04828 g014
Figure 15. Resultant trajectories from simulation 7. Red lines: DT-RRT, Blue lines: CDT-RRT*.
Figure 15. Resultant trajectories from simulation 7. Red lines: DT-RRT, Blue lines: CDT-RRT*.
Sensors 21 04828 g015
Figure 16. Histogram of the computing time for the results from simulation 7.
Figure 16. Histogram of the computing time for the results from simulation 7.
Sensors 21 04828 g016
Table 1. The comparison of kinodyamic trajectory planners.
Table 1. The comparison of kinodyamic trajectory planners.
RRT [10]CL-RRT [25]High Speed RRT* [23]DT-RRT [29]CDT-RRT*
Car-like modelNoneGoodGoodNoneGood
Piecewise motionNoneNoneNoneGoodGood
Goal-biased samplingGoodFairFairGoodGood
Cluttered EnvironmentsGoodFairFairFairGood
ReplanningNoneFairFairGoodGood
Saving orphan nodesNoneNoneNoneGoodGood
Table 2. The simulation conditions.
Table 2. The simulation conditions.
ParametersValues Specifications
v m a x 2.7 m/sCPUIntel i7-2620M 2.7 Ghz
a m a x 1.8 m/s 2 RAM4 GB (1333 MHz)
L 2.8 mOSUbuntu 11.04
[ δ m i n , δ m a x ] [ 30 , 30 ] MiddlewareRobot Operating System
δ ˙ m a x 20 / s 2 LanguageC++
Table 3. Summary of Planning Results from simulation 1.
Table 3. Summary of Planning Results from simulation 1.
Mean (s) σ Min (s)Max (s)Failure Count
RRTComputing time8.627.930.0227.5966
Travel time35.017.1519.2049.80
DT-RRTComputing time0.360.200.061.040
Travel time18.670.6217.3019.30
CDT-RRT*Computing time0.360.520.075.000
Travel time18.870.8217.3021.70
Table 4. Summary of Planning Results from simulation 3.
Table 4. Summary of Planning Results from simulation 3.
Mean (s) σ Min (s)Max (s)Failure Count
RRTComputing time29.891.1118.9030.0099
Travel time85.500.0085.5085.50
T-RRTComputing time12.0812.190.6030.0026
Travel time58.792.2255.7073.30
CDT-RRT*Computing time2.791.470.708.600
Travel time57.911.0755.7061.30
Table 5. Summary of Planning Results from simulation 4.
Table 5. Summary of Planning Results from simulation 4.
Mean (s) σ Min (s)Max (s)Failure Count
RRTComputing time29.811.9310.7130.0099
Travel time62.700.0062.7062.70
DT-RRTComputing time10.2012.300.2030.0023
Travel time40.561.9135.7045.20
CDT-RRT*Computing time6.787.030.3230.003
Travel time40.714.7135.2061.30
Table 6. Summary of Planning Results from simulation 5.
Table 6. Summary of Planning Results from simulation 5.
Mean (s) σ Min (s)Max (s)Failure Count
RRTComputing time30.00-30.0030.00100
Travel time----
DT-RRTComputing time14.5012.390.9830.0036
Travel time72.8311.6058.30102.70
CDT-RRT*Computing time6.463.441.6017.340
Travel time66.548.5257.6086.00
Table 7. Summary of Planning Results from simulation 6.
Table 7. Summary of Planning Results from simulation 6.
Mean (s) σ Min (s)Max (s)Failure Count
RRTComputing time30.00-30.0030.00100
Travel time----
DT-RRTComputing time7.6110.030.9030.0014
Travel time62.403.3757.5074.60
CDT-RRT*Computing time5.252.062.2011.100
Travel time61.334.2256.0075.70
Table 8. Summary of Planning Results from simulation 7.
Table 8. Summary of Planning Results from simulation 7.
Mean (s) σ Min (s)Max (s)Failure Count
RRTComputing time30.00-30.0030.00100
Travel time----
DT-RRTComputing time3.533.781.2330.001
Travel time47.105.1942.6066.90
CDT-RRT*Computing time1.740.690.604.450
Travel time46.434.2942.6061.80
Publisher’s Note: MDPI stays neutral with regard to jurisdictional claims in published maps and institutional affiliations.

Share and Cite

MDPI and ACS Style

Kwon, H.; Cha, D.; Seong, J.; Lee, J.; Chung, W. Trajectory Planner CDT-RRT* for Car-Like Mobile Robots toward Narrow and Cluttered Environments. Sensors 2021, 21, 4828. https://doi.org/10.3390/s21144828

AMA Style

Kwon H, Cha D, Seong J, Lee J, Chung W. Trajectory Planner CDT-RRT* for Car-Like Mobile Robots toward Narrow and Cluttered Environments. Sensors. 2021; 21(14):4828. https://doi.org/10.3390/s21144828

Chicago/Turabian Style

Kwon, Hyunki, Donggeun Cha, Jihoon Seong, Jinwon Lee, and Woojin Chung. 2021. "Trajectory Planner CDT-RRT* for Car-Like Mobile Robots toward Narrow and Cluttered Environments" Sensors 21, no. 14: 4828. https://doi.org/10.3390/s21144828

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