Classes | Namespaces | Macros
processor.h File Reference
#include <image_proc/processor.h>
#include <image_geometry/stereo_camera_model.h>
#include <opencv2/calib3d/calib3d.hpp>
#include <stereo_msgs/DisparityImage.h>
#include <sensor_msgs/PointCloud.h>
#include <sensor_msgs/PointCloud2.h>
Include dependency graph for processor.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

struct  stereo_image_proc::StereoImageSet
 
class  stereo_image_proc::StereoProcessor
 

Namespaces

 stereo_image_proc
 

Macros

#define STEREO_IMAGE_PROC_BM_ONLY_OPENCV2(GET, SET, TYPE, PARAM)
 
#define STEREO_IMAGE_PROC_ONLY_OPENCV3(MEMBER, GET, SET, TYPE, GET_OPENCV, SET_OPENCV)
 
#define STEREO_IMAGE_PROC_OPENCV2(GET, SET, TYPE, PARAM)
 
#define STEREO_IMAGE_PROC_OPENCV3(GET, SET, TYPE, GET_OPENCV, SET_OPENCV)
 
#define STEREO_IMAGE_PROC_SGBM_ONLY_OPENCV2(GET, SET, TYPE, PARAM)
 

Macro Definition Documentation

◆ STEREO_IMAGE_PROC_BM_ONLY_OPENCV2

#define STEREO_IMAGE_PROC_BM_ONLY_OPENCV2 (   GET,
  SET,
  TYPE,
  PARAM 
)
Value:
inline TYPE StereoProcessor::GET() const \
{ \
return block_matcher_.state->PARAM; \
} \
\
inline void StereoProcessor::SET(TYPE param) \
{ \
block_matcher_.state->PARAM = param; \
}

Definition at line 274 of file processor.h.

◆ STEREO_IMAGE_PROC_ONLY_OPENCV3

#define STEREO_IMAGE_PROC_ONLY_OPENCV3 (   MEMBER,
  GET,
  SET,
  TYPE,
  GET_OPENCV,
  SET_OPENCV 
)
Value:
inline TYPE StereoProcessor::GET() const \
{ \
return MEMBER->GET_OPENCV(); \
} \
\
inline void StereoProcessor::SET(TYPE param) \
{ \
MEMBER->SET_OPENCV(param); \
}

Definition at line 296 of file processor.h.

◆ STEREO_IMAGE_PROC_OPENCV2

#define STEREO_IMAGE_PROC_OPENCV2 (   GET,
  SET,
  TYPE,
  PARAM 
)
Value:
inline TYPE StereoProcessor::GET() const \
{ \
if (current_stereo_algorithm_ == BM) \
return block_matcher_.state->PARAM; \
return sg_block_matcher_.PARAM; \
} \
\
inline void StereoProcessor::SET(TYPE param) \
{ \
block_matcher_.state->PARAM = param; \
sg_block_matcher_.PARAM = param; \
}

Definition at line 228 of file processor.h.

◆ STEREO_IMAGE_PROC_OPENCV3

#define STEREO_IMAGE_PROC_OPENCV3 (   GET,
  SET,
  TYPE,
  GET_OPENCV,
  SET_OPENCV 
)
Value:
inline TYPE StereoProcessor::GET() const \
{ \
if (current_stereo_algorithm_ == BM) \
return block_matcher_->GET_OPENCV(); \
return sg_block_matcher_->GET_OPENCV(); \
} \
\
inline void StereoProcessor::SET(TYPE param) \
{ \
block_matcher_->SET_OPENCV(param); \
sg_block_matcher_->SET_OPENCV(param); \
}

Definition at line 242 of file processor.h.

◆ STEREO_IMAGE_PROC_SGBM_ONLY_OPENCV2

#define STEREO_IMAGE_PROC_SGBM_ONLY_OPENCV2 (   GET,
  SET,
  TYPE,
  PARAM 
)
Value:
inline TYPE StereoProcessor::GET() const \
{ \
return sg_block_matcher_.PARAM; \
} \
\
inline void StereoProcessor::SET(TYPE param) \
{ \
sg_block_matcher_.PARAM = param; \
}

Definition at line 285 of file processor.h.

param
T param(const std::string &param_name, const T &default_val)


stereo_image_proc
Author(s): Patrick Mihelich, Kurt Konolige, Jeremy Leibs
autogenerated on Wed Jan 24 2024 03:57:24