#include <convex_hull_mask_image.h>

Public Member Functions | |
| ConvexHullMaskImage () | |
Protected Member Functions | |
| virtual void | onInit () |
| virtual void | rectify (const sensor_msgs::Image::ConstPtr &mask_msg) |
| virtual void | subscribe () |
| virtual void | unsubscribe () |
Protected Attributes | |
| boost::mutex | mutex_ |
| ros::Publisher | pub_ |
| ros::Subscriber | sub_ |
Definition at line 48 of file convex_hull_mask_image.h.
Definition at line 51 of file convex_hull_mask_image.h.
| void jsk_perception::ConvexHullMaskImage::onInit | ( | ) | [protected, virtual] |
Reimplemented from jsk_topic_tools::DiagnosticNodelet.
Definition at line 47 of file convex_hull_mask_image.cpp.
| void jsk_perception::ConvexHullMaskImage::rectify | ( | const sensor_msgs::Image::ConstPtr & | mask_msg | ) | [protected, virtual] |
Definition at line 66 of file convex_hull_mask_image.cpp.
| void jsk_perception::ConvexHullMaskImage::subscribe | ( | ) | [protected, virtual] |
Implements jsk_topic_tools::ConnectionBasedNodelet.
Definition at line 54 of file convex_hull_mask_image.cpp.
| void jsk_perception::ConvexHullMaskImage::unsubscribe | ( | ) | [protected, virtual] |
Implements jsk_topic_tools::ConnectionBasedNodelet.
Definition at line 61 of file convex_hull_mask_image.cpp.
boost::mutex jsk_perception::ConvexHullMaskImage::mutex_ [protected] |
Definition at line 59 of file convex_hull_mask_image.h.
Definition at line 60 of file convex_hull_mask_image.h.
Definition at line 61 of file convex_hull_mask_image.h.