$search
#include "swissranger.h"#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.
Defines | |
| #define | _dot(x, y) ((x[0])*(y[0])+(x[1])*(y[1])+(x[2])*(y[2])) |
| #define | _sqr(x) ((x)*(x)) |
| #define | _sqr_sum_3d(x) (_sqr(x[0])+_sqr(x[1])+_sqr(x[2])) |
| #define | SR_EXCEPT(except, msg) |
| Macro for throwing an exception with a message. | |
| #define | SR_EXCEPT_ARGS(except, msg,...) |
| Macro for throwing an exception with a message, passing args. | |
| #define _dot | ( | x, | |||
| y | ) | ((x[0])*(y[0])+(x[1])*(y[1])+(x[2])*(y[2])) |
Definition at line 171 of file swissranger.cpp.
| #define _sqr | ( | x | ) | ((x)*(x)) |
Definition at line 169 of file swissranger.cpp.
| #define _sqr_sum_3d | ( | x | ) | (_sqr(x[0])+_sqr(x[1])+_sqr(x[2])) |
Definition at line 170 of file swissranger.cpp.
| #define SR_EXCEPT | ( | except, | |||
| msg | ) |
{ \
char buf[100]; \
snprintf(buf, 100, "[SwissRanger::%s]: " msg, __FUNCTION__); \
throw except(buf); \
}
Macro for throwing an exception with a message.
Definition at line 35 of file swissranger.cpp.
| #define SR_EXCEPT_ARGS | ( | except, | |||
| msg, | |||||
| ... | ) |
{ \
char buf[100]; \
snprintf(buf, 100, "[SwissRanger::%s]: " msg, __FUNCTION__, __VA_ARGS__); \
throw except(buf); \
}
Macro for throwing an exception with a message, passing args.
Definition at line 43 of file swissranger.cpp.