Public Types | Public Member Functions | Protected Member Functions | Protected Attributes
jsk_pcl_ros_utils::PointIndicesToMaskImage Class Reference

#include <point_indices_to_mask_image.h>

Inheritance diagram for jsk_pcl_ros_utils::PointIndicesToMaskImage:
Inheritance graph
[legend]

List of all members.

Public Types

typedef
message_filters::sync_policies::ApproximateTime
< PCLIndicesMsg,
sensor_msgs::Image > 
ApproximateSyncPolicy
typedef
message_filters::sync_policies::ExactTime
< PCLIndicesMsg,
sensor_msgs::Image > 
SyncPolicy

Public Member Functions

 PointIndicesToMaskImage ()

Protected Member Functions

virtual void convertAndPublish (const PCLIndicesMsg::ConstPtr &indices_msg, const int width, const int height)
virtual void mask (const PCLIndicesMsg::ConstPtr &indices_msg)
virtual void mask (const PCLIndicesMsg::ConstPtr &indices_msg, const sensor_msgs::Image::ConstPtr &image_msg)
virtual void onInit ()
virtual void subscribe ()
virtual void unsubscribe ()
virtual void updateDiagnostic (diagnostic_updater::DiagnosticStatusWrapper &stat)

Protected Attributes

bool approximate_sync_
boost::shared_ptr
< message_filters::Synchronizer
< ApproximateSyncPolicy > > 
async_
int height_
ros::Publisher pub_
int queue_size_
bool static_image_size_
message_filters::Subscriber
< sensor_msgs::Image > 
sub_image_
message_filters::Subscriber
< PCLIndicesMsg
sub_input_
ros::Subscriber sub_input_static_
boost::shared_ptr
< message_filters::Synchronizer
< SyncPolicy > > 
sync_
int width_

Detailed Description

Definition at line 50 of file point_indices_to_mask_image.h.


Member Typedef Documentation

Definition at line 55 of file point_indices_to_mask_image.h.

Definition at line 58 of file point_indices_to_mask_image.h.


Constructor & Destructor Documentation

Definition at line 60 of file point_indices_to_mask_image.h.


Member Function Documentation

void jsk_pcl_ros_utils::PointIndicesToMaskImage::convertAndPublish ( const PCLIndicesMsg::ConstPtr &  indices_msg,
const int  width,
const int  height 
) [protected, virtual]

Definition at line 85 of file point_indices_to_mask_image_nodelet.cpp.

void jsk_pcl_ros_utils::PointIndicesToMaskImage::mask ( const PCLIndicesMsg::ConstPtr &  indices_msg) [protected, virtual]

Definition at line 107 of file point_indices_to_mask_image_nodelet.cpp.

void jsk_pcl_ros_utils::PointIndicesToMaskImage::mask ( const PCLIndicesMsg::ConstPtr &  indices_msg,
const sensor_msgs::Image::ConstPtr &  image_msg 
) [protected, virtual]

Definition at line 114 of file point_indices_to_mask_image_nodelet.cpp.

void jsk_pcl_ros_utils::PointIndicesToMaskImage::onInit ( void  ) [protected, virtual]

Reimplemented from jsk_topic_tools::DiagnosticNodelet.

Definition at line 43 of file point_indices_to_mask_image_nodelet.cpp.

Reimplemented from jsk_topic_tools::DiagnosticNodelet.

Definition at line 122 of file point_indices_to_mask_image_nodelet.cpp.


Member Data Documentation

Definition at line 83 of file point_indices_to_mask_image.h.

Definition at line 89 of file point_indices_to_mask_image.h.

Definition at line 87 of file point_indices_to_mask_image.h.

Definition at line 93 of file point_indices_to_mask_image.h.

Definition at line 84 of file point_indices_to_mask_image.h.

Definition at line 85 of file point_indices_to_mask_image.h.

Definition at line 92 of file point_indices_to_mask_image.h.

Definition at line 91 of file point_indices_to_mask_image.h.

Definition at line 90 of file point_indices_to_mask_image.h.

Definition at line 88 of file point_indices_to_mask_image.h.

Definition at line 86 of file point_indices_to_mask_image.h.


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


jsk_pcl_ros_utils
Author(s): Yohei Kakiuchi
autogenerated on Sun Oct 8 2017 02:43:05