#include <image_algos.h>
Public Types | |
typedef sensor_msgs::Image | InputType |
typedef void | OutputType |
Public Member Functions | |
ImageAlgo () | |
virtual void | init (ros::NodeHandle &)=0 |
OutputType | output () |
virtual void | post ()=0 |
virtual void | pre ()=0 |
virtual std::vector< std::string > | provides ()=0 |
virtual std::vector< std::string > | requires ()=0 |
Static Public Member Functions | |
static std::string | default_input_topic () |
static std::string | default_node_name () |
static std::string | default_output_topic () |
Definition at line 15 of file image_algos.h.
typedef sensor_msgs::Image image_algos::ImageAlgo::InputType |
Reimplemented in image_algos::PCDToImageProjector, and image_algos::ColorFindHSV.
Definition at line 21 of file image_algos.h.
Reimplemented in image_algos::PCDToImageProjector, and image_algos::ColorFindHSV.
Definition at line 18 of file image_algos.h.
image_algos::ImageAlgo::ImageAlgo | ( | ) | [inline] |
Definition at line 18 of file image_algos.h.
static std::string image_algos::ImageAlgo::default_input_topic | ( | ) | [inline, static] |
Reimplemented in image_algos::PCDToImageProjector, and image_algos::ColorFindHSV.
Definition at line 23 of file image_algos.h.
static std::string image_algos::ImageAlgo::default_node_name | ( | ) | [inline, static] |
Reimplemented in image_algos::PCDToImageProjector, and image_algos::ColorFindHSV.
Definition at line 24 of file image_algos.h.
static std::string image_algos::ImageAlgo::default_output_topic | ( | ) | [inline, static] |
Reimplemented in image_algos::PCDToImageProjector, and image_algos::ColorFindHSV.
Definition at line 22 of file image_algos.h.
virtual void image_algos::ImageAlgo::init | ( | ros::NodeHandle & | ) | [pure virtual] |
Implemented in image_algos::PCDToImageProjector, and image_algos::ColorFindHSV.
Reimplemented in image_algos::PCDToImageProjector, and image_algos::ColorFindHSV.
virtual void image_algos::ImageAlgo::post | ( | ) | [pure virtual] |
Implemented in image_algos::PCDToImageProjector, and image_algos::ColorFindHSV.
virtual void image_algos::ImageAlgo::pre | ( | ) | [pure virtual] |
Implemented in image_algos::PCDToImageProjector, and image_algos::ColorFindHSV.
virtual std::vector<std::string> image_algos::ImageAlgo::provides | ( | ) | [pure virtual] |
Implemented in image_algos::PCDToImageProjector, and image_algos::ColorFindHSV.
virtual std::vector<std::string> image_algos::ImageAlgo::requires | ( | ) | [pure virtual] |
Implemented in image_algos::PCDToImageProjector, and image_algos::ColorFindHSV.