Provides a ROS interface for creating videos that are useful for capturing the operation of a robot. More...
#include <gazebo_video_monitor_plugin.h>
Public Member Functions | |
GazeboVideoMonitorPlugin () | |
virtual void | Load (sensors::SensorPtr _sensor, sdf::ElementPtr _sdf) override |
virtual void | Reset () override |
virtual | ~GazeboVideoMonitorPlugin () override |
![]() | |
GazeboMonitorBasePlugin (const std::string &name) | |
virtual void | Init () override |
virtual | ~GazeboMonitorBasePlugin () override |
Private Member Functions | |
virtual void | initRos () override |
virtual void | onNewImages (const ImageDataPtrVector &images) override |
bool | startRecordingServiceCallback (gazebo_video_monitor_msgs::StartGvmRecordingRequest &req, gazebo_video_monitor_msgs::StartGvmRecordingResponse &res) |
std::string | stopRecording (bool discard, std::string filename="") |
bool | stopRecordingServiceCallback (gazebo_video_monitor_msgs::StopRecordingRequest &req, gazebo_video_monitor_msgs::StopRecordingResponse &res) |
Private Attributes | |
const std::vector< std::string > | camera_names_ |
bool | disable_window_ |
GazeboVideoRecorderPtr | recorder_ |
std::mutex | recorder_mutex_ |
bool | world_as_main_view_ |
Additional Inherited Members | |
![]() | |
using | ImageDataPtrVector = std::vector< sensors::GvmMulticameraSensor::ImageDataPtr > |
![]() | |
RefModelConfigConstPtr | getCameraRefConfig (const std::string &name) const |
void | initialize () |
![]() | |
const std::string | logger_prefix_ |
ros::NodeHandlePtr | nh_ |
boost::filesystem::path | save_path_ |
sdf::ElementPtr | sdf_ |
sensors::GvmMulticameraSensorPtr | sensor_ |
ros::ServiceServer | start_recording_service_ |
ros::ServiceServer | stop_recording_service_ |
physics::WorldPtr | world_ |
Provides a ROS interface for creating videos that are useful for capturing the operation of a robot.
Creates videos that present two views of the gazebo world: one stationary (world) view, and one view that is attached to a (robot) model. Additional metadata are shown in the video, like real time, sim time, and elapsed real time since the start of the recording.
Definition at line 55 of file gazebo_video_monitor_plugin.h.
gazebo::GazeboVideoMonitorPlugin::GazeboVideoMonitorPlugin | ( | ) |
Definition at line 25 of file gazebo_video_monitor_plugin.cpp.
|
overridevirtual |
Definition at line 29 of file gazebo_video_monitor_plugin.cpp.
|
overrideprivatevirtual |
Reimplemented from gazebo::GazeboMonitorBasePlugin.
Definition at line 59 of file gazebo_video_monitor_plugin.cpp.
|
overridevirtual |
Reimplemented from gazebo::GazeboMonitorBasePlugin.
Definition at line 31 of file gazebo_video_monitor_plugin.cpp.
|
overrideprivatevirtual |
Implements gazebo::GazeboMonitorBasePlugin.
Definition at line 81 of file gazebo_video_monitor_plugin.cpp.
|
overridevirtual |
Definition at line 54 of file gazebo_video_monitor_plugin.cpp.
|
private |
Definition at line 97 of file gazebo_video_monitor_plugin.cpp.
|
private |
Definition at line 91 of file gazebo_video_monitor_plugin.cpp.
|
private |
Definition at line 121 of file gazebo_video_monitor_plugin.cpp.
|
private |
Definition at line 73 of file gazebo_video_monitor_plugin.h.
|
private |
Definition at line 77 of file gazebo_video_monitor_plugin.h.
|
private |
Definition at line 75 of file gazebo_video_monitor_plugin.h.
|
private |
Definition at line 76 of file gazebo_video_monitor_plugin.h.
|
private |
Definition at line 78 of file gazebo_video_monitor_plugin.h.