#include <stdexcept>
#include <stdio.h>
#include <stdlib.h>
#include <string>
#include <string.h>
#include <opencv/cv.h>
#include <libusbSR.h>
#include "std_msgs/PointCloud.h"
#include "std_msgs/ImageArray.h"
#include "ros/common.h"
Go to the source code of this file.
Classes | |
class | swissranger::SwissRanger |
Namespaces | |
namespace | swissranger |
Defines | |
#define | DEF_EXCEPTION(name, parent) |
Macro for defining an exception with a given parent (std::runtime_error should be top parent) | |
#define | DWORD unsigned int |
#define | MODE (AM_CONF_MAP | AM_COR_FIX_PTRN | AM_SW_ANF | AM_MEDIAN | AM_DENOISE_ANF | AM_MEDIANCROSS | AM_CONV_GRAY) |
#define | SR_IMG_AMPLITUDE 1 |
#define | SR_IMG_CONFIDENCE 2 |
#define | SR_IMG_DISTANCE 0 |
Functions | |
swissranger::DEF_EXCEPTION (Exception, std::runtime_error) | |
A standard SwissRanger exception. | |
Variables | |
const unsigned int | swissranger::SR_COLS = 176 |
const unsigned int | swissranger::SR_ROWS = 144 |
#define DEF_EXCEPTION | ( | name, | |
parent | |||
) |
class name : public parent { \ public: \ name (const char* msg) : parent (msg) {} \ }
Macro for defining an exception with a given parent (std::runtime_error should be top parent)
Definition at line 64 of file swissranger.h.
#define DWORD unsigned int |
Definition at line 44 of file swissranger.h.
#define MODE (AM_CONF_MAP | AM_COR_FIX_PTRN | AM_SW_ANF | AM_MEDIAN | AM_DENOISE_ANF | AM_MEDIANCROSS | AM_CONV_GRAY) |
Definition at line 58 of file swissranger.h.
#define SR_IMG_AMPLITUDE 1 |
Definition at line 47 of file swissranger.h.
#define SR_IMG_CONFIDENCE 2 |
Definition at line 48 of file swissranger.h.
#define SR_IMG_DISTANCE 0 |
Definition at line 46 of file swissranger.h.