Result of scan matching. More...
#include <karto_scan_matcher.h>
Public Member Functions | |
ScanMatchResult (const geometry_msgs::Pose2D &pose, const Eigen::Matrix3f &cov, const double response) | |
Public Attributes | |
Eigen::Matrix3f | cov |
geometry_msgs::Pose2D | pose |
double | response |
Result of scan matching.
Definition at line 83 of file karto_scan_matcher.h.
karto_scan_matcher::ScanMatchResult::ScanMatchResult | ( | const geometry_msgs::Pose2D & | pose, | |
const Eigen::Matrix3f & | cov, | |||
const double | response | |||
) | [inline] |
Definition at line 85 of file karto_scan_matcher.h.
Eigen::Matrix3f karto_scan_matcher::ScanMatchResult::cov |
Definition at line 91 of file karto_scan_matcher.h.
geometry_msgs::Pose2D karto_scan_matcher::ScanMatchResult::pose |
Definition at line 90 of file karto_scan_matcher.h.
Definition at line 92 of file karto_scan_matcher.h.