Classes | |
class | ImiDevice |
class | ImiDriver |
Typedefs | |
typedef boost::function< void(boost::shared_ptr< sensor_msgs::PointCloud2 > cloudPtr)> | CloudCallbackFunction |
typedef boost::function< void(sensor_msgs::ImagePtr image)> | FrameCallbackFunction |
Functions | |
uint64_t | imi_time () |
uint64_t | imi_timeNanos () |
Variables | |
uint64_t | depthCount = 0 |
uint64_t | depthStartTime = 0 |
static const double | imi_cx = 316.2 |
static const double | imi_cy = 235.7 |
static const double | imi_factor = 1000.0 |
static const double | imi_fx = 565.0 |
static const double | imi_fy = 566.3 |
static const int64_t | NUM_MICROSECS_PER_MILLESEC |
static const int64_t | NUM_MICROSECS_PER_SEC = 1000000 |
static const int64_t | NUM_MILLISEC_PER_SEC = 1000 |
static const int64_t | NUM_NANNOSECS_PER_SEC = 1000000000 |
static const int64_t | NUM_NANOSECS_PER_MICROSEC |
static const int64_t | NUM_NANOSECS_PER_MILLESEC |
ImiCameraFrameMode | supportCameraFrameMode [] |
ImiFrameMode | supportFrameMode [] |
uint64_t | uvcCount = 0 |
uint64_t | uvcStartTime = 0 |
typedef boost::function<void(boost::shared_ptr<sensor_msgs::PointCloud2> cloudPtr)> imi_wrapper::CloudCallbackFunction |
Definition at line 25 of file imi_Device.h.
typedef boost::function<void(sensor_msgs::ImagePtr image)> imi_wrapper::FrameCallbackFunction |
Definition at line 24 of file imi_Device.h.
uint64_t imi_wrapper::imi_time | ( | ) |
Definition at line 38 of file imi_Driver.cpp.
uint64_t imi_wrapper::imi_timeNanos | ( | ) |
Definition at line 28 of file imi_Driver.cpp.
uint64_t imi_wrapper::depthCount = 0 |
Definition at line 44 of file imi_Driver.cpp.
uint64_t imi_wrapper::depthStartTime = 0 |
Definition at line 43 of file imi_Driver.cpp.
|
static |
Definition at line 14 of file imi_Device.cpp.
|
static |
Definition at line 15 of file imi_Device.cpp.
|
static |
Definition at line 13 of file imi_Device.cpp.
|
static |
Definition at line 16 of file imi_Device.cpp.
|
static |
Definition at line 17 of file imi_Device.cpp.
|
static |
Definition at line 21 of file imi_Driver.cpp.
|
static |
Definition at line 18 of file imi_Driver.cpp.
|
static |
Definition at line 17 of file imi_Driver.cpp.
|
static |
Definition at line 19 of file imi_Driver.cpp.
|
static |
Definition at line 25 of file imi_Driver.cpp.
|
static |
Definition at line 23 of file imi_Driver.cpp.
ImiCameraFrameMode imi_wrapper::supportCameraFrameMode[] |
Definition at line 52 of file imi_Driver.cpp.
ImiFrameMode imi_wrapper::supportFrameMode[] |
Definition at line 49 of file imi_Driver.cpp.
uint64_t imi_wrapper::uvcCount = 0 |
Definition at line 47 of file imi_Driver.cpp.
uint64_t imi_wrapper::uvcStartTime = 0 |
Definition at line 46 of file imi_Driver.cpp.