#include <processor.h>
Public Types | |
| enum | { MONO = 1 << 0, RECT = 1 << 1, COLOR = 1 << 2, RECT_COLOR = 1 << 3, ALL = MONO | RECT | COLOR | RECT_COLOR } |
Public Member Functions | |
| bool | process (const sensor_msgs::ImageConstPtr &raw_image, const image_geometry::PinholeCameraModel &model, ImageSet &output, int flags=ALL) const |
| Processor () | |
Public Attributes | |
| int | interpolation_ |
Definition at line 18 of file processor.h.
| anonymous enum |
Definition at line 28 of file processor.h.
| image_proc::Processor::Processor | ( | ) | [inline] |
Definition at line 21 of file processor.h.
| bool image_proc::Processor::process | ( | const sensor_msgs::ImageConstPtr & | raw_image, | |
| const image_geometry::PinholeCameraModel & | model, | |||
| ImageSet & | output, | |||
| int | flags = ALL | |||
| ) | const |
Definition at line 7 of file processor.cpp.
Definition at line 26 of file processor.h.