Classes | Typedefs | Enumerations | Functions
astra_wrapper Namespace Reference

Classes

class  AstraDevice
 
struct  AstraDeviceInfo
 
class  AstraDeviceInfoComparator
 
class  AstraDeviceListener
 
class  AstraDeviceManager
 
class  AstraDriver
 
class  AstraException
 General exception class. More...
 
class  AstraFrameListener
 
class  AstraTimerFilter
 
struct  AstraVideoMode
 

Typedefs

typedef std::set< AstraDeviceInfo, AstraDeviceInfoComparatorDeviceSet
 
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 AstraDeviceInfo astra_convert (const openni::DeviceInfo *pInfo)
 
const AstraVideoMode astra_convert (const openni::VideoMode &input)
 
const openni::VideoMode astra_convert (const AstraVideoMode &input)
 
const std::vector< AstraVideoModeastra_convert (const openni::Array< openni::VideoMode > &input)
 
bool operator!= (const AstraVideoMode &video_mode_a, const AstraVideoMode &video_mode_b)
 
std::ostream & operator<< (std::ostream &stream, const AstraDeviceInfo &device_info)
 
std::ostream & operator<< (std::ostream &stream, const AstraVideoMode &video_mode)
 
std::ostream & operator<< (std::ostream &stream, const AstraDeviceManager &device_manager)
 
std::ostream & operator<< (std::ostream &stream, const AstraDevice &device)
 
bool operator== (const AstraVideoMode &video_mode_a, const AstraVideoMode &video_mode_b)
 
void throwOpenNIException (const char *function, const char *file, unsigned line, const char *format,...)
 

Typedef Documentation

Definition at line 59 of file astra_device_manager.cpp.

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

Definition at line 64 of file astra_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 43 of file astra_video_mode.h.

Function Documentation

const AstraDeviceInfo astra_wrapper::astra_convert ( const openni::DeviceInfo pInfo)

Definition at line 43 of file astra_convert.cpp.

const AstraVideoMode astra_wrapper::astra_convert ( const openni::VideoMode input)

Definition at line 60 of file astra_convert.cpp.

const openni::VideoMode astra_wrapper::astra_convert ( const AstraVideoMode input)

Definition at line 72 of file astra_convert.cpp.

const std::vector< AstraVideoMode > astra_wrapper::astra_convert ( const openni::Array< openni::VideoMode > &  input)

Definition at line 84 of file astra_convert.cpp.

bool astra_wrapper::operator!= ( const AstraVideoMode video_mode_a,
const AstraVideoMode video_mode_b 
)

Definition at line 89 of file astra_video_mode.cpp.

std::ostream & astra_wrapper::operator<< ( std::ostream &  stream,
const AstraDeviceInfo device_info 
)

Definition at line 39 of file astra_device_info.cpp.

std::ostream & astra_wrapper::operator<< ( std::ostream &  stream,
const AstraVideoMode video_mode 
)

Definition at line 39 of file astra_video_mode.cpp.

std::ostream & astra_wrapper::operator<< ( std::ostream &  stream,
const AstraDeviceManager device_manager 
)

Definition at line 257 of file astra_device_manager.cpp.

std::ostream & astra_wrapper::operator<< ( std::ostream &  stream,
const AstraDevice device 
)

Definition at line 822 of file astra_device.cpp.

bool astra_wrapper::operator== ( const AstraVideoMode video_mode_a,
const AstraVideoMode video_mode_b 
)

Definition at line 81 of file astra_video_mode.cpp.

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

Definition at line 82 of file astra_exception.h.



astra_camera
Author(s): Tim Liu
autogenerated on Wed Dec 16 2020 03:54:34