Wiki

Nodes

Visual and Lidar Odometry

Common odometry stuff for rgbd_odometry, stereo_odometry and icp_odometry nodes. These nodes wrap the various odometry approaches of RTAB-Map. When a transformation cannot be computed, a null transformation is sent to notify the receiver that odometry is not updated or lost.

Arguments

Subscribed Topics

imu (sensor_msgs/Imu)

Published Topics

odom (nav_msgs/Odometry) odom_info (rtabmap_msgs/OdomInfo) odom_last_frame (sensor_msgs/PointCloud2) odom_local_map (sensor_msgs/PointCloud2)

Services

reset_odom (std_srvs/Empty) reset_odom_to_pose (rtabmap_msgs/ResetPose) pause_odom (std_srvs/Empty) resume_odom (std_srvs/Empty)

Parameters

~frame_id (string, default: "base_link") ~odom_frame_id (string, default: "odom") ~publish_tf (bool, default: "true") ~tf_prefix (bool, default: "") ~wait_for_transform (bool, default: "false") ~initial_pose (string, default: "") ~queue_size (int, default: 10) ~publish_null_when_lost (bool, default: true) ~ground_truth_frame_id (string, default: "") ~ground_truth_base_frame_id (string, default: "") ~guess_frame_id (string, default: "") ~guess_min_translation (float, default: 0.0 m) ~guess_min_rotation (float, default: 0.0 rad) ~config_path (string, default: "") ~wait_imu_to_init (bool, default: false)

Required tf Transforms

base_link<the frame attached to sensors of incoming data>

Provided tf Transforms

odombase_link

rgbd_odometry

This node wraps the RGBD odometry approach of RTAB-Map. Using RGBD images, odometry is computed using visual features extracted from the RGB images with their depth information from the depth images. Using the feature correspondences between the images, a RANSAC approach computes the transformation between the consecutive images.

See also Visual Odometry for common odometry stuff used by this node.

Subscribed Topics

rgb/image (sensor_msgs/Image) rgb/camera_info (sensor_msgs/CameraInfo) depth/image (sensor_msgs/Image) rgbd_image (rtabmap_msgs/RGBDImage) rgbd_image# (rtabmap_msgs/RGBDImage) rgbd_images (rtabmap_msgs/RGBDImages)

Parameters

~approx_sync (bool, default: "true") ~subscribe_rgbd (bool, default: "false") ~rgbd_cameras (int, default: 1)

stereo_odometry

This node wraps the stereo odometry approach of RTAB-Map. Using stereo images, odometry is computed using visual features extracted from the left images with their depth information computed by finding the same features on the right images. Using the feature correspondences, a RANSAC approach computes the transformation between the consecutive left images.

See also Visual Odometry for common odometry stuff used by this node.

Subscribed Topics

left/image_rect (sensor_msgs/Image) left/camera_info (sensor_msgs/CameraInfo) right/image_rect (sensor_msgs/Image) right/camera_info (sensor_msgs/CameraInfo) rgbd_image (rtabmap_msgs/RGBDImage) rgbd_image# (rtabmap_msgs/RGBDImage) rgbd_images (rtabmap_msgs/RGBDImages)

Parameters

~approx_sync (bool, default: "false") ~subscribe_rgbd (bool, default: "false") ~rgbd_cameras (int, default: 1)

icp_odometry

This node wraps the icp odometry approach of RTAB-Map. Using laser scan or a point cloud, odometry is computed by Iterative Closest Point (ICP) registration.

See also Visual Odometry for common odometry stuff used by this node.

Subscribed Topics

scan (sensor_msgs/LaserScan) scan_cloud (sensor_msgs/PointCloud2)

Parameters

~scan_cloud_max_points (int, default: 0) ~scan_downsampling_step (int, default: 1) ~scan_voxel_size (float, default: 0.0 m) ~scan_normal_k (int, default: 0) ~scan_normal_radius (float, default: 0.0) ~deskewing (bool, default: false) ~deskewing_slerp (bool, default: false)

Wiki: rtabmap_odom (last edited 2023-08-05 23:05:47 by MathieuLabbe)