Package Summary
Documented
This package includes launch files for slam
- Maintainer status: developed
- Maintainer: clobot-git <ros AT clobot.co DOT kr>
- Author:
- License: Apache License 2.0
- Source: git https://github.com/CLOBOT-Co-Ltd/clober.git (branch: noetic-devel)
Contents
ROS Software Maintainer: Clobot
Clober SLAM Package
Clober e-Manual
ROS API
clober_slam
This package is used gmapping.Subscribed Topics
tf (tf/tfMessage)- Transforms necessary to relate frames for laser, base, and odometry (see below)
- Laser scans to create the map from
Published Topics
map_metadata (nav_msgs/MapMetaData)- Get the map data from this topic, which is latched, and updated periodically.
- Get the map data from this topic, which is latched, and updated periodically
- Estimate of the entropy of the distribution over the robot's pose (a higher value indicates greater uncertainty). New in 1.1.0.
Services
dynamic_map (nav_msgs/GetMap)- Call this service to get the map data
Parameters
~base_frame (string, default: base_footprint)- The frame attached to the mobile base.
- The frame attached to the odometry system.
- Map update interval (sec).
- Max Range of laser sensor to use (meter).
- Min Score considering the results of scan matching.
- Max Range of laser sensor to use (meter).
- Min rotation angle required for processing.
- If the last scan time exceeds this update time, the scan is performed. Negative values will be ignored and not used.
- Max Range of laser sensor to use (meter).
- Number of beams to skip in each scan.
- Number of particles in the filter.
- Standard deviation of laser-assisted search.
- Max Range of laser sensor to use (meter).
- Window size of laser-assisted search.
- Initial search step (translation).
- Initial search step (rotation).
- Number of scan-matching iterations.
- The sigma of a beam used for likelihood computation
- Gain to be used while evaluating the likelihood.
- Odometry error (translation→ translation).
- Odometry error (translation→ translation).
- Odometry error (rotation → translation).
- Odometry error (rotation → rotation).
- Resampling threshold value.
- Initial map size (min x).
- Initial map size (min y).
- Initial map size (max x).
- Initial map size (max y).
- Translational sampling range for the likelihood.
- Translational sampling step for the likelihood.
- Angular sampling range for the likelihood.
- Angular sampling step for the likelihood.
Required tf Transforms
<the frame attached to incoming scans> → base_link- usually a fixed value, broadcast periodically by a robot_state_publisher, or a tf static_transform_publisher.
- usually provided by the odometry system (e.g., the driver for the mobile base)
Provided tf Transforms
map → odom- the current estimate of the robot's pose within the map frame