Public Member Functions | |
NDTMatcherNode () | |
void | points2Callback (const sensor_msgs::PointCloud2::ConstPtr &msg_in) |
~NDTMatcherNode () | |
Protected Member Functions | |
void | TransformEigenToTF (const Eigen::Transform< double, 3, Eigen::Affine, Eigen::ColMajor > &k, tf::Transform &t) |
Protected Attributes | |
Eigen::Transform< double, 3, Eigen::Affine, Eigen::ColMajor > | incremental_pose_ |
boost::mutex | m |
lslgeneric::NDTMatcherF2F * | matcher |
unsigned int | nb_added_clouds_ |
ros::NodeHandle | nh_ |
ros::Publisher | output_pub_ |
std::vector< pcl::PointCloud < pcl::PointXYZ > , Eigen::aligned_allocator < pcl::PointCloud < pcl::PointXYZ > > > | pcl_buffer_ |
ros::Subscriber | points2_sub_ |
tf::TransformBroadcaster | tf_ |
Definition at line 22 of file ndt_matcher_node.cc.
NDTMatcherNode::NDTMatcherNode | ( | ) | [inline] |
Definition at line 52 of file ndt_matcher_node.cc.
NDTMatcherNode::~NDTMatcherNode | ( | ) | [inline] |
Definition at line 63 of file ndt_matcher_node.cc.
void NDTMatcherNode::points2Callback | ( | const sensor_msgs::PointCloud2::ConstPtr & | msg_in | ) | [inline] |
Definition at line 70 of file ndt_matcher_node.cc.
void NDTMatcherNode::TransformEigenToTF | ( | const Eigen::Transform< double, 3, Eigen::Affine, Eigen::ColMajor > & | k, |
tf::Transform & | t | ||
) | [inline, protected] |
Definition at line 43 of file ndt_matcher_node.cc.
Eigen::Transform<double,3,Eigen::Affine,Eigen::ColMajor> NDTMatcherNode::incremental_pose_ [protected] |
Definition at line 42 of file ndt_matcher_node.cc.
boost::mutex NDTMatcherNode::m [protected] |
Definition at line 39 of file ndt_matcher_node.cc.
lslgeneric::NDTMatcherF2F* NDTMatcherNode::matcher [protected] |
Definition at line 40 of file ndt_matcher_node.cc.
unsigned int NDTMatcherNode::nb_added_clouds_ [protected] |
Definition at line 38 of file ndt_matcher_node.cc.
ros::NodeHandle NDTMatcherNode::nh_ [protected] |
Definition at line 26 of file ndt_matcher_node.cc.
ros::Publisher NDTMatcherNode::output_pub_ [protected] |
Definition at line 34 of file ndt_matcher_node.cc.
std::vector<pcl::PointCloud<pcl::PointXYZ>,Eigen::aligned_allocator<pcl::PointCloud<pcl::PointXYZ> > > NDTMatcherNode::pcl_buffer_ [protected] |
Definition at line 37 of file ndt_matcher_node.cc.
ros::Subscriber NDTMatcherNode::points2_sub_ [protected] |
Definition at line 29 of file ndt_matcher_node.cc.
tf::TransformBroadcaster NDTMatcherNode::tf_ [protected] |
Definition at line 33 of file ndt_matcher_node.cc.