#include <rgb_decomposer.h>
Public Member Functions | |
RGBDecomposer () | |
Protected Member Functions | |
virtual void | decompose (const sensor_msgs::Image::ConstPtr &image_msg) |
virtual void | onInit () |
virtual void | subscribe () |
virtual void | unsubscribe () |
Protected Attributes | |
ros::Publisher | pub_b_ |
ros::Publisher | pub_g_ |
ros::Publisher | pub_r_ |
ros::Subscriber | sub_ |
Definition at line 45 of file rgb_decomposer.h.
jsk_perception::RGBDecomposer::RGBDecomposer | ( | ) | [inline] |
Definition at line 48 of file rgb_decomposer.h.
void jsk_perception::RGBDecomposer::decompose | ( | const sensor_msgs::Image::ConstPtr & | image_msg | ) | [protected, virtual] |
Definition at line 62 of file rgb_decomposer.cpp.
void jsk_perception::RGBDecomposer::onInit | ( | ) | [protected, virtual] |
Reimplemented from jsk_topic_tools::DiagnosticNodelet.
Definition at line 44 of file rgb_decomposer.cpp.
void jsk_perception::RGBDecomposer::subscribe | ( | ) | [protected, virtual] |
Implements jsk_topic_tools::ConnectionBasedNodelet.
Definition at line 52 of file rgb_decomposer.cpp.
void jsk_perception::RGBDecomposer::unsubscribe | ( | ) | [protected, virtual] |
Implements jsk_topic_tools::ConnectionBasedNodelet.
Definition at line 57 of file rgb_decomposer.cpp.
ros::Publisher jsk_perception::RGBDecomposer::pub_b_ [protected] |
Definition at line 58 of file rgb_decomposer.h.
ros::Publisher jsk_perception::RGBDecomposer::pub_g_ [protected] |
Definition at line 57 of file rgb_decomposer.h.
ros::Publisher jsk_perception::RGBDecomposer::pub_r_ [protected] |
Definition at line 56 of file rgb_decomposer.h.
ros::Subscriber jsk_perception::RGBDecomposer::sub_ [protected] |
Definition at line 55 of file rgb_decomposer.h.