Go to the documentation of this file.
29 #define DEPTHMAP_SEGMENT 1
30 #define DEVICESTATUS_SEGMENT 2
32 #define LOCALIOS_SEGMENT 4
33 #define FIELDINFORMATION_SEGMENT 5
34 #define LOGICSIGNALS_SEGMENT 6
117 #pragma pack(push, 1)
209 #pragma pack(push, 1)
276 #pragma pack(push, 1)
297 #pragma pack(push, 1)
328 #pragma pack(push, 1)
448 bool parseXML(
const std::string& xmlString, uint32_t changeCounter);
453 bool parseBinaryData(std::vector<uint8_t>::iterator itBuf,
size_t length);
457 bool parseRoiData(std::vector<uint8_t>::iterator itBuf,
size_t length);
477 bool parseIMUData(std::vector<uint8_t>::iterator itBuf,
size_t length);
constexpr std::uint32_t MAX_LOGICSIGNALS_VALUES
static const float DISTANCE_MAP_UNIT
factor to convert Radial distance map from fixed point to floating point
DEVICE_STATUS m_deviceStatus
Contains the received device status.
DEVICE_STATUS getDeviceStatus() const
DataHandlerError m_lastDataHandlerError
Stores the last error which occurred while parsing the Blob data segments.
void clearData(uint32_t changedCounter)
uint32_t COPNonSaftyRelated
uint16_t getFlags() const
DataSetsActive m_dataSetsActive
const ROI_DATA & getRoiData() const
@ ROI_QUALITY_CLASS_INVALID
bool isDistanceMapFiltered() const
@ INVALID_CRC_SEGMENT_ROI
const IMU_ELEMENT getIMUData() const
ROI_DATA_SAFETY_DATA safetyRelatedData
@ INVALID_VERSION_SEGMENT_FIELDINFORMATION
bool parseRoiData(std::vector< uint8_t >::iterator itBuf, size_t length)
constexpr std::uint32_t MAX_ROI_VALUES
DEVICE_STATUS_ELEMENT getDeviceStatusData() const
Gets Device Status element.
uint8_t invalidDueToOverexposure
DEVICESTATUS_DATA_ACTIVE_MONITORING_CASE activeMonitoringCase
constexpr std::uint32_t MAX_FIELDINFORMATION_VALUES
@ INVALID_CRC_SEGMENT_DEPTHMAP
FIELDINFORMATION_DATA m_fieldInformationData
@ DEVICE_STATUS_APPLICATION_STOPPED
bool parseDeviceStatusData(std::vector< uint8_t >::iterator itBuf, size_t length)
@ INVALID_CRC_SEGMENT_DEVICESTATUS
@ ROI_QUALITY_CLASS_MODERATE
@ DEVICE_STATUS_NORMAL_OPERATION
uint8_t deadZoneDetection
IMU_QUATERNION orientation
@ INVALID_LENGTH_SEGMENT_DEVICESTATUS
@ INVALID_LENGTH_SEGMENT_FIELDINFORMATION
uint8_t invalidDueToOutsideOfMeasurementRange
bool parseBinaryData(std::vector< uint8_t >::iterator itBuf, size_t length)
DataHandlerError getLastError()
@ INVALID_VERSION_SEGMENT_DEVICESTATUS
@ INVALID_CRC_SEGMENT_LOCALIOS
uint16_t directionValueUniIOPin6
uint8_t currentCaseNumberMonitoringCase2
bool isIntrudedPixelStateValid() const
bool parseLogicSignalsData(std::vector< uint8_t >::iterator itBuf, size_t length)
@ INVALID_LENGTH_SEGMENT_LOGICSIGNALS
uint8_t temperatureWarning
bool parseFieldInformationData(std::vector< uint8_t >::iterator itBuf, size_t length)
uint8_t contaminationError
virtual ~SafeVisionaryData()
@ DEVICE_STATUS_WAIT_FOR_INPUTS
DataSetsActive getDataSetsActive()
uint32_t m_distanceByteDepth
Byte depth of depth map.
uint32_t COPResetRequired
const LOGICSIGNALS_DATA & getLogicSignalsData() const
uint8_t invalidDueToVariance
std::vector< uint16_t > m_intensityMap
Vector containing the intensity map.
@ INVALID_LENGTH_SEGMENT_ROI
bool parseXML(const std::string &xmlString, uint32_t changeCounter)
void generatePointCloud(std::vector< PointXYZ > &pointCloud) override
LOCALIOS_UNIVERSALIO_DIRECTION universalIODirection
@ INVALID_LENGTH_SEGMENT_IMU
@ INVALID_VERSION_SEGMENT_LOCALIOS
DEVICE_STATUS_ELEMENT m_deviceStatusData
@ INVALID_LENGTH_SEGMENT_DEPTHMAP
LOCALIOS_UNIVERSALIO_OUTPUTVALUES universalIOOutputValue
uint8_t invalidDueToTemporalVariance
@ INVALID_LENGTH_SEGMENT_LOCALIOS
@ INVALID_VERSION_SEGMENT_IMU
uint8_t contaminationLevel
@ INVALID_CRC_SEGMENT_LOGICSIGNALS
LOGICSIGNALS_DATA m_logicSignalsData
LOCALIOS_ELEMENT m_localIOsData
bool parseIMUData(std::vector< uint8_t >::iterator itBuf, size_t length)
LOGICSIGNALS_ELEMENT logicSignals[MAX_LOGICSIGNALS_VALUES]
ROI_DATA m_roiData
Contains the ROI data.
ROI_ELEMENT roiData[MAX_ROI_VALUES]
struct visionary::ROI_DATA_SAFETY_DATA::@0 tMembers
const std::vector< uint8_t > & getStateMap() const
LOCALIOS_UNIVERSALIO_CONFIGURED universalIOConfigured
DEVICESTATUS_DATA_GENERALSTATUS generalStatus
uint16_t filteredDepthMap
const FIELDINFORMATION_DATA & getFieldInformationData() const
@ INVALID_VERSION_SEGMENT_ROI
uint16_t directionValueUniIOPin8
@ INVALID_VERSION_SEGMENT_LOGICSIGNALS
uint16_t directionValueUniIOPin5
const std::vector< uint16_t > & getDistanceMap() const
LOCALIOS_ELEMENT getLocalIOData() const
uint16_t directionValueUniIOPin7
uint8_t currentCaseNumberMonitoringCase4
uint32_t m_stateByteDepth
Byte depth of pixel state map.
@ DEVICE_STATUS_CONFIGURATION
const std::vector< uint16_t > & getIntensityMap() const
uint8_t contaminationError
std::vector< uint16_t > m_distanceMap
Vector containing the depth map.
uint8_t currentCaseNumberMonitoringCase3
uint8_t invalidDueToUnderexposure
IMU_VECTOR angularVelocity
@ INVALID_VERSION_SEGMENT_DEPTHMAP
uint8_t contaminationWarning
std::vector< uint8_t > m_stateMap
Vector containing the pixel state map.
DEVICE_STATUS deviceStatus
Union for BitSet structure and alternative generic access : ROI distance measurement - safety related...
@ INVALID_CRC_SEGMENT_FIELDINFORMATION
uint8_t invalidDueToRetroReflectorInterference
LOCALIOS_OSSDS_STATE ossdsState
uint16_t m_flags
Contains the received flags.
bool parseLocalIOsData(std::vector< uint8_t >::iterator itBuf, size_t length)
uint16_t DynamicValidFlags
LOCALIOS_UNIVERSALIO_INPUTVALUES universalIOInputValue
uint32_t m_intensityByteDepth
Byte depth of intensity map.
uint8_t invalidDueToInvalidPixels
uint8_t currentCaseNumberMonitoringCase1
@ INVALID_CRC_SEGMENT_IMU