这是用户在 2024-5-5 16:57 为 https://ieeexplore.ieee.org/abstract/document/9734323 保存的双语快照页面,由 沉浸式翻译 提供双语支持。了解如何保存?
基于拓扑图的室内移动的机器人路径规划改进A—star算法|IEEE会议出版物|IEEE Xplore --- Improved A-star Algorithm based on Topological Maps for Indoor Mobile Robot Path Planning | IEEE Conference Publication | IEEE Xplore

Improved A-star Algorithm based on Topological Maps for Indoor Mobile Robot Path Planning
基于拓扑图的室内移动的机器人路径规划改进A-star算法

Publisher: IEEE 出版商:IEEE

Abstract:Aiming at the problem of low planning efficiency of traditional A-star algorithm in large indoor scenes, this paper proposes to improve the A-star algorithm based on the ...View more
Abstract: 摘要:
Aiming at the problem of low planning efficiency of traditional A-star algorithm in large indoor scenes, this paper proposes to improve the A-star algorithm based on the use of topological maps to improve the efficiency of A-star path planning in large scenes. First, use 2D lidar to construct a grid map to obtain high-precision environmental information. Secondly, the depth camera is used to capture indoor objects and construct a topological map. Finally, the connectivity of nodes in the topological map is used to improve the path planning problem of the A-star algorithm in large scenarios. Experiments show that the improved algorithm can quickly plan a path in large scenarios. Compared with the original A-star algorithm, this algorithm shortens the time cost and reduces the amount of calculation. Improve the planning efficiency of the algorithm.
针对传统A-star算法在室内大场景下规划效率较低的问题,提出利用拓扑地图对A-star算法进行改进,以提高大场景下A-star路径规划的效率。首先,使用二维激光雷达构建栅格地图,获取高精度的环境信息。其次,使用深度相机捕获室内物体并构建拓扑图。最后,利用拓扑图中节点的连通性,改进了A-star算法在大场景下的路径规划问题。实验表明,改进后的算法能够在大场景下快速规划出路径。与原A-star算法相比,该算法缩短了时间开销,减少了计算量。提高了算法的规划效率。
Published in: 2022 IEEE 6th Information Technology and Mechatronics Engineering Conference (ITOEC)
2022 IEEE第六届信息技术与机电一体化工程会议(ITOEC)
Date of Conference: 04-06 March 2022
会议日期:2022年3月4日至6日
Date Added to IEEE Xplore: 23 March 2022
添加到IEEE Xplore的日期:2022年3月23日
ISBN Information: ISBN信息:
ISSN Information: ISSN信息:
DOI: 10.1109/ITOEC53115.2022.9734323
DOI:10.1109/ITOEC53115.2022.9734323
Publisher: IEEE 出版商:IEEE
Conference Location: Chongqing, China
会议地点:中国重庆

SECTION I. 第一节

Introduction 介绍

With the rapid development of robotics and artificial intelligence, mobile robots have been widely used. To accomplish the navigation task on the basis of the existing grid map, reasonable path planning becomes crucial. Therefore, many researchers have done a lot of work on path planning algorithms.
随着机器人技术和人工智能的迅速发展,移动的机器人得到了广泛的应用。要在现有栅格地图的基础上完成导航任务,合理的路径规划就变得至关重要。因此,许多研究者在路径规划算法方面做了大量的工作。

At present, many path planning algorithms have been proposed, including artificial potential field method [1], A-star algorithm [2], ant colony algorithm [3], Dijkstra [4] and RRT [5] algorithm and various optimization algorithms for RRT [6]–​[8]. Among them, the A-star algorithm is widely used for path planning of robots. Wang [9] et al. proposed to control the node weights so that the A-star algorithm can approach the target point quickly when it is far away from the target point and can search locally and carefully when it is close to the target point to ensure that the target is reachable when there are more obstacles near the target point. It solves the problem of poor real-time path planning for mobile robots in complex indoor environments. Lu et al. [10] proposed to add a judgment threshold to the set open of A-star algorithm to improve the real-time path planning and reduce the number of search nodes. Chen et al [11] combined the idea of artificial potential field with the traditional A-star algorithm to give the repulsive field function to the obstacles in the grid map and calculate the repulsive magnitude of the surrounding grid to solve the problem that the traditional A-star algorithm does not consider the influence of the obstacle distribution on the path selection when planning the path. Zhao et al [12] combined the A-star algorithm with the jump point search algorithm to extend by screening jump points, which reduces unnecessary node computation and solves the problems of large memory overhead and long computation time of A-star pathfinding algorithm in larger scenarios.
目前,已经提出了许多路径规划算法,包括人工势场法 [1] 、A-star算法 [2] 、蚁群算法 [3] 、Dijkstra算法 [4] 和RRT算法 [5] 以及RRT算法 [6] - [8] 的各种优化算法。其中,A-star算法被广泛用于机器人的路径规划。Wang [9] 等提出控制节点权重,使A-star算法在远离目标点时能快速接近目标点,在接近目标点时能局部仔细搜索,保证目标点附近障碍物较多时目标可达。解决了室内复杂环境下移动的机器人路径规划实时性差的问题。Lu等 [10] 提出在A-star算法的集合开度中增加判断阈值,以提高路径规划的实时性,减少搜索节点数。 Chen等 [11] 将人工势场的思想与传统的A-star算法相结合,对栅格地图中的障碍物给予排斥场函数,并计算周围栅格的排斥大小,解决了传统A-star算法在规划路径时没有考虑障碍物分布对路径选择的影响的问题; Zhao等 [12] 将A-star算法与传统的A-star算法相结合,星星算法通过筛选跳转点,对跳转点搜索算法进行扩展,减少了不必要的节点计算,解决了A-星星寻路算法在较大场景下内存开销大、计算时间长的问题。

To address the problems of low computational efficiency and long convergence time of A-star algorithm, this paper proposes to improve the A-star algorithm based on using topological maps to enhance the efficiency of A-star in path planning under large scenes. Firstly, the grid map is constructed by using laser SLAM. Secondly, a topological mapping system is proposed to construct the topological map. Finally, the node connectivity relationship in the topological map is used to improve the path planning problem of A-star algorithm in large scenes. The time cost is shortened and the computation is reduced. The planning efficiency of the algorithm is improved.
针对A-star算法计算效率低、收敛时间长的问题,提出利用拓扑地图对A-star算法进行改进,以提高A-star算法在大场景下的路径规划效率。首先,利用激光SLAM构建栅格地图。其次,提出了一个拓扑映射系统来构造拓扑图。最后,利用拓扑图中节点的连通关系,改进了A-star算法在大场景下的路径规划问题。缩短了计算时间,减少了计算量。提高了算法的规划效率。

SECTION II. 第二节

A-Star Algorithm Principle
A-Star算法原理

The A-star algorithm is the most effective direct search method for solving the shortest path, and is currently widely used in path planning. Applicable to static grid maps, the cost function expression is:

f(n)=g(n)+h(n)(1)
View SourceRight-click on figure for MathML and additional features. where f(n) denotes the minimum cost estimate from the initial state (starting point) to the target state (end point) via state n. g(n) denotes the minimum cost from the initial state to state n in the state space. h(n) denotes the minimum estimated cost of the path from state n to the target state. Where A-star is the key to ensure that the optimal path is found The choice of the path can affect the accuracy of the algorithm and the time efficiency of the search. When the actual cost of moving from the current state to the target is higher than that of moving from the current state to the target, the path searched is not guaranteed to be optimal, but the search time of the algorithm is fast. When the actual cost of moving from the current state to the target is small, the number of points searched is large and the search path is optimal, but the efficiency of the search is low and the time spent is long. The search efficiency is highest when the two are equal. Therefore, it is important to maintain a balance between the two so that the performance of A-star is optimal. Also known as the heuristic function. The commonly used heuristic function distance is the Euclidean distance. Euclidean distance is the linear distance between two nodes and can be expressed as follows:
h(n)=(xnxgoal)2+(ynygoal)2(2)
View SourceRight-click on figure for MathML and additional features.

A-star算法是求解最短路径最有效的直接搜索方法,目前在路径规划中得到广泛应用。适用于静态网格地图,成本函数表达式为:
f(n)=g(n)+h(n)(1)
View SourceRight-click on figure for MathML and additional features.
其中 f(n) 表示从初始状态(起点)经由状态n到目标状态(终点)的最小成本估计。 g(n) 表示状态空间中从初始状态到状态n的最小成本。 h(n) 表示从状态n到目标状态的路径的最小估计成本。其中A-star是确保找到最优路径的关键,路径的选择会影响算法的精度和搜索的时间效率。当从当前状态移动到目标的实际代价高于从当前状态移动到目标的实际代价时,不能保证搜索到的路径是最优的,但算法的搜索时间较快。 当从当前状态移动到目标的实际代价较小时,搜索的点数较多,搜索路径最优,但搜索的效率较低,花费的时间较长。当两者相等时,搜索效率最高。因此,重要的是要在两者之间保持平衡,使A-star的性能达到最佳。也称为启发式函数。常用的启发式函数距离是欧几里得距离。 欧几里得距离是两个节点之间的线性距离,可以表示为:

The specific implementation steps of the traditional A-star algorithm are given below [13].
传统A-star算法的具体实现步骤如下 [13]

SECTION Algorithm 1 SECTION算法1

A-star algorithm A-star算法

Input: start map, goal 输入:开始 map, goal

1:

close NULL 关闭 NULL

2:

open start 打开 start

3:

G[start]g[start]=0,H[start]h[start]

4:

F[start]H[start] 5: while open ϕ do
F[start]H[start] 5:打开时 ϕ

6:

current_node Node with the minimum F value in open
current_node 打开时F值最小的节点

7:

open open{currentnote} 打开 open{currentnote}

8:

close close{currentnote} 关闭 close{currentnote}

9:

if current_node =goal then 如果当前节点 =goal ,则

10:

return best_path 返回最佳路径

11:

end if

12:

neighbor_nodes All neighbor nodes of cur-rentnodeof current_node
neighbor_nodes 当前节点的所有邻居节点current_node的所有邻居节点

13:

for N neighbor_nodes do
对于N个 neighbor_nodes,

14:

if N close then
如果N 关闭,则

15:

do nothing 什么都不做

16:

else if N open then
否则,如果N 打开,则

17:

G[N_new _calculated]'H, F calculated N's G, H, F
G[N_new _calculated] N ′ H,F 计算N的G,H,F

18:

if G[Nopen]>G[Nnewcalculated] then 如果 G[Nopen]>G[Nnewcalculated] ,则

19:

N's parent - current_node
N的父节点 - current_node

20:

end if

21:

N's parent current_node
N的父节点 current_node

22:

end if

23:

end for 

24:

end while

SECTION III. 第三节

Improving the A-Star Algorithm
A-Star算法的改进

A. Topological Map Acquisition Method
A.一种拓扑图获取方法

Occupancy grid maps use a binarized representation. This static grid map is convenient for various path search algorithms for path planning. The 2D grid map is first created using laser SLAM, and the current mainstream map building algorithm is Cartographer, which has loopback detection to create maps with high accuracy and is suitable for map creation of large scenes.
占领区网格地图使用二进制表示。该静态栅格地图便于各种路径搜索算法进行路径规划。2D栅格地图首先使用激光SLAM创建,目前主流的地图创建算法是Cartographer,它具有快速检测以创建高精度的地图,适用于大型场景的地图创建。

Fig. 1. - Process flow diagram for semantic topological map creation.
Fig. 1.  图1.

Process flow diagram for semantic topological map creation.
创建语义拓扑图的过程流程图。

In indoor environments, several kinds of objects are generally present in different areas, and the features and locations of some of these objects can be used for the construction of topological nodes. As shown in Figure 1, the flowchart of the acquisition method of semantic topological map is shown, firstly, RGB images and depth images are acquired using realsense camera. The semantic objects in the room are obtained by combining with solov2 instance segmentation algorithm. Secondly, according to the obtained semantic objects are transformed to the camera coordinate system, according to the inverse imaging principle, the pixel coordinates (u,v,d)T are transformed to the image polar coordinate system (Zc,Xc,Yc)T can be expressed as:

Zc=d/1000Xc=(ucx)Zc/fxYc=(vcy)Zc/fy(3)
View SourceRight-click on figure for MathML and additional features. u,v is the pixel coordinate value of the object segmented in the RGB image; d is the depth value of the pixel coordinate of (u,v) in the depth image. The depth information of the corresponding semantic pixel points can be obtained by performing the image alignment operation using the RGB map and the depth image. Cx Cy fx fy is the camera internal parameter. At this point, the semantic point cloud contains some noise, so the noise is filtered out by using the filtering method. Finally, the relative relationship between the camera coordinate system and the map coordinate system is obtained, and the conversion of the semantic point cloud Pc to the map coordinate system Pm can be expressed as:
Pm=R×Pc+T(4)
View SourceRight-click on figure for MathML and additional features.
where R is the rotation matrix and T is the translation vector. The semantic point cloud in the camera coordinate system is converted to the map coordinate system by equation 4. At this point, the corresponding semantic landmark information is obtained.
在室内环境中,几种类型的对象通常存在于不同的区域中,并且这些对象中的一些对象的特征和位置可以用于拓扑节点的构造。如图 Figure 1 所示,示出了语义拓扑图的获取方法的流程图,首先使用realsense相机获取RGB图像和深度图像。结合solov 2实例分割算法得到房间内的语义对象。其次,根据得到的语义对象变换到摄像机坐标系,根据逆成像原理,将像素坐标 (u,v,d)T 变换到图像极坐标系 (Zc,Xc,Yc)T ,可以表示为:
Zc=d/1000Xc=(ucx)Zc/fxYc=(vcy)Zc/fy(3)
View SourceRight-click on figure for MathML and additional features.
u,v 为分割对象在RGB图像中的像素坐标值; d 是深度图像中 (u,v) 的像素坐标的深度值。 对应的语义像素点的深度信息可以通过使用RGB图和深度图像执行图像对准操作来获得。 Cx Cy fx fy 是相机内部参数。此时,语义点云包含一些噪声,因此使用滤波方法滤除噪声。最后,得到摄像机坐标系与地图坐标系的相对关系,语义点云 Pc 到地图坐标系 Pm 的转换可以表示为:
Pm=R×Pc+T(4)
View SourceRight-click on figure for MathML and additional features.
,其中 R 为旋转矩阵, T 为平移向量。相机坐标系中的语义点云通过等式 4 转换为地图坐标系。此时,获得相应的语义地标信息。

According to the nature of graph, it is known that a graph is composed of several vertices and edges connected to each other. Among them, each edge connects two vertices, and a graph with no direction between two vertices is called an undirected graph. The robot is bi-directional during the motion of two points, so this paper proposes to connect the semantic landmarks of different regions using undirected graphs. As shown in Figure 2, a semantic topological map of 14 m long and 10 m wide is created.
根据图的性质,我们知道一个图是由若干个相互连接的顶点和边组成的。其中,每条边连接两个顶点,两个顶点之间没有方向的图称为无向图。机器人在两点运动时是双向的,因此本文提出用无向图连接不同区域的语义标志。如 Figure 2 所示,创建了14米长、10米宽的语义拓扑图。

Fig. 2. - Schematic diagram of topological nodes based on semantic maps.
Fig. 2.  图2.

Schematic diagram of topological nodes based on semantic maps.
基于语义地图的拓扑节点示意图。

B. A-Star Algorithm Topological Node Search Strategy
B。A—Star算法的拓扑节点搜索策略

Based on the created semantic topological map, the navigation of the mobile robot has a priori information. The mobile robot performs path planning based on the topological grid map. the heuristic function of the A-star algorithm acts on the search effect. In large scenarios, the grid base of the A-star search becomes inflated extremely fast, the complexity of the search is high, and the computational effort is large. Therefore, the search takes a long time and significantly reduces the speed of path planning.
基于所创建的语义拓扑地图,移动的机器人的导航具有先验信息。移动的机器人根据拓扑栅格地图进行路径规划。A-star算法的启发函数影响搜索效果。在大型场景中,A星搜索的网格基础变得非常快,搜索的复杂性很高,计算量很大。因此,搜索需要很长的时间,并大大降低了路径规划的速度。

To improve the path planning speed and success rate of A -star algorithm in large scenes, this paper proposes the A-star path search algorithm based on semantic topological map. The path planning in large scenes is divided into two parts: path planning based on grid map and path planning based on semantic nodes to complete. The semantic topological map completes the planning of the path trunk, and then connects it with the traditional path planning algorithm. In order to improve the efficiency of search and save time, this paper adopts a two-way A-star algorithm to connect different semantic nodes, as shown in Figure 3, when the mobile robot goes from the starting point Pstart to the end point Pgoal, A-star search is performed from the starting point and the end point respectively until the same point is encountered in the set open.
为提高A -星星算法在大场景下的路径规划速度和成功率,提出了基于语义拓扑图的A-星星路径搜索算法。将大场景中的路径规划分为两部分:基于栅格地图的路径规划和基于语义节点的路径规划来完成。语义拓扑图完成路径主干的规划,然后将其与传统的路径规划算法相衔接。为了提高搜索效率和保存时间,本文采用双向A星算法连接不同的语义节点,如图 Figure 3 所示,当移动的机器人从起点 Pstart 到终点 Pgoal 时,分别从起点和终点进行A星搜索,直到在集合开中遇到相同的点。

Fig. 3. - Bidirectional a-star algorithm schematic.
Fig. 3.  图3.

Bidirectional a-star algorithm schematic.
双向a-star算法原理图。

Next, the semantic nodes whose projections fall between the line of the two points are identified according to the positions of the starting point and the target point under the map coordinate system. As shown in Figure 4, five points from PA to PE in the figure. Then the paths of the starting point and the target point are segmented and planned based on the semantic landmark location relationship. The sequence of all vertices of the path from vertex Pstart to another vertex Pgoal (containing both vertices) is called a path.
接着,根据起点和目标点在地图坐标系下的位置,识别投影落在两点连线之间的语义节点。如 Figure 4 所示,图中从 PAPE 的五个点。然后基于语义地标位置关系对起始点和目标点的路径进行分割和规划。从顶点 Pstart 到另一个顶点 Pgoal (包含两个顶点)的路径的所有顶点的序列称为路径。

Fig. 4. - Semantic topological node path diagram.
Fig. 4.  图4.

Semantic topological node path diagram.
语义拓扑节点路径图。

Because the OutDegree and InDegree of some vertices are greater than one, the paths of the starting point and the target point are also not unique. To solve the path non-uniqueness problem, this paper first calculates the right between two vertices. As shown in Figure 5, the weights kAB corresponding to the edges connecting vertex PA and vertex PB can be expressed as:

kAB=(xAxB)2+(yAyB)2+|lAlB|(5)
View SourceRight-click on figure for MathML and additional features.
由于某些顶点的OutDegree和InDegree大于1,因此起始点和目标点的路径也不是唯一的。为了解决路径的不唯一性问题,本文首先计算两个顶点之间的距离。如图 Figure 5 所示,连接顶点 PA 和顶点 PB 的边所对应的权重 kAB 可以表示为:

According to Equation 5, the corresponding weights of all edges are found. Finally, Floyd's algorithm is used to find the shortest path between two vertices in the graph with weights. The core idea of this algorithm is whether there exists a path whose weight and is less than the weight of vertex A directly to vertex B. If there exists this updated path. It can be expressed as follows.

Dis(PA,PO)+Dis(PO,PB)<Dis(PA,PB)(6)
View SourceRight-click on figure for MathML and additional features. where PO is all the other vertices. Finally, the algorithm is used to find the shortest path from Pstart to Pgoal. The advantage of using segmented path planning is that it reduces the number of grids in the set open, which indirectly improves the overall planning time. This makes the A-star algorithm more efficient.
根据公式 5 求出所有边对应的权值,最后用弗洛伊德算法求出带权图中两个顶点之间的最短路径。该算法的核心思想是判断是否存在一条权和小于顶点A到顶点B的权的路径。如果存在此更新路径,则可以表示为:
Dis(PA,PO)+Dis(PO,PB)<Dis(PA,PB)(6)
View SourceRight-click on figure for MathML and additional features.
其中 PO 是所有其他顶点。最后,利用该算法求出从 PstartPgoal 的最短路径。使用分段路径规划的优点是它减少了开放集合中的网格数量,从而间接提高了整体规划时间。这使得A-star算法更加高效。

Fig. 5. - Topological path diagram with weighted semantics.
Fig. 5.  图5.

Topological path diagram with weighted semantics.
具有加权语义的拓扑路径图。

SECTION IV. 第四节

Data Simulation and Analysis
数据模拟与分析

To verify the feasibility and search efficiency of the algorithm in this paper, the improved A-star algorithm is simulated with the original A-star algorithm and the two-way A-star algorithm in a large environment, and the average data of 60 experiments are counted as the experimental results to compare the time cost and the search computation cost. The experiments are conducted on a computer with Intel Core i7-9750H, 2.6 GHz CPU and 16G memory, and the algorithm experiment platform is matplotlib environment introduced by Python3.
为了验证算法的可行性和搜索效率,在大环境下对改进的A-star算法与原A-star算法和双向A-star算法进行了仿真,并将60次实验的平均数据作为实验结果,比较了时间开销和搜索计算开销。实验在Intel Core i7- 9750 H、2.6 GHz CPU和16 G内存的计算机上进行,算法实验平台是Python 3. 0引入的matplotlib环境。

The simulation environment of Fig. 2 is simulated as a map of [140], [100] for verifying the algorithm's ability to search between the start and end points, with the start position set to [5], [5] and marked with blue and the end position set to [130], [90] and marked with red. The experimental results are shown in Figure 6.
Fig. 2 的模拟环境被模拟为[140]、[100]的地图,用于验证算法在起点和终点之间搜索的能力,其中起始位置被设置为 [5][5] 并且用蓝色标记,并且结束位置被设置为[130]、[90]并且用红色标记。实验结果见 Figure 6

Fig. 6. - Comparison of path planning results.
Fig. 6.  见图6。

Comparison of path planning results.
路径规划结果比较。

The experimental results obtained by each of the three algorithms after 60 iterations of path planning are summarized in Table 1.
在路径规划的60次迭代之后通过三种算法中的每一种获得的实验结果总结在 Table 1 中。

Table I. Table of Comparison of Algorithm Simulation Data
表I.算法模拟数据对比表
Table I.- Table of Comparison of Algorithm Simulation Data

It can be seen from Figure 6 that the original A-star and bidirectional A-star algorithms have a large search range, which wastes computational resources and has low planning time efficiency. The improved A-star algorithm avoids the invalid grid search and improves the computational efficiency, as can be seen from Table 1, the improved A-star algorithm improves the time cost by more than 60%.
Figure 6 可以看出,原有的A-star和双向A-star算法搜索范围大,浪费计算资源,规划时间效率低。改进后的A-star算法避免了无效网格搜索,提高了计算效率,从 Table 1 可以看出,改进后的A-star算法时间开销提高了60%以上。

SECTION V. 第五节

Conclusions 结论

This paper addresses the problem of low planning efficiency of the traditional A-star algorithm in large scenes. By improving the A-star algorithm using topological maps, the efficiency of A-star in path planning under large scenes is improved. First, a grid map is constructed using Cartographer algorithm. Then, use the depth camera to capture indoor object instances and build an instance mapping system to construct the topological map. Finally, the node connectivity relationship in the topological map is used to improve the path planning problem of A-star algorithm in large scenes. Simulation experiments show that the improved algorithm can plan the paths quickly in large scenes. Compared with the original A-star algorithm, the algorithm is less computationally intensive and improves more than 60% in terms of time cost. The improved algorithm in has higher planning efficiency and has certain theoretical and application values.
针对传统A-star算法在大场景下规划效率低的问题。利用拓扑图对A-star算法进行改进,提高了A-star算法在大场景下的路径规划效率。首先,使用Cartographer算法构建栅格地图。然后,使用深度相机捕获室内物体实例,并建立实例映射系统来构建拓扑图。最后,利用拓扑图中节点的连通关系,改进了A-star算法在大场景下的路径规划问题。仿真实验表明,改进后的算法能够在大场景下快速规划路径。与原A-star算法相比,该算法计算量小,时间开销提高了60%以上。改进后的算法具有更高的规划效率,具有一定的理论和应用价值。

ACKNOWLEDGMENT 确认

This research is supported by National Natural Science Foundation of China(61803058), and China Postdoctoral Science Foundation (2021MD703939).
本研究得到了国家自然科学基金(61803058)和国家博士后科学基金(2021MD703939)的资助。

References 引用

1.
S. Campbell, N. O'mahony, A. Carvalho et al., "Path Planning Techniques for Mobile Robots A Review", 6th International Conference on Mechatronics and Robotics Engineering, pp. 12-16, 2020.
2.
F. Duchon, A. Babinec, M. Kajan et al., "Path planning with modified A star algorithm for a mobile robot", 6th Conference on Modelling of Mechanical and Mechatronic Systems (MMaMS), pp. 59-69, 2014.
3.
W. Wu and Y. Wei, "Guiding unmanned aerial vehicle path planning design based on improved ant colony algorithm", Mechatronic Systems and Control, vol. 49, no. 1, pp. 48-54, 2021.
4.
Z. Cheng, H. Zhang and Q. Zhao, "The Method Based on Dijkstra of Multi-directional Ship's Path Planning", 32nd Chinese Control and Decision Conference, pp. 5142-5146, 2020.
5.
S. M. Lavalle and J. J. Kuffner, "Randomized kinodynamic planning", International Journal of Robotics Research, vol. 20, no. 5, pp. 378-400, 2001.
6.
J. J. Kuffner and S. M. La Valle, "RRT-connect: an efficient approach to single-query path planning", ICRA 2000: IEEE International Conference on Robotics and Automation, pp. 995-1001, 2000.
7.
X. Tang and F. Chen, "Robot Path Planning Algorithm based on Bi-RRT and Potential Field", 17th IEEE International Conference on Mechatronics and Automation, pp. 1251-1256, 2020.
8.
Z. Liu, F. Lan and H. Yang, "Partition Heuristic RRT Algorithm of Path Planning Based on Q-learning", 4th IEEE Advanced Information Technology Electronic and Automation Control Conference, pp. 386-392, 2019.
9.
W. Wang, D. Pei and Z. Feng, "Improved A~* algorithm for shortest path planning of mobile robots", Computer Applications, vol. 38, no. 05, pp. 1523-1526, 2018.
10.
W. Lu, J. Lei and S. Yan, "Improved A~* algorithm-based path planning for mobile robots", Journal of Arms and Equipment Engineering, vol. 40, no. 04, pp. 197-201, 2019.
11.
J. Chen, C. Tan, R. Mo et al., "A~* algorithm based on artificial potential field for mobile robot path planning", Computer Science, vol. 48, no. 11, pp. 327-333, 2021.
12.
Z. Xiao, W. Zheng, H. Chengkan et al., "Mobile Robot Path Planning Based on an Improved A* Algorithm", Robot, 2018.
13.
C. Ju, Q. Luo and X. Yan, "Path Planning Using an Improved A-star Algorithm", 11th International Conference on Prognostics and System Health Management, pp. 23-26, 2020.