Declarations for the DEPTH node. More...
#include "time.h"
#include <stereo_msgs/DisparityImage.h>
#include <sensor_msgs/CameraInfo.h>
#include <sensor_msgs/PointCloud2.h>
#include <sensor_msgs/image_encodings.h>
#include <image_transport/image_transport.h>
#include <boost/thread/thread.hpp>
#include <ros/ros.h>
#include <image_geometry/stereo_camera_model.h>
#include "ros_resources.hpp"
#include "general_resources.hpp"
#include "opencv_resources.hpp"
#include "camera.hpp"
#include "tools.hpp"
#include "improc.hpp"
#include "stereo.hpp"
#include <dynamic_reconfigure/server.h>
#include "depthConfig.h"
Go to the source code of this file.
Classes | |
struct | stereoData |
Stores configuration information for the stereo routine. More... | |
class | stereoDepthNode |
Manages the stereo procedure. More... | |
Defines | |
#define | MAXIMUM_FRAMES_TO_STORE 100 |
Typedefs | |
typedef dynamic_reconfigure::Server < thermalvis::depthConfig > | Server |
Variables | |
const char | __PROGRAM__ [] = "DEPTH" |
Declarations for the DEPTH node.
Definition in file depth.hpp.
#define MAXIMUM_FRAMES_TO_STORE 100 |
typedef dynamic_reconfigure::Server< thermalvis::depthConfig > Server |
const char __PROGRAM__[] = "DEPTH" |