#include <ros/ros.h>
#include <ros/package.h>
#include <std_msgs/String.h>
#include <topic_tools/shape_shifter.h>
#include <rosbag/bag.h>
#include <rosbag/view.h>
#include <boost/foreach.hpp>
Go to the source code of this file.
Classes |
struct | BagMessage |
Functions |
std::vector< BagMessage > * | rrosBagRead (const char *filename, std::vector< std::string > *topics, unsigned int max_size=-1) |
Function Documentation
std::vector<BagMessage>* rrosBagRead |
( |
const char * |
filename, |
|
|
std::vector< std::string > * |
topics, |
|
|
unsigned int |
max_size = -1 |
|
) |
| |