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 Member Functions inherited from testing::Test | |
virtual void | TearDown () |
Test () | |
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_ |
Additional Inherited Members | |
Public Types inherited from testing::Test | |
typedef internal::SetUpTestCaseFunc | SetUpTestCaseFunc |
typedef internal::TearDownTestCaseFunc | TearDownTestCaseFunc |
Public Member Functions inherited from testing::Test | |
virtual | ~Test () |
Static Public Member Functions inherited from testing::Test | |
static bool | HasFailure () |
static bool | HasFatalFailure () |
static bool | HasNonfatalFailure () |
static void | RecordProperty (const std::string &key, const std::string &value) |
static void | RecordProperty (const std::string &key, int value) |
static void | SetUpTestCase () |
static void | TearDownTestCase () |
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.
|
inlineprotectedvirtual |
Definition at line 158 of file test_extract_indices.cpp.
|
inlineprotectedvirtual |
Definition at line 172 of file test_extract_indices.cpp.
|
inlineprotectedvirtual |
Definition at line 121 of file test_extract_indices.cpp.
|
inlineprotectedvirtual |
Definition at line 139 of file test_extract_indices.cpp.
|
inlineprotectedvirtual |
Definition at line 165 of file test_extract_indices.cpp.
|
inlineprotectedvirtual |
Definition at line 179 of file test_extract_indices.cpp.
|
inlineprotectedvirtual |
Definition at line 147 of file test_extract_indices.cpp.
|
inlineprotectedvirtual |
Reimplemented from testing::Test.
Definition at line 83 of file test_extract_indices.cpp.
|
protected |
Definition at line 191 of file test_extract_indices.cpp.
|
protected |
Definition at line 194 of file test_extract_indices.cpp.
|
protected |
Definition at line 192 of file test_extract_indices.cpp.
|
protected |
Definition at line 186 of file test_extract_indices.cpp.
|
protected |
Definition at line 191 of file test_extract_indices.cpp.
|
protected |
Definition at line 194 of file test_extract_indices.cpp.
|
protected |
Definition at line 192 of file test_extract_indices.cpp.
|
protected |
Definition at line 190 of file test_extract_indices.cpp.
|
protected |
Definition at line 193 of file test_extract_indices.cpp.
|
protected |
Definition at line 189 of file test_extract_indices.cpp.
|
protected |
Definition at line 189 of file test_extract_indices.cpp.
|
protected |
Definition at line 189 of file test_extract_indices.cpp.
|
protected |
Definition at line 188 of file test_extract_indices.cpp.
|
protected |
Definition at line 187 of file test_extract_indices.cpp.
|
protected |
Definition at line 188 of file test_extract_indices.cpp.
|
protected |
Definition at line 187 of file test_extract_indices.cpp.