#include "imi_Driver.h"#include "imi_Device.h"#include <unistd.h>#include <stdlib.h>#include <stdio.h>#include <sys/shm.h>#include <time.h>#include <sensor_msgs/image_encodings.h>#include <sensor_msgs/distortion_models.h>#include "ImiDefines.h"#include "ImiProperties.h"#include <boost/thread/thread.hpp>
Go to the source code of this file.
Namespaces | |
| imi_wrapper | |
Functions | |
| uint64_t | imi_wrapper::imi_time () |
| uint64_t | imi_wrapper::imi_timeNanos () |
Variables | |
| uint64_t | imi_wrapper::depthCount = 0 |
| uint64_t | imi_wrapper::depthStartTime = 0 |
| static const int64_t | imi_wrapper::NUM_MICROSECS_PER_MILLESEC |
| static const int64_t | imi_wrapper::NUM_MICROSECS_PER_SEC = 1000000 |
| static const int64_t | imi_wrapper::NUM_MILLISEC_PER_SEC = 1000 |
| static const int64_t | imi_wrapper::NUM_NANNOSECS_PER_SEC = 1000000000 |
| static const int64_t | imi_wrapper::NUM_NANOSECS_PER_MICROSEC |
| static const int64_t | imi_wrapper::NUM_NANOSECS_PER_MILLESEC |
| ImiCameraFrameMode | imi_wrapper::supportCameraFrameMode [] |
| ImiFrameMode | imi_wrapper::supportFrameMode [] |
| uint64_t | imi_wrapper::uvcCount = 0 |
| uint64_t | imi_wrapper::uvcStartTime = 0 |