(六)学习笔记autoware源码core_planning(lane_navi)

#include <sstream>

#include <ros/console.h>
#include <tf/transform_datatypes.h>

#include <vector_map/vector_map.h>
#include "autoware_msgs/LaneArray.h"

#include "lane_planner/lane_planner_vmap.hpp"

namespace {

int waypoint_max;
double search_radius; // meter
double velocity; // km/h
std::string frame_id;
std::string output_file;

ros::Publisher waypoint_pub;

//lane_planner::vmap::VectorMap数据类型用于储存决策规划所需要的部分矢量地图要素数据。
lane_planner::vmap::VectorMap all_vmap;
lane_planner::vmap::VectorMap lane_vmap;
tablet_socket_msgs::route_cmd cached_route;

std::vector<std::string> split(const std::string& str, char delim)
{
  std::stringstream ss(str);
  std::string s;
  std::vector<std::string> vec;
  while (std::getline(ss, s, delim))
    vec.push_back(s);

  if (!str.empty() && str.back() == delim)
    vec.push_back(std::string());

  return vec;
}

std::string join(const std::vector<std::string>& vec, char delim)
{
  std::string str;
  for (size_t i = 0; i < vec.size(); ++i) {
    str += vec[i];
    if (i != (vec.size() - 1))
      str += delim;
  }

  return str;
}


//count_lane函数返回传入函数的矢量地图 vmap中的最大车道数。
int count_lane(const lane_planner::vmap::VectorMap& vmap)
{
  int lcnt = -1;

  for (const vector_map::Lane& l : vmap.lanes) {
    if (l.lcnt > lcnt)// l.lcnt是 Lane 1的车道数
      lcnt = l.lcnt;
  }

  return lcnt;//返回的是矢量地图vmap中各个Lane 中的最大车道数
}

//create_waypoint 函数是话题"/route_cmd"的回调函数。
void create_waypoint(const tablet_socket_msgs::route_cmd& msg)
{
  std_msgs::Header header;
  header.stamp = ros::Time::now();
  header.frame_id = frame_id;

  if (all_vmap.points.empty() || all_vmap.lanes.empty() || all_vmap.nodes.empty()) {
    cached_route.header = header;
    cached_route.point = msg.point;
    return;
  }

/*coarse_vmap是根据传入create_coarse_vmap_from_route函数的route_cmd msg构建而得的,
是只包含无人车预计要经过的Point数据的粗略地图。其被当作一个粗略的导航用以在信息更完备的针对整个路网的
矢量地图lane_vmap中找到对应的轨迹点Point和道路Lane构建更完善的导航地图*/
  lane_planner::vmap::VectorMap coarse_vmap = lane_planner::vmap::create_coarse_vmap_from_route(msg);
  if (coarse_vmap.points.size() < 2)
    return;

  std::vector<lane_planner::vmap::VectorMap> fine_vmaps;

/*
根据只有轨迹点的导航地图coarse_vmap从整个路网地图lane_vmap中搜寻信息
构建信息完备的导航地图fine_mostleft_vmap(包括轨迹点,道路,道路限速曲率等信息)
*/
  lane_planner::vmap::VectorMap fine_mostleft_vmap =
    lane_planner::vmap::create_fine_vmap(lane_vmap, lane_planner::vmap::LNO_MOSTLEFT, coarse_vmap,
                 search_radius, waypoint_max);
  if (fine_mostleft_vmap.points.size() < 2)
    return;
  fine_vmaps.push_back(fine_mostleft_vmap);


/*
count_lane函数返回传入函数的矢量地图fine_mostleft_vmap中的最大车道数
*/
  int lcnt = count_lane(fine_mostleft_vmap);

  /*下面的for循环补充完善fine_vmaps,往里面添加以其他车道编号为基准寻找后续Lane 的导航地图*/
  for (int i = lane_planner::vmap::LNO_MOSTLEFT + 1; i <= lcnt; ++i) {
    lane_planner::vmap::VectorMap v =
      lane_planner::vmap::create_fine_vmap(lane_vmap, i, coarse_vmap, search_radius, waypoint_max);
    if (v.points.size() < 2)
      continue;
    fine_vmaps.push_back(v);
  }

//下面从fine_vmaps中读取信息构建lane_waypoint
  autoware_msgs::LaneArray lane_waypoint;
  for (const lane_planner::vmap::VectorMap& v : fine_vmaps) {
    autoware_msgs::Lane l;
    l.header = header;
    l.increment = 1;

    size_t last_index = v.points.size() - 1;
    for (size_t i = 0; i < v.points.size(); ++i) {
      double yaw;
      if (i == last_index) {
        geometry_msgs::Point p1 =
          lane_planner::vmap::create_geometry_msgs_point(v.points[i]);
        geometry_msgs::Point p2 =
          lane_planner::vmap::create_geometry_msgs_point(v.points[i - 1]);
        yaw = atan2(p2.y - p1.y, p2.x - p1.x);
        yaw -= M_PI;
      } else {
        geometry_msgs::Point p1 =
          lane_planner::vmap::create_geometry_msgs_point(v.points[i]);
        geometry_msgs::Point p2 =
          lane_planner::vmap::create_geometry_msgs_point(v.points[i + 1]);
        yaw = atan2(p2.y - p1.y, p2.x - p1.x);
      }

      autoware_msgs::Waypoint w;
      w.pose.header = header;
      w.pose.pose.position = lane_planner::vmap::create_geometry_msgs_point(v.points[i]);
      w.pose.pose.orientation = tf::createQuaternionMsgFromYaw(yaw);
      w.twist.header = header;
      w.twist.twist.linear.x = velocity / 3.6; // to m/s
      l.waypoints.push_back(w);
    }
    lane_waypoint.lanes.push_back(l);
  }
  waypoint_pub.publish(lane_waypoint);

/*在话题"/ lane_waypoints_array"发布lane_waypointwaypoint_pub .publish(lane_waypoint);*/
  for (size_t i = 0; i < fine_vmaps.size(); ++i) {
    std::stringstream ss;
    ss << "_" << i;

    std::vector<std::string> v1 = split(output_file, '/');
    std::vector<std::string> v2 = split(v1.back(), '.');
    v2[0] = v2.front() + ss.str();
    v1[v1.size() - 1] = join(v2, '.');
    std::string path = join(v1, '/');

    lane_planner::vmap::write_waypoints(fine_vmaps[i].points, velocity, path);
  }
}

/*
update_values函数被cache_point,cache_lane和 cache_node这三个回调函数调用,
用以在接收到数据时更新lane_vmap,当然要保证 all_vmap中的points,lanes和nodes数据皆完备才可以根据
all_vmap去生成新的lane_vmap。接着如果接收到了路径规划的数据(cached_route.point存在数据),
则根据cached_route创建导航轨迹点。随后清除已被使用的cached_route.point数据。
*/
void update_values()
{
  if (all_vmap.points.empty() || all_vmap.lanes.empty() || all_vmap.nodes.empty())
    return;

// lane_vmap是vectorMap类型数据,与all_vmap一致,并且lane_planner : : vmap : :LNO_ALL=-1
  lane_vmap = lane_planner::vmap::create_lane_vmap(all_vmap, lane_planner::vmap::LNO_ALL);

  if (!cached_route.point.empty()) {
    create_waypoint(cached_route);
    cached_route.point.clear();
    cached_route.point.shrink_to_fit();
  }
}



/*
cache_point,cache_lane 和 cache_node函数分别是对应于话题"/vector_map_info/point" ,"/vector_map_info/lane"
和"/vector_map_info/node"的回调函数,更新all_vmap中对应值。函数内all_vmap 
 的数据类型是lane_planner::vmap::VectorMap。
*/
void cache_point(const vector_map::PointArray& msg)
{
  all_vmap.points = msg.data;
  update_values();
}

void cache_lane(const vector_map::LaneArray& msg)
{
  all_vmap.lanes = msg.data;
  update_values();
}

void cache_node(const vector_map::NodeArray& msg)
{
  all_vmap.nodes = msg.data;
  update_values();
}

} // namespace


//首先是其main函数,main函数在lane_navi.cpp中。首先设置了一些参数,接着设置发布者和监听者。
int main(int argc, char **argv)
{
  ros::init(argc, argv, "lane_navi");

  ros::NodeHandle n;

  int sub_vmap_queue_size;
  n.param<int>("/lane_navi/sub_vmap_queue_size", sub_vmap_queue_size, 1);
  int sub_route_queue_size;
  n.param<int>("/lane_navi/sub_route_queue_size", sub_route_queue_size, 1);
  int pub_waypoint_queue_size;
  n.param<int>("/lane_navi/pub_waypoint_queue_size", pub_waypoint_queue_size, 1);
  bool pub_waypoint_latch;
  n.param<bool>("/lane_navi/pub_waypoint_latch", pub_waypoint_latch, true);

  n.param<int>("/lane_navi/waypoint_max", waypoint_max, 10000);//点的最大数目
  n.param<double>("/lane_navi/search_radius", search_radius, 10);//默认搜索半径
  n.param<double>("/lane_navi/velocity", velocity, 40);//默认速度
  n.param<std::string>("/lane_navi/frame_id", frame_id, "map");//id
  n.param<std::string>("/lane_navi/output_file", output_file, "/tmp/lane_waypoint.csv");//输出的文件名 
//上面为设置的一些参数



  if (output_file.empty()) {
    ROS_ERROR_STREAM("output filename is empty");
    return EXIT_FAILURE;
  }
  if (output_file.back() == '/') {
    ROS_ERROR_STREAM(output_file << " is directory");
    return EXIT_FAILURE;
  }

  waypoint_pub = n.advertise<autoware_msgs::LaneArray>("/lane_waypoints_array", pub_waypoint_queue_size,
                 pub_waypoint_latch);


//订阅一些节点信息
  ros::Subscriber route_sub = n.subscribe("/route_cmd", sub_route_queue_size, create_waypoint);
  ros::Subscriber point_sub = n.subscribe("/vector_map_info/point", sub_vmap_queue_size, cache_point);
  ros::Subscriber lane_sub = n.subscribe("/vector_map_info/lane", sub_vmap_queue_size, cache_lane);
  ros::Subscriber node_sub = n.subscribe("/vector_map_info/node", sub_vmap_queue_size, cache_node);

  ros::spin();

  return EXIT_SUCCESS;
}

参考书目《Autoware与自动驾驶技术》

注:可以下载Visual Studio Coded代码编辑软件,展示性好点。

  • 1
    点赞
  • 3
    收藏
    觉得还不错? 一键收藏
  • 0
    评论

“相关推荐”对你有帮助么?

  • 非常没帮助
  • 没帮助
  • 一般
  • 有帮助
  • 非常有帮助
提交
评论
添加红包

请填写红包祝福语或标题

红包个数最小为10个

红包金额最低5元

当前余额3.43前往充值 >
需支付:10.00
成就一亿技术人!
领取后你会自动成为博主和红包主的粉丝 规则
hope_wisdom
发出的红包
实付
使用余额支付
点击重新获取
扫码支付
钱包余额 0

抵扣说明:

1.余额是钱包充值的虚拟货币,按照1:1的比例进行支付金额的抵扣。
2.余额无法直接购买下载,可以购买VIP、付费专栏及课程。

余额充值