Go to the documentation of this file.
43 std::vector<std::string> topics;
44 for(
auto const &
cb :
cbs_ )
45 topics.push_back(
cb.first);
50 for(
auto const &
m :
view )
52 if (
cbs_.find(
m.getTopic()) ==
cbs_.end())
58 cbs_[
m.getTopic()]->call(
m);
Time representation. May either represent wall clock time or ROS clock time.
BagPlayer(const std::string &filename)
rs2rosinternal::Time get_time()
GLsizei const GLchar *const * string
std::map< std::string, BagCallback * > cbs_
void close()
Close the bag file.
static Time now()
Retrieve the current time. If ROS clock time is in use, this returns the time according to the ROS cl...
rs2rosinternal::Time real_time(const rs2rosinternal::Time &msg_time)
void set_end(const rs2rosinternal::Time &end)
void unregister_callback(const std::string &topic)
void set_start(const rs2rosinternal::Time &start)
rs2rosinternal::Time bag_end_
rs2rosinternal::Time play_start_
static bool sleepUntil(const Time &end)
Sleep until a specific time has been reached.
::std_msgs::Time_< std::allocator< void > > Time
rs2rosinternal::Time last_message_time_
void set_playback_speed(double scale)
void open(std::string const &filename, uint32_t mode=bagmode::Read)
Open a bag file.
rs2rosinternal::Time bag_start_
librealsense2
Author(s): LibRealSense ROS Team
autogenerated on Fri Aug 2 2024 08:30:01