Classes |
struct | rsimpl::f200::cam_asic_coefficients |
struct | rsimpl::f200::IVCAMTesterData |
struct | rsimpl::f200::OACOffsetData |
struct | rsimpl::sr300::SR300RawCalibration |
Namespaces |
namespace | rsimpl |
namespace | rsimpl::f200 |
namespace | rsimpl::ivcam |
namespace | rsimpl::sr300 |
Enumerations |
enum | rsimpl::sr300::cam_data_source { rsimpl::sr300::TakeFromRO = 0,
rsimpl::sr300::TakeFromRW = 1,
rsimpl::sr300::TakeFromRAM = 2
} |
enum | rsimpl::ivcam::Property {
rsimpl::ivcam::IVCAM_PROPERTY_COLOR_EXPOSURE = 1,
rsimpl::ivcam::IVCAM_PROPERTY_COLOR_BRIGHTNESS = 2,
rsimpl::ivcam::IVCAM_PROPERTY_COLOR_CONTRAST = 3,
rsimpl::ivcam::IVCAM_PROPERTY_COLOR_SATURATION = 4,
rsimpl::ivcam::IVCAM_PROPERTY_COLOR_HUE = 5,
rsimpl::ivcam::IVCAM_PROPERTY_COLOR_GAMMA = 6,
rsimpl::ivcam::IVCAM_PROPERTY_COLOR_WHITE_BALANCE = 7,
rsimpl::ivcam::IVCAM_PROPERTY_COLOR_SHARPNESS = 8,
rsimpl::ivcam::IVCAM_PROPERTY_COLOR_BACK_LIGHT_COMPENSATION = 9,
rsimpl::ivcam::IVCAM_PROPERTY_COLOR_GAIN = 10,
rsimpl::ivcam::IVCAM_PROPERTY_COLOR_POWER_LINE_FREQUENCY = 11,
rsimpl::ivcam::IVCAM_PROPERTY_AUDIO_MIX_LEVEL = 12,
rsimpl::ivcam::IVCAM_PROPERTY_APERTURE = 13,
rsimpl::ivcam::IVCAM_PROPERTY_DISTORTION_CORRECTION_I = 202,
rsimpl::ivcam::IVCAM_PROPERTY_DISTORTION_CORRECTION_DPTH = 203,
rsimpl::ivcam::IVCAM_PROPERTY_DEPTH_MIRROR = 204,
rsimpl::ivcam::IVCAM_PROPERTY_COLOR_MIRROR = 205,
rsimpl::ivcam::IVCAM_PROPERTY_COLOR_FIELD_OF_VIEW = 207,
rsimpl::ivcam::IVCAM_PROPERTY_COLOR_SENSOR_RANGE = 209,
rsimpl::ivcam::IVCAM_PROPERTY_COLOR_FOCAL_LENGTH = 211,
rsimpl::ivcam::IVCAM_PROPERTY_COLOR_PRINCIPAL_POINT = 213,
rsimpl::ivcam::IVCAM_PROPERTY_DEPTH_FIELD_OF_VIEW = 215,
rsimpl::ivcam::IVCAM_PROPERTY_DEPTH_UNDISTORTED_FIELD_OF_VIEW = 223,
rsimpl::ivcam::IVCAM_PROPERTY_DEPTH_SENSOR_RANGE = 217,
rsimpl::ivcam::IVCAM_PROPERTY_DEPTH_FOCAL_LENGTH = 219,
rsimpl::ivcam::IVCAM_PROPERTY_DEPTH_UNDISTORTED_FOCAL_LENGTH = 225,
rsimpl::ivcam::IVCAM_PROPERTY_DEPTH_PRINCIPAL_POINT = 221,
rsimpl::ivcam::IVCAM_PROPERTY_MF_DEPTH_LOW_CONFIDENCE_VALUE = 5000,
rsimpl::ivcam::IVCAM_PROPERTY_MF_DEPTH_UNIT = 5001,
rsimpl::ivcam::IVCAM_PROPERTY_MF_CALIBRATION_DATA = 5003,
rsimpl::ivcam::IVCAM_PROPERTY_MF_LASER_POWER = 5004,
rsimpl::ivcam::IVCAM_PROPERTY_MF_ACCURACY = 5005,
rsimpl::ivcam::IVCAM_PROPERTY_MF_INTENSITY_IMAGE_TYPE = 5006,
rsimpl::ivcam::IVCAM_PROPERTY_MF_MOTION_VS_RANGE_TRADE = 5007,
rsimpl::ivcam::IVCAM_PROPERTY_MF_POWER_GEAR = 5008,
rsimpl::ivcam::IVCAM_PROPERTY_MF_FILTER_OPTION = 5009,
rsimpl::ivcam::IVCAM_PROPERTY_MF_VERSION = 5010,
rsimpl::ivcam::IVCAM_PROPERTY_MF_DEPTH_CONFIDENCE_THRESHOLD = 5013,
rsimpl::ivcam::IVCAM_PROPERTY_ACCELEROMETER_READING = 3000,
rsimpl::ivcam::IVCAM_PROPERTY_PROJECTION_SERIALIZABLE = 3003,
rsimpl::ivcam::IVCAM_PROPERTY_CUSTOMIZED = 0x04000000
} |
Functions |
int | rsimpl::f200::bcdtoint (uint8_t *buf, int bufsize) |
void | rsimpl::ivcam::claim_ivcam_interface (uvc::device &device) |
void | rsimpl::ivcam::enable_timestamp (uvc::device &device, std::timed_mutex &mutex, bool colorEnable, bool depthEnable) |
void | rsimpl::ivcam::force_hardware_reset (uvc::device &device, std::timed_mutex &mutex) |
void | rsimpl::f200::generate_asic_calibration_coefficients (const ivcam::camera_calib_params &compensated_calibration, std::vector< int > resolution, const bool isZMode, float *values) |
void | rsimpl::ivcam::get_accuracy (const uvc::device &device, uint8_t &accuracy) |
void | rsimpl::ivcam::get_confidence_threshold (const uvc::device &device, uint8_t &conf_thresh) |
void | rsimpl::f200::get_dynamic_fps (const uvc::device &device, uint8_t &dynamic_fps) |
std::tuple
< ivcam::camera_calib_params,
cam_temperature_data,
thermal_loop_params > | rsimpl::f200::get_f200_calibration (uint8_t *rawCalibData, size_t len) |
void | rsimpl::f200::get_f200_calibration_raw_data (uvc::device &device, std::timed_mutex &usbMutex, uint8_t *data, size_t &bytesReturned) |
void | rsimpl::ivcam::get_filter_option (const uvc::device &device, uint8_t &filter_option) |
void | rsimpl::ivcam::get_firmware_version_string (uvc::device &device, std::timed_mutex &mutex, std::string &version, int gvd_cmd, int offset) |
FirmwareError | rsimpl::ivcam::get_fw_last_error (uvc::device &device, std::timed_mutex &mutex) |
void | rsimpl::ivcam::get_gvd (uvc::device &device, std::timed_mutex &mutex, size_t sz, char *gvd, int gvd_cmd) |
void | rsimpl::ivcam::get_laser_power (const uvc::device &device, uint8_t &laser_power) |
void | rsimpl::ivcam::get_module_serial_string (uvc::device &device, std::timed_mutex &mutex, std::string &serial, int offset) |
void | rsimpl::ivcam::get_motion_range (const uvc::device &device, uint8_t &motion_range) |
void | rsimpl::sr300::get_sr300_calibration_raw_data (uvc::device &device, std::timed_mutex &mutex, uint8_t *data, size_t &bytesReturned) |
int | rsimpl::f200::get_version_of_calibration (uint8_t *validation, uint8_t *version) |
size_t | rsimpl::ivcam::prepare_usb_command (uint8_t *request, size_t &requestSize, uint32_t op, uint32_t p1, uint32_t p2, uint32_t p3, uint32_t p4, uint8_t *data, size_t dataLength) |
std::tuple
< ivcam::camera_calib_params,
cam_temperature_data,
thermal_loop_params > | rsimpl::f200::read_f200_calibration (uvc::device &device, std::timed_mutex &mutex) |
int | rsimpl::f200::read_ir_temp (uvc::device &device, std::timed_mutex &mutex) |
float | rsimpl::f200::read_mems_temp (uvc::device &device, std::timed_mutex &mutex) |
ivcam::camera_calib_params | rsimpl::sr300::read_sr300_calibration (uvc::device &device, std::timed_mutex &mutex) |
void | rsimpl::ivcam::set_accuracy (uvc::device &device, uint8_t accuracy) |
void | rsimpl::f200::set_asic_coefficients (uvc::device &device, std::timed_mutex &mutex, const cam_asic_coefficients &coeffs) |
void | rsimpl::ivcam::set_auto_range (uvc::device &device, std::timed_mutex &mutex, int enableMvR, int16_t minMvR, int16_t maxMvR, int16_t startMvR, int enableLaser, int16_t minLaser, int16_t maxLaser, int16_t startLaser, int16_t ARUpperTH, int16_t ARLowerTH) |
void | rsimpl::ivcam::set_confidence_threshold (uvc::device &device, uint8_t conf_thresh) |
void | rsimpl::f200::set_dynamic_fps (uvc::device &device, uint8_t dynamic_fps) |
void | rsimpl::ivcam::set_filter_option (uvc::device &device, uint8_t filter_option) |
void | rsimpl::ivcam::set_laser_power (uvc::device &device, uint8_t laser_power) |
void | rsimpl::ivcam::set_motion_range (uvc::device &device, uint8_t motion_range) |
void | rsimpl::f200::update_asic_coefficients (uvc::device &device, std::timed_mutex &mutex, const ivcam::camera_calib_params &compensated_params) |
void | rsimpl::ivcam::xu_read (const uvc::device &device, uint8_t xu_ctrl, void *buffer, uint32_t length) |
void | rsimpl::ivcam::xu_write (uvc::device &device, uint8_t xu_ctrl, void *buffer, uint32_t length) |