Macros | Functions
dev_camera1394.cpp File Reference

libdc1394 digital camera library interface implementation More...

#include <stdint.h>
#include "yuv.h"
#include <cstdlib>
#include <sensor_msgs/image_encodings.h>
#include "dev_camera1394.h"
#include "features.h"
#include "modes.h"
Include dependency graph for dev_camera1394.cpp:

Go to the source code of this file.

Macros

#define CAM_EXCEPT(except, msg)
 Macro for throwing an exception with a message. More...
 
#define CAM_EXCEPT_ARGS(except, msg, ...)
 Macro for throwing an exception with a message, passing args. More...
 

Functions

std::string bayer_string (dc1394color_filter_t pattern, unsigned int bits)
 

Detailed Description

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_camera1394.cpp.

Macro Definition Documentation

#define CAM_EXCEPT (   except,
  msg 
)
Value:
{ \
char buf[100]; \
snprintf(buf, 100, "[Camera1394::%s]: " msg, __FUNCTION__); \
throw except(buf); \
}

Macro for throwing an exception with a message.

Definition at line 60 of file dev_camera1394.cpp.

#define CAM_EXCEPT_ARGS (   except,
  msg,
  ... 
)
Value:
{ \
char buf[100]; \
snprintf(buf, 100, "[Camera1394::%s]: " msg, __FUNCTION__, __VA_ARGS__); \
throw except(buf); \
}

Macro for throwing an exception with a message, passing args.

Definition at line 68 of file dev_camera1394.cpp.

Function Documentation

std::string bayer_string ( dc1394color_filter_t  pattern,
unsigned int  bits 
)

Definition at line 413 of file dev_camera1394.cpp.



camera1394
Author(s): Jack O'Quin, Ken Tossell, Patrick Beeson, Nate Koenig, Andrew Howard, Damien Douxchamps, Dan Dennedy
autogenerated on Mon Jun 10 2019 12:52:31