Functions | Variables
video_recorder.cpp File Reference
#include <opencv2/highgui/highgui.hpp>
#include <ros/ros.h>
#include <cv_bridge/cv_bridge.h>
#include <image_transport/image_transport.h>
#include <camera_calibration_parsers/parse.h>
Include dependency graph for video_recorder.cpp:

Go to the source code of this file.

Functions

void callback (const sensor_msgs::ImageConstPtr &image_msg, const sensor_msgs::CameraInfoConstPtr &info)
int main (int argc, char **argv)

Variables

std::string codec
std::string encoding
std::string filename
int fps
int g_count = 0
cv::VideoWriter outputVideo

Function Documentation

void callback ( const sensor_msgs::ImageConstPtr &  image_msg,
const sensor_msgs::CameraInfoConstPtr &  info 
)

Definition at line 35 of file video_recorder.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 81 of file video_recorder.cpp.


Variable Documentation

std::string codec

Definition at line 31 of file video_recorder.cpp.

std::string encoding

Definition at line 30 of file video_recorder.cpp.

std::string filename

Definition at line 33 of file video_recorder.cpp.

int fps

Definition at line 32 of file video_recorder.cpp.

int g_count = 0

Definition at line 29 of file video_recorder.cpp.

cv::VideoWriter outputVideo

Definition at line 27 of file video_recorder.cpp.



image_view
Author(s): Patrick Mihelich
autogenerated on Mon Oct 6 2014 00:45:31