G2VD Planner: Efficient Motion Planning With Grid-based Generalized Voronoi Diagrams
Abstract
In this paper, an efficient motion planning approach with grid-based generalized Voronoi diagrams (G2VD) is newly proposed for mobile robots. Different from existing approaches, the novelty of this work is twofold: 1) a new state lattice-based path searching approach is proposed, in which the search space is reduced to a novel Voronoi corridor to further improve the search efficiency; 2) an efficient quadratic programming-based path smoothing approach is presented, wherein the clearance to obstacles is considered to improve the path clearance of hard-constrained path smoothing approaches. We validate the efficiency and smoothness of our approach in various challenging simulation scenarios and outdoor environments. It is shown that the computational efficiency is improved by 17.1% in the path searching stage, and path smoothing with the proposed approach is 6.6 times faster than an advanced sparse-banded structure-based path smoothing approach and 53.3 times faster than the popular timed-elastic-band planner. A video showing outdoor navigation on our campus is available at https://youtu.be/iMXGthgvp58.
Note to Practitioners
This paper is motivated by the challenges of motion planning problems of mobile robots. An efficient motion planning approach called G2VD planner is proposed by combining path searching, path smoothing, and time-optimal velocity planning. Extensive simulation and experimental results show the effectiveness of the proposed motion planning approach. However, the prediction information of dynamic obstacles is not incorporated in the proposed motion planner, thus the motion planner may be a bit sluggish in response to dynamic obstacles. Furthermore, we plan to integrate the intention/trajectory prediction of pedestrians/vehicles into the proposed framework to enhance the foreseeability of the motion planner.
Index Terms:
Autonomous navigation, mobile robots, motion planning, path planning, path optimizationI Introduction
Mobile robots have been widely applied in various fields including but not limited to intelligent inspection, logistics, and search-and-rescue applications [1, 2, 3]. Autonomous navigation is the key technology for mobile robots to achieve full autonomy in these scenarios [4, 5], which typically consists of localization [6, 7], mapping [8, 9], motion planning, and control, wherein motion planning plays an essential role in generating safe, smooth, and efficient motions [10, 11]. Although plenty of works on motion planning of mobile robots have been put forward [12, 13, 14], it is still challenging to design a motion planning approach that can ensure both efficiency, safety, and smoothness in complex environments [15, 16, 17, 18, 19].
I-A Path Searching
Many path searching approaches have been proposed in terms of different theories [20], which can be classified into three categories. The sampling-based planning algorithms such as the famous probabilistic roadmap (PRM) [21] and rapidly-exploring random trees (RRTs) [22] have gained popularity for the capability of efficient searching in the configuration space (C-space). However, they are limited by completeness and optimality, and even some excellent variants such as RRT* [23] can only guarantee asymptotic optimality. The classical artificial potential field (APF) algorithm [24] finds a feasible path by following the steepest descent of a potential field. However, the APF algorithm often suffers from the local minimum problem. In this paper, we focus on grid-based planning algorithms. Grid-based planning overlays a hyper-grid on the C-space and assumes each configuration is identified with the grid-cell center [25]. Then, search algorithms are used to find a path from the start to the goal. Grid-based planning can always find a resolution-optimal path if it exists in the discrete search space, namely, completeness and optimality in the sense of resolution are guaranteed. However, these approaches depend on space discretization and do not perform fast as the environment dimension increases.
I-B Path Smoothing
The path obtained by path searching approaches usually fails to meet the smoothness requirement for robot navigation and needs further smoothing [26]. Two types of path smoothing approaches are investigated in this paper, namely, soft-constrained approaches and hard-constrained approaches.
I-B1 Soft-constrained Approaches
These approaches formulate path smoothing as a non-linear unconstrained optimization problem, wherein the constraints are considered in the optimization objective in the form of penalty cost terms [27, 28, 29]. Generally, the smoothness of the path and the clearance to obstacles are both taken into account. Then, gradient-based optimization algorithms are employed to solve the problem. Soft-constrained approaches utilize gradient information to push the path far from obstacles and can obtain a smooth path with a reasonable distance from obstacles. However, it is difficult for these approaches to guarantee the optimized path strictly satisfies the constraints. In addition, the optimization objective of soft-constrained approaches contains convex and non-convex terms, making these approaches suffer from local optima and time-consuming issues [30].
I-B2 Hard-constrained Approaches
These approaches formulate path smoothing as a non-linear constrained optimization problem and can obtain a path that theoretically satisfies the constraints [31, 32]. The optimization objective usually considers the smoothness or the length of the path and thus is convex. This convexity allows the problem to be solved efficiently in general [33, 34]. However, hard-constrained approaches treat all free space equally, namely, distance from feasible paths to obstacles is ignored. As a result, the optimized path is often close to the obstacle and has poor safety.
I-C Contributions
Motivated by the aforementioned limitations of existing works, an efficient motion planning approach called G2VD planner is newly proposed. Specifically, a G2VD is utilized to aid path searching and path smoothing to achieve better performance in terms of efficiency, safety, smoothness, etc.
I-C1 Path Searching
Given the start and the goal, we first employ the A* search to find the shortest grid path in a G2VD. This shortest Voronoi path contains the topological information of the search direction and provides rough guidance for the subsequent fine search. Along the Voronoi grid path, a region called Voronoi corridor is proposed and constructed by adding a bounding box to each path pixel. Furthermore, the cost function of path searching is redesigned based on a potential called Voronoi field to make the searched path keep a reasonable distance from obstacles. Finally, the A* search combined with motion primitives is utilized to finely search a kinematically feasible path within the Voronoi corridor. Different from the original state lattice-based path planner [35] that takes the whole grid map as the search space, the proposed approach reduces the search space to the Voronoi corridor, thus considerable time is saved for path searching. In addition, the certain clearance to obstacles provides sufficient optimization margin for further path smoothing.
I-C2 Path Smoothing
Taking the path searched above as the reference path, an efficient quadratic programming (QP)-based path smoothing approach is proposed, wherein the smoothness of the path and the deviation from the reference path are both considered in the optimization objective. Our goal is to obtain a smooth path while minimizing the deviation between the optimized path and the reference path. Because the reference path searched above has a certain distance to obstacles, the clearance to obstacles is implicitly considered in the proposed approach, and the path clearance issue of such a hard-constrained approach is addressed. This is also the second reason why we introduce the Voronoi field and redesign the cost function of path searching to improve the path clearance of the searched path, in addition to providing wider optimization margin for path smoothing.
To summarize, the main contributions of this work are as follows:
-
1)
A new state lattice-based path searching approach is proposed, in which a novel Voronoi corridor is introduced to reduce the search space to significantly improve the search efficiency, along with a Voronoi potential constructed to make the searched path keep a reasonable distance from obstacles to provide sufficient optimization margin for further path smoothing.
-
2)
A new QP-based path smoothing approach is presented to efficiently smooth the searched path, wherein the clearance to obstacles is considered in the form of the penalty of the deviation from the safe reference path to address the path clearance issue of existing hard-constrained path smoothing approaches.
-
3)
Autonomous navigation is realized in outdoor environments. Extensive simulation and experimental evaluations are presented to validate the effectiveness of the proposed approach.
The rest of this paper is organized as follows. We first review the related work in Section II. The proposed G2VD planner is detailed in Section IV. Section V provides some implementation details. The results of simulations and experiments are presented in Sections VI and VII, respectively. Finally, this paper is concluded in Section VIII.
II Related work
Grid-based planning obtains the resolution-optimal path by discretizing the C-space first and then using graph search algorithms to find the path. In [25], a novel grid modeling-based path planning approach is introduced, which has been successfully applied in the distributed multi-vehicle task assignment. However, original grid-based planning approaches only visit the centers of grid cells and produce piecewise-linear paths that do not generally satisfy the kinodynamic constraints of the robot. To address this problem, Pivtoraiko et al. [36] propose the state lattice approach for graph construction. In particular, the connectivity between two nodes in the graph is built from a pre-designed motion primitive that fulfills the kinodynamic constraints of the robot. Based on the work [36], Likhachev et al. present a state lattice-based path planner by combining AD* search with motion primitives [35], which has been successfully applied in the DARPA Urban Challenge [37]. In this paper, a new state lattice-based path planner is proposed, wherein the search space is reduced to a Voronoi corridor derived from a generalized Voronoi diagram (GVD) to further improve the search efficiency.
The use of GVDs has long been proposed in the context of robot motion planning. In [38], Ayawli et al. propose a path planning approach for mobile robots using Voronoi diagrams and computational geometry technologies. In [39], Choset and Burdick use the GVD to derive skeletons of the free space and then search on the graph. However, the shortest Voronoi path may be far from the actual optimal path. In [40], Ziegler et al. utilize the GVD to inform the A* search by constructing a heuristic where the cost of a search state is the sum of the straight-line path to the closest Voronoi edge and the shortest path along the GVD edges. However, the resulting heuristic cannot be guaranteed to be admissible since the cost of the shortest Voronoi path may be greater than that of the actual shortest path. In [41], Dolgov et al. design a potential field based on the GVD for path smoothing. This potential allows precise navigation in narrow passages while also effectively pushing the robot away from obstacles in wider areas. Inspired by the Voronoi field, we redesign the cost function of the state lattice-based path planner to obtain a path with a reasonable distance from obstacles.
The path obtained by path searching approaches usually needs further smoothing. In [42, 43], comparisons of path smoothing approaches in dynamic environments are presented. In [41], Dolgov et al. present a conjugate gradient-based path smoothing approach to smooth the path generated by the hybrid A* algorithm. In [44], Wen et al. propose a gradient-based local path smoothing approach for mobile robots, wherein the sparse-banded system structure of the underlying optimization problem is fully exploited to efficiently solve the problem. The above soft-constrained approaches utilize gradient information to push the path far from obstacles and can obtain a path with better safety. However, it is difficult for these approaches to guarantee the optimized path strictly satisfies the constraints. Recently, Zhou et al. propose a dual-loop iterative anchoring path smoothing approach for autonomous driving [45], in which the nonlinear curvature constraint is linearized and sequential convex programming is used to efficiently solve the path optimization problem. Such a hard-constrained approach can theoretically guarantee that the obtained path strictly satisfies the constraints. However, distance from feasible paths to obstacles is ignored, which often results in the optimized path being close to obstacles and poor safety. In this paper, a new QP-based path smoothing approach is proposed, in which the clearance to obstacles is implicitly considered in the form of the penalty of the deviation from the safe reference path to improve the path clearance of hard-constrained approaches.

III Problem Definition
Let be the state space. The obstacle space and the free space are denoted as and , respectively. The motion planning aims to find a feasible trajectory such that
(1) |
where is the timestamp, and denote the start and goal states, respectively. In this work, the state is defined as a tuple of , where denotes the position of the robot in the world and represents the heading of the robot.
Directly solving the mapping of has a huge computational burden. In consideration of the computational efficiency, the motion planning problem is typically decoupled as path planning and velocity planning [46]. In particular, the path planning solves the mapping of and the velocity planning solves the mapping of , where is the accumulated distance along a given path. In this work, a new state lattice-based path searching approach combined with an efficient QP-based path searching approach is proposed to solve the mapping of , while the mapping of is solved by our previously proposed time-optimal velocity planning algorithm [47].
IV G2VD Planner
In this paper, an efficient three-layer motion planning framework called G2VD planner is carefully designed, which consists of path searching, path smoothing, and velocity planning, as shown in Fig. 1. The path searching module is utilized to provide a safe reference path for the robot, and the path smoothing module combined with our previously proposed time-optimal velocity planning [47] is employed to generate safe, smooth, and efficient motion commands. In this section, we will detail the newly proposed path searching and path smoothing modules.

IV-A Grid-based Generalized Voronoi Diagrams
The GVD is defined as the set of points in the free space to which the two closest obstacles have the same distance [39]. In this paper, an efficient, incrementally updatable GVD construction algorithm presented in [48] is utilized to convert the occupancy grid map to a GVD in discrete form. The core of this algorithm [48] is to employ a dynamic variant of the brushfire algorithm [49] to incrementally compute Euclidean distances. Specifically, the G2VD is firstly initialized based on a prior grid map, which is usually generated by simultaneous localization and mapping (SLAM) [50]. On top of the initial G2VD, both moving dynamic obstacles and unknown static obstacles are detected by external sensors mounted on the robot. Movement, insertion, and deletion of obstacles change the states of individual cells in the G2VD from free to occupied or vice versa. Newly occupied cells initiate “lower” wavefronts that update the distance to the closest obstacle of affected cells. Similarly, “raise” wavefronts start at newly freed cells and clear the distance entries of all cells whose closest obstacle is the deleted one. The processing of raised and lower wavefronts is interwoven and controlled by a single priority queue that sorts the enqueued cells by distance. Both the raised and lower wavefronts enqueue the neighbors of a processed cell to propagate the wavefronts. Readers can refer to [48] for more details about this algorithm. Fig. 2 illustrates the G2VD of an office-like environment, in which the Voronoi edge pixels are colored in blue and red.
As mentioned above, the employed incrementally updatable G2VD construction algorithm can deal with both moving dynamic obstacles and unknown static obstacles. Therefore, even if the prior grid map is not available, the robot can still observe the surrounding environment through external sensors and update the G2VD in real-time. That is to say, the proposed framework can be theoretically applied in completely unknown scenarios. In practice, if a prior grid map containing the basic environmental structural information is available, it will enable the G2VD planner to provide better global guidance.
IV-B Voronoi Corridor
After obtaining the G2VD, breadth-first search is employed to find the cells and closest to the start cell and the goal cell on the GVD, respectively. And the shortest grid paths from to and from to are also computed in this process. Then, the A* search is utilized to search the shortest grid path from to along the GVD edge pixels, in which collision detection is carried out based on the circumscribed radius of the robot. In particular, the cells whose distance to the closest obstacle is less than the circumscribed radius of the robot are considered invalid and eliminated. Therefore, the final searched 2-D grid path consisting of valid cells is guaranteed to be collision-free. As shown by the red path in Fig. 2, the final shortest Voronoi grid path from to is composed of , , and .
Based on the shortest Voronoi grid path searched above, a region called Voronoi corridor is constructed as follows. For every cell in the shortest Voronoi grid path, the minimum distance to the closest obstacle cell is retrieved from the G2VD. Then, a square bounding box with a side length of is centered on . The obstacle-free cells covered by all bounding boxes make up the Voronoi corridor, as illustrated by the gray region in Fig. 2. Every time the G2VD updates, the shortest Voronoi grid path is searched from scratch and the Voronoi corridor is constructed based on the newly obtained Voronoi grid path.
Different from the traditional cost map, which is usually constructed by inflating the obstacle cells and typically used to improve the efficiency of collision detection, the Voronoi corridor is constructed to broadly reduce the search space of path searching and improve the search efficiency. Therefore, elaborate collision detection considering the footprint of the robot is not involved when constructing the 2-D Voronoi corridor, which is done in the 3-D path searching stage. In the stage of the Voronoi corridor construction, only the minimum distances from the cells along the Voronoi grid path to the closest obstacle cells are used to make sure that the Voronoi corridor contains the feasible region.
IV-C Path Searching
The shortest Voronoi grid path is far from the actual optimal path, and its piecewise-linear form also does not satisfy the kinodynamic constraints of the robot. To address these issues, a new state lattice-based path planner is proposed to perform fine path searching within the Voronoi corridor.
A typical state lattice-based path planner consists of two parts, namely, graph construction and graph search [35]. As for graph construction, the 3-D search space is discretized first, where denotes the position of the robot in the world and represents the heading of the robot. In particular, the orientation space is discretized into 16 angles. Furthermore, the connectivity between two states in the graph is built from motion primitives which fulfill the kinematic constraints of the robot. In this work, a quintic Bézier curve-based path generation approach described in [47] is employed to generate motion primitives from each discretized angle offline. A motion primitive consists of a sequence of internal robot poses when moving from state to state , where is the number of poses contained in the motion primitive. As for graph search, the standard A* search is employed, where the 2-D heuristic proposed in [35] is utilized to guide the A* search away from those areas with dead-ends. is constructed by computing the costs of shortest 2-D grid paths from the goal cell to other cells in the search space through dynamic programming.

In addition, since the motion primitives from each discretized angle are designed offline in advance, the covered cells of each motion primitive considering the robot footprint can be also computed and recorded as a lookup table in advance at the origin . During every A* expansion, the covered cells of the selected motion primitive are retrieved in the lookup table and translated according to the robot position. As long as one of the covered cells is occupied by obstacles, the corresponding motion primitive is considered invalid and eliminated in this expansion. Therefore, the final searched path consisting of valid motion primitives is guaranteed to be collision-free.
Different from the original state lattice-based path planner [35] that takes the whole grid map as the search space, we reduce the search space to the Voronoi corridor to further improve the search efficiency. In addition, every time the grid map is updated, needs recalculation before performing path searching. Since the search space of the newly proposed state lattice-based path planner is reduced to the Voronoi corridor, dynamic programming is accordingly limited to only compute the costs of shortest paths from the goal cell to those cells that are within the Voronoi corridor. Therefore, considerable time is also saved for the recalculation of .
Although the path searched above is optimal in the search space, it may be very close to obstacles since only the path length is considered in the cost function. The ideal path is to keep a reasonable distance from obstacles to provide sufficient optimization margin for subsequent path smoothing. To this end, inspired by the Voronoi field presented in [41], we design the following potential function
(2) |
where and denote the distances from the given path vertex to the closest Voronoi edge and the closest obstacle, respectively. The operation of squaring in Eq. (2) is to make the potential function non-negative. is a threshold specifying the minimum safety distance to obstacles. An example of the Voronoi field is shown in Fig. 3.
According to [41], this potential function has the following properties:
-
i)
and is continuous on since we cannot simultaneously have and ;
-
ii)
reaches its maximum only when is within obstacle areas;
-
iii)
reaches its minimum only when is on the edges of the GVD or the distance from to the closest obstacle is greater than .
It is noteworthy that the potential cost is set to zero when the distance to the closest obstacle is greater than the safety threshold (). The reason for this design is as follows. Our goal is to make the searched path close to Voronoi edges through the Voronoi field so that the obtained path can keep an appropriate distance from obstacles and provide sufficient optimization margin for subsequent path smoothing. However, if the environment is wider and the Voronoi edge is far from the obstacles on both sides, which may make the searched path far away from the optimal path. Therefore, we set a safety distance threshold and regard the area where the distance to the closest obstacle exceeds as a safe region. In this way, the searched path can keep a certain distance from obstacles and will not be far away from the optimal path through the Voronoi field.
Based on the above Voronoi field, the cost of motion primitives is defined as follows. For the sake of computational efficiency, we broadly follow the work [41] and temporarily assume that the robot travels at constant linear and angular velocities. If a motion primitive collides with obstacles, the cost is set to infinity. Otherwise, the cost of this motion primitive is defined as
(3) |
where is the minimum travel time spent on assuming uniform motion under the constraints of the maximum linear velocity and the maximum angular velocity
(4) |
denotes the set of 2-D cells covered by the robot when moving from state to state . The “+1” operation in Eq. (3) is used to ensure that is a positive number. Intuitively, the Voronoi field penalizes slightly more those actions for which the robot traverses high potential cost areas (e.g., obstacles) and makes the searched path as close as possible to the Voronoi edges or keep a certain distance from obstacles. In addition, the 2-D heuristic is also multiplied by the potential costs to be consistent with the cost definition of motion primitives.
Remark: In general, the path length is considered in the cost function of path planning approaches. However, the action of rotation in place is contained in the designed motion primitives in this work since our platform is a differential-drive mobile robot. And the cost of this action will be 0 if the cost function of the motion primitive is defined as the path length. Therefore, the travel time spent on the motion primitive is considered in the cost function instead of the path length in this work.


It should be noted that the Voronoi potential field in [41] is used for path smoothing and the region of interest is the whole map. While the search space of the newly proposed state lattice-based path planner is reduced to the Voronoi corridor, and we only need to compute the Voronoi potential costs within the Voronoi corridor. In particular, an efficient distance transform algorithm presented in [51] is employed to compute the Euclidean distance to the closest Voronoi edge for those cells within the Voronoi corridor. Figs. 4(a) and 4(b) illustrate the paths searched by the original state lattice-based path planner [35] and the newly proposed path planner, respectively. Compared with the original state lattice-based path planner, the path obtained by the proposed path planner has a certain distance from obstacles and can provide wider optimization margin (green bounding boxes) for further path smoothing, which will be detailed in Section IV-D.
Remark: The final path is found within the Voronoi corridor, namely, the final solution is searched in a subset of the complete solution set to achieve high computational efficiency performance. The Voronoi corridor is generated based on the shortest Voronoi grid path searched in the G2VD and usually contains the optimal solution in the complete solution set. However, when there is a significantly large difference in the dimension of the environment, it is possible that the optimal solution is contained in a sub-optimal Voronoi corridor derived based on a sub-optimal Voronoi grid path. Therefore, we cannot theoretically guarantee the optimality of the proposed approach. However, the practical performance is satisfactory, which is demonstrated through extensive simulation and experimental tests in Sections VI and VII. In addition, there may be potential extreme scenarios where regional disconnections occur, which will cause the failures of both the Voronoi path search and the Voronoi corridor construction. In these circumstances, the proposed path searching approach degenerates into the original state lattice-based path planner.
IV-D Path Smoothing
The path obtained by the state lattice-based path planner is kinematically feasible, but it is still piecewise-linear and not suitable for velocity planning. Therefore, an efficient QP-based path smoothing approach combined with cubic spline interpolation is employed to further smooth the path.
The input of path smoothing is several path vertices, which are obtained by sampling in the path generated by the state lattice-based path planner with a fixed interval. Given reference path vertices to be further smoothed, a convex QP-based path smoothing formulation is defined as
(5) |
subject to
(6a) | |||
(6b) |
where is a -dimensional parameter vector, and denotes the world coordinates of a path vertex. is the corresponding reference path vertex of , and and are the weights of cost terms. is a state bubble constraining the feasible region of the path vertex . In this work, is approximated as an inscribed square of a circle centered on , where the radius of the circle is equal to the distance from to the closest obstacle minus the circumscribed radius of the robot, as shown in Fig. 5. The footprint of the robot is approximated as a rectangle in this work. To compute , we sequentially calculate the distances from the center of the rectangle to its vertices. And the maximum distance is token as . Therefore, in Eq. (6b) is approximated as
(7a) | |||
(7b) |
where the optimization margin is defined as
(8) |
Based on the constraints in Eqs. (7) and (8), the distance between every optimized path vertex and the corresponding closest obstacle is greater than the circumscribed radius of the robot, thus the final smoothed path is guaranteed to be collision-free. According to Eq. (8), a path vertex will be fixed during the optimization process if the corresponding reference path vertex is close to the obstacle (). Intuitively, a reference path with a certain distance from obstacles can provide sufficient optimization margin for path smoothing. This is one of the main reasons why we introduce the Voronoi field and redesign the cost function of path searching to make the searched path keep a reasonable distance from obstacles in Section IV-C.

The first term in Eq. (5) is a measure of the path smoothness. The cost function can be rewritten as . As shown in Fig. 5, from a physical point of view, this cost term treats the path as a series spring system, where and are the forces on the two springs connecting the vertices , and , , respectively. If the forces and are equal in size and opposite in direction, the resultant force is a zero vector and the norm is minimum. If all the resultant forces are zero vectors, all the vertices would uniformly distribute in a straight line, and the path is ideally smooth.
The second term in Eq. (5) is used to penalize the deviation from the original safe reference path. As mentioned before, the hard-constrained formulation does not explicitly consider the path clearance, namely, distance from feasible paths to obstacles is ignored. As a result, the optimized path may be close to obstacles. To address this issue, the penalty of the deviation from the original reference path is introduced in the optimization objective. Our goal is to obtain a smooth path while minimizing the deviation between the optimized path and the reference path. Because the reference path searched by the proposed state lattice-based path planner has certain clearance to obstacles, the safety of the path is implicitly considered in the optimization formulation, and the final optimized path will not be close to obstacles. This is also the second reason why we introduce the Voronoi field and redesign the cost function of path searching to improve the path clearance of the searched path, in addition to providing wider optimization margin for path smoothing.
Before path smoothing, the proposed state lattice-based path searching approach is used to find an initial path. Thanks to grid-based planning, the initial path is globally optimal in the sense of resolution. Furthermore, the proposed path smoothing approach formulates the path smoothing problem in the form of convex quadratic programming. The convexity ensures that the obtained solution is the global optimal solution of the underlying path smoothing problem.
Compared with traditional smoothing approaches such as cubic spline interpolation and curve optimization algorithms, the proposed QP-based path smoothing approach densely samples the searched path to serve as optimization variables. Such a framework achieves the maximum control and flexibility of the path shape to deal with complex scenarios, such as U-turns, S-shaped turns, etc.
IV-E Velocity Profile Generation
After path optimization, a path that is much smoother than the original reference path is obtained. However, the number of the path vertices is the same as that of the input reference path and the optimized path is still piecewise-linear. Therefore, we further smooth the path via cubic spline interpolation to obtain a continuous curve. Finally, a numerical integration (NI)-based time-optimal velocity planning algorithm presented in [47] is employed to generate a feasible linear velocity profile along the smoothed path, i.e., to solve the mapping problem mentioned in Section III. The NI-based algorithm can acquire a provably time-optimal trajectory with low computational complexity, which solves the problem by computing the maximum velocity curve (MVC) considering both kinematic and environmental constraints and then performing numerical integration under MVC [52, 53, 54]. Readers can refer to [47] for more details about the proofs of feasibility, completeness, and time-optimality of this algorithm.
Finally, the trajectory tracking controller proposed in the textbook [55] is employed to track the desired Cartesian trajectory for the differential-drive mobile robot used in this work. In particular, the control law is as
(9) |
wherein , , and are the proportional coefficients, which are set to , , and , respectively. And the error terms of , , and in Eq. (9) are calculated as follows:
(10) |
Readers can refer to [55] for more details about the controller.
V Implementation details
V-A Setup
The proposed G2VD planner is implemented in C/C++. The convex QP problem described in Section IV-D is solved by an alternating direction method of multipliers (ADMM)-based QP solver, OSQP [56]. The reference path vertices of path smoothing are obtained by sampling in the path generated by the state lattice-based path planner with an interval of . Densely sampling vertices along the path will introduce more optimization variables and increase the computational burden. In this work, the sampling interval is set according to the resolution of the underlying G2VD and the dimension of the robot. The weights and are set to and , respectively. The minimum safety distance is set to . The update frequency of the G2VD is set to . Each update takes an average of . All the simulations and experiments are tested on a laptop with an Intel Core i7-9750H processor and 16 GB RAM.
V-B Metrics
The proposed Voronoi corridor is integrated into the original state lattice-based path planner (A* + motion primitives) [35] to derive a new state lattice-based path planner (A* + motion primitives + Voronoi corridor). And the new path planner is compared with the original state lattice-based path planner to validate the effectiveness of the Voronoi corridor. The performance of path searching approaches is evaluated in terms of computational efficiency and memory consumption. In particular, the number of expanded states and the planning time are used to evaluate the computational efficiency, and the graph size, i.e., the number of created nodes in the search graph, is used to evaluate the memory consumption.
Remark: The runtime of the proposed path searching approach includes three parts: searching the shortest Voronoi grid path, constructing the Voronoi corridor, and searching the kinematically feasible path within the Voronoi corridor. In this work, the incrementally updatable GVD construction algorithm [48] is integrated into the mapper module. Therefore, the time used to construct the G2VD is not included in the runtime of the proposed path searching approach.
To validate the effectiveness of the proposed QP-based path smoothing approach, we compare it with an advanced sparse-banded structure-based path smoothing approach SBA [44] and the popular optimization-based timed-elastic-band planner TEB [30]. We comprehensively evaluate path smoothing approaches in terms of computational efficiency. The weights of the smoothness and safety terms in the objective function of SBA [44] are set to and respectively according to the original paper. We believe these parameters were carefully tuned by the authors to achieve the best performance, and using these parameters makes our comparisons more convincing. Similarly, TEB uses the default parameters of its open-source implementation111https://github.com/rst-tu-dortmund/teb_local_planner.
VI Simulations
In this section, we verify the applicability of the proposed G2VD planner in simulation. The popular Gazebo [57] is chosen as the simulator. In this work, we choose the large-scale complex maze scenario222https://github.com/NKU-MobFly-Robotics/local-planning-benchmark designed in [58] for evaluation. The dimension of the maze scenario is , and the resolution of the grid map is . To obtain the grid map of the maze scenario, we first build the scenario in Gazebo and then perform a breath-first exploration over the grid starting from the origin of the Gazebo world coordinate system.
# of | Time | Graph | Path | ||
---|---|---|---|---|---|
expands | (secs) | size | cost | ||
Test 1 | Lattice | 155,715 | 0.115 | 161,848 | 291,590 |
Ours | 140,909 | 0.097 | 144,943 | 291,590 | |
Test 2 | Lattice | 167,912 | 0.122 | 174,356 | 324,846 |
Ours | 146,300 | 0.103 | 149,912 | 324,846 | |
Test 3 | Lattice | 202,680 | 0.151 | 210,043 | 383,376 |
Ours | 169,949 | 0.121 | 173,716 | 383,376 |








VI-A Comparison on Path Searching
As mentioned before, the incrementally updatable GVD construction algorithm described in [48] is employed to generate the G2VD of the maze environment, as shown in Fig. 6. Furthermore, we randomly select three sets of start and goal configurations in the maze for testing. Both the original state lattice-based path planner and the proposed path planner generate equal quality paths. The quantitative statistics of path searching results in these tests are enumerated in Table I.
The cyan cells in Fig. 6 represent the constructed Voronoi corridor in Test 1. Figs. 6 and 6 show the path planning results of the two path planners in Test 1, respectively, where the green cells denote the visited cells during the searching process. Compared with the original state lattice-based path planner [35], the search space of the proposed path planner is reduced to the Voronoi corridor, thus the search effort spent in those unpromising search areas is significantly saved. As shown in Table I, the number of expanded search states of the proposed path planner decreases by an average of , and the computational efficiency is improved by . Furthermore, since the search branches for searching in those unpromising search areas are reduced, the number of created nodes in the search graph also decreases. Compared with the original state lattice-based path planner, the graph size of the proposed path planner decreases by an average of .
In conclusion, the newly proposed path planner generates equal quality paths with less time and memory consumption than the original state lattice-based path planner.
VI-B Comparison on Path Smoothing
We choose four challenging local scenarios containing continuous S-shaped or U-shaped turns in the maze environment to compare the computational efficiency of path smoothing approaches. For a fair comparison, the proposed path searching approach is employed to generate the same reference path for SBA [44], TEB [30], and the proposed QP-based path smoothing approach. In each scenario, we set the same start and goal configurations and repeat the test times. For testing purposes, we do not limit the length of the initial path for path smoothing, namely, we sample all path points obtained by path searching with an interval of . The searched paths obtained by the proposed path searching approach and the corresponding smoothed paths generated by the proposed QP-based path smoothing approach are shown in green and red in Fig. 7 respectively, and the statistics of the runtime performance are shown in Table II. According to [44] and [30], both SBA and TEB are soft-constrained path smoothing approaches, wherein both the path smoothness and path clearance to obstacles are considered in the optimization formulation. The terms of path clearance to obstacles are non-convex, resulting in the final optimization formulation is also non-convex. While the proposed path smoothing approach formulates the path smoothing problem in the form of convex quadratic programming, and the convexity allows the problem to be solved efficiently. As shown in Table II, the maximum runtime of the proposed path smoothing approach is less than in all four tests, and the computational efficiency of the proposed approach is approximatively and times faster than that of SBA and TEB on average, respectively. In addition, the curvature profiles of the paths generated by SBA, TEB, and the proposed path smoothing approach are presented in Fig. 8. Since the smoothness of the path is explicitly considered in the optimization objective of our approach and SBA, their curvature profiles are much smoother than that of TEB.
Mean | Max | Min | Std | ||
---|---|---|---|---|---|
Fig. 7 | TEB | 31.65 | 33.96 | 29.51 | 1.16 |
SBA | 3.55 | 3.61 | 3.46 | 0.04 | |
Ours | 0.49 | 0.50 | 0.48 | 0.01 | |
Fig. 7 | TEB | 32.26 | 33.90 | 29.50 | 1.31 |
SBA | 4.24 | 4.29 | 4.20 | 0.03 | |
Ours | 0.61 | 0.67 | 0.60 | 0.02 | |
Fig. 7 | TEB | 34.65 | 36.23 | 32.64 | 1.02 |
SBA | 5.57 | 5.62 | 5.53 | 0.02 | |
Ours | 0.64 | 0.65 | 0.64 | 0.01 | |
Fig. 7 | TEB | 37.38 | 38.67 | 35.05 | 1.27 |
SBA | 3.27 | 3.63 | 3.22 | 0.08 | |
Ours | 0.51 | 0.55 | 0.49 | 0.01 |












In conclusion, the newly proposed QP-based path smoothing approach achieves a significant performance improvement in terms of computational efficiency.

VII Experiments
In this section, outdoor experimental results on our campus are presented and analyzed to validate the effectiveness of the proposed G2VD planner.







VII-A Experimental Setup
As shown in Fig. 9, the mobile robot SUMMIT-XL HL is used as the experimental platform, which is equipped with a Velodyne VLP-16 LiDAR, an Intel Realsense D435i depth camera, and an Intel NUC computer. The footprint of the robot is approximated as a square, and the maximum linear velocity is . Considering the safety of robot navigation, the upper bound of the linear velocity is set to in the experiments.
To generate a prior global map for autonomous navigation, we first employ a LiDAR-inertial odometry algorithm described in [59] to build a large-scale 3-D point cloud map. And then, a point clouds segmentation algorithm presented in [60] is used to filter out point clouds that hit the ground and tree canopy. Finally, the filtered point clouds are projected to a 2-D plane to derive traversable regions in the form of the occupancy grid map, as shown in Fig. 10. The dimension of the environment is approximately , and the resolution of the grid map is . During robot navigation, the LiDAR-inertial odometry algorithm [59] and the point clouds segmentation algorithm [60] are also utilized to provide state estimation and local traversable regions for the robot, respectively.
VII-B Comparison on Path Searching
To validate that the proposed path searching approach can provide sufficient optimization margin for hard-constrained path smoothing approaches, we select an S-shaped scenario shown in Fig. 11 to compare path searching approaches. The path shown in Fig. 11 is obtained by the original state lattice-based path planner [35]. Since the path clearance is not considered in the original state lattice-based path planner, the searched path is close to the corner of the S-shaped turn, and the corresponding path vertices are fixed in the path smoothing process. As a result, the smoothed path is intuitively rough, as shown in Fig. 11. On the contrary, the path clearance is explicitly considered in the proposed path searching approach, thus the searched path shown in Fig. 11 has a certain distance from obstacles and provides sufficient optimization margin for the path vertices near the corner. The final smoothed path shown in Fig. 11 is much smoother than the path shown in Fig. 11, which demonstrates the proposed path searching approach can provide sufficient optimization margin for hard-constrained path smoothing approaches.


VII-C Comparison on Path Smoothing
VII-C1 Comparison on Safety
We select the start and goal configurations shown in Fig. 12 to validate the performance improvement of the proposed path smoothing approach in terms of safety. For a fair comparison, the proposed path searching approach is used to generate the reference path for path smoothing. For testing purposes, we also do not limit the length of the initial path for path smoothing. Generally, hard-constrained path smoothing approaches treat all free space equally, namely, distance from feasible paths to obstacles is ignored. As a result, the optimized path is close to obstacles, as shown in Fig. 12. And the penalty of the deviation from the reference path is introduced in the proposed path smoothing approach. Because the reference path searched by the proposed path searching approach has a certain distance from obstacles, the safety of the path is implicitly considered during path smoothing, and the path clearance of the final optimized path is improved, as shown in Fig. 12. The minimum distance between the path shown in Fig. 12 and obstacles is , which is the same as the circumscribed radius of the robot. While the path clearance of the path shown in Fig. 12 is , and the path safety is improved by .
VII-C2 Comparison on Computational Efficiency
We select the start and goal configurations shown in Figs. 11 and 12 to further compare the computational efficiency of path smoothing approaches. For a fair comparison, the proposed path searching approach is employed to generate the same reference path for SBA [44], TEB [30], and the proposed QP-based path smoothing approach. In each scenario, we also repeat the test times. The statistics of the runtime performance are shown in Table III. Thanks to the convexity of the proposed path optimization formulation, the maximum runtime of the proposed path smoothing approach is less than in all two tests, and the computational efficiency of the proposed path smoothing approach is approximatively and times faster than that of SBA and TEB on average, respectively.




VII-D Autonomous Navigation
Finally, the proposed path searching and path smoothing approaches are integrated into the powerful ROS navigation stack333https://github.com/ros-planning/navigation to validate the effectiveness and practicability of the G2VD planner. In particular, we implement a G2VD cost map layer on top of the original ROS cost map. On this basis, the proposed path searching approach and the path smoothing approach are implemented as global and local planner plugins for the ROS navigation stack, respectively. Considering the computational efficiency and sensing range, the length of the initial local path is set to . As illustrated in Fig. 10, we select two sets of different start and goal configurations for outdoor navigation. The total travel distances of these two sets of outdoor navigation are approximately and , respectively.
Here we summarize several representative experimental results of outdoor autonomous navigation to demonstrate the key characteristics of the G2VD planner. More details are included in the video.
VII-D1 Dealing With Static Obstacles
Fig. 13(a) illustrates the scenario with unknown static obstacles. The robot avoids a temporarily parked tricycle smoothly, according to the reliable path smoothing results.
VII-D2 Dealing With Dynamic Obstacles
Fig. 13(b) shows the scenario with dynamic obstacles. The robot implements fast re-planning and avoids an oncoming person successfully, thanks to the efficient path smoothing approach.
Remark: In this work, dynamic obstacles are regarded as instantaneous static obstacles. Namely, both dynamic and static obstacles are considered in a unified framework. Moving dynamic obstacles and unknown static obstacles are detected by external sensors mounted on the robot and the states of affected cells in the G2VD are updated according to the update mechanism described in Section IV-A.
VIII Conclusion
In this paper, an efficient motion planning approach called G2VD planner is newly proposed for mobile robots. Based on a G2VD, a new state lattice-based path planner is proposed, in which the search space is reduced to a Voronoi corridor to further improve the search efficiency. And an efficient QP-based path smoothing approach is presented, wherein the clearance to obstacles is considered to improve the path clearance of hard-constrained path smoothing approaches. We validate the G2VD planner in various complex simulation scenarios and outdoor environments. The results show that the computational efficiency is improved by 17.1% in the path searching stage, and path smoothing with the proposed approach is 25.3 times faster than an advanced sparse-banded structure-based path smoothing approach.
In the future, we plan to integrate the intention/trajectory prediction of pedestrians/vehicles into the proposed framework to enhance the foreseeability of the motion planner.
References
- [1] Z. Chen, J. Alonso-Mora, X. Bai, D. D. Harabor, and P. J. Stuckey, “Integrated task assignment and path planning for capacitated multi-agent pickup and delivery,” IEEE Robotics and Automation Letters, vol. 6, no. 3, pp. 5816–5823, 2021.
- [2] X. Bai, M. Cao, W. Yan, and S. S. Ge, “Efficient routing for precedence-constrained package delivery for heterogeneous vehicles,” IEEE Transactions on Automation Science and Engineering, vol. 17, no. 1, pp. 248–260, 2019.
- [3] X. Bai, A. Fielbaum, M. Kronmüller, L. Knoedler, and J. Alonso-Mora, “Group-based distributed auction algorithms for multi-robot task assignment,” IEEE Transactions on Automation Science and Engineering, vol. 20, no. 2, pp. 1292–1303, 2022.
- [4] G. Li, J. Xu, Z. Li, C. Chen, and Z. Kan, “Sensing and navigation of wearable assistance cognitive systems for the visually impaired,” IEEE Transactions on Cognitive and Developmental Systems, vol. 15, no. 1, pp. 122–133, 2022.
- [5] Y. Song, Z. Li, G. Li, B. Wang, M. Zhu, and P. Shi, “Multi-sensory visual-auditory fusion of wearable navigation assistance for people with impaired vision,” IEEE Transactions on Automation Science and Engineering, 2023, doi: 10.1109/TASE.2023.3340335.
- [6] H. Gao, X. Zhang, J. Yuan, and Y. Fang, “NEGL: Lightweight and efficient neighborhood encoding-based global localization for unmanned ground vehicles,” IEEE Transactions on Vehicular Technology, vol. 72, no. 6, pp. 7111–7122, 2023.
- [7] T. Wen, K. Jiang, B. Wijaya, H. Li, M. Yang, and D. Yang, “TM3Loc: Tightly-coupled monocular map matching for high precision vehicle localization,” IEEE Transactions on Intelligent Transportation Systems, vol. 23, no. 11, pp. 20 268–20 281, 2022.
- [8] T. Wen, D. Yang, K. Jiang, C. Yu, J. Lin, B. Wijaya, and X. Jiao, “Bridging the gap of lane detection performance between different datasets: Unified viewpoint transformation,” IEEE Transactions on Intelligent Transportation Systems, vol. 22, no. 10, pp. 6198–6207, 2021.
- [9] T. Wen, K. Jiang, J. Miao, B. Wijaya, P. Jia, M. Yang, and D. Yang, “Roadside HD map object reconstruction using monocular camera,” IEEE Robotics and Automation Letters, vol. 7, no. 3, pp. 7722–7729, 2022.
- [10] J.-C. Latombe, Robot Motion Planning. Kluwer Academic Publishers, 1991.
- [11] H. M. Choset, K. M. Lynch, S. Hutchinson, G. Kantor, W. Burgard, L. Kavraki, S. Thrun, and R. C. Arkin, Principles of Robot Motion: Theory, Algorithms, and Implementation. MIT Press, 2005.
- [12] J. Wang, W. Chi, C. Li, and M. Q.-H. Meng, “Efficient robot motion planning using bidirectional-unidirectional RRT extend function,” IEEE Transactions on Automation Science and Engineering, vol. 19, no. 3, pp. 1859–1868, 2022.
- [13] J. Wang, X. Jia, T. Zhang, N. Ma, and M. Q.-H. Meng, “Deep neural network enhanced sampling-based path planning in 3D space,” IEEE Transactions on Automation Science and Engineering, vol. 19, no. 4, pp. 3434–3443, 2022.
- [14] X. Zhou, X. Yu, Y. Zhang, Y. Luo, and X. Peng, “Trajectory planning and tracking strategy applied to an unmanned ground vehicle in the presence of obstacles,” IEEE Transactions on Automation Science and Engineering, vol. 18, no. 4, pp. 1575–1589, 2021.
- [15] Q. Bi, X. Zhang, J. Wen, Z. Pan, S. Zhang, R. Wang, and J. Yuan, “CURE: A hierarchical framework for multi-robot autonomous exploration inspired by centroids of unknown regions,” IEEE Transactions on Automation Science and Engineering, 2023, doi: 10.1109/TASE.2023.3285300.
- [16] W. Chi, C. Wang, J. Wang, and M. Q.-H. Meng, “Risk-DTRRT-based optimal motion planning algorithm for mobile robots,” IEEE Transactions on Automation Science and Engineering, vol. 16, no. 3, pp. 1271–1288, 2019.
- [17] J. Wang, W. Chi, C. Li, C. Wang, and M. Q.-H. Meng, “Neural RRT*: Learning-based optimal path planning,” IEEE Transactions on Automation Science and Engineering, vol. 17, no. 4, pp. 1748–1758, 2020.
- [18] J. Wang, M. Q.-H. Meng, and O. Khatib, “EB-RRT: Optimal motion planning for mobile robots,” IEEE Transactions on Automation Science and Engineering, vol. 17, no. 4, pp. 2063–2073, 2020.
- [19] S. Zhang, R. Cui, W. Yan, and Y. Li, “Dual-layer path planning with pose SLAM for autonomous exploration in GPS-denied environments,” IEEE Transactions on Industrial Electronics, vol. 71, no. 5, pp. 4976–4986, 2024.
- [20] S. M. LaValle, Planning Algorithms. Cambridge University Press, 2006.
- [21] L. E. Kavraki, P. Svestka, J.-C. Latombe, and M. H. Overmars, “Probabilistic roadmaps for path planning in high-dimensional configuration spaces,” IEEE Transactions on Robotics and Automation, vol. 12, no. 4, pp. 566–580, 1996.
- [22] S. M. LaValle and J. J. Kuffner, “Randomized kinodynamic planning,” The International Journal of Robotics Research, vol. 20, no. 5, pp. 378–400, 2001.
- [23] S. Karaman and E. Frazzoli, “Sampling-based algorithms for optimal motion planning,” The International Journal of Robotics Research, vol. 30, no. 7, pp. 846–894, 2011.
- [24] O. Khatib, “Real-time obstacle avoidance for manipulators and mobile robots,” The International Journal of Robotics Research, vol. 5, no. 1, pp. 90–98, 1986.
- [25] X. Bai, W. Yan, M. Cao, and D. Xue, “Distributed multi-vehicle task assignment in a time-invariant drift field with obstacles,” IET Control Theory & Applications, vol. 13, no. 17, pp. 2886–2893, 2019.
- [26] A. Ravankar, A. A. Ravankar, Y. Kobayashi, Y. Hoshino, and C.-C. Peng, “Path smoothing techniques in robot navigation: State-of-the-art, current and future challenges,” Sensors, vol. 18, no. 9, pp. 1–30, 2018.
- [27] C. Rösmann, F. Hoffmann, and T. Bertram, “Kinodynamic trajectory optimization and control for car-like robots,” in Proceedings of the 2017 IEEE/RSJ International Conference on Intelligent Robots and Systems, 2017, pp. 5681–5686.
- [28] J. Deray, B. Magyar, J. Solà, and J. Andrade-Cetto, “Timed-elastic smooth curve optimization for mobile-base motion planning,” in Proceedings of the 2019 IEEE/RSJ International Conference on Intelligent Robots and Systems, 2019, pp. 3143–3149.
- [29] J. S. Smith, R. Xu, and P. Vela, “egoTEB: Egocentric, perception space navigation using timed-elastic-bands,” in Proceedings of the 2020 IEEE International Conference on Robotics and Automation, 2020, pp. 2703–2709.
- [30] C. Rösmann, F. Hoffmann, and T. Bertram, “Integrated online trajectory planning and optimization in distinctive topologies,” Robotics and Autonomous Systems, vol. 88, pp. 142–153, 2017.
- [31] X. Zhang, A. Liniger, A. Sakai, and F. Borrelli, “Autonomous parking using optimization-based collision avoidance,” in Proceedings of the 2018 IEEE Conference on Decision and Control, 2018, pp. 4327–4332.
- [32] X. Zhang, A. Liniger, and F. Borrelli, “Optimization-based collision avoidance,” IEEE Transactions on Control Systems Technology, vol. 29, no. 3, pp. 972–983, 2021.
- [33] Z. Zhu, E. Schmerling, and M. Pavone, “A convex optimization approach to smooth trajectories for motion planning with car-like robots,” in Proceedings of the 2015 IEEE Conference on Decision and Control, 2015, pp. 835–842.
- [34] C. Liu, C.-Y. Lin, Y. Wang, and M. Tomizuka, “Convex feasible set algorithm for constrained trajectory smoothing,” in Proceedings of the 2017 American Control Conference, 2017, pp. 4177–4182.
- [35] M. Likhachev and D. Ferguson, “Planning long dynamically feasible maneuvers for autonomous vehicles,” The International Journal of Robotics Research, vol. 28, no. 8, pp. 933–945, 2009.
- [36] M. Pivtoraiko, R. A. Knepper, and A. Kelly, “Differentially constrained mobile robot motion planning in state lattices,” Journal of Field Robotics, vol. 26, no. 3, pp. 308–333, 2009.
- [37] D. Ferguson, T. M. Howard, and M. Likhachev, “Motion planning in urban environments,” Journal of Field Robotics, vol. 25, no. 11–12, pp. 939–960, 2008.
- [38] B. B. K. Ayawli, X. Mei, M. Shen, A. Y. Appiah, and F. Kyeremeh, “Mobile robot path planning in dynamic environment using Voronoi diagram and computation geometry technique,” IEEE Access, vol. 7, pp. 86 026–86 040, 2019.
- [39] H. Choset and J. Burdick, “Sensor-based exploration: The hierarchical generalized Voronoi graph,” The International Journal of Robotics Research, vol. 19, no. 2, pp. 96–125, 2000.
- [40] J. Ziegler, M. Werling, and J. Schroder, “Navigating car-like robots in unstructured environments using an obstacle sensitive cost function,” in Proceedings of the 2008 IEEE Intelligent Vehicles Symposium, 2008, pp. 787–791.
- [41] D. Dolgov, S. Thrun, M. Montemerlo, and J. Diebel, “Path planning for autonomous vehicles in unknown semi-structured environments,” The International Journal of Robotics Research, vol. 29, no. 5, pp. 485–501, 2010.
- [42] K. Cai, W. Chen, C. Wang, S. Song, and M. Q.-H. Meng, “Human-aware path planning with improved virtual Doppler method in highly dynamic environments,” IEEE Transactions on Automation Science and Engineering, vol. 20, no. 2, pp. 1304–1321, 2023.
- [43] Y. Suzuki, S. Thompson, and S. Kagami, “Smooth path planning with pedestrian avoidance for wheeled robots,” Journal of Robotics and Mechatronics, vol. 22, no. 1, pp. 21–27, 2010.
- [44] J. Wen, X. Zhang, H. Gao, J. Yuan, and Y. Fang, “E3MoP: Efficient motion planning based on heuristic-guided motion primitives pruning and path optimization with sparse-banded structure,” IEEE Transactions on Automation Science and Engineering, vol. 19, no. 4, pp. 2762–2775, 2022.
- [45] J. Zhou, R. He, Y. Wang, S. Jiang, Z. Zhu, J. Hu, J. Miao, and Q. Luo, “Autonomous driving trajectory optimization with dual-loop iterative anchoring path smoothing and piecewise-jerk speed optimization,” IEEE Robotics and Automation Letters, vol. 6, no. 2, pp. 439–446, 2021.
- [46] K. Kant and S. W. Zucker, “Toward efficient trajectory planning: The path-velocity decomposition,” The International Journal of Robotics Research, vol. 5, no. 3, pp. 72–89, 1986.
- [47] X. Zhang, J. Wang, Y. Fang, and J. Yuan, “Multilevel humanlike motion planning for mobile robots in complex indoor environments,” IEEE Transactions on Automation Science and Engineering, vol. 16, no. 3, pp. 1244–1258, 2019.
- [48] B. Lau, C. Sprunk, and W. Burgard, “Efficient grid-based spatial representations for robot navigation in dynamic environments,” Robotics and Autonomous Systems, vol. 61, no. 10, pp. 1116–1130, 2013.
- [49] N. Kalra, D. Ferguson, and A. Stentz, “Incremental reconstruction of generalized Voronoi diagrams on grids,” Robotics and Autonomous Systems, vol. 57, no. 2, pp. 123–128, 2009.
- [50] G. Grisetti, C. Stachniss, and W. Burgard, “Improved techniques for grid mapping with Rao-Blackwellized particle filters,” IEEE Transactions on Robotics, vol. 23, no. 1, pp. 34–46, 2007.
- [51] P. F. Felzenszwalb and D. P. Huttenlocher, “Distance transforms of sampled functions,” Theory of Computing, vol. 8, no. 1, pp. 415–428, 2012.
- [52] P. Shen, X. Zhang, and Y. Fang, “Essential properties of numerical integration for time-optimal path-constrained trajectory planning,” IEEE Robotics and Automation Letters, vol. 2, no. 2, pp. 888–895, 2017.
- [53] P. Shen, X. Zhang, and Y. Fang, “Complete and time-optimal path-constrained trajectory planning with torque and velocity constraints: Theory and applications,” IEEE/ASME Transactions on Mechatronics, vol. 23, no. 2, pp. 735–746, 2018.
- [54] P. Shen, X. Zhang, Y. Fang, and M. Yuan, “Real-time acceleration-continuous path-constrained trajectory planning with built-in tradeoff between cruise and time-optimal motions,” IEEE Transactions on Automation Science and Engineering, vol. 17, no. 4, pp. 1911–1924, 2020.
- [55] B. Siciliano, L. Sciavicco, L. Villani, and G. Oriolo, Robotics: Modelling, Planning and Control. Springer, 2009.
- [56] B. Stellato, G. Banjac, P. Goulart, A. Bemporad, and S. Boyd, “OSQP: An operator splitting solver for quadratic programs,” Mathematical Programming Computation, vol. 12, no. 4, pp. 637–672, 2020.
- [57] N. Koenig and A. Howard, “Design and use paradigms for Gazebo, an open-source multi-robot simulator,” in Proceedings of the 2004 IEEE/RSJ International Conference on Intelligent Robots and Systems, 2004, pp. 2149–2154.
- [58] J. Wen, X. Zhang, Q. Bi, Z. Pan, Y. Feng, J. Yuan, and Y. Fang, “MRPB 1.0: A unified benchmark for the evaluation of mobile robot local planning approaches,” in Proceedings of the 2021 IEEE International Conference on Robotics and Automation, 2021, pp. 8238–8244.
- [59] T. Shan, B. Englot, D. Meyers, W. Wang, C. Ratti, and R. Daniela, “LIO-SAM: Tightly-coupled lidar inertial odometry via smoothing and mapping,” in Proceedings of the 2020 IEEE/RSJ International Conference on Intelligent Robots and Systems, 2020, pp. 5135–5142.
- [60] H. Liu, R. Song, X. Zhang, and H. Liu, “Point clouds segmentation based on Euclidean clustering and multi-plane extraction in rugged field,” Measurement Science and Technology, vol. 32, no. 9, pp. 1–14, 2021.
![]() |
Jian Wen received the B.S. degree in automation and the Ph.D. degree in control science and engineering from Nankai University, Tianjin, China, in 2017 and 2022, respectively. He is currently working as a Senior Algorithm Engineer with the Group of Autonomous Driving, Xiaomi EV Company Limited, Beijing, China. His research interests include behavioral reasoning, decision making, and motion planning for autonomous driving vehicles. |
![]() |
Xuebo Zhang (M’12SM’17) received the B.Eng. degree in automation from Tianjin University, Tianjin, China, in 2006, and the Ph.D. degree in control theory and control engineering from Nankai University, Tianjin, China, in 2011. From 2014 to 2015, he was a Visiting Scholar with the Department of Electrical and Computer Engineering, University of Windsor, Windsor, ON, Canada. He was a Visiting Scholar with the Department of Mechanical and Biomedical Engineering, City University of Hong Kong, Hong Kong, in 2017. He is currently a Professor with the Institute of Robotics and Automatic Information System, Nankai University, and Tianjin Key Laboratory of Intelligent Robotics, Nankai University. His research interests include planning and control of autonomous robotics and mechatronic system with focus on time-optimal planning and visual servo control; intelligent perception including robot vision, visual sensor networks, SLAM; reinforcement learning and game theory. Dr. Zhang is a Technical Editor of IEEE/ASME Transactions on Mechatronics and an Associate Editor of ASME Journal of Dynamic Systems, Measurement, and Control. |
![]() |
Qingchen Bi received the B.S. degree in detection guidance and control technology from Northwestern Polytechnical University, Xi’an, China, in 2021, where he is currently pursuing the Ph.D. degree in control science and engineering with the Institute of Robotics and Automatic Information System, Nankai University, Tianjin, China. His research interests include mobile robot motion planning and autonomous exploration. |
![]() |
Hui Liu received the B.S. degree in intelligence science and technology from Hebei University of Technology, Tianjin, China, in 2019, and the M.S. degree in control science and engineering from Nankai University, Tianjin, China, in 2022. He is currently working as an Algorithm Engineer at Baidu Inc., Beijing, China. His research interests include SLAM and calibration. |
![]() |
Jing Yuan (M’12) received the B.S. degree in automatic control, and the Ph.D. degree in control theory and control engineering from Nankai University, Tianjin, China, in 2002 and 2007, respectively. Since 2007, he has been with the College of Computer and Control Engineering, Nankai University, where he is currently a Professor. His current research interests include robotic control, motion planning, and SLAM. |
![]() |
Yongchun Fang (S’00M’02SM’08) received the B.S. degree in electrical engineering and the M.S. degree in control theory and applications from Zhejiang University, Hangzhou, China, in 1996 and 1999, respectively, and the Ph.D. degree in electrical engineering from Clemson University, Clemson, SC, in 2002. From 2002 to 2003, he was a Post-Doctoral Fellow with the Sibley School of Mechanical and Aerospace Engineering, Cornell University, Ithaca, NY, USA. He is currently a Professor with the Institute of Robotics and Automatic Information System, Nankai University, Tianjin, China. His research interests include visual servoing, AFM-based nano-systems, and control of underactuated systems including overhead cranes. |