!

Note: This tutorial assume that your familiar with Navigation package, Amcl, Hector slam.
(!) Please ask about problems and questions regarding this tutorial on answers.ros.org. Don't forget to include in your question the link to this page, the versions of your OS & ROS, and also add appropriate tags.

Robot navigation

Description: Navigation with SLAM and localization algorithms

Tutorial Level: ADVANCED

Overview

The Navigation Stack is fully supported on Komodo2.

You can choose between controlling the robot directly using the differential drive controller as explained in the Command your robot with simple motion commands tutorial, or use the move_base interface for high level commands.

In this tutorial we will also cover the supported localization and mapping options.

The move_base interface

The move_base package provides an implementation of an action (see the actionlib package) that, given a goal in the world, will attempt to reach it with a mobile base. The move_base node links together a global and local planner to accomplish its global navigation task. For more reference on move_base interface please refer to this link

Graphical use

To understand how to work with graphical interface, launch the simulated demo of amcl. To do that, open a new terminal and type the following:

$ roslaunch komodo2 komodo2.launch gazebo:=true lidar:=true amcl:=true have_map:=true map:="`rospack find komodo2_navigation`/maps/home.yaml" world_name:="`rospack find komodo2_gazebo`/worlds/home.world" move_base:=true

Open a new terminal and write the following to launch the Rviz interface:

 rosrun rviz rviz -d `rospack find komodo2_navigation`/rviz/amcl.rviz

The launch contain the following packages:

  1. Move base. (For planning the path to the goal and moving the robot)
  2. Gazebo with komodo model.
  3. Server map. (To provide a map for the amcl package)

  4. Amcl. (To position the robot in the map)
  5. Rviz. (For the graphical use)

The following video demonstrates how navigation stack work with the Rviz graphical interface.

GMapping SLAM

Rao-Blackwellized particle filters have been introduced as effective means to solve the simultaneous localization and mapping (SLAM) problem. This approach uses a particle filter in which each particle carries an individual map of the environment. Accordingly, a key question is how to reduce the number of particles. We present adaptive techniques to reduce the number of particles in a Rao- Blackwellized particle filter for learning grid maps. We propose an approach to compute an accurate proposal distribution taking into account, not only the movement of the robot but also the most recent observation. This drastically decrease the uncertainty about the robot's pose in the prediction step of the filter. Furthermore, we apply an approach to selectively carry out re-sampling operations which seriously reduces the problem of particle depletion. For more reference on this package please refer gmapping

To see the gmapping_slam work in komodo, simply add the parameters lidar:=true and gmapping:=true when you run the launch file.

Saving the map

To save the current map just type the following command in a new terminal:

$ rosrun map_server map_saver 

The map_saver program will save the map in the current folder, and will output two file:

  1. map.pgm
  2. map.yaml

NOTE:To change the name of the files go to map.yaml file. In the image field change the map.pgm to <my_map>.pgm

Localization

AMCL

amcl is a probabilistic localization system for a robot moving in 2D. It implements the adaptive (or KLD-sampling) Monte Carlo localization approach (as described by Dieter Fox), which uses a particle filter to track the pose of a robot against a known map.

To see how amcl work with our robots refer to the first example in this page.

Wiki: komodo2/Tutorials/Robot navigation (last edited 2018-04-24 07:16:09 by YairShlomi)