Private Types | Private Member Functions | Private Attributes | List of all members
depth_image_proc::PointCloudXyzNodelet Class Reference
Inheritance diagram for depth_image_proc::PointCloudXyzNodelet:
Inheritance graph
[legend]

Private Types

typedef sensor_msgs::PointCloud2 PointCloud
 

Private Member Functions

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

Private Attributes

boost::mutex connect_mutex_
 
boost::shared_ptr< image_transport::ImageTransportit_
 
image_geometry::PinholeCameraModel model_
 
ros::Publisher pub_point_cloud_
 
int queue_size_
 
image_transport::CameraSubscriber sub_depth_
 

Additional Inherited Members

- Public Member Functions inherited from nodelet::Nodelet
void init (const std::string &name, const M_string &remapping_args, const V_string &my_argv, ros::CallbackQueueInterface *st_queue=NULL, ros::CallbackQueueInterface *mt_queue=NULL)
 
 Nodelet ()
 
virtual ~Nodelet ()
 
- Protected Member Functions inherited from nodelet::Nodelet
ros::CallbackQueueInterfacegetMTCallbackQueue () const
 
ros::NodeHandlegetMTNodeHandle () const
 
ros::NodeHandlegetMTPrivateNodeHandle () const
 
const V_stringgetMyArgv () const
 
const std::string & getName () const
 
ros::NodeHandlegetNodeHandle () const
 
ros::NodeHandlegetPrivateNodeHandle () const
 
const M_stringgetRemappingArgs () const
 
ros::CallbackQueueInterfacegetSTCallbackQueue () const
 
std::string getSuffixedName (const std::string &suffix) const
 

Detailed Description

Definition at line 48 of file point_cloud_xyz.cpp.

Member Typedef Documentation

typedef sensor_msgs::PointCloud2 depth_image_proc::PointCloudXyzNodelet::PointCloud
private

Definition at line 57 of file point_cloud_xyz.cpp.

Member Function Documentation

void depth_image_proc::PointCloudXyzNodelet::connectCb ( )
private

Definition at line 87 of file point_cloud_xyz.cpp.

void depth_image_proc::PointCloudXyzNodelet::depthCb ( const sensor_msgs::ImageConstPtr &  depth_msg,
const sensor_msgs::CameraInfoConstPtr &  info_msg 
)
private

Definition at line 101 of file point_cloud_xyz.cpp.

void depth_image_proc::PointCloudXyzNodelet::onInit ( )
privatevirtual

Implements nodelet::Nodelet.

Definition at line 70 of file point_cloud_xyz.cpp.

Member Data Documentation

boost::mutex depth_image_proc::PointCloudXyzNodelet::connect_mutex_
private

Definition at line 56 of file point_cloud_xyz.cpp.

boost::shared_ptr<image_transport::ImageTransport> depth_image_proc::PointCloudXyzNodelet::it_
private

Definition at line 51 of file point_cloud_xyz.cpp.

image_geometry::PinholeCameraModel depth_image_proc::PointCloudXyzNodelet::model_
private

Definition at line 60 of file point_cloud_xyz.cpp.

ros::Publisher depth_image_proc::PointCloudXyzNodelet::pub_point_cloud_
private

Definition at line 58 of file point_cloud_xyz.cpp.

int depth_image_proc::PointCloudXyzNodelet::queue_size_
private

Definition at line 53 of file point_cloud_xyz.cpp.

image_transport::CameraSubscriber depth_image_proc::PointCloudXyzNodelet::sub_depth_
private

Definition at line 52 of file point_cloud_xyz.cpp.


The documentation for this class was generated from the following file:


depth_image_proc
Author(s): Patrick Mihelich
autogenerated on Fri May 3 2019 02:59:48