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

Private Types

typedef message_filters::Synchronizer< ExactSyncPolicyExactSynchronizer
 
typedef ExactTime< sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo > ExactSyncPolicy
 
typedef sensor_msgs::PointCloud2 PointCloud
 
typedef message_filters::Synchronizer< SyncPolicySynchronizer
 
typedef ApproximateTime< sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo > SyncPolicy
 

Private Member Functions

void connectCb ()
 
template<typename T >
void convert (const sensor_msgs::ImageConstPtr &depth_msg, const sensor_msgs::ImageConstPtr &rgb_msg, const PointCloud::Ptr &cloud_msg, int red_offset, int green_offset, int blue_offset, int color_step)
 
void imageCb (const sensor_msgs::ImageConstPtr &depth_msg, const sensor_msgs::ImageConstPtr &rgb_msg, const sensor_msgs::CameraInfoConstPtr &info_msg)
 
virtual void onInit ()
 

Private Attributes

boost::mutex connect_mutex_
 
boost::shared_ptr< image_transport::ImageTransportdepth_it_
 
boost::shared_ptr< ExactSynchronizerexact_sync_
 
image_geometry::PinholeCameraModel model_
 
ros::Publisher pub_point_cloud_
 
boost::shared_ptr< image_transport::ImageTransportrgb_it_
 
ros::NodeHandlePtr rgb_nh_
 
image_transport::SubscriberFilter sub_depth_
 
message_filters::Subscriber< sensor_msgs::CameraInfo > sub_info_
 
image_transport::SubscriberFilter sub_rgb_
 
boost::shared_ptr< Synchronizersync_
 

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 60 of file point_cloud_xyzrgb.cpp.

Member Typedef Documentation

Definition at line 71 of file point_cloud_xyzrgb.cpp.

typedef ExactTime<sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo> depth_image_proc::PointCloudXyzrgbNodelet::ExactSyncPolicy
private

Definition at line 69 of file point_cloud_xyzrgb.cpp.

typedef sensor_msgs::PointCloud2 depth_image_proc::PointCloudXyzrgbNodelet::PointCloud
private

Definition at line 77 of file point_cloud_xyzrgb.cpp.

Definition at line 70 of file point_cloud_xyzrgb.cpp.

typedef ApproximateTime<sensor_msgs::Image, sensor_msgs::Image, sensor_msgs::CameraInfo> depth_image_proc::PointCloudXyzrgbNodelet::SyncPolicy
private

Definition at line 68 of file point_cloud_xyzrgb.cpp.

Member Function Documentation

void depth_image_proc::PointCloudXyzrgbNodelet::connectCb ( )
private

Definition at line 132 of file point_cloud_xyzrgb.cpp.

template<typename T >
void depth_image_proc::PointCloudXyzrgbNodelet::convert ( const sensor_msgs::ImageConstPtr &  depth_msg,
const sensor_msgs::ImageConstPtr &  rgb_msg,
const PointCloud::Ptr &  cloud_msg,
int  red_offset,
int  green_offset,
int  blue_offset,
int  color_step 
)
private

Definition at line 285 of file point_cloud_xyzrgb.cpp.

void depth_image_proc::PointCloudXyzrgbNodelet::imageCb ( const sensor_msgs::ImageConstPtr &  depth_msg,
const sensor_msgs::ImageConstPtr &  rgb_msg,
const sensor_msgs::CameraInfoConstPtr &  info_msg 
)
private

Definition at line 158 of file point_cloud_xyzrgb.cpp.

void depth_image_proc::PointCloudXyzrgbNodelet::onInit ( )
privatevirtual

Implements nodelet::Nodelet.

Definition at line 97 of file point_cloud_xyzrgb.cpp.

Member Data Documentation

boost::mutex depth_image_proc::PointCloudXyzrgbNodelet::connect_mutex_
private

Definition at line 76 of file point_cloud_xyzrgb.cpp.

boost::shared_ptr<image_transport::ImageTransport> depth_image_proc::PointCloudXyzrgbNodelet::depth_it_
private

Definition at line 63 of file point_cloud_xyzrgb.cpp.

boost::shared_ptr<ExactSynchronizer> depth_image_proc::PointCloudXyzrgbNodelet::exact_sync_
private

Definition at line 73 of file point_cloud_xyzrgb.cpp.

image_geometry::PinholeCameraModel depth_image_proc::PointCloudXyzrgbNodelet::model_
private

Definition at line 80 of file point_cloud_xyzrgb.cpp.

ros::Publisher depth_image_proc::PointCloudXyzrgbNodelet::pub_point_cloud_
private

Definition at line 78 of file point_cloud_xyzrgb.cpp.

boost::shared_ptr<image_transport::ImageTransport> depth_image_proc::PointCloudXyzrgbNodelet::rgb_it_
private

Definition at line 63 of file point_cloud_xyzrgb.cpp.

ros::NodeHandlePtr depth_image_proc::PointCloudXyzrgbNodelet::rgb_nh_
private

Definition at line 62 of file point_cloud_xyzrgb.cpp.

image_transport::SubscriberFilter depth_image_proc::PointCloudXyzrgbNodelet::sub_depth_
private

Definition at line 66 of file point_cloud_xyzrgb.cpp.

message_filters::Subscriber<sensor_msgs::CameraInfo> depth_image_proc::PointCloudXyzrgbNodelet::sub_info_
private

Definition at line 67 of file point_cloud_xyzrgb.cpp.

image_transport::SubscriberFilter depth_image_proc::PointCloudXyzrgbNodelet::sub_rgb_
private

Definition at line 66 of file point_cloud_xyzrgb.cpp.

boost::shared_ptr<Synchronizer> depth_image_proc::PointCloudXyzrgbNodelet::sync_
private

Definition at line 72 of file point_cloud_xyzrgb.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