ardupilot/libraries/AP_RangeFinder/AP_RangeFinder_LeddarOne.h

100 lines
2.8 KiB
C
Raw Normal View History

2016-09-13 00:24:41 -03:00
#pragma once
#include "AP_RangeFinder.h"
#include "AP_RangeFinder_Backend_Serial.h"
2016-09-13 00:24:41 -03:00
#ifndef AP_RANGEFINDER_LEDDARONE_ENABLED
#define AP_RANGEFINDER_LEDDARONE_ENABLED AP_RANGEFINDER_BACKEND_DEFAULT_ENABLED
#endif
#if AP_RANGEFINDER_LEDDARONE_ENABLED
// defines
2016-09-13 00:24:41 -03:00
#define LEDDARONE_DEFAULT_ADDRESS 0x01
#define LEDDARONE_MODOBUS_FUNCTION_CODE 0x04
#define LEDDARONE_MODOBUS_FUNCTION_REGISTER_ADDRESS 20
#define LEDDARONE_MODOBUS_FUNCTION_READ_NUMBER 10
#define LEDDARONE_SERIAL_PORT_MAX 250
#define LEDDARONE_READ_BUFFER_SIZE 25
#define LEDDARONE_DETECTIONS_MAX 3
#define LEDDARONE_DETECTION_DATA_NUMBER_INDEX 10
#define LEDDARONE_DETECTION_DATA_INDEX_OFFSET 11
#define LEDDARONE_DETECTION_DATA_OFFSET 4
2016-09-13 00:24:41 -03:00
// LeddarOne status
enum LeddarOne_Status {
LEDDARONE_STATE_OK = 0,
LEDDARONE_STATE_READING_BUFFER = 1,
LEDDARONE_STATE_ERR_BAD_CRC = -1,
LEDDARONE_STATE_ERR_NO_RESPONSES = -2,
LEDDARONE_STATE_ERR_BAD_RESPONSE = -3,
LEDDARONE_STATE_ERR_SHORT_RESPONSE = -4,
LEDDARONE_STATE_ERR_SERIAL_PORT = -5,
LEDDARONE_STATE_ERR_NUMBER_DETECTIONS = -6
};
2016-09-13 00:24:41 -03:00
// LeddarOne Modbus status
enum LeddarOne_ModbusStatus {
LEDDARONE_MODBUS_STATE_INIT = 0,
LEDDARONE_MODBUS_STATE_PRE_SEND_REQUEST,
LEDDARONE_MODBUS_STATE_SENT_REQUEST,
LEDDARONE_MODBUS_STATE_AVAILABLE
};
class AP_RangeFinder_LeddarOne : public AP_RangeFinder_Backend_Serial
2016-09-13 00:24:41 -03:00
{
public:
static AP_RangeFinder_Backend_Serial *create(
RangeFinder::RangeFinder_State &_state,
AP_RangeFinder_Params &_params) {
return new AP_RangeFinder_LeddarOne(_state, _params);
}
2016-09-13 00:24:41 -03:00
protected:
MAV_DISTANCE_SENSOR _get_mav_distance_sensor_type() const override {
return MAV_DISTANCE_SENSOR_LASER;
}
2016-09-13 00:24:41 -03:00
private:
using AP_RangeFinder_Backend_Serial::AP_RangeFinder_Backend_Serial;
2016-09-13 00:24:41 -03:00
// get a reading
bool get_reading(float &reading_m) override;
2016-09-13 00:24:41 -03:00
// CRC16
bool CRC16(uint8_t *aBuffer, uint8_t aLength, bool aCheck);
// parse a response message from ModBus
LeddarOne_Status parse_response(uint8_t &number_detections);
2016-09-13 00:24:41 -03:00
uint32_t last_sending_request_ms;
uint32_t last_available_ms;
2016-09-13 00:24:41 -03:00
uint32_t sum_distance_mm;
LeddarOne_ModbusStatus modbus_status = LEDDARONE_MODBUS_STATE_INIT;
uint8_t read_buffer[LEDDARONE_READ_BUFFER_SIZE];
uint32_t read_len;
// Modbus send request buffer
// read input register (function code 0x04)
const uint8_t send_request_buffer[8] = {
LEDDARONE_DEFAULT_ADDRESS,
LEDDARONE_MODOBUS_FUNCTION_CODE,
0,
LEDDARONE_MODOBUS_FUNCTION_REGISTER_ADDRESS, // 20: Address of first register to read
0,
LEDDARONE_MODOBUS_FUNCTION_READ_NUMBER, // 10: The number of consecutive registers to read
0x30, // CRC Lo
0x09 // CRC Hi
};
2016-09-13 00:24:41 -03:00
};
#endif // AP_RANGEFINDER_LEDDARONE_ENABLED