Public Member Functions | Private Attributes
PointCloudCapturer Class Reference

List of all members.

Public Member Functions

void callback (const sensor_msgs::PointCloud2ConstPtr &pc, const sensor_msgs::ImageConstPtr &im)
void move_head (std::string frame_id, double x, double y, double z)
 PointCloudCapturer (ros::NodeHandle &n)
void spin ()
 ~PointCloudCapturer ()

Private Attributes

rosbag::Bag bag_
std::string bag_name_
sensor_msgs::CameraInfoConstPtr cam_info_
message_filters::Subscriber
< sensor_msgs::Image > 
camera_sub_
bool cloud_and_image_received_
message_filters::Subscriber
< sensor_msgs::PointCloud2 > 
cloud_sub_
double current_position_x_
double current_position_y_
double current_position_z_
double EPS
std::string input_camera_info_topic_
std::string input_cloud_topic_
std::string input_image_topic_
bool move_head_
double move_offset_x_
double move_offset_y_max_
double move_offset_y_min_
double move_offset_z_max_
double move_offset_z_min_
ros::NodeHandle nh_
PointHeadClientpoint_head_client_
double rate_
boost::thread spin_thread_
double step_y_
double step_z_
message_filters::Connection sync_connection_
message_filters::Synchronizer
< MySyncPolicy
synchronizer_
tf::TransformListener tf_
std::string to_frame_

Detailed Description

Definition at line 29 of file pointcloud_acquisition_with_head_movement.cpp.


Constructor & Destructor Documentation


Member Function Documentation

void PointCloudCapturer::callback ( const sensor_msgs::PointCloud2ConstPtr &  pc,
const sensor_msgs::ImageConstPtr &  im 
) [inline]
void PointCloudCapturer::move_head ( std::string  frame_id,
double  x,
double  y,
double  z 
) [inline]
void PointCloudCapturer::spin ( ) [inline]

Member Data Documentation

std::string PointCloudCapturer::bag_name_ [private]
sensor_msgs::CameraInfoConstPtr PointCloudCapturer::cam_info_ [private]
message_filters::Subscriber<sensor_msgs::PointCloud2> PointCloudCapturer::cloud_sub_ [private]
double PointCloudCapturer::EPS [private]
double PointCloudCapturer::rate_ [private]
boost::thread PointCloudCapturer::spin_thread_ [private]
double PointCloudCapturer::step_y_ [private]
double PointCloudCapturer::step_z_ [private]
std::string PointCloudCapturer::to_frame_ [private]

The documentation for this class was generated from the following file:
 All Classes Namespaces Files Functions Variables Typedefs Enumerations Properties Friends


pr2_data_acquisition_tools
Author(s): Dejan Pangercic
autogenerated on Sun Oct 6 2013 11:56:39