#include <image_bag_processor.h>
Public Types | |
typedef boost::function< void(const sensor_msgs::CompressedImageConstPtr &)> | CallbackCompressedType |
typedef boost::function< void(const sensor_msgs::ImageConstPtr &)> | CallbackType |
Public Member Functions | |
ImageBagProcessor (const std::string &image_topic) | |
void | processBag (const std::string &filename) |
void | registerCallback (const CallbackType &callback) |
void | registerCompressedCallback (const CallbackCompressedType &callback) |
Private Attributes | |
CallbackType | callback_ |
CallbackCompressedType | callback_compressed_ |
std::string | image_topic_ |
Definition at line 42 of file image_bag_processor.h.
typedef boost::function<void (const sensor_msgs::CompressedImageConstPtr&)> bag_tools::ImageBagProcessor::CallbackCompressedType |
Definition at line 48 of file image_bag_processor.h.
typedef boost::function<void (const sensor_msgs::ImageConstPtr&)> bag_tools::ImageBagProcessor::CallbackType |
Definition at line 47 of file image_bag_processor.h.
bag_tools::ImageBagProcessor::ImageBagProcessor | ( | const std::string & | image_topic | ) | [inline] |
Definition at line 50 of file image_bag_processor.h.
void bag_tools::ImageBagProcessor::processBag | ( | const std::string & | filename | ) | [inline] |
Processes given bagfile, calls registered callback function when a message is found.
Definition at line 70 of file image_bag_processor.h.
void bag_tools::ImageBagProcessor::registerCallback | ( | const CallbackType & | callback | ) | [inline] |
Definition at line 56 of file image_bag_processor.h.
void bag_tools::ImageBagProcessor::registerCompressedCallback | ( | const CallbackCompressedType & | callback | ) | [inline] |
Definition at line 61 of file image_bag_processor.h.
Definition at line 112 of file image_bag_processor.h.
Definition at line 113 of file image_bag_processor.h.
std::string bag_tools::ImageBagProcessor::image_topic_ [private] |
Definition at line 111 of file image_bag_processor.h.