| Public Member Functions | |
| void | createMap () | 
| void | dofile (const char *fn) | 
| void | pointCloudSubCallback (const sensor_msgs::PointCloud2ConstPtr &pc_in) | 
| TestNode2 () | |
| ~TestNode2 () | |
| Protected Attributes | |
| bool | build_map_always_ | 
| bool | first_ | 
| ros::NodeHandle | n_ | 
| ros::Subscriber | point_cloud_sub_ | 
| int | registered_fr_ | 
| Private Types | |
| typedef pcl::PointXYZRGB | Point | 
| Private Attributes | |
| boost::mutex | mutex2_ | 
| boost::mutex | mutex_ | 
| pcl::PointCloud< pcl::PointXYZRGB > | pcreg | 
| boost::thread * | pthread_ | 
| Registration_Infobased< Point > | reg | 
| sensor_msgs::PointCloud2ConstPtr | temporal_pcmsg_ | 
| Eigen::Matrix4f | tf_ | 
Definition at line 5056 of file frir_freehand.cpp.
| typedef pcl::PointXYZRGB TestNode2::Point  [private] | 
Definition at line 5058 of file frir_freehand.cpp.
| TestNode2::TestNode2 | ( | ) |  [inline] | 
Definition at line 5077 of file frir_freehand.cpp.
| TestNode2::~TestNode2 | ( | ) |  [inline] | 
Definition at line 5105 of file frir_freehand.cpp.
| void TestNode2::createMap | ( | ) |  [inline] | 
Definition at line 5231 of file frir_freehand.cpp.
| void TestNode2::dofile | ( | const char * | fn | ) |  [inline] | 
Definition at line 5112 of file frir_freehand.cpp.
| void TestNode2::pointCloudSubCallback | ( | const sensor_msgs::PointCloud2ConstPtr & | pc_in | ) |  [inline] | 
Definition at line 5169 of file frir_freehand.cpp.
| bool TestNode2::build_map_always_  [protected] | 
Definition at line 5071 of file frir_freehand.cpp.
| bool TestNode2::first_  [protected] | 
Definition at line 5071 of file frir_freehand.cpp.
| boost::mutex TestNode2::mutex2_  [private] | 
Definition at line 5065 of file frir_freehand.cpp.
| boost::mutex TestNode2::mutex_  [private] | 
Definition at line 5065 of file frir_freehand.cpp.
| ros::NodeHandle TestNode2::n_  [protected] | 
Definition at line 5069 of file frir_freehand.cpp.
| pcl::PointCloud<pcl::PointXYZRGB> TestNode2::pcreg  [private] | 
Definition at line 5061 of file frir_freehand.cpp.
| ros::Subscriber TestNode2::point_cloud_sub_  [protected] | 
Definition at line 5068 of file frir_freehand.cpp.
| boost::thread* TestNode2::pthread_  [private] | 
Definition at line 5066 of file frir_freehand.cpp.
| Registration_Infobased<Point> TestNode2::reg  [private] | 
Definition at line 5060 of file frir_freehand.cpp.
| int TestNode2::registered_fr_  [protected] | 
Definition at line 5074 of file frir_freehand.cpp.
| sensor_msgs::PointCloud2ConstPtr TestNode2::temporal_pcmsg_  [private] | 
Definition at line 5064 of file frir_freehand.cpp.
| Eigen::Matrix4f TestNode2::tf_  [private] | 
Definition at line 5063 of file frir_freehand.cpp.