#include <stdlib.h>
#include <unistd.h>
#include <iostream>
#include <gst/gst.h>
#include <gst/app/gstappsink.h>
#include <ros/ros.h>
#include <image_transport/image_transport.h>
#include <sensor_msgs/Image.h>
#include <sensor_msgs/CameraInfo.h>
#include <sensor_msgs/SetCameraInfo.h>
#include <camera_calibration_parsers/parse_ini.h>
#include <sys/ipc.h>
#include <sys/shm.h>
Go to the source code of this file.
Function Documentation
int main |
( |
int |
argc, |
|
|
char ** |
argv |
|
) |
| |
static gboolean processData |
( |
GstPad * |
pad, |
|
|
GstBuffer * |
buffer, |
|
|
gpointer |
u_data |
|
) |
| [static] |
bool setCameraInfo |
( |
sensor_msgs::SetCameraInfo::Request & |
req, |
|
|
sensor_msgs::SetCameraInfo::Response & |
rsp |
|
) |
| |
Variable Documentation