Public Member Functions | |
| DataCollectNode (ros::NodeHandle &n) | |
| void | sensorCallback (const sensor_msgs::ImageConstPtr &img_msg, const sensor_msgs::ImageConstPtr &depth_msg, const sensor_msgs::PointCloud2ConstPtr &cloud_msg) | 
| void | spin () | 
Protected Attributes | |
| std::string | base_output_path_ | 
| sensor_msgs::CvBridge | bridge_ | 
| sensor_msgs::CameraInfo | cam_info_ | 
| std::string | cam_info_topic_ | 
| bool | camera_initialized_ | 
| message_filters::Subscriber < sensor_msgs::PointCloud2 >  | cloud_sub_ | 
| bool | cluster_ | 
| std_msgs::Header | cur_camera_header_ | 
| message_filters::Subscriber < sensor_msgs::Image >  | depth_sub_ | 
| int | display_wait_ms_ | 
| message_filters::Subscriber < sensor_msgs::Image >  | image_sub_ | 
| double | max_depth_ | 
| ros::NodeHandle | n_ | 
| ros::NodeHandle | n_private_ | 
| shared_ptr < PointCloudSegmentation >  | pcl_segmenter_ | 
| std_msgs::Header | prev_camera_header_ | 
| bool | save_all_ | 
| int | save_count_ | 
| message_filters::Synchronizer < MySyncPolicy >  | sync_ | 
| shared_ptr< tf::TransformListener > | tf_ | 
| std::string | workspace_frame_ | 
Definition at line 97 of file save_kinect_images.cpp.
| DataCollectNode::DataCollectNode | ( | ros::NodeHandle & | n | ) |  [inline] | 
        
Definition at line 100 of file save_kinect_images.cpp.
| void DataCollectNode::sensorCallback | ( | const sensor_msgs::ImageConstPtr & | img_msg, | 
| const sensor_msgs::ImageConstPtr & | depth_msg, | ||
| const sensor_msgs::PointCloud2ConstPtr & | cloud_msg | ||
| ) |  [inline] | 
        
Definition at line 163 of file save_kinect_images.cpp.
| void DataCollectNode::spin | ( | ) |  [inline] | 
        
Executive control function for launching the node.
Definition at line 282 of file save_kinect_images.cpp.
std::string DataCollectNode::base_output_path_ [protected] | 
        
Definition at line 303 of file save_kinect_images.cpp.
sensor_msgs::CvBridge DataCollectNode::bridge_ [protected] | 
        
Definition at line 298 of file save_kinect_images.cpp.
sensor_msgs::CameraInfo DataCollectNode::cam_info_ [protected] | 
        
Definition at line 297 of file save_kinect_images.cpp.
std::string DataCollectNode::cam_info_topic_ [protected] | 
        
Definition at line 304 of file save_kinect_images.cpp.
bool DataCollectNode::camera_initialized_ [protected] | 
        
Definition at line 306 of file save_kinect_images.cpp.
message_filters::Subscriber<sensor_msgs::PointCloud2> DataCollectNode::cloud_sub_ [protected] | 
        
Definition at line 295 of file save_kinect_images.cpp.
bool DataCollectNode::cluster_ [protected] | 
        
Definition at line 311 of file save_kinect_images.cpp.
std_msgs::Header DataCollectNode::cur_camera_header_ [protected] | 
        
Definition at line 309 of file save_kinect_images.cpp.
message_filters::Subscriber<sensor_msgs::Image> DataCollectNode::depth_sub_ [protected] | 
        
Definition at line 294 of file save_kinect_images.cpp.
int DataCollectNode::display_wait_ms_ [protected] | 
        
Definition at line 301 of file save_kinect_images.cpp.
message_filters::Subscriber<sensor_msgs::Image> DataCollectNode::image_sub_ [protected] | 
        
Definition at line 293 of file save_kinect_images.cpp.
double DataCollectNode::max_depth_ [protected] | 
        
Definition at line 308 of file save_kinect_images.cpp.
ros::NodeHandle DataCollectNode::n_ [protected] | 
        
Definition at line 291 of file save_kinect_images.cpp.
ros::NodeHandle DataCollectNode::n_private_ [protected] | 
        
Definition at line 292 of file save_kinect_images.cpp.
shared_ptr<PointCloudSegmentation> DataCollectNode::pcl_segmenter_ [protected] | 
        
Definition at line 300 of file save_kinect_images.cpp.
std_msgs::Header DataCollectNode::prev_camera_header_ [protected] | 
        
Definition at line 310 of file save_kinect_images.cpp.
bool DataCollectNode::save_all_ [protected] | 
        
Definition at line 302 of file save_kinect_images.cpp.
int DataCollectNode::save_count_ [protected] | 
        
Definition at line 307 of file save_kinect_images.cpp.
Definition at line 296 of file save_kinect_images.cpp.
shared_ptr<tf::TransformListener> DataCollectNode::tf_ [protected] | 
        
Definition at line 299 of file save_kinect_images.cpp.
std::string DataCollectNode::workspace_frame_ [protected] | 
        
Definition at line 305 of file save_kinect_images.cpp.