#include <image_subscriber.h>
Public Types | |
typedef boost::shared_ptr < ImageSubscriber > | ptr |
Public Member Functions | |
void | emptyQueue () |
void | getImageFromQueue (sensor_msgs::ImageConstPtr &frame) |
ImageSubscriber (const std::string &topic, const std::string &transport) | |
virtual | ~ImageSubscriber () |
Private Member Functions | |
void | image_cb (const sensor_msgs::ImageConstPtr &msg) |
void | reset () |
void | subscribe () |
Private Attributes | |
boost::mutex | frame_mutex_ |
std::deque < sensor_msgs::ImageConstPtr > | frame_queue_ |
image_transport::ImageTransport | it |
ros::NodeHandle | nh |
boost::shared_ptr < image_transport::SubscriberFilter > | sub |
const std::string | topic_ |
const std::string | transport_ |
Definition at line 60 of file image_subscriber.h.
typedef boost::shared_ptr<ImageSubscriber> ros_http_video_streamer::ImageSubscriber::ptr |
Definition at line 64 of file image_subscriber.h.
ros_http_video_streamer::ImageSubscriber::ImageSubscriber | ( | const std::string & | topic, |
const std::string & | transport | ||
) |
Definition at line 44 of file image_subscriber.cpp.
Definition at line 59 of file image_subscriber.cpp.
Definition at line 76 of file image_subscriber.cpp.
void ros_http_video_streamer::ImageSubscriber::getImageFromQueue | ( | sensor_msgs::ImageConstPtr & | frame | ) |
Definition at line 93 of file image_subscriber.cpp.
void ros_http_video_streamer::ImageSubscriber::image_cb | ( | const sensor_msgs::ImageConstPtr & | msg | ) | [private] |
Definition at line 81 of file image_subscriber.cpp.
void ros_http_video_streamer::ImageSubscriber::reset | ( | ) | [private] |
void ros_http_video_streamer::ImageSubscriber::subscribe | ( | ) | [private] |
Definition at line 65 of file image_subscriber.cpp.
boost::mutex ros_http_video_streamer::ImageSubscriber::frame_mutex_ [private] |
Definition at line 96 of file image_subscriber.h.
std::deque<sensor_msgs::ImageConstPtr> ros_http_video_streamer::ImageSubscriber::frame_queue_ [private] |
Definition at line 98 of file image_subscriber.h.
Definition at line 92 of file image_subscriber.h.
Definition at line 90 of file image_subscriber.h.
boost::shared_ptr<image_transport::SubscriberFilter> ros_http_video_streamer::ImageSubscriber::sub [private] |
Definition at line 93 of file image_subscriber.h.
const std::string ros_http_video_streamer::ImageSubscriber::topic_ [private] |
Definition at line 85 of file image_subscriber.h.
const std::string ros_http_video_streamer::ImageSubscriber::transport_ [private] |
Definition at line 87 of file image_subscriber.h.