#include <ros/ros.h>
#include <sensor_msgs/CompressedImage.h>
#include <image_transport/image_transport.h>
#include <boost/thread.hpp>
#include <boost/tuple/tuple.hpp>
#include <boost/lexical_cast.hpp>
#include "mongoose.h"
Go to the source code of this file.
Classes | |
class | JPEGStreamer |
Functions | |
int | main (int argc, char **argv) |
void * | new_req_callback (enum mg_event event, struct mg_connection *con, const struct mg_request_info *req) |
Variables | |
static JPEGStreamer * | g_status_video |
static char | header_text [] = "Content-Type: multipart/x-mixed-replace;boundary=--myboundary\r\n\r\n" |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 122 of file jpeg_streamer.cpp.
void* new_req_callback | ( | enum mg_event | event, |
struct mg_connection * | con, | ||
const struct mg_request_info * | req | ||
) |
Definition at line 34 of file jpeg_streamer.cpp.
JPEGStreamer* g_status_video [static] |
Definition at line 32 of file jpeg_streamer.cpp.
char header_text[] = "Content-Type: multipart/x-mixed-replace;boundary=--myboundary\r\n\r\n" [static] |
Definition at line 74 of file jpeg_streamer.cpp.