Public Member Functions | |
| void | image_cb (const sensor_msgs::Image &msg) |
| magnitude_converter () | |
| virtual | ~magnitude_converter () |
Private Attributes | |
| ros::NodeHandle | _n |
| ros::Subscriber | _sub |
Definition at line 11 of file image_histogram.cpp.
| magnitude_converter::magnitude_converter | ( | ) | [inline] |
Definition at line 18 of file image_histogram.cpp.
| virtual magnitude_converter::~magnitude_converter | ( | ) | [inline, virtual] |
Definition at line 24 of file image_histogram.cpp.
| void magnitude_converter::image_cb | ( | const sensor_msgs::Image & | msg | ) | [inline] |
Definition at line 29 of file image_histogram.cpp.
ros::NodeHandle magnitude_converter::_n [private] |
Definition at line 14 of file image_histogram.cpp.
ros::Subscriber magnitude_converter::_sub [private] |
Definition at line 15 of file image_histogram.cpp.