#include <camera_bag_processor.h>
Public Member Functions | |
CameraBagProcessor (const std::string &camera_base_topic) | |
void | processBag (const std::string &filename) |
template<class C > | |
void | registerCallback (const C &callback) |
Private Attributes | |
std::string | camera_base_topic_ |
BagSubscriber< sensor_msgs::Image > | img_sub_ |
BagSubscriber < sensor_msgs::CameraInfo > | info_sub_ |
message_filters::TimeSynchronizer < sensor_msgs::Image, sensor_msgs::CameraInfo > | sync_ |
Definition at line 60 of file camera_bag_processor.h.
bag_tools::CameraBagProcessor::CameraBagProcessor | ( | const std::string & | camera_base_topic | ) | [inline] |
Definition at line 64 of file camera_bag_processor.h.
void bag_tools::CameraBagProcessor::processBag | ( | const std::string & | filename | ) | [inline] |
Processes given bagfile, calls registered callback function when a synchronized stereo pair with camera infos is found.
Definition at line 81 of file camera_bag_processor.h.
void bag_tools::CameraBagProcessor::registerCallback | ( | const C & | callback | ) | [inline] |
Definition at line 72 of file camera_bag_processor.h.
std::string bag_tools::CameraBagProcessor::camera_base_topic_ [private] |
Definition at line 130 of file camera_bag_processor.h.
BagSubscriber<sensor_msgs::Image> bag_tools::CameraBagProcessor::img_sub_ [private] |
Definition at line 127 of file camera_bag_processor.h.
BagSubscriber<sensor_msgs::CameraInfo> bag_tools::CameraBagProcessor::info_sub_ [private] |
Definition at line 128 of file camera_bag_processor.h.
message_filters::TimeSynchronizer<sensor_msgs::Image, sensor_msgs::CameraInfo> bag_tools::CameraBagProcessor::sync_ [private] |
Definition at line 132 of file camera_bag_processor.h.