| Protected Member Functions | |
| virtual void | evenCallback (const sensor_msgs::PointCloud2::ConstPtr &cloud_msg) | 
| virtual void | evenOrganizedCallback (const sensor_msgs::PointCloud2::ConstPtr &cloud_msg) | 
| virtual void | generateTestData () | 
| virtual bool | isReady () | 
| virtual void | oddCallback (const sensor_msgs::PointCloud2::ConstPtr &cloud_msg) | 
| virtual void | oddOrganizedCallback (const sensor_msgs::PointCloud2::ConstPtr &cloud_msg) | 
| virtual void | publishData () | 
| virtual void | SetUp () | 
| Protected Attributes | |
| pcl::PointCloud< pcl::PointXYZ > ::Ptr | even_cloud_ | 
| pcl_msgs::PointIndices | even_indices_msg_ | 
| pcl::PointCloud< pcl::PointXYZ > ::Ptr | even_organized_cloud_ | 
| boost::mutex | mutex_ | 
| pcl::PointCloud< pcl::PointXYZ > ::Ptr | odd_cloud_ | 
| pcl_msgs::PointIndices | odd_indices_msg_ | 
| pcl::PointCloud< pcl::PointXYZ > ::Ptr | odd_organized_cloud_ | 
| pcl::PointCloud< pcl::PointXYZ > ::Ptr | original_cloud_ | 
| sensor_msgs::PointCloud2 | original_cloud_msg_ | 
| ros::Publisher | pub_cloud_ | 
| ros::Publisher | pub_even_indices_ | 
| ros::Publisher | pub_odd_indices_ | 
| ros::Subscriber | sub_even_organized_result_ | 
| ros::Subscriber | sub_even_result_ | 
| ros::Subscriber | sub_odd_organized_result_ | 
| ros::Subscriber | sub_odd_result_ | 
Publish static pointcloud and indices. They should be passed to jsk_pcl/ExtractIndices nodelet (running outside of this node) and this node checks the result of jsk_pcl/ExtractIndices
Definition at line 48 of file test_extract_indices.cpp.
| virtual void ExtractIndicesTest::evenCallback | ( | const sensor_msgs::PointCloud2::ConstPtr & | cloud_msg | ) |  [inline, protected, virtual] | 
Definition at line 126 of file test_extract_indices.cpp.
| virtual void ExtractIndicesTest::evenOrganizedCallback | ( | const sensor_msgs::PointCloud2::ConstPtr & | cloud_msg | ) |  [inline, protected, virtual] | 
Definition at line 140 of file test_extract_indices.cpp.
| virtual void ExtractIndicesTest::generateTestData | ( | ) |  [inline, protected, virtual] | 
Definition at line 89 of file test_extract_indices.cpp.
| virtual bool ExtractIndicesTest::isReady | ( | ) |  [inline, protected, virtual] | 
Definition at line 107 of file test_extract_indices.cpp.
| virtual void ExtractIndicesTest::oddCallback | ( | const sensor_msgs::PointCloud2::ConstPtr & | cloud_msg | ) |  [inline, protected, virtual] | 
Definition at line 133 of file test_extract_indices.cpp.
| virtual void ExtractIndicesTest::oddOrganizedCallback | ( | const sensor_msgs::PointCloud2::ConstPtr & | cloud_msg | ) |  [inline, protected, virtual] | 
Definition at line 147 of file test_extract_indices.cpp.
| virtual void ExtractIndicesTest::publishData | ( | ) |  [inline, protected, virtual] | 
Definition at line 115 of file test_extract_indices.cpp.
| virtual void ExtractIndicesTest::SetUp | ( | ) |  [inline, protected, virtual] | 
Definition at line 51 of file test_extract_indices.cpp.
| pcl::PointCloud<pcl::PointXYZ>::Ptr ExtractIndicesTest::even_cloud_  [protected] | 
Definition at line 159 of file test_extract_indices.cpp.
| pcl_msgs::PointIndices ExtractIndicesTest::even_indices_msg_  [protected] | 
Definition at line 162 of file test_extract_indices.cpp.
| pcl::PointCloud<pcl::PointXYZ>::Ptr ExtractIndicesTest::even_organized_cloud_  [protected] | 
Definition at line 160 of file test_extract_indices.cpp.
| boost::mutex ExtractIndicesTest::mutex_  [protected] | 
Definition at line 154 of file test_extract_indices.cpp.
| pcl::PointCloud<pcl::PointXYZ>::Ptr ExtractIndicesTest::odd_cloud_  [protected] | 
Definition at line 159 of file test_extract_indices.cpp.
| pcl_msgs::PointIndices ExtractIndicesTest::odd_indices_msg_  [protected] | 
Definition at line 162 of file test_extract_indices.cpp.
| pcl::PointCloud<pcl::PointXYZ>::Ptr ExtractIndicesTest::odd_organized_cloud_  [protected] | 
Definition at line 160 of file test_extract_indices.cpp.
| pcl::PointCloud<pcl::PointXYZ>::Ptr ExtractIndicesTest::original_cloud_  [protected] | 
Definition at line 158 of file test_extract_indices.cpp.
| sensor_msgs::PointCloud2 ExtractIndicesTest::original_cloud_msg_  [protected] | 
Definition at line 161 of file test_extract_indices.cpp.
| ros::Publisher ExtractIndicesTest::pub_cloud_  [protected] | 
Definition at line 157 of file test_extract_indices.cpp.
| ros::Publisher ExtractIndicesTest::pub_even_indices_  [protected] | 
Definition at line 157 of file test_extract_indices.cpp.
| ros::Publisher ExtractIndicesTest::pub_odd_indices_  [protected] | 
Definition at line 157 of file test_extract_indices.cpp.
Definition at line 156 of file test_extract_indices.cpp.
| ros::Subscriber ExtractIndicesTest::sub_even_result_  [protected] | 
Definition at line 155 of file test_extract_indices.cpp.
Definition at line 156 of file test_extract_indices.cpp.
| ros::Subscriber ExtractIndicesTest::sub_odd_result_  [protected] | 
Definition at line 155 of file test_extract_indices.cpp.