Functions | Variables
servers.cpp File Reference
#include <actionlib/server/action_server.h>
#include <boost/foreach.hpp>
#include <cv_bridge/cv_bridge.h>
#include <fstream>
#include <opencv-3.3.1-dev/opencv2/opencv.hpp>
#include <opencv-3.3.1-dev/opencv2/videoio.hpp>
#include <ros/ros.h>
#include <rosbag/bag.h>
#include <rosbag/view.h>
#include <rqt_bag_exporter/CloseBag.h>
#include <rqt_bag_exporter/EstimateVideoFps.h>
#include <rqt_bag_exporter/ExportToCSVAction.h>
#include <rqt_bag_exporter/ExportToVideoAction.h>
#include <rqt_bag_exporter/GetDuration.h>
#include <rqt_bag_exporter/ListTopics.h>
#include <rqt_bag_exporter/OpenBag.h>
#include <sensor_msgs/CompressedImage.h>
#include <std_msgs/Bool.h>
#include <std_msgs/Duration.h>
#include <std_msgs/Float32.h>
#include <std_msgs/Float64.h>
#include <std_msgs/Int16.h>
#include <std_msgs/Int32.h>
#include <std_msgs/Int64.h>
#include <std_msgs/Int8.h>
#include <std_msgs/String.h>
#include <std_msgs/Time.h>
#include <std_msgs/UInt16.h>
#include <std_msgs/UInt32.h>
#include <std_msgs/UInt64.h>
#include <std_msgs/UInt8.h>
#include <string>
Include dependency graph for servers.cpp:

Go to the source code of this file.

Functions

std::string bag_file_name ("")
 
bool closeBag (rqt_bag_exporter::CloseBag::Request &, rqt_bag_exporter::CloseBag::Response &)
 
bool estimateVideoFps (rqt_bag_exporter::EstimateVideoFps::Request &req, rqt_bag_exporter::EstimateVideoFps::Response &res)
 
void exportCsv (actionlib::ServerGoalHandle< rqt_bag_exporter::ExportToCSVAction > gh)
 
void exportCsvCancelCb (actionlib::ServerGoalHandle< rqt_bag_exporter::ExportToCSVAction > gh)
 
void exportVideo (actionlib::ServerGoalHandle< rqt_bag_exporter::ExportToVideoAction > gh)
 
void exportVideoCancelCb (actionlib::ServerGoalHandle< rqt_bag_exporter::ExportToVideoAction > gh)
 
bool getDuration (rqt_bag_exporter::GetDuration::Request &, rqt_bag_exporter::GetDuration::Response &res)
 
bool listTopics (rqt_bag_exporter::ListTopics::Request &, rqt_bag_exporter::ListTopics::Response &res)
 
int main (int argc, char **argv)
 
bool openBag (rqt_bag_exporter::OpenBag::Request &req, rqt_bag_exporter::OpenBag::Response &res)
 

Variables

std::shared_ptr< rosbag::Bagbag
 

Function Documentation

std::string bag_file_name ( ""  )
bool closeBag ( rqt_bag_exporter::CloseBag::Request &  ,
rqt_bag_exporter::CloseBag::Response &   
)

Definition at line 340 of file servers.cpp.

bool estimateVideoFps ( rqt_bag_exporter::EstimateVideoFps::Request &  req,
rqt_bag_exporter::EstimateVideoFps::Response &  res 
)

Definition at line 369 of file servers.cpp.

void exportCsv ( actionlib::ServerGoalHandle< rqt_bag_exporter::ExportToCSVAction >  gh)

Definition at line 161 of file servers.cpp.

void exportCsvCancelCb ( actionlib::ServerGoalHandle< rqt_bag_exporter::ExportToCSVAction >  gh)

Definition at line 305 of file servers.cpp.

void exportVideo ( actionlib::ServerGoalHandle< rqt_bag_exporter::ExportToVideoAction >  gh)

Definition at line 37 of file servers.cpp.

void exportVideoCancelCb ( actionlib::ServerGoalHandle< rqt_bag_exporter::ExportToVideoAction >  gh)

Definition at line 154 of file servers.cpp.

bool getDuration ( rqt_bag_exporter::GetDuration::Request &  ,
rqt_bag_exporter::GetDuration::Response &  res 
)

Definition at line 383 of file servers.cpp.

bool listTopics ( rqt_bag_exporter::ListTopics::Request &  ,
rqt_bag_exporter::ListTopics::Response &  res 
)

Definition at line 350 of file servers.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 397 of file servers.cpp.

bool openBag ( rqt_bag_exporter::OpenBag::Request &  req,
rqt_bag_exporter::OpenBag::Response &  res 
)

Definition at line 312 of file servers.cpp.

Variable Documentation

std::shared_ptr<rosbag::Bag> bag

Definition at line 34 of file servers.cpp.



rqt_bag_exporter
Author(s): Romain Hernandez, Victor Lamoine - Institut Maupertuis
autogenerated on Mon Jun 10 2019 14:57:01