Public Member Functions | |
ScanMatcherTest () | |
Private Member Functions | |
void | attemptScanMatch (const ros::WallTimerEvent &e) |
Pose2D | perturbPose (const Pose2D &pose) |
void | scanCallback (const sm::LaserScan &scan) |
Private Attributes | |
boost::shared_ptr < KartoScanMatcher > | matcher_ |
boost::mutex | mutex_ |
ros::NodeHandle | nh_ |
const double | noise_level_ |
const unsigned | scan_history_length_ |
ros::WallTimer | scan_match_timer_ |
ros::Subscriber | scan_sub_ |
ScanBuffer | scans_ |
tf::TransformListener | tf_ |
Definition at line 35 of file test_scan_matcher.cpp.
Definition at line 93 of file test_scan_matcher.cpp.
void karto_scan_matcher::ScanMatcherTest::attemptScanMatch | ( | const ros::WallTimerEvent & | e | ) | [private] |
Definition at line 158 of file test_scan_matcher.cpp.
Pose2D karto_scan_matcher::ScanMatcherTest::perturbPose | ( | const Pose2D & | pose | ) | [private] |
Definition at line 149 of file test_scan_matcher.cpp.
void karto_scan_matcher::ScanMatcherTest::scanCallback | ( | const sm::LaserScan & | scan | ) | [private] |
Definition at line 107 of file test_scan_matcher.cpp.
boost::shared_ptr<KartoScanMatcher> karto_scan_matcher::ScanMatcherTest::matcher_ [private] |
Definition at line 75 of file test_scan_matcher.cpp.
boost::mutex karto_scan_matcher::ScanMatcherTest::mutex_ [private] |
Definition at line 74 of file test_scan_matcher.cpp.
Definition at line 70 of file test_scan_matcher.cpp.
const double karto_scan_matcher::ScanMatcherTest::noise_level_ [private] |
Definition at line 57 of file test_scan_matcher.cpp.
const unsigned karto_scan_matcher::ScanMatcherTest::scan_history_length_ [private] |
Definition at line 56 of file test_scan_matcher.cpp.
Definition at line 73 of file test_scan_matcher.cpp.
Definition at line 72 of file test_scan_matcher.cpp.
Definition at line 64 of file test_scan_matcher.cpp.
Definition at line 71 of file test_scan_matcher.cpp.