Wiki

Algorithm

RF2O is a fast and precise method to estimate the planar motion of a lidar from consecutive range scans. For every scanned point we formulate the range flow constraint equation in terms of the sensor velocity, and minimize a robust function of the resulting geometric constraints to obtain the motion estimate. Conversely to traditional approaches, this method does not search for correspondences but performs dense scan alignment based on the scan gradients, in the fashion of dense 3D visual odometry. The minimization problem is solved in a coarse-to-fine scheme to cope with large displacements, and a smooth filter based on the covariance of the estimate is employed to handle uncertainty in unconstraint scenarios (e.g. corridors).

The user is advised to check the related papers (see here) for a more detailed description of the method.

Demo Video

Nodes

rf2o_laser_odometry

The rf2o_laser_odometry node publishes planar odometry estimations for a mobile robot from scan lasers of an onboard 2D lidar. It initially estimates the odometry of the lidar device, and then calculates the robot base odometry by using tf transforms.

Subscribed Topics

laser_scan (sensor_msgs/LaserScan) tf (tf/tfMessage)

Published Topics

odom (nav_msgs/Odometry) tf (tf/tfMessage)

Parameters

~laser_scan_topic (string, default: /laser_scan) ~base_frame_id (string, default: /base_link) ~odom_frame_id (string, default: /odom) ~freq (double, default: 10.0)

Wiki: rf2o_laser_odometry (last edited 2025-03-26 00:43:19 by ChristopheBedard)