openni_camera::PointCloudXyzNodelet Class Reference

List of all members.

Private Types

typedef pcl::PointCloud
< pcl::PointXYZ > 
PointCloud

Private Member Functions

void connectCb ()
void depthCb (const sensor_msgs::ImageConstPtr &depth_msg, const sensor_msgs::CameraInfoConstPtr &info_msg)
void maskIndicesCb (const pcl::PointIndicesConstPtr &indices)
virtual void onInit ()

Private Attributes

boost::shared_ptr
< image_transport::ImageTransport > 
it_
std::vector< int32_t > mask_indices_
 Vector to hold the 'mask' (indices to output).
image_geometry::PinholeCameraModel model_
ros::Publisher pub_point_cloud_
image_transport::CameraSubscriber sub_depth_
ros::Subscriber sub_mask_indices_
bool subscribed_
bool use_indices_
 Whether to listen for mask_indices.

Detailed Description

Todo:
Consider dropping mask indices when full (multiple!) ROI, decimation support in driver

Definition at line 15 of file point_cloud_xyz.cpp.


Member Typedef Documentation

typedef pcl::PointCloud<pcl::PointXYZ> openni_camera::PointCloudXyzNodelet::PointCloud [private]

Definition at line 17 of file point_cloud_xyz.cpp.


Member Function Documentation

void openni_camera::PointCloudXyzNodelet::connectCb (  )  [private]

Definition at line 58 of file point_cloud_xyz.cpp.

void openni_camera::PointCloudXyzNodelet::depthCb ( const sensor_msgs::ImageConstPtr &  depth_msg,
const sensor_msgs::CameraInfoConstPtr &  info_msg 
) [private]

Todo:
Support float (metric) depth images also?
Todo:
Check for no sample value and shadow value once they are non-zero
Todo:
Check for no sample value and shadow value once they are non-zero

Definition at line 73 of file point_cloud_xyz.cpp.

void openni_camera::PointCloudXyzNodelet::maskIndicesCb ( const pcl::PointIndicesConstPtr &  indices  )  [private]

Definition at line 176 of file point_cloud_xyz.cpp.

void openni_camera::PointCloudXyzNodelet::onInit (  )  [private, virtual]

Definition at line 42 of file point_cloud_xyz.cpp.


Member Data Documentation

boost::shared_ptr<image_transport::ImageTransport> openni_camera::PointCloudXyzNodelet::it_ [private]

Definition at line 11 of file point_cloud_xyz.cpp.

Vector to hold the 'mask' (indices to output).

Definition at line 23 of file point_cloud_xyz.cpp.

image_geometry::PinholeCameraModel openni_camera::PointCloudXyzNodelet::model_ [private]

Definition at line 20 of file point_cloud_xyz.cpp.

Definition at line 18 of file point_cloud_xyz.cpp.

image_transport::CameraSubscriber openni_camera::PointCloudXyzNodelet::sub_depth_ [private]

Definition at line 12 of file point_cloud_xyz.cpp.

Definition at line 13 of file point_cloud_xyz.cpp.

Definition at line 14 of file point_cloud_xyz.cpp.

Whether to listen for mask_indices.

Definition at line 22 of file point_cloud_xyz.cpp.


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


openni_camera_unstable
Author(s): Suat Gedikli, Patrick Mihelich, Radu Bogdan Rusu
autogenerated on Fri Jan 11 09:15:04 2013