libdc1394 digital camera library interface implementation More...
#include <stdint.h>#include "yuv.h"#include <sensor_msgs/image_encodings.h>#include "dev_camera1394stereo.h"#include "featuresstereo.h"#include "modes.h"
Go to the source code of this file.
Defines | |
| #define | CAM_EXCEPT(except, msg) |
| Macro for throwing an exception with a message. | |
| #define | CAM_EXCEPT_ARGS(except, msg,...) |
| Macro for throwing an exception with a message, passing args. | |
| #define | NUM_DMA_BUFFERS 4 |
Functions | |
| std::string | bayer_string (dc1394color_filter_t pattern, unsigned int bits) |
libdc1394 digital camera library interface implementation
This device interface is partly derived from the Player 1394 camera driver.
The ROS image pipeline provides Bayer filtering at a higher level (in image_proc). In some cases it is useful to run the driver without the entire image pipeline, so libdc1394 Bayer decoding is also provided here.
Definition in file dev_camera1394stereo.cpp.
| #define CAM_EXCEPT | ( | except, | |
| msg | |||
| ) |
{ \
char buf[100]; \
snprintf(buf, 100, "[Camera1394Stereo::%s]: " msg, __FUNCTION__); \
throw except(buf); \
}
Macro for throwing an exception with a message.
Definition at line 63 of file dev_camera1394stereo.cpp.
| #define CAM_EXCEPT_ARGS | ( | except, | |
| msg, | |||
| ... | |||
| ) |
{ \
char buf[100]; \
snprintf(buf, 100, "[Camera1394Stereo::%s]: " msg, __FUNCTION__, __VA_ARGS__); \
throw except(buf); \
}
Macro for throwing an exception with a message, passing args.
Definition at line 71 of file dev_camera1394stereo.cpp.
| #define NUM_DMA_BUFFERS 4 |
Definition at line 59 of file dev_camera1394stereo.cpp.
| std::string bayer_string | ( | dc1394color_filter_t | pattern, |
| unsigned int | bits | ||
| ) |
Definition at line 404 of file dev_camera1394stereo.cpp.