#include <rocon_rtsp_camera_relay.hpp>
Public Member Functions | |
bool | init (const std::string video_stream_url) |
bool | reset (const std::string video_stream_url) |
RoconRtspCameraRelay (ros::NodeHandle &n) | |
void | spin () |
~RoconRtspCameraRelay () | |
Protected Member Functions | |
void | convertCvToRosImg (const cv::Mat &mat, sensor_msgs::Image &ros_img, sensor_msgs::CameraInfo &ci) |
Private Attributes | |
ros::NodeHandle | nh_ |
ros::Publisher | pub_camera_info_ |
ros::Publisher | pub_status_ |
image_transport::Publisher | pub_video_ |
std::string | status_ |
cv::VideoCapture | vcap_ |
std::string | video_stream_address_ |
Definition at line 21 of file rocon_rtsp_camera_relay.hpp.
Definition at line 10 of file rocon_rtsp_camera_relay.cpp.
Definition at line 18 of file rocon_rtsp_camera_relay.cpp.
void rocon::RoconRtspCameraRelay::convertCvToRosImg | ( | const cv::Mat & | mat, |
sensor_msgs::Image & | ros_img, | ||
sensor_msgs::CameraInfo & | ci | ||
) | [protected] |
Definition at line 41 of file rocon_rtsp_camera_relay.cpp.
bool rocon::RoconRtspCameraRelay::init | ( | const std::string | video_stream_url | ) |
Definition at line 23 of file rocon_rtsp_camera_relay.cpp.
bool rocon::RoconRtspCameraRelay::reset | ( | const std::string | video_stream_url | ) |
Definition at line 32 of file rocon_rtsp_camera_relay.cpp.
void rocon::RoconRtspCameraRelay::spin | ( | ) |
Definition at line 57 of file rocon_rtsp_camera_relay.cpp.
Definition at line 42 of file rocon_rtsp_camera_relay.hpp.
Definition at line 40 of file rocon_rtsp_camera_relay.hpp.
Definition at line 41 of file rocon_rtsp_camera_relay.hpp.
Definition at line 39 of file rocon_rtsp_camera_relay.hpp.
std::string rocon::RoconRtspCameraRelay::status_ [private] |
Definition at line 37 of file rocon_rtsp_camera_relay.hpp.
cv::VideoCapture rocon::RoconRtspCameraRelay::vcap_ [private] |
Definition at line 35 of file rocon_rtsp_camera_relay.hpp.
std::string rocon::RoconRtspCameraRelay::video_stream_address_ [private] |
Definition at line 36 of file rocon_rtsp_camera_relay.hpp.