#include <robot_to_mask_image.h>
Public Member Functions | |
RobotToMaskImage () | |
Protected Member Functions | |
virtual void | infoCallback (const sensor_msgs::CameraInfo::ConstPtr &info_msg) |
virtual void | initSelfMask (const ros::NodeHandle &pnh) |
virtual void | onInit () |
virtual void | subscribe () |
virtual void | unsubscribe () |
Protected Attributes | |
double | max_robot_dist_ |
ros::Publisher | pub_ |
boost::shared_ptr < robot_self_filter::SelfMask < pcl::PointXYZ > > | self_mask_ |
ros::Subscriber | sub_ |
tf::TransformListener | tf_listener_ |
Definition at line 49 of file robot_to_mask_image.h.
jsk_perception::RobotToMaskImage::RobotToMaskImage | ( | ) | [inline] |
Definition at line 52 of file robot_to_mask_image.h.
void jsk_perception::RobotToMaskImage::infoCallback | ( | const sensor_msgs::CameraInfo::ConstPtr & | info_msg | ) | [protected, virtual] |
Definition at line 62 of file robot_to_mask_image.cpp.
void jsk_perception::RobotToMaskImage::initSelfMask | ( | const ros::NodeHandle & | pnh | ) | [protected, virtual] |
Definition at line 89 of file robot_to_mask_image.cpp.
void jsk_perception::RobotToMaskImage::onInit | ( | ) | [protected, virtual] |
Reimplemented from jsk_topic_tools::DiagnosticNodelet.
Definition at line 43 of file robot_to_mask_image.cpp.
void jsk_perception::RobotToMaskImage::subscribe | ( | ) | [protected, virtual] |
Implements jsk_topic_tools::ConnectionBasedNodelet.
Definition at line 51 of file robot_to_mask_image.cpp.
void jsk_perception::RobotToMaskImage::unsubscribe | ( | ) | [protected, virtual] |
Implements jsk_topic_tools::ConnectionBasedNodelet.
Definition at line 57 of file robot_to_mask_image.cpp.
double jsk_perception::RobotToMaskImage::max_robot_dist_ [protected] |
Definition at line 66 of file robot_to_mask_image.h.
ros::Publisher jsk_perception::RobotToMaskImage::pub_ [protected] |
Definition at line 61 of file robot_to_mask_image.h.
boost::shared_ptr<robot_self_filter::SelfMask<pcl::PointXYZ> > jsk_perception::RobotToMaskImage::self_mask_ [protected] |
Definition at line 63 of file robot_to_mask_image.h.
Definition at line 60 of file robot_to_mask_image.h.
Definition at line 64 of file robot_to_mask_image.h.