Public Member Functions | |
OfflineClutterTestNode (ros::NodeHandle n) | |
void | spin () |
Protected Attributes | |
sensor_msgs::CvBridge | bridge_ |
std::string | clutter_output_name_ |
std::string | input_image_name_ |
std::string | input_mask_name_ |
std::string | input_pcd_name_ |
ros::NodeHandle | n_ |
std::string | smooth_output_name_ |
ros::ServiceClient | superpixel_client_ |
Definition at line 16 of file offline_clutter_test_node.cpp.
Definition at line 19 of file offline_clutter_test_node.cpp.
void OfflineClutterTestNode::spin | ( | ) | [inline] |
Definition at line 38 of file offline_clutter_test_node.cpp.
sensor_msgs::CvBridge OfflineClutterTestNode::bridge_ [protected] |
Definition at line 103 of file offline_clutter_test_node.cpp.
std::string OfflineClutterTestNode::clutter_output_name_ [protected] |
Definition at line 102 of file offline_clutter_test_node.cpp.
std::string OfflineClutterTestNode::input_image_name_ [protected] |
Definition at line 99 of file offline_clutter_test_node.cpp.
std::string OfflineClutterTestNode::input_mask_name_ [protected] |
Definition at line 100 of file offline_clutter_test_node.cpp.
std::string OfflineClutterTestNode::input_pcd_name_ [protected] |
Definition at line 98 of file offline_clutter_test_node.cpp.
ros::NodeHandle OfflineClutterTestNode::n_ [protected] |
Definition at line 93 of file offline_clutter_test_node.cpp.
std::string OfflineClutterTestNode::smooth_output_name_ [protected] |
Definition at line 101 of file offline_clutter_test_node.cpp.
Definition at line 97 of file offline_clutter_test_node.cpp.