Functions | Variables
record.cpp File Reference
#include <string>
#include <ros/callback_queue.h>
#include <ros/console.h>
#include <ros/init.h>
#include <ros/node_handle.h>
#include <ros/param.h>
#include <ros/publisher.h>
#include <ros/service_server.h>
#include <ros/spinner.h>
#include <rosbag/recorder.h>
#include <std_msgs/Bool.h>
#include <std_srvs/Empty.h>
#include <boost/scoped_ptr.hpp>
#include <boost/thread/thread.hpp>
Include dependency graph for record.cpp:

Go to the source code of this file.

Functions

int main (int argc, char *argv[])
 
void publishIsRecording (const bool is_recording)
 
void sleepAndShutdown ()
 
bool start (std_srvs::Empty::Request &, std_srvs::Empty::Response &)
 
bool stop (std_srvs::Empty::Request &, std_srvs::Empty::Response &)
 

Variables

ros::Publisher is_recording_publisher
 
boost::scoped_ptr< rosbag::Recorderrecorder
 
boost::thread run_thread
 
boost::thread shutdown_thread
 

Function Documentation

int main ( int  argc,
char *  argv[] 
)

Definition at line 120 of file record.cpp.

void publishIsRecording ( const bool  is_recording)

Definition at line 23 of file record.cpp.

void sleepAndShutdown ( )

Definition at line 92 of file record.cpp.

bool start ( std_srvs::Empty::Request &  ,
std_srvs::Empty::Response &   
)

Definition at line 29 of file record.cpp.

bool stop ( std_srvs::Empty::Request &  ,
std_srvs::Empty::Response &   
)

Definition at line 97 of file record.cpp.

Variable Documentation

ros::Publisher is_recording_publisher

Definition at line 21 of file record.cpp.

boost::scoped_ptr< rosbag::Recorder > recorder

Definition at line 18 of file record.cpp.

boost::thread run_thread

Definition at line 19 of file record.cpp.

boost::thread shutdown_thread

Definition at line 20 of file record.cpp.



remote_rosbag_record
Author(s):
autogenerated on Wed Jan 27 2021 03:18:31