#include <web_video_server.h>
Definition at line 19 of file web_video_server.h.
web_video_server::WebVideoServer::WebVideoServer | ( | ros::NodeHandle & | nh, |
ros::NodeHandle & | private_nh | ||
) |
web_video_server::WebVideoServer::~WebVideoServer | ( | ) | [virtual] |
Destructor - Cleans up.
Definition at line 70 of file web_video_server.cpp.
void web_video_server::WebVideoServer::cleanup_inactive_streams | ( | ) | [private] |
Definition at line 83 of file web_video_server.cpp.
bool web_video_server::WebVideoServer::handle_list_streams | ( | const async_web_server_cpp::HttpRequest & | request, |
async_web_server_cpp::HttpConnectionPtr | connection, | ||
const char * | begin, | ||
const char * | end | ||
) |
Definition at line 161 of file web_video_server.cpp.
bool web_video_server::WebVideoServer::handle_snapshot | ( | const async_web_server_cpp::HttpRequest & | request, |
async_web_server_cpp::HttpConnectionPtr | connection, | ||
const char * | begin, | ||
const char * | end | ||
) |
Definition at line 122 of file web_video_server.cpp.
bool web_video_server::WebVideoServer::handle_stream | ( | const async_web_server_cpp::HttpRequest & | request, |
async_web_server_cpp::HttpConnectionPtr | connection, | ||
const char * | begin, | ||
const char * | end | ||
) |
Definition at line 102 of file web_video_server.cpp.
bool web_video_server::WebVideoServer::handle_stream_viewer | ( | const async_web_server_cpp::HttpRequest & | request, |
async_web_server_cpp::HttpConnectionPtr | connection, | ||
const char * | begin, | ||
const char * | end | ||
) |
Definition at line 134 of file web_video_server.cpp.
Starts the server and spins.
Definition at line 74 of file web_video_server.cpp.
std::string web_video_server::WebVideoServer::address_ [private] |
Definition at line 57 of file web_video_server.h.
Definition at line 54 of file web_video_server.h.
async_web_server_cpp::HttpRequestHandlerGroup web_video_server::WebVideoServer::handler_group_ [private] |
Definition at line 59 of file web_video_server.h.
std::vector<boost::shared_ptr<ImageStreamer> > web_video_server::WebVideoServer::image_subscribers_ [private] |
Definition at line 61 of file web_video_server.h.
Definition at line 53 of file web_video_server.h.
int web_video_server::WebVideoServer::port_ [private] |
Definition at line 56 of file web_video_server.h.
int web_video_server::WebVideoServer::ros_threads_ [private] |
Definition at line 55 of file web_video_server.h.
boost::shared_ptr<async_web_server_cpp::HttpServer> web_video_server::WebVideoServer::server_ [private] |
Definition at line 58 of file web_video_server.h.
std::map<std::string, boost::shared_ptr<ImageStreamerType> > web_video_server::WebVideoServer::stream_types_ [private] |
Definition at line 62 of file web_video_server.h.
boost::mutex web_video_server::WebVideoServer::subscriber_mutex_ [private] |
Definition at line 63 of file web_video_server.h.