[go: up one dir, main page]

CN115755908B - A mobile robot path planning method based on JPS guided Hybrid A* - Google Patents

A mobile robot path planning method based on JPS guided Hybrid A* Download PDF

Info

Publication number
CN115755908B
CN115755908B CN202211440318.2A CN202211440318A CN115755908B CN 115755908 B CN115755908 B CN 115755908B CN 202211440318 A CN202211440318 A CN 202211440318A CN 115755908 B CN115755908 B CN 115755908B
Authority
CN
China
Prior art keywords
node
mobile robot
current
extend
value
Prior art date
Legal status (The legal status is an assumption and is not a legal conclusion. Google has not performed a legal analysis and makes no representation as to the accuracy of the status listed.)
Active
Application number
CN202211440318.2A
Other languages
Chinese (zh)
Other versions
CN115755908A (en
Inventor
陈正升
刘凯旋
王雪松
程玉虎
李川
Current Assignee (The listed assignees may be inaccurate. Google has not performed a legal analysis and makes no representation or warranty as to the accuracy of the list.)
China University of Mining and Technology CUMT
Original Assignee
China University of Mining and Technology CUMT
Priority date (The priority date is an assumption and is not a legal conclusion. Google has not performed a legal analysis and makes no representation as to the accuracy of the date listed.)
Filing date
Publication date
Application filed by China University of Mining and Technology CUMT filed Critical China University of Mining and Technology CUMT
Priority to CN202211440318.2A priority Critical patent/CN115755908B/en
Publication of CN115755908A publication Critical patent/CN115755908A/en
Application granted granted Critical
Publication of CN115755908B publication Critical patent/CN115755908B/en
Active legal-status Critical Current
Anticipated expiration legal-status Critical

Links

Landscapes

  • Control Of Position, Course, Altitude, Or Attitude Of Moving Bodies (AREA)
  • Manipulator (AREA)

Abstract

本发明公开了一种基于JPS引导HybridA*的移动机器人路径规划方法,在经典HybridA*算法的基础上利用JPS算法的扩展特点进行优化,在二维网格下考虑hcollision_avoidance1启发值时,用JPS算法代替A*算法进行长度计算;在计算gextend函数值中加入pbias惩罚项,用JPS算法遍历获得引导路径点集合。本发明方法相比于经典Hybrid A*算法,在遍历速度,迭代次数及路径长度上提升效果显著。

The invention discloses a mobile robot path planning method based on JPS guided HybridA*. On the basis of the classic HybridA* algorithm, the extended characteristics of the JPS algorithm are used for optimization. When considering the h collision_avoidance1 heuristic value under the two-dimensional grid, the JPS algorithm is used Replace the A* algorithm for length calculation; add the p bias penalty term in the calculation of the g extend function value, and use the JPS algorithm to traverse to obtain the guide path point set. Compared with the classic Hybrid A* algorithm, the method of the present invention has a significant improvement in traversal speed, number of iterations and path length.

Description

一种基于JPS引导Hybrid A*的移动机器人路径规划方法A mobile robot path planning method based on JPS guided Hybrid A*

技术领域Technical field

本发明涉及移动机器人路径规划领域,具体是一种基于JPS引导Hybrid A*的移动机器人路径规划方法。The invention relates to the field of mobile robot path planning, specifically a mobile robot path planning method based on JPS guided Hybrid A*.

背景技术Background technique

路径规划的研究是移动机器人研究领域中一个重要的组成部分,它的目的是使移动机器人能够在一个已知或者未知的环境中,找到一条从起始状态到目标状态的无碰撞路径。传统的路径规划算法大部分只考虑机器人的位姿空间,然而,实际上机器人不仅受到位姿空间的约束,还会受到各种外力的约束。路径规划技术作为移动机器人的导航技术甚至是整个移动机器人技术的重要核心技术,也更加受到广大研究学者的关注。The study of path planning is an important part of the field of mobile robot research. Its purpose is to enable the mobile robot to find a collision-free path from the starting state to the target state in a known or unknown environment. Most traditional path planning algorithms only consider the pose space of the robot. However, in fact, the robot is not only constrained by the pose space, but also constrained by various external forces. As the navigation technology of mobile robots and even an important core technology of the entire mobile robot technology, path planning technology has attracted more attention from researchers.

传统的移动机器人路径规划算法大多数是将地图栅格化之后,使用图搜索算法例如A*算法或Dijkstra算法进行路径规划,这些算法在生成路径时并未考虑机器人运动学约束,因此规划出的路径大多是离散的,不满足机器人非完整性约束;而Hybrid A*算法作为A*算法的拓展,在算法中加入了机器人运动学约束条件并将离散的拓展点修改为连续的拓展点,这样便可以使机器人得到一条连续可执行的路径。Most of the traditional mobile robot path planning algorithms rasterize the map and then use graph search algorithms such as the A* algorithm or Dijkstra algorithm for path planning. These algorithms do not consider the kinematic constraints of the robot when generating paths, so the planned Most paths are discrete and do not satisfy the non-integrity constraints of the robot; as an extension of the A* algorithm, the Hybrid A* algorithm adds robot kinematic constraints to the algorithm and changes the discrete expansion points to continuous expansion points, so that This allows the robot to obtain a continuous executable path.

但是当Hybrid A*算法在宽敞的自由空间区域拓展且终点位于狭窄区域中时,会在列表中加入大量的备选节点,只有少部分节点可以引导路径进入狭窄区域,从而导致迭代次数增加,甚至无法找到可行路径。However, when the Hybrid A* algorithm expands in a spacious free space area and the end point is located in a narrow area, a large number of candidate nodes will be added to the list, and only a small number of nodes can guide the path into the narrow area, resulting in an increase in the number of iterations, or even Unable to find feasible path.

发明内容Contents of the invention

发明目的:针对上述现有技术,提出一种基于JPS引导Hybrid A*的移动机器人路径规划方法,在大规模地图下,提高节点遍历速度,减少迭代次数以及提高输出路径长度。Purpose of the invention: In view of the above existing technology, a mobile robot path planning method based on JPS guided Hybrid A* is proposed to increase the node traversal speed, reduce the number of iterations and increase the output path length under large-scale maps.

技术方案:一种基于JPS引导Hybrid A*的移动机器人路径规划方法,包括如下步骤:Technical solution: A mobile robot path planning method based on JPS guided Hybrid A*, including the following steps:

步骤1:全局地图初始化;其方法为:进行环境建模并建立二维坐标系,对环境中的所有障碍物进行离散化并用均匀分布的点集合来表示,设障碍物数量为k,组成障碍物集合为{OBSi},即OBS1i=1,…,k;Step 1: Initialize the global map; the method is: model the environment and establish a two-dimensional coordinate system, discretize all obstacles in the environment and represent them with a uniformly distributed point set, and set the number of obstacles to k to form obstacles. The object set is {OBS i }, that is, OBS 1 , i=1,…,k;

步骤2:参数初始化;其方法为:在地图中设置初始位姿Start(xinit,yinitinit),终点位姿Goal(xend,yendend),构建节点采样函数Expansion_pattern、待探索列表Openlist、已探索列表Closedlist,以及移动机器人运动学模型;其中,(x*,y*)为移动机器人运动学模型的质心在*条件下绝对坐标系下的坐标,θ*表示在*条件下移动机器人航向角;Step 2: Parameter initialization; the method is: set the initial pose Start (x init , y init , θ init ), the end pose Goal (x end , y end , θ end ) in the map, and construct the node sampling function Expansion_pattern, The list to be explored Openlist, the explored list Closedlist, and the mobile robot kinematics model; among them, (x * , y * ) is the coordinate of the center of mass of the mobile robot kinematics model in the absolute coordinate system under * conditions, and θ * represents * The heading angle of the mobile robot under the conditions;

步骤3:从待探索列表Openlist中选择代价值最小的节点作为当前节点,通过前向模拟寻找下一个扩展结点,判断扩展节点与终点的距离是否小于阈值,若是,则继续步骤6,否则继续步骤4;Step 3: Select the node with the smallest value from the list to be explored Openlist as the current node, find the next expansion node through forward simulation, and determine whether the distance between the expansion node and the end point is less than the threshold. If so, continue to step 6, otherwise continue Step 4;

步骤4:计算起始点到扩展结点的代价值gextend以及扩展结点位姿到终点位姿并同时考虑移动机器人运动学约束及避障条件的启发值hextend,并计算扩展节点的总代价值fextendStep 4: Calculate the cost value g extend from the starting point to the extended node and the heuristic value h extend from the extended node pose to the end pose while considering the kinematic constraints and obstacle avoidance conditions of the mobile robot, and calculate the total generation of the extended node value f extend ;

步骤5:将扩展结点与其总代价值fextend放入待探索列表Openlist中,返回步骤3继续;Step 5: Put the extended node and its total cost value f extend into the list to be explored Openlist, and return to step 3 to continue;

步骤6:使用Reeds-Sheep曲线将扩展结点与终点连接,同时判断曲线上是否有障碍物,若是,则返回步骤3继续;否则,返回路径点集合;Step 6: Use the Reeds-Sheep curve to connect the extended node to the end point, and determine whether there are obstacles on the curve. If so, return to step 3 to continue; otherwise, return to the path point set;

步骤7:对路径点集合进行重采样,输出优化路径。Step 7: Resample the path point set and output the optimized path.

进一步的,所述步骤2中,构建节点采样函数Expansion_pattern的具体过程为:Further, in step 2, the specific process of constructing the node sampling function Expansion_pattern is:

算法先在φ∈{-φmax,0,φmax},v∈{-vmax,vmax}的范围内进行均匀采样获得采样值,然后在单位时间内按照采样值[v,φ]前向模拟移动机器人前进过程来判断该采样值是否符合碰撞条件;其中,v为前行速度,φ为移动机器人前轮偏转角,φmax为移动机器人前轮的最大偏转角,vmax为最大前行速度。The algorithm first performs uniform sampling within the range of φ∈{-φ max ,0,φ max }, v∈{-v max ,v max } to obtain the sampled value, and then in unit time according to the sample value [v,φ] Simulate the moving process of the mobile robot to determine whether the sampled value meets the collision condition; where v is the forward speed, φ is the deflection angle of the front wheel of the mobile robot, φ max is the maximum deflection angle of the front wheel of the mobile robot, and v max is the maximum deflection angle of the front wheel of the mobile robot. travel speed.

进一步的,所述步骤3中,前向模拟寻找扩展结点的具体过程为:Further, in step 3, the specific process of forward simulation to find expansion nodes is:

通过前向模拟计算公式扩展当前节点,并用Reeds-Sheep曲线将节点相连;当前节点位姿为Ncurrent(xcurrent,ycurrentcurrent),扩展节点位姿为Nexpend(xexpend,yexpendexpend),前向模拟计算公式如下所示:Expand the current node through the forward simulation calculation formula and connect the nodes with the Reeds-Sheep curve; the current node pose is N current (x current ,y currentcurrent ), and the extended node pose is N expend (x expend ,y expendexpend ), the forward simulation calculation formula is as follows:

xexpend=xcurrent+cosθcurrentvdtx expend =x current +cosθ current vdt

yexpend=ycurrent+cosθcurrentvdty expend =y current +cosθ current vdt

式中,Lw为移动机器人运动学模型前后轴的距离;N为常数。In the formula, L w is the distance between the front and rear axes of the mobile robot kinematic model; N is a constant.

进一步的,所述步骤4中,计算扩展结点的总代价值fextend的具体过程为:Further, in step 4, the specific process of calculating the total generation value f extend of the extended node is:

fextend=gextend+hextend f extend =g extend +h extend

其中:in:

gextend=gcurrent+Csimu+pbias+pv_change+pv_reverse+pphy_change g extend =g current +C simu +p bias +p v_change +p v_reverse +p phy_change

式中,gcurrent为起始点扩展到当前节点的代价值,Csimu为每次扩展子节点时叠加的前向模拟代价值,pbias为扩展结点偏离引导路径的惩罚,pv_change为移动机器人前行速度v改变时引入的惩罚,pv_reverse为移动机器人前行速度v方向改变时引入的惩罚,pphy_change为改变移动机器人前轮偏转角φ时引入的惩罚;In the formula, g current is the cost value of the starting point extending to the current node, C simu is the forward simulation cost value superimposed each time the child node is expanded, p bias is the penalty for the expanded node to deviate from the guidance path, and p v_change is the mobile robot The penalty introduced when the forward speed v changes, p v_reverse is the penalty introduced when the forward speed v direction of the mobile robot changes, p phy_change is the penalty introduced when the front wheel deflection angle φ of the mobile robot is changed;

hextend=β*max(hnonholonomics,max(hcollision_avoidance1,hcollision_avoidance2))h extend =β*max(h nonholonomics ,max(h collision_avoidance1 ,h collision_avoidance2 ))

式中,β为启发值的权重系数,hnonholonomics为使用Reeds-Sheep曲线在不考虑避障条件下估算从扩展结点位姿到终点位姿的启发值,hcollision_avoidance1为JPS算法在二维网格下从扩展结点到终点的启发值,hcollision_avoidance2为扩展结点到终点的曼哈顿距离。In the formula, β is the weight coefficient of the heuristic value, h nonholonomics is the heuristic value from the extended node pose to the end pose using the Reeds-Sheep curve without considering obstacle avoidance conditions, h collision_avoidance1 is the JPS algorithm in the two-dimensional network The heuristic value from the extended node to the end point under the grid, h collision_avoidance2 is the Manhattan distance from the extended node to the end point.

进一步的,所述步骤3中前向模拟以及步骤6中判断曲线上是否有障碍物中均采用了碰撞检测方法,所述碰撞检测方法中将每个路径点作为移动机器人后轴轴心,通过计算移动机器人四个顶点坐标构建简单运动学模型来进行边界碰撞检测。Furthermore, the collision detection method is used in the forward simulation in step 3 and in the judgment of whether there are obstacles on the curve in step 6. In the collision detection method, each path point is used as the axis center of the rear axis of the mobile robot. Calculate the coordinates of the four vertices of the mobile robot to construct a simple kinematics model for boundary collision detection.

有益效果:(1)本发明的一种基于JPS引导Hybrid A*的移动机器人路径规划方法作为一种Hybrid A*的改进算法,结合了JPS算法本身在节点遍历速度和数量上的一定优势,使得JPS算法的生成路径会比A*算法的生成路径在转角时会更加贴合障碍物且输出路径更精简但不发生碰撞,因此改进算法在大规模地图下,节点遍历速度,迭代次数以及输出路径长度等指标提升效果显著。Beneficial effects: (1) The mobile robot path planning method based on JPS guided Hybrid A* of the present invention, as an improved algorithm of Hybrid A*, combines the certain advantages of the JPS algorithm itself in node traversal speed and quantity, so that The path generated by the JPS algorithm will fit more closely with obstacles when turning corners than the path generated by the A* algorithm, and the output path will be more streamlined but will not cause collisions. Therefore, the improved algorithm improves the node traversal speed, number of iterations, and output paths in large-scale maps. The improvement effect of indicators such as length is significant.

(2)Hybrid A*算法在宽敞的自由空间区域拓展且终点位于狭窄区域中时,由于其遍历特点会导致迭代次数增加,甚至无法找到可行路径。JPS算法因为强迫领居的存在,对障碍物较多的狭窄区域更为敏感,因此到达终点所需的迭代次数相比于A*算法大大减少而本发明采用JPS算法代替A*算法计算考虑避障时的启发值,以及采用JPS算法获得引导路径点集合,有效避免了无关节点的扩展,快速生成有效路径。(2) When the Hybrid A* algorithm expands into a spacious free space area and the end point is located in a narrow area, due to its traversal characteristics, the number of iterations will increase and even a feasible path cannot be found. Because of the existence of forced settlement, the JPS algorithm is more sensitive to narrow areas with many obstacles. Therefore, the number of iterations required to reach the end point is greatly reduced compared to the A* algorithm. The present invention uses the JPS algorithm instead of the A* algorithm to calculate avoidance. The heuristic value at the time of failure and the use of JPS algorithm to obtain the guidance path point set effectively avoid the expansion of irrelevant nodes and quickly generate effective paths.

附图说明Description of the drawings

图1是本方法的流程图;Figure 1 is a flow chart of this method;

图2是JPS算法原理示意图;Figure 2 is a schematic diagram of the JPS algorithm principle;

图3是移动机器人运动学模型示意图;Figure 3 is a schematic diagram of the kinematics model of the mobile robot;

图4是初始化及参数设置地图;Figure 4 is the initialization and parameter setting map;

图5、图6是本发明的算法仿真结果示意图。Figures 5 and 6 are schematic diagrams of algorithm simulation results of the present invention.

具体实施方式Detailed ways

下面结合附图对本发明做更进一步的解释。The present invention will be further explained below in conjunction with the accompanying drawings.

参照附图1所示,本实施例的一种基于JPS引导Hybrid A*的移动机器人路径规划方法,主要包括如下步骤:Referring to Figure 1, a mobile robot path planning method based on JPS guided Hybrid A* in this embodiment mainly includes the following steps:

步骤1:全局地图初始化。其方法为:进行环境建模并建立二维坐标系,对环境中的所有障碍物进行离散化并用均匀分布的点集合来表示,假设障碍物数量为k,组成障碍物集合为{OBSi},即OBS1i=1,…,k。Step 1: Global map initialization. The method is: model the environment and establish a two-dimensional coordinate system, discretize all obstacles in the environment and represent them with a uniformly distributed point set. Assume that the number of obstacles is k, and the obstacle set is {OBS i } , that is, OBS 1 , i=1,…,k.

步骤2:参数初始化。其方法为:在地图中设置初始位姿Start(xinit,yinitinit),终点位姿Goal(xend,yendend),构建节点采样函数Expansion_pattern,待探索列表Openlist,已探索列表Closedlist,以及移动机器人运动学模型;其中,(x*,y*)为移动机器人运动学模型的质心在*条件下绝对坐标系下的坐标,θ*表示在*条件下移动机器人航向角,此处*条件为初始位姿init以及终点位姿end。Step 2: Parameter initialization. The method is: set the initial pose Start (x init , y init , θ init ), the end pose Goal (x end , y end , θ end ) in the map, build the node sampling function Expansion_pattern, and open the list to be explored. Explore the Closedlist list, and the mobile robot kinematic model; where (x * , y * ) is the coordinate of the center of mass of the mobile robot kinematic model in the absolute coordinate system under * conditions, and θ * represents the heading angle of the mobile robot under * conditions , where the * condition is the initial pose init and the end pose end.

本步骤中,构建节点采样函数Expansion_pattern的具体过程为:算法先在φ∈{-φmax,0,φmax},v∈{-vmax,vmax}的范围内进行均匀采样获得采样值,然后在单位时间内按照采样值[v,φ]前向模拟移动机器人前进过程来判断该采样值是否符合碰撞条件;其中,v为前行速度,φ为移动机器人前轮偏转角,φmax为移动机器人前轮的最大偏转角,vmax为最大前行速度。In this step, the specific process of constructing the node sampling function Expansion_pattern is as follows: the algorithm first conducts uniform sampling within the range of φ∈{-φ max ,0,φ max }, v∈{-v max ,v max } to obtain the sampling value, Then the forward process of the mobile robot is simulated forward according to the sampled value [v,φ] in unit time to determine whether the sampled value meets the collision condition; where v is the forward speed, φ is the deflection angle of the front wheel of the mobile robot, and φ max is The maximum deflection angle of the front wheel of the mobile robot, v max is the maximum forward speed.

步骤3:从待探索列表Openlist中选择代价值fextend最小的节点作为当前节点,通过前向模拟寻找下一个扩展结点,判断扩展节点与终点的距离是否小于阈值,若是,则继续步骤6,否则继续步骤4。Step 3: Select the node with the smallest cost value f extend from the list to be explored Openlist as the current node, find the next extension node through forward simulation, and determine whether the distance between the extension node and the end point is less than the threshold. If so, continue to step 6. Otherwise continue to step 4.

本步骤中,通过前向模拟寻找扩展结点的具体过程为:通过前向模拟计算公式扩展当前节点,并用Reeds-Sheep曲线将节点相连。当前节点位姿为Ncurrent(xcurrent,ycurrentcurrent),扩展节点位姿为Nexpend(xexpend,yexpendexpend),前向模拟计算公式如下所示:In this step, the specific process of finding expanded nodes through forward simulation is: expand the current node through the forward simulation calculation formula, and connect the nodes with the Reeds-Sheep curve. The current node pose is N current (x current , y current , θ current ), and the extended node pose is N expend (x expend , y expend , θ expend ). The forward simulation calculation formula is as follows:

xexpend=xcurrent+cosθcurrentvdtx expend =x current +cosθ current vdt

yexpend=ycurrent+cosθcurrentvdty expend =y current +cosθ current vdt

式中,Lw为移动机器人运动学模型前后轴的距离,N为常数,将单位时间均分。In the formula, L w is the distance between the front and rear axes of the mobile robot kinematic model, N is a constant, and the unit time is divided equally.

步骤4:计算起始点到扩展结点的代价值gextend以及扩展结点位姿到终点位姿并同时考虑移动机器人运动学约束及避障条件的启发值hextend,并计算扩展节点的总代价值fextendStep 4: Calculate the cost value g extend from the starting point to the extended node and the heuristic value h extend from the extended node pose to the end pose while considering the kinematic constraints and obstacle avoidance conditions of the mobile robot, and calculate the total generation of the extended node value f extend .

本步骤中,计算扩展结点的总代价值fextend的具体过程为:In this step, the specific process of calculating the total generation value f extend of the extended node is:

fextend=gextend+hextend f extend =g extend +h extend

其中:in:

gextend=gcurrent+Csimu+pbias+pv_change+pv_reverse+pphy_change g extend =g current +C simu +p bias +p v_change +p v_reverse +p phy_change

式中,gcurrent为起始点扩展到当前节点的代价值,Csimu为每次扩展子节点时叠加的前向模拟代价值,pbias为扩展结点偏离引导路径的惩罚,pv_change为移动机器人前行速度v改变时引入的惩罚,pv_reverse为移动机器人前行速度v方向改变时引入的惩罚,pphy_change为改变移动机器人前轮偏转角φ时引入的惩罚。In the formula, g current is the cost value of the starting point extending to the current node, C simu is the forward simulation cost value superimposed each time the child node is expanded, p bias is the penalty for the expanded node to deviate from the guidance path, and p v_change is the mobile robot The penalty introduced when the forward speed v changes, p v_reverse is the penalty introduced when the forward speed v direction of the mobile robot changes, and p phy_change is the penalty introduced when the front wheel deflection angle φ of the mobile robot is changed.

hextend=β*max(hnonholonomics,max(hcollision_avoidance1,hcollision_avoidance2))h extend =β*max(h nonholonomics ,max(h collision_avoidance1 ,h collision_avoidance2 ))

式中,β为启发值的权重系数,hnonholonomics为使用Reeds-Sheep曲线在不考虑避障条件下估算从扩展结点位姿到终点位姿的启发值,hcollision_avoidance1为JPS算法在二维网格下从扩展结点到终点的启发值,hcollision_avoidance2为扩展结点到终点的曼哈顿距离。取最大值意味着两类启发值中更大的一项将被用于体现从扩展结点行驶至终点的困难程度。In the formula, β is the weight coefficient of the heuristic value, h nonholonomics is the heuristic value from the extended node pose to the end pose using the Reeds-Sheep curve without considering obstacle avoidance conditions, h collision_avoidance1 is the JPS algorithm in the two-dimensional network The heuristic value from the extended node to the end point under the grid, h collision_avoidance2 is the Manhattan distance from the extended node to the end point. Taking the maximum value means that the larger of the two heuristic values will be used to reflect the difficulty of traveling from the expansion node to the end point.

步骤5:将扩展结点与其代价值fextend放入待探索列表Openlist列表中,返回步骤3继续。Step 5: Put the extension node and its cost value f extend into the Openlist list to be explored, and return to step 3 to continue.

步骤6:使用Reeds-Sheep曲线将扩展结点与终点连接,同时判断曲线上是否有障碍物,若是,则返回步骤3继续;否则,返回路径点集合。Step 6: Use the Reeds-Sheep curve to connect the extended node and the end point, and determine whether there are obstacles on the curve. If so, return to step 3 to continue; otherwise, return to the path point set.

步骤7:对路径点集合进行重采样,输出优化路径。Step 7: Resample the path point set and output the optimized path.

本方法中,步骤3中前向模拟以及步骤6中判断曲线上是否有障碍物中均采用了碰撞检测方法,考虑到算法本身基于移动机器人运动学模型进行路径规划,因此将每个路径点作为移动机器人后轴轴心,通过计算移动机器人四个顶点坐标构建简单运动学模型来进行边界碰撞检测。In this method, the collision detection method is used in the forward simulation in step 3 and in determining whether there are obstacles on the curve in step 6. Considering that the algorithm itself is based on the kinematic model of the mobile robot for path planning, each path point is regarded as For the rear axis of the mobile robot, a simple kinematics model is constructed by calculating the coordinates of the four vertices of the mobile robot to perform boundary collision detection.

图2是JPS算法的一个简易原理图,图3是在绝对坐标系下建立的移动机器人运动学模型,在算法中用简易的长方形代替,运行时仅用移动机器人质心代替模型,图4是算法规划前的初始环境以及起点和终点位置,图5和图6分别是在两个不同的地图中本发明算法的仿真结果。Figure 2 is a simple schematic diagram of the JPS algorithm. Figure 3 is the kinematic model of the mobile robot established in the absolute coordinate system. It is replaced by a simple rectangle in the algorithm. Only the center of mass of the mobile robot is used to replace the model during runtime. Figure 4 is the algorithm. The initial environment before planning, as well as the starting and ending positions, Figure 5 and Figure 6 are the simulation results of the algorithm of the present invention in two different maps respectively.

以上所述仅是本发明的优选实施方式,应当指出,对于本技术领域的普通技术人员来说,在不脱离本发明原理的前提下,还可以做出若干改进和润饰,这些改进和润饰也应视为本发明的保护范围。The above are only preferred embodiments of the present invention. It should be noted that those skilled in the art can make several improvements and modifications without departing from the principles of the present invention. These improvements and modifications can also be made. should be regarded as the protection scope of the present invention.

Claims (2)

1. The path planning method of the mobile robot based on JPS guiding hybrid A is characterized by comprising the following steps:
step 1: initializing a global map; the method comprises the following steps: performing environment modeling and establishing a two-dimensional coordinate system, discretizing all barriers in the environment and representing by uniformly distributed point sets, wherein the number of barriers is k, and the composition barrier set is { OBS } i "i.e.)i=1,…,k;
Step 2: initializing parameters; the method comprises the following steps: setting initial pose Start (x) in map init ,y initinit ) Final point pose gold (x end ,y endend ) Constructing a node sampling function Expansion_pattern, a list to be explored Openlist, an explored list Closedlist and a mobile robot kinematic model; wherein, (x) * ,y * ) For the coordinates of the centroid of the kinematic model of the mobile robot in an absolute coordinate system under the condition of θ * Expressed under the following conditionsHeading angle of lower mobile robot;
step 3: selecting a node with the minimum cost value from the Openlist to be explored as a current node, searching for the next expansion node through forward simulation, judging whether the distance between the expansion node and the terminal point is smaller than a threshold value, if so, continuing the step 6, otherwise, continuing the step 4;
step 4: calculating cost value g from starting point to expansion node extend Expanding the node pose to the end pose and simultaneously considering the heuristic value h of the kinematic constraint and obstacle avoidance condition of the mobile robot extend And calculates the total cost value f of the expansion node extend
Step 5: the expansion node and the total cost value f extend Putting the search result into an Openlist to be explored, and returning to the step 3 for continuing;
step 6: connecting the expansion node with the end point by using a Reeds-sheet curve, judging whether an obstacle exists on the curve or not, and if yes, returning to the step 3 to continue; otherwise, returning to the path point set;
step 7: resampling the path point set and outputting an optimized path;
in the step 2, the specific process of constructing the node sampling function expansion_pattern is as follows:
the algorithm is firstly that phi is epsilon { -phi max ,0,φ max },v∈{-v max ,v max Uniformly sampling in the range of } to obtain sampling value, and then according to the sampling value [ v, phi ] in unit time]Forward simulating the moving robot to judge whether the sampling value accords with the collision condition; wherein v is the forward speed, phi is the deflection angle of the front wheel of the mobile robot, phi max V is the maximum deflection angle of the front wheel of the mobile robot max Is the maximum forward speed;
in the step 3, the specific process of searching the expansion node by forward simulation is as follows:
expanding a current node through a forward simulation calculation formula, and connecting the nodes by using a Reeds-shaep curve; the current node pose is N current (x current ,y currentcurrent ) Expanding the node pose to N expend (x expend ,y expendexpend ) The forward simulation calculation formula is as follows:
x expend =x current +cosθ current vdt
y expend =y current +cosθ current vdt
wherein L is w Distance between front and rear axes of the kinematic model of the mobile robot; n is a constant;
in the step 4, the total cost value f of the extension node is calculated extend The specific process of (2) is as follows:
f extend =g extend +h extend
wherein:
g extend =g current +C simu +p bias +p v_change +p v_reverse +p phy_change
in the formula g current C for the cost value of the starting point expansion to the current node simu For forward simulation cost value, p, superimposed each time a child node is extended bias To extend the penalty of a node for deviating from the bootstrap path, p v_change Penalty introduced when the mobile robot forward speed v is changed, p v_reverse Penalty introduced when the travelling speed v direction of the mobile robot is changed, p phy_change Penalty introduced when changing the front wheel deflection angle phi of the mobile robot;
h extend =β*max(h nonholonomics ,max(h collision_avoidance1 ,h collision_avoidance2 ))
wherein, beta is a weight coefficient of heuristic value, h nonholonomics Estimating the secondary expansion junction without considering obstacle avoidance for using Reeds-Sheep curveHeuristic value from point pose to end pose, h collision_avoidance1 Heuristic value h from expansion node to end point of JPS algorithm under two-dimensional grid collision_avoidance2 To extend the manhattan distance from the node to the endpoint.
2. The method for planning a path of a mobile robot based on JPS guided hybrid a of claim 1, wherein: in the step 3, a collision detection method is adopted in forward simulation and in the step 6, whether an obstacle exists on the curve or not is judged, each path point is used as the axis of a rear axle of the mobile robot in the collision detection method, and a simple kinematic model is built by calculating four vertex coordinates of the mobile robot to detect boundary collision.
CN202211440318.2A 2022-11-17 2022-11-17 A mobile robot path planning method based on JPS guided Hybrid A* Active CN115755908B (en)

Priority Applications (1)

Application Number Priority Date Filing Date Title
CN202211440318.2A CN115755908B (en) 2022-11-17 2022-11-17 A mobile robot path planning method based on JPS guided Hybrid A*

Applications Claiming Priority (1)

Application Number Priority Date Filing Date Title
CN202211440318.2A CN115755908B (en) 2022-11-17 2022-11-17 A mobile robot path planning method based on JPS guided Hybrid A*

Publications (2)

Publication Number Publication Date
CN115755908A CN115755908A (en) 2023-03-07
CN115755908B true CN115755908B (en) 2023-10-27

Family

ID=85372665

Family Applications (1)

Application Number Title Priority Date Filing Date
CN202211440318.2A Active CN115755908B (en) 2022-11-17 2022-11-17 A mobile robot path planning method based on JPS guided Hybrid A*

Country Status (1)

Country Link
CN (1) CN115755908B (en)

Families Citing this family (3)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
CN116541927A (en) * 2023-04-21 2023-08-04 西南交通大学 Railway plane linear green optimization design method
CN116817913B (en) * 2023-05-30 2024-09-10 中国测绘科学研究院 New path planning method utilizing turning penalty factors and twin road network improvement
CN116481557B (en) * 2023-06-20 2023-09-08 北京斯年智驾科技有限公司 An intersection traffic path planning method, device, electronic equipment and storage medium

Citations (5)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
CN105955280A (en) * 2016-07-19 2016-09-21 Tcl集团股份有限公司 Mobile robot path planning and obstacle avoidance method and system
CN106662874A (en) * 2014-06-03 2017-05-10 奥卡多创新有限公司 Methods, systems and apparatus for controlling movement of transporting devices
CN112034836A (en) * 2020-07-16 2020-12-04 北京信息科技大学 Mobile robot path planning method for improving A-x algorithm
CN114545921A (en) * 2021-12-24 2022-05-27 大连理工大学人工智能大连研究院 Unmanned vehicle path planning algorithm based on improved RRT algorithm
WO2022193584A1 (en) * 2021-03-15 2022-09-22 西安交通大学 Multi-scenario-oriented autonomous driving planning method and system

Family Cites Families (2)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
US9821801B2 (en) * 2015-06-29 2017-11-21 Mitsubishi Electric Research Laboratories, Inc. System and method for controlling semi-autonomous vehicles
KR20220138438A (en) * 2021-02-26 2022-10-13 현대자동차주식회사 Apparatus for generating multi path of moving robot and method thereof

Patent Citations (5)

* Cited by examiner, † Cited by third party
Publication number Priority date Publication date Assignee Title
CN106662874A (en) * 2014-06-03 2017-05-10 奥卡多创新有限公司 Methods, systems and apparatus for controlling movement of transporting devices
CN105955280A (en) * 2016-07-19 2016-09-21 Tcl集团股份有限公司 Mobile robot path planning and obstacle avoidance method and system
CN112034836A (en) * 2020-07-16 2020-12-04 北京信息科技大学 Mobile robot path planning method for improving A-x algorithm
WO2022193584A1 (en) * 2021-03-15 2022-09-22 西安交通大学 Multi-scenario-oriented autonomous driving planning method and system
CN114545921A (en) * 2021-12-24 2022-05-27 大连理工大学人工智能大连研究院 Unmanned vehicle path planning algorithm based on improved RRT algorithm

Non-Patent Citations (3)

* Cited by examiner, † Cited by third party
Title
基于改进JPS和A_算法的组合路径规划;金震等;高技术通讯;第32卷(第4期);412-420 *
基于改进JPS算法的电站巡检机器人路径规划;张凡;蔡涛;刘文达;范亚雷;;电子测量技术(第08期);全文 *
室内移动机器人路径规划研究;杨兴;张亚;杨巍;张慧娟;常皓;;科学技术与工程(第15期);全文 *

Also Published As

Publication number Publication date
CN115755908A (en) 2023-03-07

Similar Documents

Publication Publication Date Title
CN115755908B (en) A mobile robot path planning method based on JPS guided Hybrid A*
CN107063280B (en) A system and method for intelligent vehicle path planning based on control sampling
CN106949893B (en) A kind of the Indoor Robot air navigation aid and system of three-dimensional avoidance
CN112304318B (en) An autonomous navigation method for robots under virtual-real coupling constraints
CN110471426B (en) Automatic collision avoidance method for unmanned intelligent vehicles based on quantum wolf pack algorithm
CN110989352B (en) Group robot collaborative search method based on Monte Carlo tree search algorithm
CN110231824A (en) Path Planning Method for Agent Based on Straight-line Deviation Method
CN114237256B (en) Three-dimensional path planning and navigation method suitable for under-actuated robot
CN113359768A (en) Path planning method based on improved A-x algorithm
CN110032182B (en) Visual graph method and stable sparse random fast tree robot planning algorithm are fused
CN111596668B (en) Mobile robot anthropomorphic path planning method based on reverse reinforcement learning
CN112539750B (en) Intelligent transportation vehicle path planning method
CN114596360B (en) Double-stage active real-time positioning and mapping algorithm based on graph topology
CN113296520A (en) Routing planning method for inspection robot by fusing A and improved Hui wolf algorithm
CN117968714A (en) A navigation path planning system and method for unmanned vehicles on complex and rugged terrain cluster maps
CN117451068A (en) A hybrid path planning method based on improved A* algorithm and dynamic window method
CN113124875A (en) Path navigation method
CN116878515A (en) Local navigation method in dynamic environment facing multiple pedestrians
CN118392179A (en) Robot inspection method and system based on grid-octree hybrid map
Latif et al. Seal: Simultaneous exploration and localization for multi-robot systems
CN116147653B (en) Three-dimensional reference path planning method for unmanned vehicle
CN116136417B (en) Unmanned vehicle local path planning method facing off-road environment
CN109977455A (en) It is a kind of suitable for the ant group optimization path construction method with terrain obstruction three-dimensional space
Liu et al. An autonomous quadrotor exploration combining frontier and sampling for environments with narrow entrances
Zhang Research and implementation of AGV navigation method based on LiDAR synchronous positioning and map construction

Legal Events

Date Code Title Description
PB01 Publication
PB01 Publication
SE01 Entry into force of request for substantive examination
SE01 Entry into force of request for substantive examination
GR01 Patent grant
GR01 Patent grant