Public Member Functions | Private Attributes | List of all members
naoqi::recorder::GlobalRecorder Class Reference

GlobalRecorder concept interface. More...

#include <globalrecorder.hpp>

Public Member Functions

 GlobalRecorder (const std::string &prefix_topic)
 Constructor for recorder interface. More...
 
bool isStarted ()
 Check if the ROSbag is opened. More...
 
void startRecord (const std::string &prefix_bag="")
 Initialize the recording of the ROSbag. More...
 
std::string stopRecord (const std::string &robot_ip="<ROBOT_IP>")
 Terminate the recording of the ROSbag. More...
 
template<class T >
void write (const std::string &topic, const T &msg, const ros::Time &time=ros::Time::now())
 Insert data into the ROSbag. More...
 
void write (const std::string &topic, const std::vector< geometry_msgs::TransformStamped > &msgtf)
 

Private Attributes

rosbag::Bag _bag
 
bool _isStarted
 
std::string _nameBag
 
std::string _prefix_topic
 
boost::mutex _processMutex
 
std::vector< Topics_topics
 

Detailed Description

GlobalRecorder concept interface.

Note
this defines an private concept struct, which each instance has to implement
a type erasure pattern in implemented here to avoid strict inheritance, thus each possible publisher instance has to implement the virtual functions mentioned in the concept

Definition at line 57 of file globalrecorder.hpp.

Constructor & Destructor Documentation

naoqi::recorder::GlobalRecorder::GlobalRecorder ( const std::string &  prefix_topic)

Constructor for recorder interface.

Definition at line 58 of file globalrecorder.cpp.

Member Function Documentation

bool naoqi::recorder::GlobalRecorder::isStarted ( )

Check if the ROSbag is opened.

Definition at line 138 of file globalrecorder.cpp.

void naoqi::recorder::GlobalRecorder::startRecord ( const std::string &  prefix_bag = "")

Initialize the recording of the ROSbag.

Definition at line 74 of file globalrecorder.cpp.

std::string naoqi::recorder::GlobalRecorder::stopRecord ( const std::string &  robot_ip = "<ROBOT_IP>")

Terminate the recording of the ROSbag.

Definition at line 109 of file globalrecorder.cpp.

template<class T >
void naoqi::recorder::GlobalRecorder::write ( const std::string &  topic,
const T &  msg,
const ros::Time time = ros::Time::now() 
)
inline

Insert data into the ROSbag.

Definition at line 81 of file globalrecorder.hpp.

void naoqi::recorder::GlobalRecorder::write ( const std::string &  topic,
const std::vector< geometry_msgs::TransformStamped > &  msgtf 
)

Definition at line 142 of file globalrecorder.cpp.

Member Data Documentation

rosbag::Bag naoqi::recorder::GlobalRecorder::_bag
private

Definition at line 108 of file globalrecorder.hpp.

bool naoqi::recorder::GlobalRecorder::_isStarted
private

Definition at line 110 of file globalrecorder.hpp.

std::string naoqi::recorder::GlobalRecorder::_nameBag
private

Definition at line 109 of file globalrecorder.hpp.

std::string naoqi::recorder::GlobalRecorder::_prefix_topic
private

Definition at line 106 of file globalrecorder.hpp.

boost::mutex naoqi::recorder::GlobalRecorder::_processMutex
private

Definition at line 107 of file globalrecorder.hpp.

std::vector<Topics> naoqi::recorder::GlobalRecorder::_topics
private

Definition at line 113 of file globalrecorder.hpp.


The documentation for this class was generated from the following files:


naoqi_driver
Author(s): Karsten Knese
autogenerated on Sat Feb 15 2020 03:24:26