Represents a 2d scan at some pose. More...
#include <karto_scan_matcher.h>
Public Member Functions | |
ScanWithPose () | |
ScanWithPose (const sensor_msgs::LaserScan &scan, const geometry_msgs::Pose2D &pose) | |
Public Attributes | |
geometry_msgs::Pose2D | pose |
sensor_msgs::LaserScan | scan |
Represents a 2d scan at some pose.
The frame_id of scan is ignored. It's treated instead as being in the sensor frame corresponding to the base frame being at pose.
Definition at line 72 of file karto_scan_matcher.h.
karto_scan_matcher::ScanWithPose::ScanWithPose | ( | const sensor_msgs::LaserScan & | scan, | |
const geometry_msgs::Pose2D & | pose | |||
) | [inline] |
Definition at line 74 of file karto_scan_matcher.h.
karto_scan_matcher::ScanWithPose::ScanWithPose | ( | ) | [inline] |
Definition at line 76 of file karto_scan_matcher.h.
geometry_msgs::Pose2D karto_scan_matcher::ScanWithPose::pose |
Definition at line 79 of file karto_scan_matcher.h.
sensor_msgs::LaserScan karto_scan_matcher::ScanWithPose::scan |
Definition at line 78 of file karto_scan_matcher.h.