#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 52 of file processor.h.
anonymous enum |
Enumerator | |
---|---|
MONO | |
RECT | |
COLOR | |
RECT_COLOR | |
ALL |
Definition at line 62 of file processor.h.
|
inline |
Definition at line 55 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 42 of file processor.cpp.
int image_proc::Processor::interpolation_ |
Definition at line 60 of file processor.h.