$search
#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 69 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 72 of file conversions.h.
| std::vector<boost::shared_ptr<InterestPoint> > flirtlib_ros::RefScan::pts |
Definition at line 73 of file conversions.h.
| std::vector<InterestPoint*> flirtlib_ros::RefScan::raw_pts |
Definition at line 74 of file conversions.h.
Definition at line 71 of file conversions.h.