#include <conversions.h>
Public Member Functions | |
| RefScan (sensor_msgs::LaserScan::ConstPtr scan, const geometry_msgs::Pose &pose, std::vector< InterestPoint * > &pts) | |
Public Attributes | |
| geometry_msgs::Pose | pose |
| std::vector< boost::shared_ptr < InterestPoint > > | pts |
| std::vector< InterestPoint * > | raw_pts |
| sensor_msgs::LaserScan::ConstPtr | scan |
Holds a scan with pose as well as interest points Wraps the interest points pointers in a shared pointer so they get freed when done
Definition at line 76 of file conversions.h.
| flirtlib_ros::RefScan::RefScan | ( | sensor_msgs::LaserScan::ConstPtr | scan, |
| const geometry_msgs::Pose & | pose, | ||
| std::vector< InterestPoint * > & | pts | ||
| ) |
Definition at line 318 of file conversions.cpp.
Definition at line 79 of file conversions.h.
| std::vector<boost::shared_ptr<InterestPoint> > flirtlib_ros::RefScan::pts |
Definition at line 80 of file conversions.h.
| std::vector<InterestPoint*> flirtlib_ros::RefScan::raw_pts |
Definition at line 81 of file conversions.h.
| sensor_msgs::LaserScan::ConstPtr flirtlib_ros::RefScan::scan |
Definition at line 78 of file conversions.h.