Function mrpt::ros2bridge::fromROS(const sensor_msgs::msg::LaserScan&, const mrpt::poses::CPose3D&, mrpt::obs::CObservation2DRangeScan&)

Function Documentation

bool mrpt::ros2bridge::fromROS(const sensor_msgs::msg::LaserScan &msg, const mrpt::poses::CPose3D &pose, mrpt::obs::CObservation2DRangeScan &obj)

ROS->MRPT: Takes a sensor_msgs::msg::LaserScan and the relative pose of the laser wrt base_link and builds a CObservation2DRangeScan

See also

toROS

Returns:

true on successful conversion, false on any error.