Classes | Typedefs | Enumerations | Functions
openni2_wrapper Namespace Reference

Classes

class  OpenNI2Device
 
struct  OpenNI2DeviceInfo
 
class  OpenNI2DeviceInfoComparator
 
class  OpenNI2DeviceListener
 
class  OpenNI2DeviceManager
 
class  OpenNI2Driver
 
class  OpenNI2Exception
 General exception class. More...
 
class  OpenNI2FrameListener
 
class  OpenNI2TimerFilter
 
struct  OpenNI2VideoMode
 

Typedefs

typedef std::set< OpenNI2DeviceInfo, OpenNI2DeviceInfoComparatorDeviceSet
 
typedef boost::function< void(sensor_msgs::ImagePtr image)> FrameCallbackFunction
 

Enumerations

enum  PixelFormat {
  PIXEL_FORMAT_DEPTH_1_MM = 100, PIXEL_FORMAT_DEPTH_100_UM = 101, PIXEL_FORMAT_SHIFT_9_2 = 102, PIXEL_FORMAT_SHIFT_9_3 = 103,
  PIXEL_FORMAT_RGB888 = 200, PIXEL_FORMAT_YUV422 = 201, PIXEL_FORMAT_GRAY8 = 202, PIXEL_FORMAT_GRAY16 = 203,
  PIXEL_FORMAT_JPEG = 204
}
 

Functions

const OpenNI2DeviceInfo openni2_convert (const openni::DeviceInfo *pInfo)
 
const OpenNI2VideoMode openni2_convert (const openni::VideoMode &input)
 
const openni::VideoMode openni2_convert (const OpenNI2VideoMode &input)
 
const std::vector< OpenNI2VideoModeopenni2_convert (const openni::Array< openni::VideoMode > &input)
 
bool operator!= (const OpenNI2VideoMode &video_mode_a, const OpenNI2VideoMode &video_mode_b)
 
std::ostream & operator<< (std::ostream &stream, const OpenNI2DeviceInfo &device_info)
 
std::ostream & operator<< (std::ostream &stream, const OpenNI2VideoMode &video_mode)
 
std::ostream & operator<< (std::ostream &stream, const OpenNI2DeviceManager &device_manager)
 
std::ostream & operator<< (std::ostream &stream, const OpenNI2Device &device)
 
bool operator== (const OpenNI2VideoMode &video_mode_a, const OpenNI2VideoMode &video_mode_b)
 
void throwOpenNIException (const char *function, const char *file, unsigned line, const char *format,...)
 

Typedef Documentation

Definition at line 58 of file openni2_device_manager.cpp.

typedef boost::function<void(sensor_msgs::ImagePtr image)> openni2_wrapper::FrameCallbackFunction

Definition at line 60 of file openni2_device.h.

Enumeration Type Documentation

Enumerator
PIXEL_FORMAT_DEPTH_1_MM 
PIXEL_FORMAT_DEPTH_100_UM 
PIXEL_FORMAT_SHIFT_9_2 
PIXEL_FORMAT_SHIFT_9_3 
PIXEL_FORMAT_RGB888 
PIXEL_FORMAT_YUV422 
PIXEL_FORMAT_GRAY8 
PIXEL_FORMAT_GRAY16 
PIXEL_FORMAT_JPEG 

Definition at line 42 of file openni2_video_mode.h.

Function Documentation

const OpenNI2DeviceInfo openni2_wrapper::openni2_convert ( const openni::DeviceInfo *  pInfo)

Definition at line 42 of file openni2_convert.cpp.

const OpenNI2VideoMode openni2_wrapper::openni2_convert ( const openni::VideoMode &  input)

Definition at line 59 of file openni2_convert.cpp.

const openni::VideoMode openni2_wrapper::openni2_convert ( const OpenNI2VideoMode input)

Definition at line 71 of file openni2_convert.cpp.

const std::vector< OpenNI2VideoMode > openni2_wrapper::openni2_convert ( const openni::Array< openni::VideoMode > &  input)

Definition at line 84 of file openni2_convert.cpp.

bool openni2_wrapper::operator!= ( const OpenNI2VideoMode video_mode_a,
const OpenNI2VideoMode video_mode_b 
)

Definition at line 88 of file openni2_video_mode.cpp.

std::ostream & openni2_wrapper::operator<< ( std::ostream &  stream,
const OpenNI2DeviceInfo device_info 
)

Definition at line 38 of file openni2_device_info.cpp.

std::ostream & openni2_wrapper::operator<< ( std::ostream &  stream,
const OpenNI2VideoMode video_mode 
)

Definition at line 38 of file openni2_video_mode.cpp.

std::ostream & openni2_wrapper::operator<< ( std::ostream &  stream,
const OpenNI2DeviceManager device_manager 
)

Definition at line 256 of file openni2_device_manager.cpp.

std::ostream & openni2_wrapper::operator<< ( std::ostream &  stream,
const OpenNI2Device device 
)

Definition at line 710 of file openni2_device.cpp.

bool openni2_wrapper::operator== ( const OpenNI2VideoMode video_mode_a,
const OpenNI2VideoMode video_mode_b 
)

Definition at line 80 of file openni2_video_mode.cpp.

void openni2_wrapper::throwOpenNIException ( const char *  function,
const char *  file,
unsigned  line,
const char *  format,
  ... 
)
inline

Definition at line 81 of file openni2_exception.h.



openni2_camera
Author(s): Julius Kammerl
autogenerated on Fri Jun 7 2019 22:05:43