• fast planner代码解析--topo_prm.cpp


    目录

    1、void TopologyPRM::init(ros::NodeHandle& nh)

    2、void TopologyPRM::findTopoPaths() 

    3、list TopologyPRM::createGraph()

    3.1 getSample()

    3.2 dist = edt_environment_->evaluateCoarseEDT(pt, -1.0)

    3.3 vector TopologyPRM::findVisibGuard()

    3.3.1 不可见的判断用函数linVisb()

    3.4 bool TopologyPRM::needConnection()

    3.4.1 判断同伦:使用函数bool TopologyPRM::sameTopoPath()

    3.5 void TopologyPRM::pruneGraph()

    4、vector> TopologyPRM::searchPaths()

    4.1深度优先搜索算法DFS:void TopologyPRM::depthFirstSearch()

    5、void TopologyPRM::shortcutPaths()

    5.1 void TopologyPRM::shortcutPath() 路径缩短

    5.1.1 vector TopologyPRM::discretizeLine() 

    6、vector> TopologyPRM::pruneEquivalent()

    7、vector> TopologyPRM::selectShortPaths()


    1、void TopologyPRM::init(ros::NodeHandle& nh)

    该函数用于初始化所有参数

    1. void TopologyPRM::init(ros::NodeHandle& nh) {
    2. //初始化
    3. graph_.clear();//图
    4. eng_ = default_random_engine(rd_());//默认随机数生成器
    5. rand_pos_ = uniform_real_distribution<double>(-1.0, 1.0);//均匀实分布
    6. // init parameter初始化参数
    7. nh.param("topo_prm/sample_inflate_x", sample_inflate_(0), -1.0);//inflate膨胀
    8. nh.param("topo_prm/sample_inflate_y", sample_inflate_(1), -1.0);
    9. nh.param("topo_prm/sample_inflate_z", sample_inflate_(2), -1.0);
    10. nh.param("topo_prm/clearance", clearance_, -1.0);//安全阈值
    11. nh.param("topo_prm/short_cut_num", short_cut_num_, -1);//短_修剪数目
    12. nh.param("topo_prm/reserve_num", reserve_num_, -1);//保留的数目
    13. nh.param("topo_prm/ratio_to_short", ratio_to_short_, -1.0);//长度比值
    14. nh.param("topo_prm/max_sample_num", max_sample_num_, -1);//最大采样数目
    15. nh.param("topo_prm/max_sample_time", max_sample_time_, -1.0);//最大采样时间
    16. nh.param("topo_prm/max_raw_path", max_raw_path_, -1);//最大偏航路径
    17. nh.param("topo_prm/max_raw_path2", max_raw_path2_, -1);//最大偏航路径2
    18. nh.param("topo_prm/parallel_shortcut", parallel_shortcut_, false);//并行剪枝
    19. resolution_ = edt_environment_->sdf_map_->getResolution();//分辨率
    20. offset_ = Eigen::Vector3d(0.5, 0.5, 0.5) - edt_environment_->sdf_map_->getOrigin() / resolution_;//偏差
    21. for (int i = 0; i < max_raw_path_; ++i) {
    22. casters_.push_back(RayCaster());//光线投射
    23. }
    24. }

    2、void TopologyPRM::findTopoPaths() 

    该函数用于寻找拓扑路径,即Topopath 路径搜索算法的调用入口,由五部分组成,下面将一一进行分析。

    1.createGraph;2.searchPaths; 3.shortcutPaths(); 4.pruneEquivalent();5.selectShortPaths();

    1. void TopologyPRM::findTopoPaths(Eigen::Vector3d start, Eigen::Vector3d end,
    2. vector start_pts, vector end_pts,
    3. list& graph, vector>& raw_paths,
    4. vector>& filtered_paths,
    5. vector>& select_paths) {
    6. //寻找Topo路径(多条)
    7. ros::Time t1, t2;//时间
    8. double graph_time, search_time, short_time, prune_time, select_time;
    9. //生成节点图的时间、路径搜索时间、路径缩短时间、路径修剪时间、路径选择时间
    10. /* ---------- create the topo graph ---------- */
    11. //创建空间中的采样节点图
    12. t1 = ros::Time::now();//t1为当前时间
    13. start_pts_ = start_pts;//起始位置
    14. end_pts_ = end_pts;//目标位置
    15. graph = createGraph(start, end);//生成节点图(以起点和目标点为节点)
    16. graph_time = (ros::Time::now() - t1).toSec();//节点图生成的时间
    17. /* ---------- search paths in the graph ---------- */
    18. //在节点图中搜索路径
    19. t1 = ros::Time::now();
    20. raw_paths = searchPaths();//搜索的路径
    21. search_time = (ros::Time::now() - t1).toSec();//搜索时间
    22. /* ---------- path shortening ---------- */
    23. //路径缩短
    24. // for parallel, save result in short_paths_
    25. //对于并行,将结果保存在短_路径 short_paths_中_
    26. t1 = ros::Time::now();
    27. shortcutPaths();//
    28. short_time = (ros::Time::now() - t1).toSec();//路径缩短时间
    29. /* ---------- prune equivalent paths ---------- */
    30. //等效路径d的修剪,只保留属于不同UVD class
    31. t1 = ros::Time::now();
    32. filtered_paths = pruneEquivalent(short_paths_);//已筛选的路径
    33. prune_time = (ros::Time::now() - t1).toSec();//修剪时间
    34. // cout << "prune: " << (t2 - t1).toSec() << endl;
    35. /* ---------- select N shortest paths ---------- */
    36. t1 = ros::Time::now();
    37. select_paths = selectShortPaths(filtered_paths, 1);//搜索最佳路径
    38. select_time = (ros::Time::now() - t1).toSec();//搜索时间
    39. final_paths_ = select_paths;//搜索的路径为最终的路径
    40. double total_time = graph_time + search_time + short_time + prune_time + select_time;//总时间的计算
    41. std::cout << "\n[Topo]: total time: " << total_time << ", graph: " << graph_time
    42. << ", search: " << search_time << ", short: " << short_time << ", prune: " << prune_time
    43. << ", select: " << select_time << std::endl;
    44. }

    3、list TopologyPRM::createGraph()

    根据起始和目标的位置信息和载入的参数来设置采样点的范围,在采样时间大于最大采样时间或采样点数大于最大采样点数时停止采样。

    1. list TopologyPRM::createGraph(Eigen::Vector3d start, Eigen::Vector3d end) {
    2. //创建节点图
    3. // std::cout << "[Topo]: searching----------------------" << std::endl;
    4. /* init the start, end and sample region */
    5. //初始化开始、结束和采样区域
    6. graph_.clear();//清除所有的图节点
    7. // collis_.clear();
    8. GraphNode::Ptr start_node = GraphNode::Ptr(new GraphNode(start, GraphNode::Guard, 0));//开始节点为开始位置
    9. GraphNode::Ptr end_node = GraphNode::Ptr(new GraphNode(end, GraphNode::Guard, 1));//结束节点为目标位置
    10. //开始节点和结束节点加入节点图中
    11. graph_.push_back(start_node);
    12. graph_.push_back(end_node);
    13. // sample region采样区域
    14. sample_r_(0) = 0.5 * (end - start).norm() + sample_inflate_(0);
    15. //sample_inflate_x为sample_inflate_(0),x方向上采样的半径
    16. sample_r_(1) = sample_inflate_(1);//y方向上采样的半径
    17. sample_r_(2) = sample_inflate_(2);//z方向上采样的半径
    18. // transformation转移
    19. translation_ = 0.5 * (start + end);
    20. Eigen::Vector3d xtf, ytf, ztf, downward(0, 0, -1);
    21. xtf = (end - translation_).normalized();
    22. ytf = xtf.cross(downward).normalized();
    23. ztf = xtf.cross(ytf);
    24. rotation_.col(0) = xtf;
    25. rotation_.col(1) = ytf;
    26. rotation_.col(2) = ztf;
    27. int node_id = 1;//节点索引
    28. /* ---------- main loop ---------- */
    29. //主循环
    30. int sample_num = 0;//采样数目
    31. double sample_time = 0.0;//采样时间
    32. Eigen::Vector3d pt;//位置
    33. ros::Time t1, t2;//时间
    34. while (sample_time < max_sample_time_ && sample_num < max_sample_num_) {
    35. //若采样时间大于最大采样时间,采样点数大于最大采样点数时,结束采样循环
    36. t1 = ros::Time::now();
    37. pt = getSample();//获取采样
    38. ++sample_num;//采样数目++
    39. double dist;//距离
    40. Eigen::Vector3d grad;//梯度
    41. // edt_environment_->evaluateEDTWithGrad(pt, -1.0, dist, grad);
    42. dist = edt_environment_->evaluateCoarseEDT(pt, -1.0);//距离为ESDF地图的离最近障碍物的距离
    43. if (dist <= clearance_) {//如果距离小于安全阈值
    44. sample_time += (ros::Time::now() - t1).toSec();//采样时间+,说明采样点在障碍物中
    45. continue;//结束
    46. }
    47. /* find visible guard */
    48. //寻找可见的guard点
    49. vector visib_guards = findVisibGuard(pt);//可见的guard点
    50. if (visib_guards.size() == 0) {//如果可见的guard的数目为0
    51. GraphNode::Ptr guard = GraphNode::Ptr(new GraphNode(pt, GraphNode::Guard, ++node_id));
    52. //该节点创建为一个新的guard点
    53. graph_.push_back(guard);
    54. } else if (visib_guards.size() == 2) {
    55. /* try adding new connection between two guard */
    56. // vector> sort_guards =
    57. // sortVisibGuard(visib_guards);
    58. //该采样点(节点)正好对两个guard的可见时
    59. bool need_connect = needConnection(visib_guards[0], visib_guards[1], pt);
    60. //利用needConnection函数判断是否要添加新的connector
    61. if (!need_connect) {
    62. sample_time += (ros::Time::now() - t1).toSec();//如果不需要连接则采样时间+
    63. continue;
    64. }
    65. // new useful connection needed, add new connector
    66. //需要新的有用连接,添加新连接器
    67. GraphNode::Ptr connector = GraphNode::Ptr(new GraphNode(pt, GraphNode::Connector, ++node_id));
    68. graph_.push_back(connector);//节点图中添加新的连接节点
    69. // connect guards,连接guards点
    70. visib_guards[0]->neighbors_.push_back(connector);
    71. visib_guards[1]->neighbors_.push_back(connector);
    72. connector->neighbors_.push_back(visib_guards[0]);
    73. connector->neighbors_.push_back(visib_guards[1]);
    74. }
    75. sample_time += (ros::Time::now() - t1).toSec();//采样时间
    76. }
    77. /* print record */
    78. std::cout << "[Topo]: sample num: " << sample_num;
    79. pruneGraph();//修剪节点图
    80. // std::cout << "[Topo]: node num: " << graph_.size() << std::endl;
    81. return graph_;//返回节点图
    82. // return searchPaths(start_node, end_node);
    83. }

    3.1 getSample()

    该函数用于获取采样的节点

    1. Eigen::Vector3d TopologyPRM::getSample() {
    2. //获取采样点
    3. /* sampling */
    4. Eigen::Vector3d pt;//位置
    5. pt(0) = rand_pos_(eng_) * sample_r_(0);//x
    6. pt(1) = rand_pos_(eng_) * sample_r_(1);//y
    7. pt(2) = rand_pos_(eng_) * sample_r_(2);//z
    8. pt = rotation_ * pt + translation_;//最终位置
    9. return pt;//返回采样节点的位置
    10. }

    3.2 dist = edt_environment_->evaluateCoarseEDT(pt, -1.0)

    用于判断采样的节点是否位于障碍物中,是则continue;

    3.3 vector TopologyPRM::findVisibGuard()

    前采样点与任一个guard都不可见时,则把它当做新的guard添加到gragh中,如果有且只有两个可见guard,则要利用needConnection函数判断是否要添加新的connector.

    1. vector TopologyPRM::findVisibGuard(Eigen::Vector3d pt) {
    2. //当一个采样点正好对两个guards可见时,创建一个新的connectors
    3. //发现可见的guards点
    4. vector visib_guards;//可见的guards点
    5. Eigen::Vector3d pc;
    6. int visib_num = 0;//可见的数目
    7. /* find visible GUARD from pt */
    8. //从pt发现可见的guard点
    9. for (list::iterator iter = graph_.begin(); iter != graph_.end(); ++iter) {
    10. //迭代
    11. if ((*iter)->type_ == GraphNode::Connector) continue;
    12. if (lineVisib(pt, (*iter)->pos_, resolution_, pc)) {
    13. visib_guards.push_back((*iter));
    14. ++visib_num;
    15. if (visib_num > 2) break;
    16. }
    17. }
    18. return visib_guards;//返回可见的guard点
    19. }

    3.3.1 不可见的判断用函数linVisb()

    将两个节点连接起来,利用利用raycast步进和ESDF中的距离信息来逐步检验连线上是否有障碍物,有障碍物则者两个节点不可见。

    1. bool TopologyPRM::lineVisib(const Eigen::Vector3d& p1, const Eigen::Vector3d& p2, double thresh,
    2. Eigen::Vector3d& pc, int caster_id) {
    3. //linVisb()判断两个guard之间是否可见的。
    4. //即把两个节点连起来,利用raycast步进和ESDF地图来逐步检验连线上的每一个点是否是障碍物。
    5. Eigen::Vector3d ray_pt;//投射位置
    6. Eigen::Vector3i pt_id;//位置索引
    7. double dist;//距离
    8. casters_[caster_id].setInput(p1 / resolution_, p2 / resolution_);//光线投射
    9. while (casters_[caster_id].step(ray_pt)) {
    10. pt_id(0) = ray_pt(0) + offset_(0);
    11. pt_id(1) = ray_pt(1) + offset_(1);
    12. pt_id(2) = ray_pt(2) + offset_(2);
    13. dist = edt_environment_->sdf_map_->getDistance(pt_id);//获取距离
    14. if (dist <= thresh) {//距离小于阈值
    15. edt_environment_->sdf_map_->indexToPos(pt_id, pc);
    16. return false;
    17. }
    18. }
    19. return true;
    20. }

    3.4 bool TopologyPRM::needConnection()

    即判断当前路径(可见guard1,当前采样点,可见guard2)为path1,是否与(可见guard1,可见guard2,…)形成的其他路径path2同伦,如果同伦,则要判断path1是否比path2短,如果path1

    1. bool TopologyPRM::needConnection(GraphNode::Ptr g1, GraphNode::Ptr g2, Eigen::Vector3d pt) {
    2. //是否需要连接
    3. //即判断当前路径(可见guard1,当前采样点,可见guard2)path1,是否与(可见guard1,可见guard2,…)形成的其他路径同伦sameTopoPath
    4. //如果同伦,则直接返回false.
    5. //如果不同伦,则要判断新的路径是否比之前的路径短,如果短,则替换之前两个guard的connector的位置并返回true,
    6. //将当前采样点添加为新的connector至graph中。。
    7. //如果更长,则直接返回fase.
    8. vector path1(3), path2(3);
    9. path1[0] = g1->pos_;//guard1的位置
    10. path1[1] = pt;//采样点的位置
    11. path1[2] = g2->pos_;//guard2的位置
    12. path2[0] = g1->pos_;//guard1的位置
    13. path2[2] = g2->pos_;//guard2的位置
    14. vector connect_pts;//连接点的位置
    15. bool has_connect = false;//初始化即两个guard点有连接为false
    16. for (int i = 0; i < g1->neighbors_.size(); ++i) {
    17. for (int j = 0; j < g2->neighbors_.size(); ++j) {
    18. if (g1->neighbors_[i]->id_ == g2->neighbors_[j]->id_) {
    19. path2[1] = g1->neighbors_[i]->pos_;
    20. bool same_topo = sameTopoPath(path1, path2, 0.0);
    21. if (same_topo) {
    22. // get shorter connection ?
    23. if (pathLength(path1) < pathLength(path2)) {
    24. g1->neighbors_[i]->pos_ = pt;
    25. // ROS_WARN("shorter!");
    26. }
    27. return false;
    28. }
    29. }
    30. }
    31. }
    32. return true;
    33. }

    3.4.1 判断同伦:使用函数bool TopologyPRM::sameTopoPath()

    判断两条路径是否可以连续映射,则使用LinVisb来查看两两映射的点的连接是否在障碍物中,所有点一一映射且无障碍物则为同伦。

    1. bool TopologyPRM::sameTopoPath(const vector& path1,
    2. const vector& path2, double thresh) {
    3. //同样的topo路径
    4. // calc the length,计算长度
    5. double len1 = pathLength(path1);//路径1 的长度
    6. double len2 = pathLength(path2);//路径2 的长度
    7. double max_len = max(len1, len2);//最大的路径长度
    8. int pt_num = ceil(max_len / resolution_);//计算点的数目
    9. // std::cout << "pt num: " << pt_num << std::endl;
    10. vector pts1 = discretizePath(path1, pt_num);//位置1为离散的路径点
    11. vector pts2 = discretizePath(path2, pt_num);
    12. Eigen::Vector3d pc;
    13. for (int i = 0; i < pt_num; ++i) {
    14. if (!lineVisib(pts1[i], pts2[i], thresh, pc)) {//两条路径是否连续映射
    15. return false;
    16. }
    17. }
    18. return true;
    19. }

    3.5 void TopologyPRM::pruneGraph()

    修剪无用的采样点,只有只有一个neighbor的guard节点。

    1. void TopologyPRM::pruneGraph() {
    2. //修剪无用的节点,删去那些只有一个neighbor的guard节点。(connector不可能只有一个邻居节点)。
    3. /* prune useless node */
    4. if (graph_.size() > 2) {//节点图的节点数目>2
    5. for (list::iterator iter1 = graph_.begin();
    6. iter1 != graph_.end() && graph_.size() > 2; ++iter1) {
    7. //迭代
    8. if ((*iter1)->id_ <= 1) continue;//删去那些只有一个neighbor的guard节点
    9. /* core */
    10. // std::cout << "id: " << (*iter1)->id_ << std::endl;
    11. if ((*iter1)->neighbors_.size() <= 1) {
    12. // delete this node from others' neighbor,从其他节点的邻居中删除此节点
    13. for (list::iterator iter2 = graph_.begin(); iter2 != graph_.end(); ++iter2) {
    14. for (vector::iterator it_nb = (*iter2)->neighbors_.begin();
    15. it_nb != (*iter2)->neighbors_.end(); ++it_nb) {
    16. if ((*it_nb)->id_ == (*iter1)->id_) {
    17. (*iter2)->neighbors_.erase(it_nb);
    18. break;
    19. }
    20. }
    21. }
    22. // delete this node from graph, restart checking
    23. //从图中删除此节点,重新开始检查
    24. graph_.erase(iter1);
    25. iter1 = graph_.begin();
    26. }
    27. }
    28. }
    29. }

    4、vector> TopologyPRM::searchPaths()

    通过深度优先搜索算法DFS,在节点图中搜索有用的路径,按节点数目对路径进行排序,选择节点数目较少的路径进行保留,并存储在raw_paths_中。

    1. vector> TopologyPRM::searchPaths() {
    2. //搜索路径
    3. raw_paths_.clear();
    4. vector visited;
    5. visited.push_back(graph_.front());
    6. depthFirstSearch(visited);
    7. // sort the path by node number,按节点数目对路径排序
    8. int min_node_num = 100000, max_node_num = 1;
    9. vectorint>> path_list(100);
    10. for (int i = 0; i < raw_paths_.size(); ++i) {
    11. if (int(raw_paths_[i].size()) > max_node_num) max_node_num = raw_paths_[i].size();
    12. if (int(raw_paths_[i].size()) < min_node_num) min_node_num = raw_paths_[i].size();
    13. path_list[int(raw_paths_[i].size())].push_back(i);
    14. }
    15. // select paths with less nodes,选择节点较少的路径
    16. vector> filter_raw_paths;
    17. for (int i = min_node_num; i <= max_node_num; ++i) {
    18. bool reach_max = false;
    19. for (int j = 0; j < path_list[i].size(); ++j) {
    20. filter_raw_paths.push_back(raw_paths_[path_list[i][j]]);
    21. if (filter_raw_paths.size() >= max_raw_path2_) {
    22. reach_max = true;
    23. break;
    24. }
    25. }
    26. if (reach_max) break;
    27. }
    28. std::cout << ", raw path num: " << raw_paths_.size() << ", " << filter_raw_paths.size();
    29. raw_paths_ = filter_raw_paths;
    30. return raw_paths_;
    31. }

    4.1深度优先搜索算法DFS:void TopologyPRM::depthFirstSearch()

    1. void TopologyPRM::depthFirstSearch(vector& vis) {
    2. //深度优先搜索
    3. GraphNode::Ptr cur = vis.back();
    4. for (int i = 0; i < cur->neighbors_.size(); ++i) {
    5. // check reach goal,检查目标
    6. if (cur->neighbors_[i]->id_ == 1) {
    7. // add this path to paths set,添加路径到路径集中
    8. vector path;
    9. for (int j = 0; j < vis.size(); ++j) {
    10. path.push_back(vis[j]->pos_);
    11. }
    12. path.push_back(cur->neighbors_[i]->pos_);
    13. raw_paths_.push_back(path);
    14. if (raw_paths_.size() >= max_raw_path_) return;
    15. break;
    16. }
    17. }
    18. for (int i = 0; i < cur->neighbors_.size(); ++i) {
    19. // skip reach goal,跳过目标点
    20. if (cur->neighbors_[i]->id_ == 1) continue;
    21. // skip already visited node,跳过已经访问过的节点
    22. bool revisit = false;
    23. for (int j = 0; j < vis.size(); ++j) {
    24. if (cur->neighbors_[i]->id_ == vis[j]->id_) {
    25. revisit = true;
    26. break;
    27. }
    28. }
    29. if (revisit) continue;
    30. // recursive search,保存搜索
    31. vis.push_back(cur->neighbors_[i]);
    32. depthFirstSearch(vis);
    33. if (raw_paths_.size() >= max_raw_path_) return;
    34. vis.pop_back();
    35. }
    36. }

    5、void TopologyPRM::shortcutPaths()

    将上一步保留的raw_paths_路径执行shortcutPath函数,对这些路径进行缩短。

    1. void TopologyPRM::shortcutPaths() {
    2. //得到经过排序筛选的原始路径后,还需要对这些路径进行缩短。
    3. //shortcutPaths这一函数利用利用了std::thread进行并行操作。
    4. //对每一条路径都执行shortcutPath函数,直到所有路径完成。即完成对所有路径的缩短
    5. short_paths_.resize(raw_paths_.size());
    6. if (parallel_shortcut_) {
    7. vector short_threads;
    8. for (int i = 0; i < raw_paths_.size(); ++i) {
    9. short_threads.push_back(thread(&TopologyPRM::shortcutPath, this, raw_paths_[i], i, 1));
    10. }
    11. for (int i = 0; i < raw_paths_.size(); ++i) {
    12. short_threads[i].join();
    13. }
    14. } else {
    15. for (int i = 0; i < raw_paths_.size(); ++i) shortcutPath(raw_paths_[i], i);
    16. }
    17. }

    5.1 void TopologyPRM::shortcutPath() 路径缩短

    对于一条待缩短的路径,首先利用discretizePath函数将其从几个节点变为更稠密的一系列路径点。然后创建 short_path来存储新的缩短后的路径。对于原始上的每一个点,都与short_path的最后一个点(初始化时为原始路径的起点)连线并利用lineVisb来衡量可见性。若不可见,则将线上不可见的点往外推至一个新的位置。推的方向与连线垂直并和ESDF梯度方共面。并把新的位置点push_back进short_path中。直到结束循环把终点Push_back进short_path中。最后判断当前short_path是否比原来的路径短,若短,则取代原来的路径,若不是,则保持不变。

    1. void TopologyPRM::shortcutPath(vector path, int path_id, int iter_num) {
    2. //对于一条待缩短的路径,首先利用discretizePath函数将其从几个节点变为更稠密的一系列路径点。
    3. //然后创建一个空的vectorEigen::Vector3d short_path来存储新的缩短后的路径。
    4. //对于原始上的每一个点,都与short_path的最后一个点(初始化时为原始路径的起点)连线
    5. //并利用lineVisb来衡量可见性。若不可见,则将线上不可见的点往外推至一个新的位置。
    6. //推的方向与连线垂直并和不可见点处的距离梯度方向面。
    7. //并把新的位置点push_back进short_path中。直到结束循环把终点Push_back进short_path中。
    8. //最后判断当前short_path是否比原来的路径短,若短,则取代原来的路径,若不是,则保持不变。
    9. vector short_path = path;//short_path来存储新的缩短后的路径
    10. vector last_path;
    11. for (int k = 0; k < iter_num; ++k) {
    12. last_path = short_path;//最后的路径为缩短后的路径
    13. vector dis_path = discretizePath(short_path);//离散化的路径
    14. if (dis_path.size() < 2) {
    15. short_paths_[path_id] = dis_path;
    16. return;
    17. }
    18. /* visibility path shortening */
    19. //可见性路径缩短
    20. Eigen::Vector3d colli_pt, grad, dir, push_dir;//障碍物位置、梯度、方向、推力方向
    21. double dist;//距离
    22. short_path.clear();
    23. short_path.push_back(dis_path.front());
    24. for (int i = 1; i < dis_path.size(); ++i) {
    25. if (lineVisib(short_path.back(), dis_path[i], resolution_, colli_pt, path_id)) continue;
    26. //对于离散路径上的每一个点,都与short_path的最后一个点(初始化时为原始路径的起点)连线
    27. edt_environment_->evaluateEDTWithGrad(colli_pt, -1, dist, grad);
    28. if (grad.norm() > 1e-3) {
    29. grad.normalize();//梯度
    30. dir = (dis_path[i] - short_path.back()).normalized();//方向
    31. push_dir = grad - grad.dot(dir) * dir;//推力方向
    32. //推的方向与连线垂直并和不可见点处的距离梯度方向面
    33. push_dir.normalize();
    34. colli_pt = colli_pt + resolution_ * push_dir;
    35. }
    36. short_path.push_back(colli_pt);//并把新的位置点push_back进short_path中。
    37. //直到结束循环把终点Push_back进short_path中。
    38. }
    39. short_path.push_back(dis_path.back());
    40. /* break if no shortcut */
    41. double len1 = pathLength(last_path);
    42. double len2 = pathLength(short_path);
    43. if (len2 > len1) {
    44. // ROS_WARN("pause shortcut, l1: %lf, l2: %lf, iter: %d", len1, len2, k +
    45. // 1);
    46. short_path = last_path;//最后判断当前short_path是否比原来的路径短
    47. //若短,则取代原来的路径,若不是,则保持不变。
    48. break;
    49. }
    50. }
    51. short_paths_[path_id] = short_path;//返回短路径
    52. }

    5.1.1 vector TopologyPRM::discretizeLine() 

    将整条轨迹从几个节点离散化为更稠密的一系列路径点。

    1. vector TopologyPRM::discretizePath(vector path) {
    2. //离散化路径
    3. vector dis_path, segment;
    4. if (path.size() < 2) {
    5. ROS_ERROR("what path? ");
    6. return dis_path;
    7. }
    8. for (int i = 0; i < path.size() - 1; ++i) {
    9. segment = discretizeLine(path[i], path[i + 1]);
    10. if (segment.size() < 1) continue;
    11. dis_path.insert(dis_path.end(), segment.begin(), segment.end());
    12. if (i != path.size() - 2) dis_path.pop_back();
    13. }
    14. return dis_path;
    15. }

    6、vector> TopologyPRM::pruneEquivalent()

    剪枝等效路径,原有路径集中的每一条路径与路径集中的路径进行比较,同伦的路径进行处理,有则不加入已存在路径且删去当前的路径,不同伦则进行保留,加入路径集。

    1. vector> TopologyPRM::pruneEquivalent(vector>& paths) {
    2. //剪枝等效路径
    3. //原有路径集中的每一条路径与路径集中的路径进行比较,
    4. //若同伦,则不加入已存在路径集且删去当前路径。若不同伦,则加入已存在路径集。
    5. vector> pruned_paths;//剪枝路径
    6. if (paths.size() < 1) return pruned_paths;//如果路径数目<1 返回该路径
    7. /* ---------- prune topo equivalent path ---------- */
    8. //修剪TOPO等效路径,同伦剪枝
    9. // output: pruned_paths
    10. vector<int> exist_paths_id;//存在的路径索引
    11. exist_paths_id.push_back(0);
    12. for (int i = 1; i < paths.size(); ++i) {
    13. // compare with exsit paths,对比存在的路径
    14. bool new_path = true;
    15. for (int j = 0; j < exist_paths_id.size(); ++j) {
    16. // compare with one path
    17. bool same_topo = sameTopoPath(paths[i], paths[exist_paths_id[j]], 0.0);
    18. if (same_topo) {
    19. new_path = false;
    20. break;
    21. }
    22. }
    23. if (new_path) {
    24. exist_paths_id.push_back(i);
    25. }
    26. }
    27. // save pruned paths,保存剪枝的路径
    28. for (int i = 0; i < exist_paths_id.size(); ++i) {
    29. pruned_paths.push_back(paths[exist_paths_id[i]]);
    30. }
    31. std::cout << ", pruned path num: " << pruned_paths.size();
    32. return pruned_paths;
    33. }

    7、vector> TopologyPRM::selectShortPaths()

    pruneEquivalent后的路径在进行筛选,筛出路径中最短的路径,shortest_path,将路径集中的其它路径与最短路径进行比较,产生一个长度比值,该比值小于一定阈值时,将该路径进行放入新的路径集中保留,直到达到最大路径数目或循环结束。

    1. vector> TopologyPRM::selectShortPaths(vector>& paths,
    2. int step) {
    3. //同伦剪枝后的函数还需要再进行一次筛选。
    4. //首先筛出所有路径中的最短路径。其次,循环地将除去最短路径集的剩余的路径中的最短路径与真正的最短路径进行比较,
    5. //若长度比值小于一定阈值,则可以将其加入新的路径集。直到达到最大路径数量或者循环结束。
    6. /* ---------- only reserve top short path ---------- */
    7. //仅仅保留最短的路径
    8. vector> short_paths;//短的路径(多条)
    9. vector short_path;//(最短的路径一条)
    10. double min_len;//最小的长度
    11. for (int i = 0; i < reserve_num_ && paths.size() > 0; ++i) {
    12. //直到达到最大路径数量或者循环结束
    13. int path_id = shortestPath(paths);//路径索引
    14. if (i == 0) {
    15. short_paths.push_back(paths[path_id]);//短路径集
    16. min_len = pathLength(paths[path_id]);//最小长度
    17. paths.erase(paths.begin() + path_id);//删除路径
    18. } else {
    19. double rat = pathLength(paths[path_id]) / min_len;//路径长度比值
    20. if (rat < ratio_to_short_) {//长度比值小于一定阈值,则可以将其加入新的路径集
    21. short_paths.push_back(paths[path_id]);
    22. paths.erase(paths.begin() + path_id);
    23. } else {
    24. break;
    25. }
    26. }
    27. }
    28. std::cout << ", select path num: " << short_paths.size();
    29. /* ---------- merge with start and end segment ---------- */
    30. for (int i = 0; i < short_paths.size(); ++i) {
    31. short_paths[i].insert(short_paths[i].begin(), start_pts_.begin(), start_pts_.end());
    32. short_paths[i].insert(short_paths[i].end(), end_pts_.begin(), end_pts_.end());
    33. }
    34. for (int i = 0; i < short_paths.size(); ++i) {
    35. shortcutPath(short_paths[i], i, 5);
    36. short_paths[i] = short_paths_[i];
    37. }
    38. short_paths = pruneEquivalent(short_paths);//并再做一遍shortcutPath和pruneEquivalent得到最终路径。
    39. return short_paths;
    40. }

  • 相关阅读:
    民安智库(第三方市场调查公司)企业如何开展员工满意度调查
    Win11快捷复制粘贴不能用怎么办?Win11快捷复制粘贴不能用
    【Web基础】Web应用体系结构 — 容器 + MVC设计模式
    mongoose 搭建 http 服务 -- 编译
    Docker开放远程安全访问(开启2376端口和CA认证)
    LoRa技术的常见应用有哪些?
    基于Python的车牌识别系统实现
    【K210+ESP8266图传上位机开发】TCP server + JPEG图像解析上位机开发
    IntelliJ IDEA - Github Copilot Waiting for Authorization [一篇必解决]
    可变参数~
  • 原文地址:https://blog.csdn.net/weixin_45868890/article/details/126090236