参考:
https://blog.csdn.net/roadseek_zw/article/details/53316177
https://blog.csdn.net/liuyanpeng12333/article/details/81946841
https://blog.csdn.net/weixin_42232742/article/details/82427801
https://blog.csdn.net/u013019296/article/details/78577268
https://blog.csdn.net/weixin_40863346/article/details/88870663
https://blog.csdn.net/weixin_42048023/article/details/85620544
https://cxx0822.github.io/2020/05/05/gmapping-suan-fa-yuan-li-ji-yuan-dai-ma-jie-xi/
https://www.cnblogs.com/xgth/p/13991651.html
https://blog.csdn.net/c417469898/article/details/106566148
https://zhuanlan.zhihu.com/p/85946393
version
2021年12月19日 更新第一部分
这篇博客以程序运行、调用顺序角度对函数进行分析 理解,第一次接触难免有错,欢迎指正。
首先唠叨两句,Gmapping 是目前广泛运用的建图算法之一,至于如何建图其实操作比较简单,配置完成参数后直接运行 gmapping.launch(网上一搜一箩筐)加载参数并运行 gmapping 节点,然后通过手柄 joystick_drivers
或者键盘 turtlebot_teleop
等控制机器人移动建立地图。它主要是利用粒子滤波原理进行实时定位再利用固定路径下的栅格地图建图方法建立占用栅格地图。至于参数配置在后期代码分析中会提到。
其次说一下 slam_gmapping 包与 openslam_gmapping 包的关系,slam_gmapping 是 openslam_gmapping 在 ros 下的二次封装,你可以直接用这个包,而真正的核心代码实现都在 openslam_gmapping 里面。如果使用 apt 工具安装的是 ros-
版本,那么openslam_gmapping
会自动安装到/opt/ros/
目录中,但其中不包含源码,无法查看 openslam 中函数定义。因此可以手动下载源码 ,手动进行编译、source,方便使用编辑器进行调用查看。
最后开始查看 gmapping 源码,从 CMakeLists.txt 中 add_executable(slam_gmapping src/main.cpp src/slam_gmapping.cpp)
可以知道 slam_gmapping.cpp 和 main.cpp 的源文件生成的该节点。因此从 init ros 的 main 函数开始读起。
1. 进入代码,先用 understand 软件看看 main 函数主要代码的调用关系。
由上图调用关系可以明显看出 main 函数直接调用三个函数:SlamGMaping
构造函数、startLiveSlam
函数、~SlamGMapping
析构函数,主要功能的实现是在 startLiveSlam 部分。析构函数不做说明,接下来会对构造函数和 startLiveSlam 函数源码做详细分析。
2. 从 main 函数开始读起
int main(int argc, char** argv)
{
ros::init(argc, argv, "slam_gmapping");
SlamGMapping gn; // code 1_1
gn.startLiveSlam(); // code 1_2
ros::spin();
return(0);
}
2.1 SlamGMapping gn; (code 1_1)
首先,创建 SlamGMapping 类对象 gn,程序运行时首先运行 SlamGMapping 类构造函数;
SlamGMapping();
SlamGMapping(ros::NodeHandle& nh, ros::NodeHandle& pnh);
SlamGMapping(unsigned long int seed, unsigned long int max_duration_buffer);
其中,构造函数被重载,这里不做深入研究,每个重载均有调用成员函数 init()
。本程序调用无参构造函数 SlamGMapping();
SlamGMapping::SlamGMapping():map_to_odom_(tf::Transform(tf::createQuaternionFromRPY(0, 0, 0), tf::Point(0, 0, 0))),laser_count_(0), private_nh_("~"), scan_filter_sub_(NULL), scan_filter_(NULL), transform_thread_(NULL) // Part A
{
seed_ = time(NULL); // Part B
init(); // Part C
}
Part A. 初始化成员变量列表:
map_to_odom_(tf::Transform(tf::createQuaternionFromRPY(0, 0, 0), tf::Point(0, 0, 0)))
从 RPY–>quaternionlaser_count_(0)
激光雷达数据计数,用于限制处理激光的间隔 Stepprivate_nh_("~")
私有句柄scan_filter_sub_(NULL)
激光雷达订阅scan_filter_(NULL)
激光雷达滤波器transform_thread_(NULL)
tf 变换线程Part B. seed_ = time(NULL);
随机种子 供后期高斯采样使用,time(NULL) 作为 srand 函数的参数,产生不同的随机数序列。
// Call the sampling function once to set the seed.
GMapping::sampleGaussian(1,seed_);
double sampleGaussian(double sigma, unsigned long int S) {
/*
static gsl_rng * r = NULL;
if(r==NULL) {
gsl_rng_env_setup();
r = gsl_rng_alloc (gsl_rng_default);
}
*/
if (S!=0) {
//gsl_rng_set(r, S);
srand48(S);
}
if (sigma==0)
return 0;
//return gsl_ran_gaussian (r,sigma);
return pf_ran_gaussian (sigma);
}
Part C. init();
gsp_ = new GMapping::GridSlamProcessor();
GMapping 为命名空间,GridSlamProcessor 为类名称,构建 gsp_ 类对象,在这里可以初始化类参数。重要的参数 period_= 5.0
,其余参数赋值,initMapper
中会重新赋值。
// openslam_gmapping/gridfastslam/gridslamprocessor.cpp GridSlamProcessor构造函数
GridSlamProcessor::GridSlamProcessor(): m_infoStream(cout) {
period_ = 5.0;
m_obsSigmaGain=1;
m_resampleThreshold=0.5;
m_minimumScore=0.;
}
tfB_ = new tf::TransformBroadcaster();
定义 tfB 变量,用于发布 map–>odom tf 关系
got_first_scan_ = false;
初始化成员变量为 false,用于地图初始化限制,直到获取到第一帧激光数据才进行地图初始化
gmapping 参数获取以及初始化如下
>
> <!-- laser的topic名称,与自己的激光topic对应 -->
> <!-- 启动slam的节点 -->
<!-- 1. Laser Parameters scanMatchingParameters setMotionModelParameters -->
> <!-- 很重要,判断scanmatch是否成功的阈值,过高的话会使scanmatch失败,从而影响地图更新速率. minimum score for considering the outcome of the scanmatching good. Can avoid 'jumping' pose estimates in large open spaces when using laser scanners with limited range (e.g. 5m). (0 = default. Scores go up to 600+, try 50 for example when experiencing 'jumping' estimate issues) -->
<!-- 2. Motion Model Parameters (all standard deviations of a gaussian noise model) -->
<!-- 3. Others -->
-1.0"/>
<!--
-50.0"/>
-50.0"/>
>
>
make the starting size small for the benefit of the Android client's memory...
-->
<!-- 4. Initial map dimensions and resolution -->
<!-- 5. Likelihood sampling (used in scan matching) -->
>
>
需要关注的两个参数:
particles (int, default: 30) gmapping 算法中的粒子数,因为 gmapping 使用的是粒子滤波算法,粒子在不断地迭代更新,所以选取一个合适的粒子数可以让算法在保证比较准确的同时有较高的速度。
minimumScore (float, default: 0.0) 最小匹配得分,这个参数很重要,它决定了对激光的一个置信度,越高说明对激光匹配算法的要求越高,激光的匹配也越容易失败而转去使用里程计数据,而设的太低又会使地图中出现大量噪声,所以需要权衡调整。
2.2 gn.startLiveSlam(); (code 1_2)
void SlamGMapping::startLiveSlam()
{
// Part B. -------------------------------------------------------------------
entropy_publisher_ = private_nh_.advertise<std_msgs::Float64>("entropy", 1, true);
sst_ = node_.advertise<nav_msgs::OccupancyGrid>("map", 1, true);
sstm_ = node_.advertise<nav_msgs::MapMetaData>("map_metadata", 1, true);
ss_ = node_.advertiseService("dynamic_map", &SlamGMapping::mapCallback, this);
// Part C. -------------------------------------------------------------------
scan_filter_sub_ = new message_filters::Subscriber<sensor_msgs::LaserScan>(node_, "scan", 5);
scan_filter_ = new tf::MessageFilter<sensor_msgs::LaserScan>(*scan_filter_sub_, tf_, odom_frame_, 5);
scan_filter_->registerCallback(boost::bind(&SlamGMapping::laserCallback, this, _1));
// Part A. -------------------------------------------------------------------
transform_thread_ = new boost::thread(boost::bind(&SlamGMapping::publishLoop, this, transform_publish_period_));
}
整个函数如上,这个函数发布的话题有信息熵、地图以及地图的详细栅格信息(Metadata),订阅的话题有 scan。另外,创建了一个新线程 transform_thread_,在固定时刻发布 odom 到 map 的 tf 变换,也在不停地纠正里程计提供的位置。接下来分段解析。
Part A. 先拿简单的 transform_thread_ 说起:
transform_thread_ = new boost::thread(boost::bind(&SlamGMapping::publishLoop, this, transform_publish_period_));
使用 boost::bind
创建线程调用成员函数 publishLoop
, 从而定频调用函数 publishTransform
发布 map --> odom 的 tf 变换,时间间隔 transform_publish_period_
默认 0.05s。添加 boost::mutex 线程互斥锁防止共享 tf 数据的读写问题。map–>odom 的 tf 实时修正更新是在 laserCallback
中进行。map_to_odom_ = (odom_to_laser * laser_to_map).inverse();
Part B. 发布话题服务
entropy_publisher_ = private_nh_.advertise<std_msgs::Float64>("entropy", 1, true);
sst_ = node_.advertise<nav_msgs::OccupancyGrid>("map", 1, true);
sstm_ = node_.advertise<nav_msgs::MapMetaData>("map_metadata", 1, true);
ss_ = node_.advertiseService("dynamic_map", &SlamGMapping::mapCallback, this);
Part C. 激光数据处理
scan_filter_sub_ = new message_filters::Subscriber<sensor_msgs::LaserScan>(node_, "scan", 5);
scan_filter_ = new tf::MessageFilter<sensor_msgs::LaserScan>(*scan_filter_sub_, tf_, odom_frame_, 5);
scan_filter_->registerCallback(boost::bind(&SlamGMapping::laserCallback, this, _1));
最麻烦也是最重要的部分,tf::MessageFilter 可以订阅任何的 ROS 消息,然后将其缓存,直到这些消息可以转换到目标坐标系,然后进行相应的处理(一般在回调函数中处理),说白了就是激光消息订阅+坐标转换处理(回调函数 laserCallback
)。当 message_filters::Subscriber 的消息能够由 tf 转换到目标坐标系时,调用回调函数,回调函数由 tf::MessageFilter::registerCallback() 进行注册。
2.3 laserCallback
接下来介绍核心部分 laserCallback 函数。
void SlamGMapping::laserCallback(const sensor_msgs::LaserScan::ConstPtr& scan)
{
// Part A. -------------------------------------------------------------------
laser_count_++;
if ((laser_count_ % throttle_scans_) != 0)
return;
/*
* 以上三行 laser_count_++ 进行 laser data 的计数,自增处理;
* throttle_scans_ 为每隔多少次处理一次激光雷达数据(设大跳过更多的扫描数据),默认为1(全处理)。
* 此条件语句为了限制激光数据处理频率,起到限流作用。
*/
// Part B. -------------------------------------------------------------------
static ros::Time last_map_update(0,0);
// We can't initialize the mapper until we've got the first scan
if(!got_first_scan_)
{
/*
* 首次获取 scan 数据,调用 initMapper 函数进行一些重要参数的初始化,将 slam 里的参数传递给 openslam,
* 设定坐标系,坐标原点,以及采样函数随机种子的初始化,等等,
* 里面还调用了 GridSlamProcessor::init,这个初始化了粒子数,子地图大小
*/
if(!initMapper(*scan))
return;
got_first_scan_ = true;
}
// Part C. -------------------------------------------------------------------
GMapping::OrientedPoint odom_pose;
if(addScan(*scan, odom_pose))
{
ROS_DEBUG("scan processed");
GMapping::OrientedPoint mpose = gsp_->getParticles()[gsp_->getBestParticleIndex()].pose;
ROS_DEBUG("new best pose: %.3f %.3f %.3f", mpose.x, mpose.y, mpose.theta);
ROS_DEBUG("odom pose: %.3f %.3f %.3f", odom_pose.x, odom_pose.y, odom_pose.theta);
ROS_DEBUG("correction: %.3f %.3f %.3f", mpose.x - odom_pose.x, mpose.y - odom_pose.y, mpose.theta - odom_pose.theta);
tf::Transform laser_to_map = tf::Transform(tf::createQuaternionFromRPY(0, 0, mpose.theta), tf::Vector3(mpose.x, mpose.y, 0.0)).inverse();
tf::Transform odom_to_laser = tf::Transform(tf::createQuaternionFromRPY(0, 0, odom_pose.theta), tf::Vector3(odom_pose.x, odom_pose.y, 0.0));
map_to_odom_mutex_.lock();
map_to_odom_ = (odom_to_laser * laser_to_map).inverse();
map_to_odom_mutex_.unlock();
if(!got_map_ || (scan->header.stamp - last_map_update) > map_update_interval_)
{
updateMap(*scan);
last_map_update = scan->header.stamp;
ROS_DEBUG("Updated the map");
}
} else
ROS_DEBUG("cannot process scan");
}
Part A. 激光数据限流
laser_count_++;
if ((laser_count_ % throttle_scans_) != 0)
return;
前三行如上,laser_count_++
进行 laser data 的自增计数;throttle_scans_
为每隔多少次处理一次激光雷达数据(设大跳过更多的扫描数据),默认为1(全处理)。此条件语句在此为了限制激光数据处理频率,起到限流作用,为了使激光雷达数据每隔若干帧进行计算。
static ros::Time last_map_update(0,0);
// We can't initialize the mapper until we've got the first scan
if (!got_first_scan_)
{
/*
* 首次获取 scan 数据,调用 initMapper 函数进行一些重要参数的初始化,将 slam 里的参数传递给 openslam,
* 设定坐标系,坐标原点,以及采样函数随机种子的初始化,等等,
* 里面还调用了 GridSlamProcessor::init,这个初始化了粒子数,子地图大小
*/
if (!initMapper(*scan))
return;
got_first_scan_ = true;
}
当获取到第一帧激光数据后初始化 mapper,其中包括一些重要参数的初始化等;具体 initMapper
函数如下:
bool SlamGMapping::initMapper(const sensor_msgs::LaserScan& scan)
{
// Part B1. -------------------------------------------------------------------
laser_frame_ = scan.header.frame_id;
// Get the laser's pose, relative to base. laer在base_link下的位置
tf::Stamped<tf::Pose> ident;
tf::Stamped<tf::Transform> laser_pose;
ident.setIdentity();
ident.frame_id_ = laser_frame_;
ident.stamp_ = scan.header.stamp;
try {
tf_.transformPose(base_frame_, ident, laser_pose);
// ROS_INFO("init map. laser_pose: %f, %f, %f", laser_pose.getOrigin().x(), laser_pose.getOrigin().y(), laser_pose.getOrigin().z());
} catch(tf::TransformException e) {
ROS_WARN("Failed to compute laser pose, aborting initialization (%s)", e.what());
return false;
}
// Part B2. ------------------------------------------------------------------
// create a point 1m above the laser position and transform it into the laser-frame
tf::Vector3 v;
v.setValue(0, 0, 1 + laser_pose.getOrigin().z());
tf::Stamped<tf::Vector3> up(v, scan.header.stamp, base_frame_);
try {
tf_.transformPoint(laser_frame_, up, up);
ROS_DEBUG("Z-Axis in sensor frame: %.3f", up.z());
} catch(tf::TransformException& e) {
ROS_WARN("Unable to determine orientation of laser: %s", e.what());
return false;
}
// gmapping doesnt take roll or pitch into account. So check for correct sensor alignment.
if (fabs(fabs(up.z()) - 1) > 0.001) {
ROS_WARN("Laser has to be mounted planar! Z-coordinate has to be 1 or -1, but gave: %.5f", up.z());
return false;
}
gsp_laser_beam_count_ = scan.ranges.size();
double angle_center = (scan.angle_min + scan.angle_max)/2;
if (up.z() > 0) {
do_reverse_range_ = scan.angle_min > scan.angle_max;
centered_laser_pose_ = tf::Stamped<tf::Pose>(tf::Transform(tf::createQuaternionFromRPY(0,0,angle_center), tf::Vector3(0,0,0)), ros::Time::now(), laser_frame_);
ROS_INFO("Laser is mounted upwards.");
} else {
do_reverse_range_ = scan.angle_min < scan.angle_max;
centered_laser_pose_ = tf::Stamped<tf::Pose>(tf::Transform(tf::createQuaternionFromRPY(M_PI,0,-angle_center), tf::Vector3(0,0,0)), ros::Time::now(), laser_frame_);
ROS_INFO("Laser is mounted upside down.");
}
// Compute the angles of the laser from -x to x, basically symmetric and in increasing order
laser_angles_.resize(scan.ranges.size());
// Make sure angles are started so that they are centered
double theta = - std::fabs(scan.angle_min - scan.angle_max)/2;
for(unsigned int i=0; i<scan.ranges.size(); ++i)
{
laser_angles_[i]=theta;
theta += std::fabs(scan.angle_increment);
}
ROS_DEBUG("Laser angles in laser-frame: min: %.3f max: %.3f inc: %.3f", scan.angle_min, scan.angle_max, scan.angle_increment);
ROS_DEBUG("Laser angles in top-down centered laser-frame: min: %.3f max: %.3f inc: %.3f", laser_angles_.front(), laser_angles_.back(), std::fabs(scan.angle_increment));
// Part B3. ------------------------------------------------------------------
GMapping::OrientedPoint gmap_pose(0, 0, 0);
// setting maxRange and maxUrange here so we can set a reasonable default
ros::NodeHandle private_nh_("~");
if(!private_nh_.getParam("maxRange", maxRange_))
maxRange_ = scan.range_max - 0.01;
if(!private_nh_.getParam("maxUrange", maxUrange_))
maxUrange_ = maxRange_;
// The laser must be called "FLASER".
// We pass in the absolute value of the computed angle increment, on the
// assumption that GMapping requires a positive angle increment. If the
// actual increment is negative, we'll swap the order of ranges before
// feeding each scan to GMapping.
gsp_laser_ = new GMapping::RangeSensor("FLASER", gsp_laser_beam_count_, fabs(scan.angle_increment), gmap_pose, 0.0, maxRange_);
ROS_ASSERT(gsp_laser_);
GMapping::SensorMap smap;
smap.insert(make_pair(gsp_laser_->getName(), gsp_laser_)); // 将”FLASER"写入gsp_laser_
gsp_->setSensorMap(smap);
gsp_odom_ = new GMapping::OdometrySensor(odom_frame_);
ROS_ASSERT(gsp_odom_);
/// @todo Expose setting an initial pose
GMapping::OrientedPoint initialPose;
if(!getOdomPose(initialPose, scan.header.stamp))
{
ROS_WARN("Unable to determine inital pose of laser! Starting point will be set to zero.");
initialPose = GMapping::OrientedPoint(0.0, 0.0, 0.0);
}
gsp_->setMatchingParameters(maxUrange_, maxRange_, sigma_, kernelSize_, lstep_, astep_, iterations_, lsigma_, ogain_, lskip_);
gsp_->setMotionModelParameters(srr_, srt_, str_, stt_);
gsp_->setUpdateDistances(linearUpdate_, angularUpdate_, resampleThreshold_);
gsp_->setUpdatePeriod(temporalUpdate_);
gsp_->setgenerateMap(false);
gsp_->GridSlamProcessor::init(particles_, xmin_, ymin_, xmax_, ymax_, delta_, initialPose);
gsp_->setllsamplerange(llsamplerange_);
gsp_->setllsamplestep(llsamplestep_);
/// @todo Check these calls; in the gmapping gui, they use
/// llsamplestep and llsamplerange intead of lasamplestep and
/// lasamplerange. It was probably a typo, but who knows.
gsp_->setlasamplerange(lasamplerange_);
gsp_->setlasamplestep(lasamplestep_);
gsp_->setminimumScore(minimum_score_);
// Call the sampling function once to set the seed.
GMapping::sampleGaussian(1,seed_);
ROS_INFO("Initialization complete");
return true;
}
Part B1. 通过 tf 获取激光在 base 坐标系下的静态位置信息,通过 ROS_INFO 可以打印比对。
laser_frame_ = scan.header.frame_id;
// Get the laser's pose, relative to base. laser在base_link下的位置
tf::Stamped<tf::Pose> ident;
tf::Stamped<tf::Transform> laser_pose;
ident.setIdentity();
ident.frame_id_ = laser_frame_;
ident.stamp_ = scan.header.stamp;
try {
tf_.transformPose(base_frame_, ident, laser_pose);
// ROS_INFO("init map. laser_pose: %f, %f, %f", laser_pose.getOrigin().x(), laser_pose.getOrigin().y(), laser_pose.getOrigin().z());
} catch(tf::TransformException e) {
ROS_WARN("Failed to compute laser pose, aborting initialization (%s)", e.what());
return false;
}
Part B2. 激光安装判断
// create a point 1m above the laser position and transform it into the laser-frame
tf::Vector3 v;
v.setValue(0, 0, 1 + laser_pose.getOrigin().z());
tf::Stamped<tf::Vector3> up(v, scan.header.stamp, base_frame_);
try {
tf_.transformPoint(laser_frame_, up, up);
ROS_DEBUG("Z-Axis in sensor frame: %.3f", up.z());
} catch(tf::TransformException& e) {
ROS_WARN("Unable to determine orientation of laser: %s", e.what());
return false;
}
// 判断激光是否水平安装
// gmapping doesnt take roll or pitch into account. So check for correct sensor alignment.
if (fabs(fabs(up.z()) - 1) > 0.001) {
ROS_WARN("Laser has to be mounted planar! Z-coordinate has to be 1 or -1, but gave: %.5f", up.z());
return false;
}
// 判断激光安装方向,是z向上还是z向下
gsp_laser_beam_count_ = scan.ranges.size();
double angle_center = (scan.angle_min + scan.angle_max)/2;
if (up.z() > 0) {
do_reverse_range_ = scan.angle_min > scan.angle_max;
centered_laser_pose_ = tf::Stamped<tf::Pose>(tf::Transform(tf::createQuaternionFromRPY(0,0,angle_center), tf::Vector3(0,0,0)), ros::Time::now(), laser_frame_);
ROS_INFO("Laser is mounted upwards.");
} else {
do_reverse_range_ = scan.angle_min < scan.angle_max;
centered_laser_pose_ = tf::Stamped<tf::Pose>(tf::Transform(tf::createQuaternionFromRPY(M_PI,0,-angle_center), tf::Vector3(0,0,0)), ros::Time::now(), laser_frame_);
ROS_INFO("Laser is mounted upside down.");
}
// Compute the angles of the laser from -x to x, basically symmetric and in increasing order 激光角度数据格式处理 (-x, x) 对称,递增
laser_angles_.resize(scan.ranges.size());
// Make sure angles are started so that they are centered
double theta = - std::fabs(scan.angle_min - scan.angle_max)/2;
for(unsigned int i=0; i<scan.ranges.size(); ++i)
{
laser_angles_[i]=theta;
theta += std::fabs(scan.angle_increment);
}
ROS_DEBUG("Laser angles in laser-frame: min: %.3f max: %.3f inc: %.3f", scan.angle_min, scan.angle_max, scan.angle_increment);
ROS_DEBUG("Laser angles in top-down centered laser-frame: min: %.3f max: %.3f inc: %.3f", laser_angles_.front(), laser_angles_.back(), std::fabs(scan.angle_increment));
在 base 坐标系原点创建一个新点位,点位 z 轴值为激光高度+1m,计算此点位位置在激光坐标系下坐标。创建新点位的原因一是 gmapping 不考虑横滚、俯仰的问题,所以需要检查实际安装的激光是否水平,与 base 坐标系是否不存在横滚、俯仰角度。若水平安装,其实在 base 坐标系下激光 z+1,与激光坐标系下+1的值是相等的。原因二是为了判断激光安装方向。
这段代码激光数据进行简单处理,判断激光安装姿态(只考虑 yaw,不考虑 roll pitch,所以需要水平安装),判断了 Z 轴方向(up or down),并将激光数据搞成规则的最小、最大、中间开始的数据。其中重要的是 centered_laser_pose_
变量,后期 getOdomPose
时会使用其转换 laser 中心位置到 odom 坐标系下。
Part B3. Slam参数初始化
// 初始化位置,后期 smap 会赋值给 m_pose (rangesensor)
GMapping::OrientedPoint gmap_pose(0, 0, 0);
// setting maxRange and maxUrange here so we can set a reasonable default
ros::NodeHandle private_nh_("~");
if(!private_nh_.getParam("maxRange", maxRange_))
maxRange_ = scan.range_max - 0.01;
if(!private_nh_.getParam("maxUrange", maxUrange_))
maxUrange_ = maxRange_;
// The laser must be called "FLASER".
// We pass in the absolute value of the computed angle increment, on the
// assumption that GMapping requires a positive angle increment. If the
// actual increment is negative, we'll swap the order of ranges before
// feeding each scan to GMapping.
// 激光name规定"FLASER",GridSlamProcessor::setSensorMap中会去find name,如果不是"FLASER"会报错 "Attempting to load the new carmen log format"
gsp_laser_ = new GMapping::RangeSensor("FLASER", gsp_laser_beam_count_, fabs(scan.angle_increment), gmap_pose, 0.0, maxRange_);
ROS_ASSERT(gsp_laser_);
// GridSlamProcessor::setSensorMap 把Beam中所有的angle pose 取出,调用ScanMatcher::setLaserParameters 函数 memcpy 给 m_laserAngles, pose赋值给m_laserPose
GMapping::SensorMap smap;
smap.insert(make_pair(gsp_laser_->getName(), gsp_laser_)); // 将”FLASER"写入gsp_laser_
gsp_->setSensorMap(smap);
gsp_odom_ = new GMapping::OdometrySensor(odom_frame_);
ROS_ASSERT(gsp_odom_);
/// @todo Expose setting an initial pose
GMapping::OrientedPoint initialPose; // 激光在odom坐标系下的 GMapping::OrientedPoint 类型的位姿(x, y, yaw) 位置获取失败就对初始位置置零
if(!getOdomPose(initialPose, scan.header.stamp))
{
ROS_WARN("Unable to determine inital pose of laser! Starting point will be set to zero.");
initialPose = GMapping::OrientedPoint(0.0, 0.0, 0.0);
}
gsp_->setMatchingParameters(maxUrange_, maxRange_, sigma_, kernelSize_, lstep_, astep_, iterations_, lsigma_, ogain_, lskip_);
gsp_->setMotionModelParameters(srr_, srt_, str_, stt_);
gsp_->setUpdateDistances(linearUpdate_, angularUpdate_, resampleThreshold_);
gsp_->setUpdatePeriod(temporalUpdate_);
gsp_->setgenerateMap(false);
gsp_->GridSlamProcessor::init(particles_, xmin_, ymin_, xmax_, ymax_, delta_, initialPose);
gsp_->setllsamplerange(llsamplerange_);
gsp_->setllsamplestep(llsamplestep_);
/// @todo Check these calls; in the gmapping gui, they use
/// llsamplestep and llsamplerange intead of lasamplestep and
/// lasamplerange. It was probably a typo, but who knows.
gsp_->setlasamplerange(lasamplerange_);
gsp_->setlasamplestep(lasamplestep_);
gsp_->setminimumScore(minimum_score_);
// Call the sampling function once to set the seed.
GMapping::sampleGaussian(1,seed_);
ROS_INFO("Initialization complete");
gsp_laser_ = new GMapping::RangeSensor("FLASER",
gsp_laser_beam_count_,
fabs(scan.angle_increment),
gmap_pose,
0.0,
maxRange_);
RangeSensor
位于 openslam_gmapping/…/sensor_range/rangesensor.h 中,新建对象 gsp_laser_
并初始化,RangeSensor
为派生类 基类为 Sensor
,派生类中构建了公有结构体 Beam
包含 pose, span, maxRange, s, c
变量,构造函数 RangeSensor
中将每一帧中 beam 上的数据封装为 RangeSensor::Beam
类型,实现测距模型的初始化。源码如下:
RangeSensor::RangeSensor(std::string name, unsigned int beams_num, double res, const OrientedPoint& position, double span, double maxrange):Sensor(name), m_pose(position), m_beams(beams_num) {
double angle=-.5*res*beams_num;
for (unsigned int i=0; i<beams_num; i++, angle+=res) {
RangeSensor::Beam& beam(m_beams[i]);
beam.span=span;
beam.pose.x=0;
beam.pose.y=0;
beam.pose.theta=angle;
beam.maxRange=maxrange;
}
newFormat=0;
updateBeamsLookup();
}
void RangeSensor::updateBeamsLookup() {
for (unsigned int i=0; i<m_beams.size(); i++) {
RangeSensor::Beam& beam(m_beams[i]);
beam.s=sin(m_beams[i].pose.theta);
beam.c=cos(m_beams[i].pose.theta);
}
}
// 每个波束的结构体
struct Beam {
OrientedPoint pose; //pose relative to the center of the sensor
double span; //spam=0 indicates a line-like beam
double maxRange; //maximum range of the sensor
double s,c; //sinus and cosinus of the beam (optimization);
};
gsp_->setMatchingParameters(maxUrange_, maxRange_, sigma_,
kernelSize_, lstep_, astep_, iterations_,
lsigma_, ogain_, lskip_);
gsp_->setMotionModelParameters(srr_, srt_, str_, stt_); // 运动模型参数
gsp_->setUpdateDistances(linearUpdate_, angularUpdate_, resampleThreshold_); // 设置更新距离
gsp_->setUpdatePeriod(temporalUpdate_); // 在h函数中 赋值period
gsp_->setgenerateMap(false); // false: 只建立障碍部分; true: 完整的建立地图,包括障碍和空地
gsp_->GridSlamProcessor::init(particles_, xmin_, ymin_, xmax_, ymax_,
delta_, initialPose); // 初始化粒子滤波器
gsp_->setllsamplerange(llsamplerange_); // gridslamprocessor.h accessor methods
gsp_->setllsamplestep(llsamplestep_); // gridslamprocessor.h accessor methods
/// @todo Check these calls; in the gmapping gui, they use
/// llsamplestep and llsamplerange intead of lasamplestep and
/// lasamplerange. It was probably a typo, but who knows.
gsp_->setlasamplerange(lasamplerange_); // gridslamprocessor.h accessor methods
gsp_->setlasamplestep(lasamplestep_); // gridslamprocessor.h accessor methods
gsp_->setminimumScore(minimum_score_); // gridslamprocessor.h accessor methods
void ScanMatcher::setMatchingParameters (double urange, double range, double sigma, int kernsize, double lopt, double aopt, int iterations, double likelihoodSigma, unsigned int likelihoodSkip){
m_usableRange=urange;
m_laserMaxRange=range;
m_kernelSize=kernsize;
m_optLinearDelta=lopt;
m_optAngularDelta=aopt;
m_optRecursiveIterations=iterations;
m_gaussianSigma=sigma;
m_likelihoodSigma=likelihoodSigma;
m_likelihoodSkip=likelihoodSkip;
}
void GridSlamProcessor::setMotionModelParameters (double srr, double srt, double str, double stt){
m_motionModel.srr=srr;
m_motionModel.srt=srt;
m_motionModel.str=str;
m_motionModel.stt=stt;
}
void GridSlamProcessor::setUpdateDistances(double linear, double angular, double resampleThreshold){
m_linearThresholdDistance=linear;
m_angularThresholdDistance=angular;
m_resampleThreshold=resampleThreshold;
}
// 粒子滤波器初始化 初始化了最初始地图的大小、初始位置以及初始粒子数
void GridSlamProcessor::init(unsigned int size, double xmin, double ymin, double xmax, double ymax, double delta, OrientedPoint initialPose){
m_xmin=xmin;
m_ymin=ymin;
m_xmax=xmax;
m_ymax=ymax;
m_delta=delta;
m_particles.clear(); // m_particles 定义见下文
TNode* node=new TNode(initialPose, 0, 0, 0);
ScanMatcherMap lmap(Point(xmin+xmax, ymin+ymax)*.5, xmax-xmin, ymax-ymin, delta);
for (unsigned int i=0; i<size; i++){
m_particles.push_back(Particle(lmap));
m_particles.back().pose=initialPose;
m_particles.back().previousPose=initialPose;
m_particles.back().setWeight(0);
m_particles.back().previousIndex=0;
// this is not needed
// m_particles.back().node=new TNode(initialPose, 0, node, 0);
// we use the root directly
m_particles.back().node= node;
}
m_neff=(double)size;
m_count=0;
m_readingCount=0;
m_linearDistance=m_angularDistance=0;
}
-----------
// gridslamprocessor.h
typedef std::vector<Particle> ParticleVector;
/**the particles*/
ParticleVector m_particles;
/**This class defines a particle of the filter. Each particle has a map, a pose, a weight and retains the current node in the trajectory tree*/
struct Particle{
/**constructs a particle, given a map
@param map: the particle map
*/
Particle(const ScanMatcherMap& map);
/** @returns the weight of a particle */
inline operator double() const {return weight;}
/** @returns the pose of a particle */
inline operator OrientedPoint() const {return pose;}
/** sets the weight of a particle
@param w the weight
*/
inline void setWeight(double w) {weight=w;}
/** The map */
ScanMatcherMap map;
/** The pose of the robot */
OrientedPoint pose;
/** The pose of the robot at the previous time frame (used for computing thr odometry displacements) */
OrientedPoint previousPose;
/** The weight of the particle */
double weight;
/** The cumulative weight of the particle */
double weightSum;
double gweight;
/** The index of the previous particle in the trajectory tree */
int previousIndex;
/** Entry to the trajectory tree */
TNode* node;
};
总的来说, initMapper
这部分代码是做初始化过程。首先判断激光 Z 轴的安装方向(up or down),只考虑水平安装情况,然后初始化 gsp_laser_
、 smap
、 gsp_odom_
,定义的 GMapping::GridSlamProcessor* gsp_
对象用于获取 gmapping
参数,导入 fastslam
和 scanMatcher
,初始化粒子滤波器。
Part C.
GMapping::OrientedPoint odom_pose;
// Part C1. ------------------------------------------------------------------
if(addScan(*scan, odom_pose))
{
ROS_DEBUG("scan processed");
GMapping::OrientedPoint mpose = gsp_->getParticles()[gsp_->getBestParticleIndex()].pose;
ROS_DEBUG("new best pose: %.3f %.3f %.3f", mpose.x, mpose.y, mpose.theta);
ROS_DEBUG("odom pose: %.3f %.3f %.3f", odom_pose.x, odom_pose.y, odom_pose.theta);
ROS_DEBUG("correction: %.3f %.3f %.3f", mpose.x - odom_pose.x, mpose.y - odom_pose.y, mpose.theta - odom_pose.theta);
tf::Transform laser_to_map = tf::Transform(tf::createQuaternionFromRPY(0, 0, mpose.theta), tf::Vector3(mpose.x, mpose.y, 0.0)).inverse();
tf::Transform odom_to_laser = tf::Transform(tf::createQuaternionFromRPY(0, 0, odom_pose.theta), tf::Vector3(odom_pose.x, odom_pose.y, 0.0));
map_to_odom_mutex_.lock();
map_to_odom_ = (odom_to_laser * laser_to_map).inverse();
map_to_odom_mutex_.unlock();
// Part C2. ------------------------------------------------------------------
// 每超过map_update_interval_时间就要调用updateMap更新地图函数,周期性更新一次地图
if(!got_map_ || (scan->header.stamp - last_map_update) > map_update_interval_)
{
updateMap(*scan);
last_map_update = scan->header.stamp;
ROS_DEBUG("Updated the map");
}
} else
ROS_DEBUG("cannot process scan");
Part C1 addScan
bool SlamGMapping::addScan(const sensor_msgs::LaserScan& scan, GMapping::OrientedPoint& gmap_pose)
{
// 获取与激光雷达时间戳相对应的机器人里程计位姿
if(!getOdomPose(gmap_pose, scan.header.stamp))
return false;
// 判断激光束数量
if(scan.ranges.size() != gsp_laser_beam_count_)
return false;
// GMapping wants an array of doubles...
double* ranges_double = new double[scan.ranges.size()];
// If the angle increment is negative, we have to invert the order of the readings.
// 如果激光是反着装的,则激光数据存储的顺序需要反过来
if (do_reverse_range_) {
ROS_DEBUG("Inverting scan");
int num_ranges = scan.ranges.size();
for(int i=0; i < num_ranges; i++) {
// Must filter out short readings, because the mapper won't
if(scan.ranges[num_ranges - i - 1] < scan.range_min)
ranges_double[i] = (double)scan.range_max;
else
ranges_double[i] = (double)scan.ranges[num_ranges - i - 1];
}
} else {
for(unsigned int i=0; i < scan.ranges.size(); i++) {
// Must filter out short readings, because the mapper won't
if(scan.ranges[i] < scan.range_min)
ranges_double[i] = (double)scan.range_max;
else
ranges_double[i] = (double)scan.ranges[i];
}
}
// 将ROS的激光雷达的数据信息转换为GMapping算法中的数据格式
GMapping::RangeReading reading(scan.ranges.size(),
ranges_double,
gsp_laser_,
scan.header.stamp.toSec());
// ...but it deep copies them in RangeReading constructor, so we don't
// need to keep our array around.
delete[] ranges_double;
// 设置和激光雷达数据时间戳相匹配的机器人位姿
reading.setPose(gmap_pose);
/*
ROS_DEBUG("scanpose (%.3f): %.3f %.3f %.3f\n",
scan.header.stamp.toSec(),
gmap_pose.x,
gmap_pose.y,
gmap_pose.theta);
*/
ROS_DEBUG("processing scan");
// 调用GMapping算法进行处理
return gsp_->processScan(reading);
}
bool SlamGMapping::getOdomPose(GMapping::OrientedPoint& gmap_pose, const ros::Time& t)
{
// Get the pose of the centered laser at the right time
centered_laser_pose_.stamp_ = t;
// Get the laser's pose that is centered
tf::Stamped<tf::Transform> odom_pose;
try {
tf_.transformPose(odom_frame_, centered_laser_pose_, odom_pose);
} catch(tf::TransformException e) {
ROS_WARN("Failed to compute odom pose, skipping scan (%s)", e.what());
return false;
}
double yaw = tf::getYaw(odom_pose.getRotation());
gmap_pose = GMapping::OrientedPoint(odom_pose.getOrigin().x(), odom_pose.getOrigin().y(), yaw);
return true;
}
接下来进入 Gmapping的主角部分。