3 #define foreach BOOST_FOREACH 15 playback_speed_ = 1.0;
45 std::vector<std::string> topics;
46 std::pair<std::string, BagCallback *> cb;
48 topics.push_back(cb.first);
std::map< std::string, BagCallback * > cbs_
rs2rosinternal::Time getEndTime()
GLenum GLenum GLenum GLenum GLenum scale
void set_end(const rs2rosinternal::Time &end)
Base class for rosbag exceptions.
void set_playback_speed(double scale)
GLsizei const GLchar *const * string
void unregister_callback(const std::string &topic)
void set_start(const rs2rosinternal::Time &start)
rs2rosinternal::Time getBeginTime()
void close()
Close the bag file.
rs2rosinternal::Time const & getTime() const
rs2rosinternal::Time bag_start_
A class pointing into a bag file.
Time representation. May either represent wall clock time or ROS clock time.
static bool sleepUntil(const Time &end)
Sleep until a specific time has been reached.
BagPlayer(const std::string &filename)
rs2rosinternal::Time real_time(const rs2rosinternal::Time &msg_time)
rs2rosinternal::Time bag_end_
rs2rosinternal::Time last_message_time_
rs2rosinternal::Time play_start_
std::string const & getTopic() const
static Time now()
Retrieve the current time. If ROS clock time is in use, this returns the time according to the ROS cl...
::std_msgs::Time_< std::allocator< void > > Time
rs2rosinternal::Time get_time()