
Go to the source code of this file.
Classes | |
| struct | rsimpl::ds::CommandResponsePacket |
Namespaces | |
| rsimpl | |
| rsimpl::ds | |
| rsimpl::zr300 | |
Macros | |
| #define | CAM_INFO_BLOCK_LEN 2048 |
| #define | NV_ADMIN_DATA_N_ENTRIES 9 |
| #define | NV_CALIBRATION_DATA_ADDRESS_INDEX 0 |
| #define | NV_NON_FIRMWARE_ROOT_ADDRESS NV_NON_FIRMWARE_START |
| #define | NV_NON_FIRMWARE_START (SPI_FLASH_SECTORS_RESERVED_FOR_FIRMWARE * SPI_FLASH_SECTOR_SIZE_IN_BYTES) |
| #define | SPI_FLASH_PAGE_SIZE_IN_BYTES 0x100 |
| #define | SPI_FLASH_PAGES_PER_SECTOR (SPI_FLASH_SECTOR_SIZE_IN_BYTES / SPI_FLASH_PAGE_SIZE_IN_BYTES) |
| #define | SPI_FLASH_SECTOR_SIZE_IN_BYTES 0x1000 |
| #define | SPI_FLASH_SECTORS_RESERVED_FOR_FIRMWARE 160 |
| #define | SPI_FLASH_SIZE_IN_SECTORS 256 |
| #define | SPI_FLASH_TOTAL_SIZE_IN_BYTES (SPI_FLASH_SIZE_IN_SECTORS * SPI_FLASH_SECTOR_SIZE_IN_BYTES) |
Enumerations | |
| enum | command : uint32_t { command::peek = 0x11, command::poke = 0x12, command::download_spi_flash = 0x1A, command::get_fwrevision = 0x21 } |
| enum | command_modifier : uint32_t { command_modifier::direct = 0x10 } |
Functions | |
| void | rsimpl::ds::bulk_usb_command (uvc::device &device, std::timed_mutex &mutex, unsigned char out_ep, uint8_t *out, size_t outSize, uint32_t &op, unsigned char in_ep, uint8_t *in, size_t &inSize, int timeout) |
| void | rsimpl::zr300::claim_motion_module_interface (uvc::device &device) |
| void | rsimpl::ds::force_firmware_reset (uvc::device &device) |
| bool | rsimpl::ds::get_emitter_state (const uvc::device &device, bool is_streaming, bool is_depth_enabled) |
| uint16_t | rsimpl::zr300::get_fisheye_exposure (const uvc::device &device) |
| uint8_t | rsimpl::zr300::get_fisheye_external_trigger (const uvc::device &device) |
| uint8_t | rsimpl::zr300::get_fisheye_strobe (const uvc::device &device) |
| void | rsimpl::ds::get_register_value (uvc::device &device, uint32_t reg, uint32_t &value) |
| void | rsimpl::ds::get_stream_status (const uvc::device &device, int &status) |
| bool | rsimpl::ds::read_admin_sector (uvc::device &dev, unsigned char data[SPI_FLASH_SECTOR_SIZE_IN_BYTES], int whichAdminSector) |
| void | rsimpl::ds::read_arbitrary_chunk (uvc::device &dev, uint32_t address, void *dataIn, int lengthInBytesIn) |
| ds_calibration | rsimpl::ds::read_calibration_and_rectification_parameters (const uint8_t(&flash_data_buffer)[SPI_FLASH_SECTOR_SIZE_IN_BYTES]) |
| ds_head_content | rsimpl::ds::read_camera_head_contents (const uint8_t(&flash_data_buffer)[SPI_FLASH_SECTOR_SIZE_IN_BYTES], uint32_t &serial_number) |
| ds_info | rsimpl::ds::read_camera_info (uvc::device &device) |
| bool | rsimpl::ds::read_device_pages (uvc::device &dev, uint32_t address, unsigned char *buffer, uint32_t nPages) |
| std::string | rsimpl::ds::read_firmware_version (uvc::device &device) |
| std::string | rsimpl::ds::read_isp_firmware_version (uvc::device &device) |
| CommandResponsePacket | rsimpl::ds::send_command_and_receive_response (uvc::device &device, const CommandResponsePacket &command) |
| void | rsimpl::ds::set_emitter_state (uvc::device &device, bool state) |
| void | rsimpl::zr300::set_fisheye_exposure (uvc::device &device, uint16_t exposure) |
| void | rsimpl::zr300::set_fisheye_external_trigger (uvc::device &device, uint8_t ext_trig) |
| void | rsimpl::zr300::set_fisheye_strobe (uvc::device &device, uint8_t strobe) |
| void | rsimpl::ds::set_register_value (uvc::device &device, uint32_t reg, uint32_t value) |
| void | rsimpl::ds::set_stream_intent (uvc::device &device, uint8_t &intent) |
| void | rsimpl::ds::xu_read (const uvc::device &device, uvc::extension_unit xu, control xu_ctrl, void *buffer, uint32_t length) |
| void | rsimpl::ds::xu_write (uvc::device &device, uvc::extension_unit xu, control xu_ctrl, void *buffer, uint32_t length) |
Variables | |
| const unsigned short | rsimpl::zr300::motion_module_interrupt_interface = 0x2 |
| const uvc::guid | rsimpl::zr300::MOTION_MODULE_USB_DEVICE_GUID = { 0xC0B55A29, 0xD7B6, 0x436E,{ 0xA6, 0xEF, 0x2E, 0x76, 0xED, 0x0A, 0xBC, 0xA5 } } |
| #define CAM_INFO_BLOCK_LEN 2048 |
Definition at line 30 of file ds-private.cpp.
| #define NV_ADMIN_DATA_N_ENTRIES 9 |
Definition at line 27 of file ds-private.cpp.
| #define NV_CALIBRATION_DATA_ADDRESS_INDEX 0 |
Definition at line 28 of file ds-private.cpp.
| #define NV_NON_FIRMWARE_ROOT_ADDRESS NV_NON_FIRMWARE_START |
Definition at line 29 of file ds-private.cpp.
| #define NV_NON_FIRMWARE_START (SPI_FLASH_SECTORS_RESERVED_FOR_FIRMWARE * SPI_FLASH_SECTOR_SIZE_IN_BYTES) |
Definition at line 26 of file ds-private.cpp.
| #define SPI_FLASH_PAGE_SIZE_IN_BYTES 0x100 |
Definition at line 20 of file ds-private.cpp.
| #define SPI_FLASH_PAGES_PER_SECTOR (SPI_FLASH_SECTOR_SIZE_IN_BYTES / SPI_FLASH_PAGE_SIZE_IN_BYTES) |
Definition at line 24 of file ds-private.cpp.
| #define SPI_FLASH_SECTOR_SIZE_IN_BYTES 0x1000 |
Definition at line 21 of file ds-private.cpp.
| #define SPI_FLASH_SECTORS_RESERVED_FOR_FIRMWARE 160 |
Definition at line 25 of file ds-private.cpp.
| #define SPI_FLASH_SIZE_IN_SECTORS 256 |
Definition at line 22 of file ds-private.cpp.
| #define SPI_FLASH_TOTAL_SIZE_IN_BYTES (SPI_FLASH_SIZE_IN_SECTORS * SPI_FLASH_SECTOR_SIZE_IN_BYTES) |
Definition at line 23 of file ds-private.cpp.
|
strong |
| Enumerator | |
|---|---|
| peek | |
| poke | |
| download_spi_flash | |
| get_fwrevision | |
Definition at line 10 of file ds-private.cpp.
|
strong |
| Enumerator | |
|---|---|
| direct | |
Definition at line 18 of file ds-private.cpp.