当前位置:   article > 正文

CMU的local_planner学习笔记

CMU的local_planner学习笔记

1.程序下载网址:https://github.com/HongbiaoZ/autonomous_exploration_development_environment

2.相关参考资料:

https://blog.csdn.net/lizjiwei/article/details/124437157

Matlab用采样的离散点做前向模拟三次样条生成路径点-CSDN博客

CMU团队开源的局部路径导航算法 localPlanner 代码详解以及如何适用于现实移动机器人_cmu-exploration localplanner-CSDN博客

3.话题间的关系

localplanner局部导航话题调用了1./state_estimation的里程计话题,用于获取车辆的当前位姿,2./registered_scan的雷达点云信息 3./terrain_map的地势地图信息,用于障碍物的判断,当前点地形的高度,用于路径选择惩罚量的确定,最终影响路径选择的成本函数4.//joy手柄话题的调用,手动控制时,将周围点云信息清空,不使用局部导航5./way_point话题,包含的是局部目标点,作为局部导航的目标

发布的是1./free_path话题,包含path.ply文件中的7*7*7*301个点的可选路径 2./path话题,包含Startpath.ply文件的1*101个点(当前规划的下一时刻路径),/path话题中的路径信息会被pathfollow路径跟踪模块调用,用于根据发布的路径信息提供每个路径点合适的速度和偏航角。

4.Localplanner原理:

1.先采用MATLAB使用线性插值方法,产生归一化的路径文件。

其路径文件一共分为三段进行线性插值。[0-1]范围,7条路径,将0-1划分为100等分插值,有7*101个路径点(对应绿色部分),存储文件为Startpath.ply文件;[1-2]范围在原来的7条路径上每条路径再线性插值分出7条路径,共7*7=49条路径;[1-2]范围在原来的49条路径上再线性插值每条路径分出7条路径,共7*7*7=343条路径,其路径终点存储在Pathlist.ply文件中(如下图的红色点);plath.ply存储所有的路径点,即7*7*7*301。

 

2.根据速度设置轨迹尺寸pathscale,将规划点云按pathscale缩放

1.忽略某些规划点云:不满足:(1.小于路径宽度(点云在车辆检测范围内)2.代检测点到车辆距离dis小于车到目标点距离(离目标太远无意义)或不启用路径截断pathCropByGoal3.启动障碍物检测的点)

2.忽略某些转向:

2.1)在路径选择不考虑车辆的当前方向(!dirToVehicle)情况下,如果去的路径点角度和目标角度差超过了设定阈值(dirThre=90),则该方向被忽略

2.2)如果路径选择考虑车辆的当前方向(dirToVehicle),且车辆朝目标点角度joyDir在-90到90之间,但转向路径点方向超出了阈值,则该方向被忽略。

2.3)对于车辆转向路径方向超出正负90度的情况,忽略该方向

3.点云网格化,将该网格的障碍物信息关联到通过该网格的路径中

将有效点云,按照MATLAB生成的体素偏移量和尺寸,进行网格化,得到点云对应的网格序号。通过readCorrespondences.txt:存储gridVoxelID体素网格序号和path_id路径点序号(0-343)之间的关系。将地势分析中点云的强度值作为h高度,判断高度是否大于阈值来判断该点云是否为障碍物,根据点云和体素网格间的序号对应关系,将该网格视为障碍物网格;通过readCorrespondences网格和路径对应关系,将通过该路径的障碍物标记+1;如果点云高度小于阈值,则将路径的惩罚值设置为h,作为计算目标函数的依据之一。

网格体范围为(0,searchRadius)(0,-searchRadius)(offsetX,offsetY)(offsetX,-offsetY)组成的梯形

4.通过目标函数得分,选择特点朝向角rotdir下的,在MATLAB中生成的path中的一条路径(group_id)

利用目标函数计算从rotdir起始角度位置,到pathlist的路径终点的得分,[1-3]的7*7=49个得分累加到其延申出来的[0-1]段的7个group_id中,选择这7个group_id中得分最高的一个作为最终路径,根据Startpath.ply文件,得到对应的1*101个路径点,并将归一化的路径点通过pathscale缩放到实际尺寸,发布到/path话题中,并将其可以选择的7*7*7*301个点发布到/freepath中(7*7*7条路径要去除2中不可到达的路径)

上述目标函数参数,

dirWeight: 权重参数

diff: 该条路径(路径终点)与目标点之间的角度差值

rotDirW: 该条路径的方向与当前车辆朝向(车辆y轴=yaw角)的角度差

penaltyScore:是根据terrainAnalysis得到的地形图,根据路径上的障碍给出的惩罚得分

angDiff=fabs(joyDir - (10.0 * rotDir - 180.0)):目标点与路径朝向夹角

5.仿真结果:

如下图仿真结果,绿色弧线路径为发布到/path话题中的实际运行路径(1*101),黄色的是发布到/free_path话题中的,其遍历搜索的所有路径(7*7*7*301)

6.全代码运行逻辑图

7.全代码注释:

  1. #include <math.h>
  2. #include <time.h>
  3. #include <stdio.h>
  4. #include <stdlib.h>
  5. #include <ros/ros.h>
  6. #include <message_filters/subscriber.h>
  7. #include <message_filters/synchronizer.h>
  8. #include <message_filters/sync_policies/approximate_time.h>
  9. #include <std_msgs/Bool.h>
  10. #include <std_msgs/Float32.h>
  11. #include <nav_msgs/Path.h>
  12. #include <nav_msgs/Odometry.h>
  13. #include <geometry_msgs/PointStamped.h>
  14. #include <geometry_msgs/PolygonStamped.h>
  15. #include <sensor_msgs/Imu.h>
  16. #include <sensor_msgs/PointCloud2.h>
  17. #include <sensor_msgs/Joy.h>
  18. #include <tf/transform_datatypes.h>
  19. #include <tf/transform_broadcaster.h>
  20. #include <pcl_conversions/pcl_conversions.h>
  21. #include <pcl/point_cloud.h>
  22. #include <pcl/point_types.h>
  23. #include <pcl/filters/voxel_grid.h>
  24. #include <pcl/kdtree/kdtree_flann.h>
  25. //局部路径规划--碰撞避免
  26. using namespace std;
  27. const double PI = 3.1415926;
  28. #define PLOTPATHSET 1
  29. string pathFolder;
  30. double vehicleLength = 0.6;
  31. double vehicleWidth = 0.6;
  32. double sensorOffsetX = 0;
  33. double sensorOffsetY = 0;
  34. bool twoWayDrive = true;
  35. double laserVoxelSize = 0.05;
  36. double terrainVoxelSize = 0.2;
  37. bool useTerrainAnalysis = false;
  38. bool checkObstacle = true;
  39. bool checkRotObstacle = false;
  40. double adjacentRange = 3.5;
  41. double obstacleHeightThre = 0.2;
  42. double groundHeightThre = 0.1;
  43. double costHeightThre = 0.1;
  44. double costScore = 0.02;
  45. bool useCost = false;
  46. const int laserCloudStackNum = 1;
  47. int laserCloudCount = 0;
  48. int pointPerPathThre = 2;
  49. double minRelZ = -0.5;// 未使用地面分割时,裁剪点云时的最小高度
  50. double maxRelZ = 0.25;
  51. double maxSpeed = 1.0;
  52. double dirWeight = 0.02;
  53. double dirThre = 90.0;
  54. bool dirToVehicle = false;//是否以车辆为主方向计算被遮挡的路径(限制车辆前进方向?)
  55. double pathScale = 1.0;
  56. double minPathScale = 0.75;
  57. double pathScaleStep = 0.25;
  58. bool pathScaleBySpeed = true;
  59. double minPathRange = 1.0;
  60. double pathRangeStep = 0.5;
  61. bool pathRangeBySpeed = true;
  62. bool pathCropByGoal = true;
  63. bool autonomyMode = false;
  64. double autonomySpeed = 1.0;
  65. double joyToSpeedDelay = 2.0;
  66. double joyToCheckObstacleDelay = 5.0;
  67. double goalClearRange = 0.5;
  68. double goalX = 0;
  69. double goalY = 0;
  70. float joySpeed = 0;
  71. float joySpeedRaw = 0;
  72. float joyDir = 0;
  73. const int pathNum = 343;//7*7*7
  74. const int groupNum = 7;//groupNum对应第一级分裂的组数
  75. float gridVoxelSize = 0.02;//体素网格大小
  76. //网格体范围为(0,searchRadius)(0,-searchRadius)(offsetX,offsetY)(offsetX,-offsetY)组成的梯形
  77. float searchRadius = 0.45;//searchRadius 搜索半径,(一个体素网格点搜索附近相关路径点的半径)。略大于车的对角线半径(sqrt(0.6*0.6+0.6*0.6))
  78. float gridVoxelOffsetX = 3.2;//体素网格x坐标上(车体坐标系)的偏移量,传感器检测范围??(离车最远x位置的体素网格距离)
  79. float gridVoxelOffsetY = 4.5;//离车最远的X处体素网格对应的Y的坐标
  80. const int gridVoxelNumX = 161;//数量 offsetX/voxelSize
  81. const int gridVoxelNumY = 451;
  82. const int gridVoxelNum = gridVoxelNumX * gridVoxelNumY;
  83. //创建点云指针,用来存储和处理激光雷达和地形数据
  84. pcl::PointCloud<pcl::PointXYZI>::Ptr laserCloud(new pcl::PointCloud<pcl::PointXYZI>());//这个点云用于存储原始的激光雷达数据
  85. pcl::PointCloud<pcl::PointXYZI>::Ptr laserCloudCrop(new pcl::PointCloud<pcl::PointXYZI>());//用于存储处理过的激光雷达数据,例如,只保留一定范围内的点。
  86. pcl::PointCloud<pcl::PointXYZI>::Ptr laserCloudDwz(new pcl::PointCloud<pcl::PointXYZI>());//用于存储降采样Downsized(例如,通过体素网格过滤)后的激光雷达数据。
  87. pcl::PointCloud<pcl::PointXYZI>::Ptr terrainCloud(new pcl::PointCloud<pcl::PointXYZI>());//用于存储原始的地形数据点云
  88. pcl::PointCloud<pcl::PointXYZI>::Ptr terrainCloudCrop(new pcl::PointCloud<pcl::PointXYZI>());//存储裁剪后的地形数据点云,可能同样只包含特定区域内的点。
  89. pcl::PointCloud<pcl::PointXYZI>::Ptr terrainCloudDwz(new pcl::PointCloud<pcl::PointXYZI>());//降采样后的地形数据点云
  90. pcl::PointCloud<pcl::PointXYZI>::Ptr laserCloudStack[laserCloudStackNum];//雷达点云数组,可能用于存储laserCloudStackNum个经过降采样后的激光雷达点云
  91. pcl::PointCloud<pcl::PointXYZI>::Ptr plannerCloud(new pcl::PointCloud<pcl::PointXYZI>());//用于路径规划过程中,存储所有需要考虑的点。
  92. pcl::PointCloud<pcl::PointXYZI>::Ptr plannerCloudCrop(new pcl::PointCloud<pcl::PointXYZI>());//路径规划过程中裁剪后的点云,只包含与路径规划相关的点。
  93. pcl::PointCloud<pcl::PointXYZI>::Ptr boundaryCloud(new pcl::PointCloud<pcl::PointXYZI>());//表示导航边界的点云
  94. pcl::PointCloud<pcl::PointXYZI>::Ptr addedObstacles(new pcl::PointCloud<pcl::PointXYZI>());//存储在规划过程中额外加入的障碍物
  95. pcl::PointCloud<pcl::PointXYZ>::Ptr startPaths[groupNum];//第一次采样时的路径点(点最多的路径)
  96. #if PLOTPATHSET == 1
  97. pcl::PointCloud<pcl::PointXYZI>::Ptr paths[pathNum];//存储路径规划器可能计算出的多条路径的点云(根据startPaths组成一条最终的局部路径path)
  98. pcl::PointCloud<pcl::PointXYZI>::Ptr freePaths(new pcl::PointCloud<pcl::PointXYZI>());//用于存储所有未被障碍物阻挡的路径(所有 clearPathList[i] < pointPerPathThre 的路径)
  99. #endif
  100. //路径相关数组
  101. int pathList[pathNum] = {0};//用于存储与路径相关的索引或标记
  102. float endDirPathList[pathNum] = {0};//计算该条路径末端点与当前位置的角度,并存储在数组中
  103. int clearPathList[36 * pathNum] = {0};//clearPathList存储障碍物数量(36代表360度方向,相对于每一条路径分裂成了36条分布在各个方向的路径)
  104. float pathPenaltyList[36 * pathNum] = {0};//一个浮点数组,用于记录给定方向上路径的惩罚得分,这可能与路径的障碍物或不平整度有关。
  105. float clearPathPerGroupScore[36 * groupNum] = {0};//一个浮点数组,记录了每个组中路径的得分,用于路径选择。
  106. std::vector<int> correspondences[gridVoxelNum];//存储可能与每个网格体素相对应的路径索引。
  107. //状态标志:
  108. bool newLaserCloud = false;//如果接收到新的激光雷达点云,则设置为true
  109. bool newTerrainCloud = false;//如果接收到新的地形点云,则设置为true
  110. //时间记录:
  111. double odomTime = 0;//记录最近一次接收到的里程计数据的时间戳。
  112. double joyTime = 0;//记录最近一次接收到的游戏手柄数据的时间戳。
  113. //车辆状态:
  114. float vehicleRoll = 0, vehiclePitch = 0, vehicleYaw = 0;//分别记录车辆的滚转、俯仰和偏航角。
  115. float vehicleX = 0, vehicleY = 0, vehicleZ = 0;//记录车辆在三维空间中的位置。
  116. //点云过滤器:
  117. pcl::VoxelGrid<pcl::PointXYZI> laserDwzFilter, terrainDwzFilter;//用于降采样激光雷达和地形点云数据。通过这种方式,可以减少处理的数据量,同时保留足够的信息进行路径规划
  118. //处理从机器人的运动传感器或定位系统接收到的里程计信息的回调函数
  119. //基于传入的里程计消息更新机器人的方向和位置,并且考虑到了里程计传感器与机器人参考点之间的偏移。
  120. //这些信息对于导航、路径规划以及与传感器数据协调移动等任务至关重要。
  121. void odometryHandler(const nav_msgs::Odometry::ConstPtr& odom)
  122. {
  123. odomTime = odom->header.stamp.toSec();//从里程计消息的头部提取时间戳,并将其转换为秒。时间戳对于与机器人环境中的其他事件同步传感器读数非常重要
  124. double roll, pitch, yaw;
  125. geometry_msgs::Quaternion geoQuat = odom->pose.pose.orientation;//从里程计消息中获取了机器人的方向,表示为四元数。四元数是避免万向锁问题并且在表示方向时比欧拉角更稳定的旋转编码方式
  126. tf::Matrix3x3(tf::Quaternion(geoQuat.x, geoQuat.y, geoQuat.z, geoQuat.w)).getRPY(roll, pitch, yaw);//使用tf(变换)库的Quaternion类,将四元数转换为3x3旋转矩阵,然后调用getRPY方法将旋转矩阵转换为滚转(roll)、俯仰(pitch)和偏航(yaw)的欧拉角
  127. vehicleRoll = roll;
  128. vehiclePitch = pitch;
  129. vehicleYaw = yaw;
  130. //确保了即使传感器不在车辆的中心,位置测量也能反映车辆相对于全局坐标系的真实位置
  131. vehicleX = odom->pose.pose.position.x - cos(yaw) * sensorOffsetX + sin(yaw) * sensorOffsetY;//1.获取车辆的当前位置odom->pose.pose.position.x 2.考虑传感器相对于车辆中心的偏移量sensorOffsetX,校正从传感器位置到车辆中心点位置
  132. vehicleY = odom->pose.pose.position.y - sin(yaw) * sensorOffsetX - cos(yaw) * sensorOffsetY;
  133. vehicleZ = odom->pose.pose.position.z;//Z位置直接从里程计消息中取得,没有进行偏移调整,因为对于地面机器人来说(假设地形平坦),垂直偏移通常不太关键
  134. }
  135. //回调函数:接收传感器原始数据,对其进行处理,然后将处理后的数据存储为PCL(点云库)的点云数据结构以便进一步使用
  136. //函数的目的是从激光雷达传感器实时处理数据,裁剪出与车辆相邻的点云部分(保留距离车体dis < adjacentRange),并通过降采样减少数据量,从而使后续的处理更加高效。
  137. //处理后的点云可以用于多种应用,包括障碍物检测、路径规划、地图构建等
  138. void laserCloudHandler(const sensor_msgs::PointCloud2ConstPtr& laserCloud2)
  139. {
  140. if (!useTerrainAnalysis) {//检查是否进行地形分析,如果不进行地形分析,则处理点云数据,否则跳过。
  141. laserCloud->clear();//清空当前点云
  142. pcl::fromROSMsg(*laserCloud2, *laserCloud);//将ROS的PointCloud2消息格式转换为PCL库可以处理的点云格式
  143. //裁剪点云:
  144. pcl::PointXYZI point;//初始化一个临时的pcl::PointXYZI点。
  145. laserCloudCrop->clear();//清空裁剪后的点云laserCloudCrop。
  146. int laserCloudSize = laserCloud->points.size();
  147. for (int i = 0; i < laserCloudSize; i++) {//遍历转换后的点云中的每一个点
  148. point = laserCloud->points[i];
  149. float pointX = point.x;
  150. float pointY = point.y;
  151. float pointZ = point.z;
  152. float dis = sqrt((pointX - vehicleX) * (pointX - vehicleX) + (pointY - vehicleY) * (pointY - vehicleY));//计算每个点到车辆当前位置(vehicleX, vehicleY)的距离
  153. if (dis < adjacentRange) {//如果点在一个给定的邻近范围内(adjacentRange,设定的裁剪点云时的距离,车辆周围用于检测障碍物的区域大小),
  154. point.x = pointX;
  155. point.y = pointY;
  156. point.z = pointZ;
  157. laserCloudCrop->push_back(point);//则将其添加到裁剪后的点云laserCloudCrop中
  158. }
  159. }
  160. //laserCloudCrop(裁减后点云)-》laserDwzFilter降采样-》laserCloudDwz
  161. laserCloudDwz->clear();//清空降采样后的点云以准备存储新数据。
  162. laserDwzFilter.setInputCloud(laserCloudCrop);//设置体素栅格滤波器的输入为裁剪后的点云
  163. laserDwzFilter.filter(*laserCloudDwz);//应用体素栅格滤波器对点云进行降采样,以减少点的数量,提高处理速度,结果存储在laserCloudDwz中
  164. newLaserCloud = true;//设置一个标志,表明现在有一个新的处理过的激光雷达点云可用
  165. }
  166. }
  167. //处理地形相关(障碍)的点云数据而设计的ROS消息回调
  168. //处理这些数据可能包括从原始点云中筛选出与车辆相邻的点(dis < adjacentRange),提取和保存与地形相关的信息,特别是那些可能影响机器人导航和路径规划的障碍物。
  169. void terrainCloudHandler(const sensor_msgs::PointCloud2ConstPtr& terrainCloud2)
  170. {
  171. if (useTerrainAnalysis) {//当useTerrainAnalysis标志被设置为true时,处理地形相关的点云数据
  172. terrainCloud->clear();//清除存储在terrainCloud变量中的所有旧点云数据
  173. pcl::fromROSMsg(*terrainCloud2, *terrainCloud);//将ROS的点云消息转换为PCL库可以处理的点云格式。
  174. pcl::PointXYZI point;
  175. terrainCloudCrop->clear();
  176. int terrainCloudSize = terrainCloud->points.size();
  177. for (int i = 0; i < terrainCloudSize; i++) {
  178. point = terrainCloud->points[i];
  179. float pointX = point.x;
  180. float pointY = point.y;
  181. float pointZ = point.z;
  182. float dis = sqrt((pointX - vehicleX) * (pointX - vehicleX) + (pointY - vehicleY) * (pointY - vehicleY));
  183. //如果点位于车辆旁边的adjacentRange距离内,并且点的强度超过障碍物高度阈值obstacleHeightThre或者使用成本分析useCost
  184. if (dis < adjacentRange && (point.intensity > obstacleHeightThre || useCost)) {//intensity代表点云距离地面的高度
  185. point.x = pointX;
  186. point.y = pointY;
  187. point.z = pointZ;
  188. terrainCloudCrop->push_back(point);//将该点添加到裁剪后的点云terrainCloudCrop中。
  189. }
  190. }
  191. terrainCloudDwz->clear();
  192. terrainDwzFilter.setInputCloud(terrainCloudCrop);
  193. terrainDwzFilter.filter(*terrainCloudDwz);
  194. newTerrainCloud = true;
  195. }
  196. }
  197. //用于处理游戏手柄(joystick)输入的ROS消息回调。它解析从游戏手柄传入的数据,并据此更新车辆控制和导航状态
  198. void joystickHandler(const sensor_msgs::Joy::ConstPtr& joy)
  199. {
  200. joyTime = ros::Time::now().toSec();//记录接收到游戏手柄输入的时刻
  201. joySpeedRaw = sqrt(joy->axes[3] * joy->axes[3] + joy->axes[4] * joy->axes[4]);//根据游戏手柄的两个轴(通常是左摇杆的水平和垂直轴)的输入值计算原始速度
  202. joySpeed = joySpeedRaw;
  203. //将计算出的速度joySpeed限制在一定范围内(0到1之间)。如果摇杆的垂直轴值为0,则速度设置为0
  204. if (joySpeed > 1.0) joySpeed = 1.0;
  205. if (joy->axes[4] == 0) joySpeed = 0;
  206. //如果速度大于0,则计算出一个方向角度joyDir。这是通过atan2函数根据摇杆的两个轴值计算得到的,表示摇杆的倾斜方向
  207. if (joySpeed > 0) {
  208. joyDir = atan2(joy->axes[3], joy->axes[4]) * 180 / PI;
  209. if (joy->axes[4] < 0) joyDir *= -1;
  210. }
  211. //处理两向驱动
  212. //如果twoWayDrive为false且摇杆的垂直轴值小于0(倒车),则速度设置为0。
  213. //这意味着如果车辆不支持两向驱动(即不能倒车),则只在摇杆向前推时允许有速度
  214. if (joy->axes[4] < 0 && !twoWayDrive) joySpeed = 0;
  215. //设置自主模式:
  216. //根据游戏手柄的另一个轴(可能是扳机按钮)的值设置autonomyMode。
  217. //如果这个轴的值大于-0.1,则设置为手动模式;否则,设置为自主模式
  218. if (joy->axes[2] > -0.1) {
  219. autonomyMode = false;
  220. } else {
  221. autonomyMode = true;
  222. }
  223. //根据游戏手柄的另一个轴的值设置checkObstacle标志。
  224. //如果这个轴的值大于-0.1,则启用障碍物检测;否则,禁用
  225. if (joy->axes[5] > -0.1) {
  226. checkObstacle = true;
  227. } else {
  228. checkObstacle = false;
  229. }
  230. }
  231. //ROS消息回调,用于处理包含目标点位置的geometry_msgs::PointStamped消息
  232. void goalHandler(const geometry_msgs::PointStamped::ConstPtr& goal)
  233. {
  234. goalX = goal->point.x;//从传入的消息中提取目标点的X坐标,并将其赋值给全局变量goalX
  235. goalY = goal->point.y;
  236. }
  237. //ROS消息回调,用于处理类型为std_msgs::Float32的速度消息
  238. //在自主模式下根据接收到手柄的速度消息调整机器人的速度
  239. //通过考虑来自游戏手柄的输入和延迟,这个函数有助于平滑地在手动控制和自主控制之间过渡
  240. void speedHandler(const std_msgs::Float32::ConstPtr& speed)
  241. {
  242. double speedTime = ros::Time::now().toSec();//获取当前时间的秒数,用于确定消息的接收时间
  243. //检查自主模式和延迟条件
  244. //调整速度条件:当前是自主模式(autonomyMode为true)+自上次接收到游戏手柄输入以来已经过去了一定的时间(speedTime - joyTime > joyToSpeedDelay),这避免了游戏手柄输入与自主速度指令之间的冲突+上次从游戏手柄接收到的原始速度为0
  245. if (autonomyMode && speedTime - joyTime > joyToSpeedDelay && joySpeedRaw == 0) {
  246. joySpeed = speed->data / maxSpeed;//将接收到的速度值(speed->data)除以预设的最大速度值(maxSpeed),从而将速度归一化到0到1的范围内
  247. //限制速度范围:
  248. if (joySpeed < 0) joySpeed = 0;
  249. else if (joySpeed > 1.0) joySpeed = 1.0;
  250. }
  251. }
  252. //ROS消息回调,用于处理包含边界信息的geometry_msgs::PolygonStamped消息
  253. //将接收到的边界信息转换为点云形式,以便进一步使用
  254. //通过在边界多边形的每两个顶点之间插入额外的点来创建一个密集的边界点云
  255. void boundaryHandler(const geometry_msgs::PolygonStamped::ConstPtr& boundary)//接收一个指向(/navigation_boundary话题)相应消息类型(geometry_msgs::PolygonStamped)的指针(& boundary)作为参数
  256. {
  257. boundaryCloud->clear();//清空之前存储的边界点云数据,准备接收新的边界数据
  258. pcl::PointXYZI point, point1, point2;//声明了三个pcl::PointXYZI类型的点变量(point, point1, point2)用于存储和处理边界点
  259. int boundarySize = boundary->polygon.points.size();
  260. if (boundarySize >= 1) {//如果边界包含至少一个点,则初始化point2为边界的第一个点。
  261. point2.x = boundary->polygon.points[0].x;
  262. point2.y = boundary->polygon.points[0].y;
  263. point2.z = boundary->polygon.points[0].z;
  264. }
  265. for (int i = 0; i < boundarySize; i++) {
  266. point1 = point2;//赋值,point1=前一个点的位置,point2=当前点位置
  267. point2.x = boundary->polygon.points[i].x;
  268. point2.y = boundary->polygon.points[i].y;
  269. point2.z = boundary->polygon.points[i].z;
  270. if (point1.z == point2.z) {//如果前一个点和当前点在同一平面
  271. float disX = point1.x - point2.x;
  272. float disY = point1.y - point2.y;
  273. float dis = sqrt(disX * disX + disY * disY);//计算两点之间距离
  274. int pointNum = int(dis / terrainVoxelSize) + 1;//根据这个距离和设定的体素大小(terrainVoxelSize),计算两点之间应该插入的点数(平滑路径)
  275. for (int pointID = 0; pointID < pointNum; pointID++) {//以point1和point2为顶点计算插入点坐标
  276. point.x = float(pointID) / float(pointNum) * point1.x + (1.0 - float(pointID) / float(pointNum)) * point2.x;
  277. point.y = float(pointID) / float(pointNum) * point1.y + (1.0 - float(pointID) / float(pointNum)) * point2.y;
  278. point.z = 0;
  279. point.intensity = 100.0;//每个点的强度值设置为100.0(激光反射?100=障碍物?)
  280. //在内部循环中,对于每个计算出的插入点,这个循环重复添加该点pointPerPathThre次到boundaryCloud点云中。
  281. //这可能是为了在点云中加重这些特定的边界点,使得它们在后续的处理中更加突出或易于识别
  282. for (int j = 0; j < pointPerPathThre; j++) {//当一条路径上存在两个障碍点,即 pointPerPathThre=2,该路径才会认为被遮挡
  283. boundaryCloud->push_back(point);
  284. }
  285. }
  286. }
  287. }
  288. }
  289. //用于处理障碍物点云的ROS消息回调,将障碍物回波强度设置为200
  290. void addedObstaclesHandler(const sensor_msgs::PointCloud2ConstPtr& addedObstacles2)
  291. {
  292. addedObstacles->clear();//清空已有的附加障碍物点云:
  293. pcl::fromROSMsg(*addedObstacles2, *addedObstacles);//将ROS消息格式的点云数据转换为PCL库可以处理的点云格式。
  294. int addedObstaclesSize = addedObstacles->points.size();
  295. for (int i = 0; i < addedObstaclesSize; i++) {
  296. addedObstacles->points[i].intensity = 200.0;//将所有附加障碍物的强度设置为200.0,可能是为了在后续的处理中将这些障碍物与其他类型的点云数据区分开来
  297. }
  298. }
  299. //ROS消息回调,用于处理std_msgs::Bool类型的消息,这些消息指示是否应该检查障碍物
  300. //根据接收到的消息,在自主模式下启用或禁用障碍物检查
  301. //这种机制允许系统在自主导航时根据消息checkObs动态调整是否进行障碍物检测,以应对可能存在的障碍物,同时也避免了与手动控制输入冲突
  302. void checkObstacleHandler(const std_msgs::Bool::ConstPtr& checkObs)
  303. {
  304. double checkObsTime = ros::Time::now().toSec();//代码获取当前时间的秒数,用于确定消息的接收时间
  305. if (autonomyMode && checkObsTime - joyTime > joyToCheckObstacleDelay) {//当前是自主模式,自上次接收到游戏手柄输入以来已经过去了一定的时间(延迟是为了避免手动控制输入与自主模式下的障碍物检查指令之间的冲突)
  306. checkObstacle = checkObs->data;//将接收到的障碍物检查状态(checkObs->data)赋值给checkObstacle。这个变量控制着是否应该检查障碍物
  307. }
  308. }
  309. //用于读取PLY(Polygon File Format)文件头,PLY文件用于存储三维模型数据
  310. //从PLY文件的头部提取点的数量
  311. int readPlyHeader(FILE *filePtr)
  312. {
  313. char str[50];//用于存储从文件中读取的字符串
  314. int val, pointNum;
  315. string strCur, strLast;//声明两个字符串变量,用于存储当前读取的字符串和上一次读取的字符串。
  316. while (strCur != "end_header") {//使用while循环读取文件,直到找到"end_header"字符串。PLY文件头以"end_header"结束
  317. val = fscanf(filePtr, "%s", str);//读取文件中的字符串
  318. if (val != 1) {//如果fscanf返回值不为1,表示读取失败
  319. printf ("\nError reading input files, exit.\n\n");
  320. exit(1);
  321. }
  322. strLast = strCur;//将当前字符串赋值作为上一个时刻字符串赋值
  323. strCur = string(str);
  324. if (strCur == "vertex" && strLast == "element") {//当找到字符串序列“element vertex”时,意味着接下来的数字表示点的数量。
  325. val = fscanf(filePtr, "%d", &pointNum);//读取点的数量
  326. if (val != 1) {
  327. printf ("\nError reading input files, exit.\n\n");
  328. exit(1);
  329. }
  330. }
  331. }
  332. return pointNum;
  333. }
  334. //从一个PLY文件中读取起始路径的点云数据,并根据组ID将这些点分配到不同的路径组中
  335. //通过读取这些点,系统可以了解在特定场景或环境下预先设定的潜在路径(相对朝向角的路径)
  336. void readStartPaths()
  337. {
  338. string fileName = pathFolder + "/startPaths.ply";
  339. FILE *filePtr = fopen(fileName.c_str(), "r");//FILE表示文件流类型,只读模式打开一个名为fileName的文件,并将文件流指针赋值给filePtr
  340. if (filePtr == NULL) {
  341. printf ("\nCannot read input files, exit.\n\n");
  342. exit(1);
  343. }
  344. int pointNum = readPlyHeader(filePtr);//调用readPlyHeader函数获得PLY文件点数
  345. pcl::PointXYZ point;
  346. int val1, val2, val3, val4, groupID;
  347. //每一行的startPaths.ply文件代表一个pointNum,一行4列,代表X,Y,Z和groupID(组别)
  348. for (int i = 0; i < pointNum; i++) {//对于每个点,读取其X、Y、Z坐标和所属的组ID(groupID)
  349. val1 = fscanf(filePtr, "%f", &point.x);//&point.x: 这是一个指向浮点变量的指针,fscanf会从filePtr文件流指针将读取到的浮点数存储在这个变量中。在这种情况下,它指向point结构中的x成员
  350. val2 = fscanf(filePtr, "%f", &point.y);
  351. val3 = fscanf(filePtr, "%f", &point.z);
  352. val4 = fscanf(filePtr, "%d", &groupID);
  353. if (val1 != 1 || val2 != 1 || val3 != 1 || val4 != 1) {//如果任何一个值未能成功读取,函数打印错误信息并退出
  354. printf ("\nError reading input files, exit.\n\n");
  355. exit(1);
  356. }
  357. if (groupID >= 0 && groupID < groupNum) {
  358. //startPaths是存储rotdir方向上group_id对应位置的点云数组(表示下一个机器人要走的路径).
  359. startPaths[groupID]->push_back(point);//将对应的第groupID点的point输入到第groupID个pcl::PointCloud<pcl::PointXYZ>::Ptr类型的全局变量startPaths树组
  360. }
  361. }
  362. fclose(filePtr);
  363. }
  364. #if PLOTPATHSET == 1//如果为真,则编译该指令和对应的#endif之间的代
  365. //从一个PLY文件中读取路径数据,并将这些数据存储到相应的数据结构中
  366. void readPaths()
  367. {
  368. string fileName = pathFolder + "/paths.ply";
  369. FILE *filePtr = fopen(fileName.c_str(), "r");
  370. if (filePtr == NULL) {
  371. printf ("\nCannot read input files, exit.\n\n");
  372. exit(1);
  373. }
  374. int pointNum = readPlyHeader(filePtr);
  375. pcl::PointXYZI point;
  376. int pointSkipNum = 30;
  377. int pointSkipCount = 0;
  378. int val1, val2, val3, val4, val5, pathID;//看paths.ply文件结构,一行5个变量,代表X,Y,Z,pathID,group_id
  379. for (int i = 0; i < pointNum; i++) {//按行取点
  380. val1 = fscanf(filePtr, "%f", &point.x);
  381. val2 = fscanf(filePtr, "%f", &point.y);
  382. val3 = fscanf(filePtr, "%f", &point.z);
  383. val4 = fscanf(filePtr, "%d", &pathID);//pathID
  384. val5 = fscanf(filePtr, "%f", &point.intensity);//group_id,强度?
  385. if (val1 != 1 || val2 != 1 || val3 != 1 || val4 != 1 || val5 != 1) {
  386. printf ("\nError reading input files, exit.\n\n");
  387. exit(1);
  388. }
  389. if (pathID >= 0 && pathID < pathNum) {
  390. pointSkipCount++;
  391. if (pointSkipCount > pointSkipNum) {//在点云中每隔一定数量(pointSkipNum=30)的点添加一个点
  392. paths[pathID]->push_back(point);//pathID(0-343)
  393. pointSkipCount = 0;
  394. }
  395. }
  396. }
  397. fclose(filePtr);
  398. }
  399. #endif
  400. //对每条路径的终点位置和方向的记录(末梢路径)
  401. void readPathList()
  402. {
  403. string fileName = pathFolder + "/pathList.ply";
  404. FILE *filePtr = fopen(fileName.c_str(), "r");
  405. if (filePtr == NULL) {
  406. printf ("\nCannot read input files, exit.\n\n");
  407. exit(1);
  408. }
  409. if (pathNum != readPlyHeader(filePtr)) {
  410. printf ("\nIncorrect path number, exit.\n\n");
  411. exit(1);
  412. }
  413. int val1, val2, val3, val4, val5, pathID, groupID;
  414. float endX, endY, endZ;
  415. for (int i = 0; i < pathNum; i++) {//pathList.ply文件中包含列的变量,x,y,z,pathID, groupID
  416. val1 = fscanf(filePtr, "%f", &endX);//将第一列的数据存入&endX指针
  417. val2 = fscanf(filePtr, "%f", &endY);
  418. val3 = fscanf(filePtr, "%f", &endZ);
  419. val4 = fscanf(filePtr, "%d", &pathID);//7*7*7
  420. val5 = fscanf(filePtr, "%d", &groupID);
  421. if (val1 != 1 || val2 != 1 || val3 != 1 || val4 != 1 || val5 != 1) {
  422. printf ("\nError reading input files, exit.\n\n");
  423. exit(1);
  424. }
  425. if (pathID >= 0 && pathID < pathNum && groupID >= 0 && groupID < groupNum) {//如果读取的路径ID和组ID在有效范围内
  426. pathList[pathID] = groupID;//groupID==groupNum=7对应第一级分裂的组数,分裂路径的尾端(第二段=49)ID,将第二段ID和第一段ID关联起来
  427. endDirPathList[pathID] = 2.0 * atan2(endY, endX) * 180 / PI;//计算该条路径末端点与当前位置(以rotdir为基准)的角度,并存储在数组中
  428. }
  429. }
  430. fclose(filePtr);
  431. }
  432. //建立网格体素和路径之间的对应关系
  433. //将correspondences点,按行号放入每一个树组中,一个树组(一行)对应一条路径?
  434. //在基于点云的导航系统中,这些对应关系可能用于快速确定哪些路径与特定的空间区域相关联
  435. void readCorrespondences()
  436. {
  437. string fileName = pathFolder + "/correspondences.txt";
  438. FILE *filePtr = fopen(fileName.c_str(), "r");
  439. if (filePtr == NULL) {
  440. printf ("\nCannot read input files, exit.\n\n");
  441. exit(1);
  442. }
  443. int val1, gridVoxelID, pathID;
  444. for (int i = 0; i < gridVoxelNum; i++) {//遍历
  445. val1 = fscanf(filePtr, "%d", &gridVoxelID);//将correspondences.txt第一列元素赋值给&gridVoxelID指针
  446. if (val1 != 1) {
  447. printf ("\nError reading input files, exit.\n\n");
  448. exit(1);
  449. }
  450. while (1) {
  451. val1 = fscanf(filePtr, "%d", &pathID);//将correspondences.txt未读完的元素赋值给&&pathID指针
  452. if (val1 != 1) {
  453. printf ("\nError reading input files, exit.\n\n");
  454. exit(1);
  455. }
  456. if (pathID != -1) {//如果pathID != -1,即路径有效,将对应的gridVoxelID行数据依次读入pathID
  457. if (gridVoxelID >= 0 && gridVoxelID < gridVoxelNum && pathID >= 0 && pathID < pathNum) {
  458. correspondences[gridVoxelID].push_back(pathID);//gridVoxelID是文件的第一列数据,pathID是第2-n列数据(代表对应的终点路径序号)
  459. }
  460. } else {
  461. break;
  462. }
  463. }
  464. }
  465. fclose(filePtr);
  466. }
  467. int main(int argc, char** argv)
  468. {
  469. ros::init(argc, argv, "localPlanner");// 初始化ROS系统,并命名节点为localPlanner。
  470. ros::NodeHandle nh;
  471. ros::NodeHandle nhPrivate = ros::NodeHandle("~");
  472. //从参数服务器获取配置参数(从launch获取)
  473. nhPrivate.getParam("pathFolder", pathFolder);//获取路径文件
  474. nhPrivate.getParam("vehicleLength", vehicleLength); //车长
  475. nhPrivate.getParam("vehicleWidth", vehicleWidth);//车宽
  476. nhPrivate.getParam("sensorOffsetX", sensorOffsetX);//获取传感器相对质心的X、Y轴偏移量
  477. nhPrivate.getParam("sensorOffsetY", sensorOffsetY);
  478. nhPrivate.getParam("twoWayDrive", twoWayDrive);//双向驱动模式(在launch文件中默认为true)
  479. nhPrivate.getParam("laserVoxelSize", laserVoxelSize);//激光点云数据处理时使用的体素网格大小,这个值决定了将点云空间划分为多大的立方体(体素),以进行下采样或密度过滤
  480. nhPrivate.getParam("terrainVoxelSize", terrainVoxelSize);//获取地形点云的体素网格大小
  481. nhPrivate.getParam("useTerrainAnalysis", useTerrainAnalysis);//检查是否使用地形分析:
  482. nhPrivate.getParam("checkObstacle", checkObstacle);//是否应该执行障碍物检测(路径中的障碍物检测)
  483. nhPrivate.getParam("checkRotObstacle", checkRotObstacle);//是否在考虑旋转时检测障碍物
  484. nhPrivate.getParam("adjacentRange", adjacentRange);//裁剪点云时的距离,车辆周围用于检测障碍物的区域大小
  485. nhPrivate.getParam("obstacleHeightThre", obstacleHeightThre);//阈值,定义何种高度的对象应被视为障碍物
  486. nhPrivate.getParam("groundHeightThre", groundHeightThre);//用于区分地面和非地面点的阈值,在地形分析或地面分割算法中常见
  487. nhPrivate.getParam("costHeightThre", costHeightThre);//计算路径惩罚得分的权重
  488. nhPrivate.getParam("costScore", costScore);//最小惩罚得分
  489. nhPrivate.getParam("useCost", useCost);//是否应该在路径规划或导航中考虑成本计算(false)
  490. nhPrivate.getParam("pointPerPathThre", pointPerPathThre);//每条路径需要有几个被遮挡的点(每条路径上需要有多少个点被视为被遮挡或阻塞的阈值,大于pointPerPathThre被视为障碍?)
  491. nhPrivate.getParam("minRelZ", minRelZ);//未使用地面分割时,裁剪点云时的最小高度,可以用于过滤掉过低的点,可能对于避免地面噪声很有用
  492. nhPrivate.getParam("maxRelZ", maxRelZ);//未使用地面分割时,裁剪点云时的最大高度
  493. nhPrivate.getParam("maxSpeed", maxSpeed);//最大速度
  494. nhPrivate.getParam("dirWeight", dirWeight);//计算得分时转向角度的权重,用来评估转向的难度或代价,更高的权重意味着转向的影响在总体评估中占据更重要的地位
  495. nhPrivate.getParam("dirThre", dirThre);//最大转向角
  496. nhPrivate.getParam("dirToVehicle", dirToVehicle);//是否以车辆为主方向计算被遮挡的路径(false)。转向决策是否主要基于车辆的当前朝向,如果设置为false,路径规划可能不会主要考虑车辆的当前朝向,以目标点的方向计算附近方向的路径,不考虑车辆的转弯半径的约束,可以直接转向目标点前进。这可能使得车辆在选择路径时更加灵活
  497. nhPrivate.getParam("pathScale", pathScale);//路径尺度(路径的大小或长度与某个参考值(如车辆尺寸或环境尺寸)的比例关系),在狭窄的空间中减小路径规模,或在开放的空间中增加路径规模以优化行进路线
  498. nhPrivate.getParam("minPathScale", minPathScale);//最小路径尺度,这个参数确保路径不会因为缩放而变得太小
  499. nhPrivate.getParam("pathScaleStep", pathScaleStep);//路径尺度的调整步长,对pathScale逐步细调路径的尺度
  500. nhPrivate.getParam("pathScaleBySpeed", pathScaleBySpeed);//是否根据速度调整路径尺度(true)
  501. nhPrivate.getParam("minPathRange", minPathRange);//路径规划时要考虑的最小有效范围或距离
  502. nhPrivate.getParam("pathRangeStep", pathRangeStep);//路径范围的调整步长。用于定义当需要增加或减少路径的考虑范围时,每次调整的大小
  503. nhPrivate.getParam("pathRangeBySpeed", pathRangeBySpeed);//是否根据速度调整路径的范围(true)
  504. nhPrivate.getParam("pathCropByGoal", pathCropByGoal);//(true)只考虑目标点+goalClearRange范围内的点云。特别是当目标点附近的区域包含重要的导航信息时(如障碍物、通道等),使用pathCropByGoal可以提高路径规划的质量。
  505. nhPrivate.getParam("autonomyMode", autonomyMode);//是否处于完全自主导航模式(true)
  506. nhPrivate.getParam("autonomySpeed", autonomySpeed);//定义了在自主模式下机器人或车辆的默认或期望行驶速度。
  507. nhPrivate.getParam("joyToSpeedDelay", joyToSpeedDelay);//从接收遥控器指令到机器人或车辆调整其速度的时间延迟
  508. nhPrivate.getParam("joyToCheckObstacleDelay", joyToCheckObstacleDelay);//遥控器发出指令和系统开始检测障碍物之间的时间延迟(导航手动切换)。这有助于管理遥控器输入与自动障碍物检测系统之间的交互
  509. nhPrivate.getParam("goalClearRange", goalClearRange);//当 pathCropByGoal = true 时,点云距离超过目标点+该值则不被处理
  510. nhPrivate.getParam("goalX", goalX);//局部路径目标点x(0)
  511. nhPrivate.getParam("goalY", goalY);//局部路径目标点y(0)
  512. //设置订阅话题
  513. ros::Subscriber subOdometry = nh.subscribe<nav_msgs::Odometry>//当接收到/state_estimation话题消息更新时启动odometryHandler回调函数 (消息格式:nav_msgs::Odometry消息内容:关于机器人或车辆的位置和方向(姿态)信息)
  514. ("/state_estimation", 5, odometryHandler);//odometryHandler是当接收到新的里程计消息时调用的回调函数,更新机器人姿态
  515. ros::Subscriber subLaserCloud = nh.subscribe<sensor_msgs::PointCloud2>
  516. ("/registered_scan", 5, laserCloudHandler);//laserCloudHandler是registered_scan话题回调函数,通过裁剪点云时的距离adjacentRange(车辆周围用于检测障碍物的区域大小),对点云进行裁减并进一步通过体素网格降采样
  517. ros::Subscriber subTerrainCloud = nh.subscribe<sensor_msgs::PointCloud2>//terrain_map话题由terrainAnalysis节点发布(.cpp)
  518. ("/terrain_map", 5, terrainCloudHandler);//terrainCloudHandler地形分析,裁减与障碍物相关点云,并进行降采用
  519. ros::Subscriber subJoystick = nh.subscribe<sensor_msgs::Joy> ("/joy", 5, joystickHandler);//joystickHandler回调,解析从游戏手柄传入的数据,并据此更新车辆控制和导航状态
  520. ros::Subscriber subGoal = nh.subscribe<geometry_msgs::PointStamped> ("/way_point", 5, goalHandler);//订阅way_point话题,更新局部目标点坐标
  521. ros::Subscriber subSpeed = nh.subscribe<std_msgs::Float32> ("/speed", 5, speedHandler);//在自主模式下根据接收到手柄的速度消息调整机器人的速度
  522. ros::Subscriber subBoundary = nh.subscribe<geometry_msgs::PolygonStamped> ("/navigation_boundary", 5, boundaryHandler);//通过在边界多边形的每两个顶点之间插入额外的点来创建一个密集的边界点云
  523. ros::Subscriber subAddedObstacles = nh.subscribe<sensor_msgs::PointCloud2> ("/added_obstacles", 5, addedObstaclesHandler);//用于处理附加障碍物点云(动态障碍物,以强度区别)
  524. ros::Subscriber subCheckObstacle = nh.subscribe<std_msgs::Bool> ("/check_obstacle", 5, checkObstacleHandler);//自主导航时根据消息checkObs动态调整是否进行障碍物检测
  525. ros::Publisher pubPath = nh.advertise<nav_msgs::Path> ("/path", 5);//发布路径话题,话题数据对象是pubPath
  526. nav_msgs::Path path;
  527. #if PLOTPATHSET == 1
  528. ros::Publisher pubFreePaths = nh.advertise<sensor_msgs::PointCloud2> ("/free_paths", 2);//发布可视化路径
  529. #endif
  530. //ros::Publisher pubLaserCloud = nh.advertise<sensor_msgs::PointCloud2> ("/stacked_scans", 2);
  531. printf ("\nReading path files.\n");
  532. if (autonomyMode) {
  533. joySpeed = autonomySpeed / maxSpeed;
  534. if (joySpeed < 0) joySpeed = 0;
  535. else if (joySpeed > 1.0) joySpeed = 1.0;
  536. }
  537. for (int i = 0; i < laserCloudStackNum; i++) {//laserCloudStackNum堆栈的大小
  538. laserCloudStack[i].reset(new pcl::PointCloud<pcl::PointXYZI>());
  539. }
  540. for (int i = 0; i < groupNum; i++) {
  541. startPaths[i].reset(new pcl::PointCloud<pcl::PointXYZ>());//reset随后使paths[i]指向一个新创建的pcl::PointCloud<pcl::PointXYZI>对象(清空数组原来数据?)
  542. }
  543. #if PLOTPATHSET == 1
  544. for (int i = 0; i < pathNum; i++) {
  545. paths[i].reset(new pcl::PointCloud<pcl::PointXYZI>());
  546. }
  547. #endif
  548. for (int i = 0; i < gridVoxelNum; i++) {//表示网格体素的总数
  549. correspondences[i].resize(0);//初始化了一个名为correspondences的数组,这个数组中的每个元素都是一个向量,用于存储网格体素与路径之间的对应关系
  550. }
  551. laserDwzFilter.setLeafSize(laserVoxelSize, laserVoxelSize, laserVoxelSize);//laserDwzFilter是pcl::VoxelGrid过滤器对象,它们用于对点云数据进行下采样,setLeafSize方法是用来设置体素网格的大小
  552. terrainDwzFilter.setLeafSize(terrainVoxelSize, terrainVoxelSize, terrainVoxelSize);
  553. //通过path文件夹中的相关文件,读取对应的路径点
  554. readStartPaths();//通过.ply文件读取第一次采样的路径(路径开始点?)(离线路径)
  555. #if PLOTPATHSET == 1
  556. readPaths();//读取一系列预定义的路径或路径选项
  557. #endif
  558. readPathList();//每条路径最后一个点的路径(离线文件)
  559. readCorrespondences();//路径点path_id和碰撞体素网格的索引关系
  560. printf ("\nInitialization complete.\n\n");
  561. //以下为输入数据处理
  562. ros::Rate rate(100);
  563. bool status = ros::ok();
  564. while (status) {
  565. ros::spinOnce();
  566. if (newLaserCloud || newTerrainCloud) {//如果有新的激光或地形点云数据到达(经过点云的裁减,体素降采用)
  567. if (newLaserCloud) {
  568. newLaserCloud = false;//将标志位重置,表示当前批次的数据正在处理
  569. laserCloudStack[laserCloudCount]->clear();//清空当前索引的点云堆栈,laserCloudCount当前堆栈序列索引
  570. *laserCloudStack[laserCloudCount] = *laserCloudDwz;;//将降采样的激光点云 (laserCloudDwz) 存储到该位置。
  571. //laserCloudStackNum表示点云堆栈的大小(堆栈一共可以存储laserCloudStackNum个点云)
  572. laserCloudCount = (laserCloudCount + 1) % laserCloudStackNum;//%取余:当 laserCloudCount 达到 laserCloudStackNum(堆栈大小)时,它会自动回绕到 0,堆栈的开始处覆盖最早的数据。
  573. plannerCloud->clear();// 清空规划用的点云
  574. for (int i = 0; i < laserCloudStackNum; i++) {//遍历堆栈的尺寸
  575. *plannerCloud += *laserCloudStack[i];//将降采用后的点云添加到路径规划点云(plannerCloud)中
  576. }
  577. }
  578. if (newTerrainCloud) {
  579. newTerrainCloud = false;
  580. plannerCloud->clear();
  581. *plannerCloud = *terrainCloudDwz;//将滤波后的的地形点云(障碍)(terrainCloudDwz) 存储到其中
  582. }
  583. //对roll,pitch,yaw角处理,获得对应的sin和cos值
  584. float sinVehicleRoll = sin(vehicleRoll);
  585. float cosVehicleRoll = cos(vehicleRoll);
  586. float sinVehiclePitch = sin(vehiclePitch);
  587. float cosVehiclePitch = cos(vehiclePitch);
  588. float sinVehicleYaw = sin(vehicleYaw);//车辆yaw角是相对map坐标系的角度
  589. float cosVehicleYaw = cos(vehicleYaw);
  590. //在仿真中,点云信息输出的坐标系是map全局坐标系。对于实际的车辆而言,点云数据进行标定之后就将点云坐标系直接转变为车辆坐标系,所以这部分内容需要删改
  591. //所用到的局部路径目标点都是在base_link下的,所以对所有的map点云信息都旋转变换到base_link车体坐标系下
  592. //在实际的获得激光雷达的数据中,不需要转换
  593. pcl::PointXYZI point;
  594. plannerCloudCrop->clear();
  595. int plannerCloudSize = plannerCloud->points.size();
  596. for (int i = 0; i < plannerCloudSize; i++) {//plannerCloud是经过上述裁减和降采样后的所有点云
  597. float pointX1 = plannerCloud->points[i].x - vehicleX;//以车辆的当前位置(vehicleX)为原点,重新构建其他点的相对坐标系位置
  598. float pointY1 = plannerCloud->points[i].y - vehicleY;
  599. float pointZ1 = plannerCloud->points[i].z - vehicleZ;
  600. point.x = pointX1 * cosVehicleYaw + pointY1 * sinVehicleYaw;
  601. point.y = -pointX1 * sinVehicleYaw + pointY1 * cosVehicleYaw;
  602. point.z = pointZ1;
  603. point.intensity = plannerCloud->points[i].intensity;//plannerCloudSize数据带intensity障碍物高度
  604. float dis = sqrt(point.x * point.x + point.y * point.y);
  605. if (dis < adjacentRange && ((point.z > minRelZ && point.z < maxRelZ) || useTerrainAnalysis)) {//点云裁减
  606. plannerCloudCrop->push_back(point);//将在小于车体adjacentRange距离范围和障碍物和地面间的点存入导航路径点云plannerCloudCrop
  607. }
  608. }
  609. //处理边界点云数据,目的是将边界点云从其原始坐标系转换到车辆的局部坐标系中,并对其进行筛选(同上)
  610. int boundaryCloudSize = boundaryCloud->points.size();
  611. for (int i = 0; i < boundaryCloudSize; i++) {
  612. point.x = ((boundaryCloud->points[i].x - vehicleX) * cosVehicleYaw
  613. + (boundaryCloud->points[i].y - vehicleY) * sinVehicleYaw);
  614. point.y = (-(boundaryCloud->points[i].x - vehicleX) * sinVehicleYaw
  615. + (boundaryCloud->points[i].y - vehicleY) * cosVehicleYaw);
  616. point.z = boundaryCloud->points[i].z;
  617. point.intensity = boundaryCloud->points[i].intensity;
  618. float dis = sqrt(point.x * point.x + point.y * point.y);
  619. if (dis < adjacentRange) {
  620. plannerCloudCrop->push_back(point);
  621. }
  622. }
  623. //将 addedObstacles点云(动态障碍物)中的每个点转换到车辆的局部坐标系中,并且只保留那些在车辆周围一定范围(adjacentRange)内的点
  624. int addedObstaclesSize = addedObstacles->points.size();
  625. for (int i = 0; i < addedObstaclesSize; i++) {
  626. point.x = ((addedObstacles->points[i].x - vehicleX) * cosVehicleYaw
  627. + (addedObstacles->points[i].y - vehicleY) * sinVehicleYaw);
  628. point.y = (-(addedObstacles->points[i].x - vehicleX) * sinVehicleYaw
  629. + (addedObstacles->points[i].y - vehicleY) * cosVehicleYaw);
  630. point.z = addedObstacles->points[i].z;
  631. point.intensity = addedObstacles->points[i].intensity;
  632. float dis = sqrt(point.x * point.x + point.y * point.y);
  633. if (dis < adjacentRange) {
  634. plannerCloudCrop->push_back(point);
  635. }
  636. }
  637. float pathRange = adjacentRange;// 设置了点云探索的边界值
  638. if (pathRangeBySpeed) pathRange = adjacentRange * joySpeed;
  639. if (pathRange < minPathRange) pathRange = minPathRange;
  640. float relativeGoalDis = adjacentRange;// 将点云探索的边界值赋予相对的目标距离
  641. //自动模式下,计算目标点(map)在base_link下的坐标,并计算和限制车辆到目标点的转角
  642. if (autonomyMode) {
  643. float relativeGoalX = ((goalX - vehicleX) * cosVehicleYaw + (goalY - vehicleY) * sinVehicleYaw);
  644. float relativeGoalY = (-(goalX - vehicleX) * sinVehicleYaw + (goalY - vehicleY) * cosVehicleYaw);
  645. relativeGoalDis = sqrt(relativeGoalX * relativeGoalX + relativeGoalY * relativeGoalY);//计算车辆当前位置到目标点的相对距离。
  646. joyDir = atan2(relativeGoalY, relativeGoalX) * 180 / PI;//计算出车辆到目标点的角度(与x轴正方向的角度)
  647. if (!twoWayDrive) {//如果非双向导航,限制向目标点转角最大为90度(始终保持向前或向后)
  648. if (joyDir > 90.0) joyDir = 90.0;
  649. else if (joyDir < -90.0) joyDir = -90.0;
  650. }
  651. }
  652. bool pathFound = false;//用来指示是否找到了有效路径。它的初始值设置为 false,表示还没有找到路径
  653. float defPathScale = pathScale;//设置路宽pathScale
  654. if (pathScaleBySpeed) pathScale = defPathScale * joySpeed;//动态路宽(速度控制)
  655. if (pathScale < minPathScale) pathScale = minPathScale;
  656. //以下为通过点云信息确定路径上是否存在障碍物??
  657. while (pathScale >= minPathScale && pathRange >= minPathRange) {//该点云是在车辆检测范围内的话
  658. //初始化clearPathList,pathPenaltyList,clearPathPerGroupScore树组
  659. for (int i = 0; i < 36 * pathNum; i++) {//pathNum路径点个数,对于每个点,考虑36个可能的转向方向(rotDir),每个方向对应10度的旋转
  660. clearPathList[i] = 0;//存储每条路径上的障碍物数量
  661. pathPenaltyList[i] = 0;//记录给定方向上路径的惩罚得分
  662. }
  663. for (int i = 0; i < 36 * groupNum; i++) {//groupNum路径组数
  664. clearPathPerGroupScore[i] = 0;//clearPathPerGroupScore每个路径组的得分
  665. }
  666. float minObsAngCW = -180.0;
  667. float minObsAngCCW = 180.0;//逆时针旋转角度赋初始值(最大的逆时针转向角度)
  668. float diameter = sqrt(vehicleLength / 2.0 * vehicleLength / 2.0 + vehicleWidth / 2.0 * vehicleWidth / 2.0);//计算车辆对角线长度用于判断障碍物是否在车辆的转向路径内
  669. float angOffset = atan2(vehicleWidth, vehicleLength) * 180.0 / PI;//angOffset 是车辆对角线与车辆前进方向之间的角度差,帮助计算出这个转弯动作是否会导致车辆的任何部分与障碍物碰撞
  670. int plannerCloudCropSize = plannerCloudCrop->points.size();
  671. for (int i = 0; i < plannerCloudCropSize; i++) {
  672. float x = plannerCloudCrop->points[i].x / pathScale;//归一化,尺度调整通常用于在不同级别的精度下处理点云数据,
  673. float y = plannerCloudCrop->points[i].y / pathScale;
  674. float h = plannerCloudCrop->points[i].intensity;//点云高度
  675. float dis = sqrt(x * x + y * y);//点云到车的距离
  676. //判断点云中的某个点是否应该被考虑在路径规划中,如果符合条件则继续处理
  677. //判断条件:1.小于路径宽度(点云在车辆检测范围内)2.代检测点到车辆距离dis小于车到目标点距离(离目标太远无意义) 3.启动障碍物检测的点
  678. if (dis < pathRange / pathScale && (dis <= (relativeGoalDis + goalClearRange) / pathScale || !pathCropByGoal) && checkObstacle) {
  679. for (int rotDir = 0; rotDir < 36; rotDir++) {//36个方向
  680. float rotAng = (10.0 * rotDir - 180.0) * PI / 180;//每个转向方向(当前位置转到路径点位置角度),计算其对应的旋转角度(rotAng),将度数转换为弧度
  681. float angDiff = fabs(joyDir - (10.0 * rotDir - 180.0));//计算的是车辆朝目标点(joyDir)与每个可能转向方向之间的角度差
  682. if (angDiff > 180.0) {//将角度差规范化到180度以内
  683. angDiff = 360.0 - angDiff;
  684. }
  685. //决定了哪些转向方向应该被考虑
  686. //在路径选择不考虑车辆的当前方向(!dirToVehicle)情况下,如果去的路径点角度和目标角度差超过了设定阈值(dirThre=90),则该方向被忽略
  687. //如果路径选择考虑车辆的当前方向(dirToVehicle),且车辆朝目标点角度joyDir在-90到90之间,但转向路径点方向超出了阈值,则该方向被忽略。
  688. //对于车辆转向路径方向超出正负90度的情况,忽略该方向
  689. if ((angDiff > dirThre && !dirToVehicle) || (fabs(10.0 * rotDir - 180.0) > dirThre && fabs(joyDir) <= 90.0 && dirToVehicle) ||
  690. ((10.0 * rotDir > dirThre && 360.0 - 10.0 * rotDir > dirThre) && fabs(joyDir) > 90.0 && dirToVehicle)) {
  691. continue;
  692. }
  693. float x2 = cos(rotAng) * x + sin(rotAng) * y;//将原始的x,y下面旋转rotAng度,将原始点转换到相对rotdir方向上(rotdir方向上角度皈依化为0)
  694. float y2 = -sin(rotAng) * x + cos(rotAng) * y;
  695. //网格体ID包含了其searchRadius搜索范围内的路径,那么只需要计算障碍物对应的网格的ID号,便可以知道哪些路径会被遮挡
  696. //计算的是一个缩放因子(scaleY=y/gridVoxelOffsetY),每一列的X所包含的Y的个数相同,离车越近,X越小,Y越密,即使得离车近的体素网格密,检测精度高,实际坐标y与gridVoxelOffsetY的相似三角形比例
  697. float scaleY = x2 / gridVoxelOffsetX + searchRadius / gridVoxelOffsetY //路径规划(障碍检索)的区域起点距离车辆本身的距离。
  698. * (gridVoxelOffsetX - x2) / gridVoxelOffsetX;//动态调整在Y方向上的体素大小,从而使体素网格能够更灵活地适应不同的环境和搜索范围
  699. // 计算该plannerCloudCropSize(i)点云对应的体素网格的索引(体素网格下包含searchRadius范围内的path_id)
  700. int indX = int((gridVoxelOffsetX + gridVoxelSize / 2 - x2) / gridVoxelSize);//计算体素网格在X方向上的索引
  701. int indY = int((gridVoxelOffsetY + gridVoxelSize / 2 - y2 / scaleY) / gridVoxelSize);
  702. if (indX >= 0 && indX < gridVoxelNumX && indY >= 0 && indY < gridVoxelNumY) {
  703. int ind = gridVoxelNumY * indX + indY;// 得到索引序号,将二维索引映射到一维(第indX行的第indY列),对应correspindence.txt文件中的第ind网格
  704. int blockedPathByVoxelNum = correspondences[ind].size();// ind是对应的体素网格ID,correspondences[ind]是该体素网格下searchRadius范围内的path_id
  705. for (int j = 0; j < blockedPathByVoxelNum; j++) {//遍历所有通过当前体素网格的路径。
  706. //未使用地面分割的情况下当前激光点的高度大于障碍物高度阈值,或者未使用地面分割时(即不符合要求点)
  707. if (h > obstacleHeightThre || !useTerrainAnalysis) {
  708. //如果对应的x,y点云存在障碍物,将范围扩展到searchRadius区域,认为通过该立方体的(pathNum * rotDir + correspondences[ind][j])路径path_id的障碍物标记+!
  709. clearPathList[pathNum * rotDir + correspondences[ind][j]]++;//pathNum * rotDir该方向rotdir上的path_id起始序号,correspondences[ind][j]对应ind体素网格下第j个位置俄path_id索引
  710. } else {
  711. // 在使用了地面分割且激光点分割后高度大于地面小于障碍物阈值高度,且惩罚值小于h
  712. if (pathPenaltyList[pathNum * rotDir + correspondences[ind][j]] < h && h > groundHeightThre) {
  713. pathPenaltyList[pathNum * rotDir + correspondences[ind][j]] = h;//将对应路径path_id的惩罚树组更新为当前高度
  714. }
  715. }
  716. }
  717. }
  718. }
  719. }
  720. //障碍物不在前面而是在侧面,转向的过程中可能会碰撞
  721. //判断是否存在这种点云,: 判断点云到车辆的距离是否小于车辆转弯直径 ,但点云不在车体内部, 并且h超过了障碍物阈值(障碍物)(if的前三个条件)
  722. if (dis < diameter / pathScale && (fabs(x) > vehicleLength / pathScale / 2.0 || fabs(y) > vehicleWidth / pathScale / 2.0) &&
  723. (h > obstacleHeightThre || !useTerrainAnalysis) && checkRotObstacle) {
  724. float angObs = atan2(y, x) * 180.0 / PI;// 点云的方向
  725. if (angObs > 0) {// 左边
  726. if (minObsAngCCW > angObs - angOffset) minObsAngCCW = angObs - angOffset;//记录的逆时针方向上的最近障碍物角度(点云角度-车辆角度偏移量)
  727. if (minObsAngCW < angObs + angOffset - 180.0) minObsAngCW = angObs + angOffset - 180.0;
  728. } else {// 右边
  729. if (minObsAngCW < angObs + angOffset) minObsAngCW = angObs + angOffset;
  730. if (minObsAngCCW > 180.0 + angObs - angOffset) minObsAngCCW = 180.0 + angObs - angOffset;
  731. }
  732. }
  733. }
  734. //防止转弯碰撞
  735. if (minObsAngCW > 0) minObsAngCW = 0;//顺时针方向上最近障碍物的角度范围大于0,说明车辆在右侧有障碍物,为了避免碰撞,将最近障碍物的角度范围设为0
  736. if (minObsAngCCW < 0) minObsAngCCW = 0;
  737. //路径得分计算??
  738. for (int i = 0; i < 36 * pathNum; i++) {//遍历36个方向(rotDir)中的每一条路径
  739. int rotDir = int(i / pathNum);//第几个方向
  740. float angDiff = fabs(joyDir - (10.0 * rotDir - 180.0));///计算的是车辆朝目标点(joyDir)与每个可能转向方向(10.0 * rotDir - 180,)之间的角度差
  741. if (angDiff > 180.0) {
  742. angDiff = 360.0 - angDiff;//归一化到0-180
  743. }
  744. //决定了哪些转向方向应该被忽略
  745. //在路径选择不考虑车辆的当前方向(!dirToVehicle)情况下,如果去的路径点角度和目标角度差超过了设定阈值(dirThre=90),则该方向被忽略
  746. //如果路径选择考虑车辆的当前方向(dirToVehicle),且车辆朝目标点角度joyDir在-90到90之间,但转向路径点方向超出了阈值(车体朝向不能改变),则该方向被忽略。
  747. //对于车辆转向路径方向超出正负90度的情况,忽略该方向
  748. if ((angDiff > dirThre && !dirToVehicle) || (fabs(10.0 * rotDir - 180.0) > dirThre && fabs(joyDir) <= 90.0 && dirToVehicle) ||
  749. ((10.0 * rotDir > dirThre && 360.0 - 10.0 * rotDir > dirThre) && fabs(joyDir) > 90.0 && dirToVehicle)) {
  750. continue;
  751. }
  752. //检查路径上的障碍物数量低于阈值时,计算路径得分的具体过程
  753. if (clearPathList[i] < pointPerPathThre) {//路径的障碍物数量是否低于阈值 pointPerPathThre
  754. float penaltyScore = 1.0 - pathPenaltyList[i] / costHeightThre;//计算惩罚的分,penaltyScore越接近1越好(惩罚小)
  755. if (penaltyScore < costScore) penaltyScore = costScore;//如果惩罚分数低于设定的最小分数 costScore,则将其设为最小分数
  756. //dirDiff该条路径与目标点之间的角度差值,(因为endDirPathList[i % pathNum]0-343包含在某一朝向rotdir内,要再减去(10.0 * rotDir - 180.0))
  757. float dirDiff = fabs(joyDir - endDirPathList[i % pathNum] - (10.0 * rotDir - 180.0));
  758. if (dirDiff > 360.0) {
  759. dirDiff -= 360.0;
  760. }
  761. if (dirDiff > 180.0) {
  762. dirDiff = 360.0 - dirDiff;
  763. }
  764. float rotDirW;//9是y轴负方向,27是y轴正方向,rotDirW代表了该条路径的方向与当前车辆朝向的角度差
  765. if (rotDir < 18) rotDirW = fabs(fabs(rotDir - 9) + 1);
  766. else rotDirW = fabs(fabs(rotDir - 27) + 1);
  767. //该目标函数考虑机器人的转角和障碍物高度
  768. float score = (1 - sqrt(sqrt(dirWeight * dirDiff))) * rotDirW * rotDirW * rotDirW * rotDirW * penaltyScore;
  769. if (score > 0) {
  770. //将所有path_id下的分数加到对应path_id下的groupid中,用于选择对应rotdir的groupid(确定第一级路径)
  771. //定位到特定路径组groupid,groupNum * rotDir是该方向上的groupid起始序号,pathList[i % pathNum]]0-343该条路径对应的groupid(0-7)中的一个
  772. clearPathPerGroupScore[groupNum * rotDir + pathList[i % pathNum]] += score;//i % pathNum=(取余0-343)对应path_id序号,pathList获得对应path_id的第一级groupid
  773. }
  774. }
  775. }
  776. float maxScore = 0;
  777. int selectedGroupID = -1;
  778. for (int i = 0; i < 36 * groupNum; i++) {//遍历可选路径(36*7)即(rotdir朝向*第一级group_id)
  779. int rotDir = int(i / groupNum);//路径方向
  780. float rotAng = (10.0 * rotDir - 180.0) * PI / 180;//从x的负半轴开始计算角度
  781. float rotDeg = 10.0 * rotDir;//从x轴正半轴计算角度
  782. if (rotDeg > 180.0) rotDeg -= 360.0;//-180到180
  783. //该路径的方向也要满足之前求取得到的minObsAngCW和minObsAngCCW,防止侧方碰撞
  784. if (maxScore < clearPathPerGroupScore[i] && ((rotAng * 180.0 / PI > minObsAngCW && rotAng * 180.0 / PI < minObsAngCCW) ||
  785. (rotDeg > minObsAngCW && rotDeg < minObsAngCCW && twoWayDrive) || !checkRotObstacle)) {
  786. maxScore = clearPathPerGroupScore[i];//取7*36条路径中,分数最大的
  787. selectedGroupID = i;//记录7*36中某个所选路径的ID
  788. }
  789. }
  790. if (selectedGroupID >= 0) {//所选路径ID有效
  791. int rotDir = int(selectedGroupID / groupNum);//路径方向
  792. float rotAng = (10.0 * rotDir - 180.0) * PI / 180;//路径朝向起始角度
  793. selectedGroupID = selectedGroupID % groupNum;//取余,获得某一朝向rotdir上的group_id
  794. int selectedPathLength = startPaths[selectedGroupID]->points.size();//第group_id个组所包含的points元素(x,y,z,group_id)
  795. path.poses.resize(selectedPathLength);//创建selectedPathLength大小的path树组
  796. for (int i = 0; i < selectedPathLength; i++) {
  797. float x = startPaths[selectedGroupID]->points[i].x;
  798. float y = startPaths[selectedGroupID]->points[i].y;
  799. float z = startPaths[selectedGroupID]->points[i].z;
  800. float dis = sqrt(x * x + y * y);
  801. if (dis <= pathRange / pathScale && dis <= relativeGoalDis / pathScale) {//如果点云在裁减范围内,点云有效
  802. path.poses[i].pose.position.x = pathScale * (cos(rotAng) * x - sin(rotAng) * y);//读取statpath中相对于rotdir的路径点,并根据朝向交rotAng和路径归一化尺寸pathScale,得到相对于车体坐标系的路径坐标
  803. path.poses[i].pose.position.y = pathScale * (sin(rotAng) * x + cos(rotAng) * y);
  804. path.poses[i].pose.position.z = pathScale * z;
  805. } else {
  806. path.poses.resize(i);//若无点云符合,清空第I个位置元素
  807. break;
  808. }
  809. }
  810. path.header.stamp = ros::Time().fromSec(odomTime);//以odomTime时间同步path消息时间
  811. path.header.frame_id = "vehicle";//路径坐标系名称
  812. pubPath.publish(path);//pubPath对象发布路径信息
  813. //用于生成无碰撞路径freePaths
  814. #if PLOTPATHSET == 1
  815. freePaths->clear();
  816. for (int i = 0; i < 36 * pathNum; i++) {//遍历可选路径(36*7)即(rotdir朝向*第一级group_id)
  817. int rotDir = int(i / pathNum);
  818. float rotAng = (10.0 * rotDir - 180.0) * PI / 180;
  819. float rotDeg = 10.0 * rotDir;
  820. if (rotDeg > 180.0) rotDeg -= 360.0;
  821. float angDiff = fabs(joyDir - (10.0 * rotDir - 180.0));//目标方向(joyDir)与路径方向(10.0 * rotDir - 180.0)之间的绝对角度差,
  822. if (angDiff > 180.0) {
  823. angDiff = 360.0 - angDiff;
  824. }
  825. //忽略不符合条件的路径
  826. //在路径选择不考虑车辆的当前方向(!dirToVehicle)情况下,如果去的路径点角度和目标角度差超过了设定阈值(dirThre=90),则该方向被忽略
  827. //如果路径选择考虑车辆的当前方向(dirToVehicle),且车辆朝目标点角度joyDir在-90到90之间,但转向路径点方向超出了阈值(车体朝向不能改变),则该方向被忽略。
  828. //对于车辆转向路径方向超出正负90度的情况,忽略该方向
  829. if ((angDiff > dirThre && !dirToVehicle) || (fabs(10.0 * rotDir - 180.0) > dirThre && fabs(joyDir) <= 90.0 && dirToVehicle) ||
  830. ((10.0 * rotDir > dirThre && 360.0 - 10.0 * rotDir > dirThre) && fabs(joyDir) > 90.0 && dirToVehicle) ||
  831. //minObsAngCW瞬时针允许非碰撞旋转的角度
  832. !((rotAng * 180.0 / PI > minObsAngCW && rotAng * 180.0 / PI < minObsAngCCW) ||
  833. (rotDeg > minObsAngCW && rotDeg < minObsAngCCW && twoWayDrive) || !checkRotObstacle)) {
  834. continue;
  835. }
  836. if (clearPathList[i] < pointPerPathThre) {//clearPathList路径障碍物个树,路径点障碍物个树小于阈值2
  837. int freePathLength = paths[i % pathNum]->points.size();//某rotdir方向,paths[i % pathNum]]该条路径对应的7个groupid中的一个
  838. for (int j = 0; j < freePathLength; j++) {
  839. point = paths[i % pathNum]->points[j];
  840. float x = point.x;
  841. float y = point.y;
  842. float z = point.z;
  843. float dis = sqrt(x * x + y * y);
  844. if (dis <= pathRange / pathScale && (dis <= (relativeGoalDis + goalClearRange) / pathScale || !pathCropByGoal)) {
  845. point.x = pathScale * (cos(rotAng) * x - sin(rotAng) * y);//将path文件中相对于rotdir下的路径转换为车体坐标系下
  846. point.y = pathScale * (sin(rotAng) * x + cos(rotAng) * y);
  847. point.z = pathScale * z;
  848. point.intensity = 1.0;
  849. freePaths->push_back(point);//可视化路径树组
  850. }
  851. }
  852. }
  853. }
  854. sensor_msgs::PointCloud2 freePaths2;
  855. pcl::toROSMsg(*freePaths, freePaths2);// 将来自点云库(Point Cloud Library,PCL)格式的点云转换为ROS(机器人操作系统)消息格式
  856. freePaths2.header.stamp = ros::Time().fromSec(odomTime);
  857. freePaths2.header.frame_id = "vehicle";
  858. pubFreePaths.publish(freePaths2);//发布无碰撞路线消息
  859. #endif
  860. }
  861. if (selectedGroupID < 0) {//如果未找到有效路径
  862. if (pathScale >= minPathScale + pathScaleStep) {//扩大路径搜索范围
  863. pathScale -= pathScaleStep;
  864. pathRange = adjacentRange * pathScale / defPathScale;
  865. } else {
  866. pathRange -= pathRangeStep;
  867. }
  868. } else {
  869. pathFound = true;
  870. break;
  871. }
  872. }
  873. pathScale = defPathScale;
  874. if (!pathFound) {//在结束所有遍历后如果未找到路径
  875. path.poses.resize(1);
  876. path.poses[0].pose.position.x = 0;
  877. path.poses[0].pose.position.y = 0;
  878. path.poses[0].pose.position.z = 0;
  879. path.header.stamp = ros::Time().fromSec(odomTime);
  880. path.header.frame_id = "vehicle";
  881. pubPath.publish(path);
  882. #if PLOTPATHSET == 1
  883. freePaths->clear();
  884. sensor_msgs::PointCloud2 freePaths2;
  885. pcl::toROSMsg(*freePaths, freePaths2);
  886. freePaths2.header.stamp = ros::Time().fromSec(odomTime);
  887. freePaths2.header.frame_id = "vehicle";
  888. pubFreePaths.publish(freePaths2);
  889. #endif
  890. }
  891. /*sensor_msgs::PointCloud2 plannerCloud2;
  892. pcl::toROSMsg(*plannerCloudCrop, plannerCloud2);
  893. plannerCloud2.header.stamp = ros::Time().fromSec(odomTime);
  894. plannerCloud2.header.frame_id = "vehicle";
  895. pubLaserCloud.publish(plannerCloud2);*/
  896. }
  897. status = ros::ok();
  898. rate.sleep();
  899. }
  900. return 0;
  901. }

声明:本文内容由网友自发贡献,不代表【wpsshop博客】立场,版权归原作者所有,本站不承担相应法律责任。如您发现有侵权的内容,请联系我们。转载请注明出处:https://www.wpsshop.cn/w/我家小花儿/article/detail/371785
推荐阅读
相关标签
  

闽ICP备14008679号