Functions | Variables
orsens_node.cpp File Reference
#include <ros/ros.h>
#include <ros/package.h>
#include <opencv2/imgproc/imgproc.hpp>
#include <opencv2/highgui/highgui.hpp>
#include <cv_bridge/cv_bridge.h>
#include <sensor_msgs/image_encodings.h>
#include <image_geometry/stereo_camera_model.h>
#include <image_transport/image_transport.h>
#include <sensor_msgs/Image.h>
#include <stereo_msgs/DisparityImage.h>
#include <std_msgs/Int32.h>
#include <sensor_msgs/fill_image.h>
#include <camera_info_manager/camera_info_manager.h>
#include <sstream>
#include <pcl_conversions/pcl_conversions.h>
#include <signal.h>
#include <errno.h>
#include <fcntl.h>
#include <linux/videodev2.h>
#include <stdint.h>
#include <stdio.h>
#include <string.h>
#include <sys/ioctl.h>
#include <sys/mman.h>
#include <unistd.h>
#include "orsens.h"
#include <orsens/Obstacles.h>
#include <orsens/Way.h>
Include dependency graph for orsens_node.cpp:

Go to the source code of this file.

Functions

int main (int argc, char **argv)
void sigint_handler (int sig)

Variables

CameraInfoManagercinfo_left
 TODO sharedptr.
CameraInfoManagercinfo_right
static Orsens orsens_device
static bool working = false

Function Documentation

int main ( int  argc,
char **  argv 
)

TODO find orsens here?

Definition at line 57 of file orsens_node.cpp.

void sigint_handler ( int  sig)

Definition at line 47 of file orsens_node.cpp.


Variable Documentation

TODO sharedptr.

Definition at line 40 of file orsens_node.cpp.

Definition at line 41 of file orsens_node.cpp.

Definition at line 43 of file orsens_node.cpp.

bool working = false [static]

Definition at line 45 of file orsens_node.cpp.



orsens_ros
Author(s):
autogenerated on Sat Jun 8 2019 18:30:26