2013-08-29 02:34:34 -03:00
|
|
|
/*
|
|
|
|
This program is free software: you can redistribute it and/or modify
|
|
|
|
it under the terms of the GNU General Public License as published by
|
|
|
|
the Free Software Foundation, either version 3 of the License, or
|
|
|
|
(at your option) any later version.
|
|
|
|
|
|
|
|
This program is distributed in the hope that it will be useful,
|
|
|
|
but WITHOUT ANY WARRANTY; without even the implied warranty of
|
|
|
|
MERCHANTABILITY or FITNESS FOR A PARTICULAR PURPOSE. See the
|
|
|
|
GNU General Public License for more details.
|
|
|
|
|
|
|
|
You should have received a copy of the GNU General Public License
|
|
|
|
along with this program. If not, see <http://www.gnu.org/licenses/>.
|
|
|
|
*/
|
|
|
|
|
2012-03-09 22:51:28 -04:00
|
|
|
/*
|
2012-11-28 14:32:38 -04:00
|
|
|
* AP_OpticalFlow_ADNS3080.cpp - ADNS3080 OpticalFlow Library for
|
|
|
|
* Ardupilot Mega
|
2012-08-17 03:20:51 -03:00
|
|
|
* Code by Randy Mackay. DIYDrones.com
|
|
|
|
*
|
|
|
|
*/
|
2012-03-09 22:51:28 -04:00
|
|
|
|
2012-11-28 14:32:38 -04:00
|
|
|
#include <AP_HAL.h>
|
2012-03-09 22:51:28 -04:00
|
|
|
#include "AP_OpticalFlow_ADNS3080.h"
|
2012-10-04 10:46:09 -03:00
|
|
|
|
2012-11-28 14:32:38 -04:00
|
|
|
extern const AP_HAL::HAL& hal;
|
2012-03-09 22:51:28 -04:00
|
|
|
|
2012-08-17 03:20:51 -03:00
|
|
|
// Constructors ////////////////////////////////////////////////////////////////
|
2014-01-08 23:26:55 -04:00
|
|
|
AP_OpticalFlow_ADNS3080::AP_OpticalFlow_ADNS3080()
|
2012-03-09 22:51:28 -04:00
|
|
|
{
|
2012-08-17 03:20:51 -03:00
|
|
|
field_of_view = AP_OPTICALFLOW_ADNS3080_08_FOV;
|
2012-03-09 22:51:28 -04:00
|
|
|
}
|
|
|
|
|
|
|
|
// Public Methods //////////////////////////////////////////////////////////////
|
|
|
|
// init - initialise sensor
|
2012-11-28 14:32:38 -04:00
|
|
|
// assumes SPI bus has been initialised but will attempt to initialise
|
|
|
|
// nonstandard SPI3 bus if required
|
2014-01-08 23:26:55 -04:00
|
|
|
void AP_OpticalFlow_ADNS3080::init()
|
2012-03-09 22:51:28 -04:00
|
|
|
{
|
2012-09-14 09:01:33 -03:00
|
|
|
int8_t retry = 0;
|
2014-01-08 23:26:55 -04:00
|
|
|
_flags.healthy = false;
|
2012-09-14 09:01:33 -03:00
|
|
|
|
|
|
|
// suspend timer while we set-up SPI communication
|
2012-11-28 14:32:38 -04:00
|
|
|
hal.scheduler->suspend_timer_procs();
|
2012-03-09 22:51:28 -04:00
|
|
|
|
2013-05-28 10:56:11 -03:00
|
|
|
// get pointer to the spi bus
|
2012-11-28 14:32:38 -04:00
|
|
|
_spi = hal.spi->device(AP_HAL::SPIDevice_ADNS3080_SPI0);
|
2014-01-08 23:26:55 -04:00
|
|
|
if (_spi != NULL) {
|
|
|
|
// check 3 times for the sensor on standard SPI bus
|
|
|
|
while (!_flags.healthy && retry < 3) {
|
|
|
|
if (read_register(ADNS3080_PRODUCT_ID) == 0x17) {
|
|
|
|
_flags.healthy = true;
|
|
|
|
}
|
|
|
|
retry++;
|
|
|
|
}
|
2012-08-17 03:20:51 -03:00
|
|
|
}
|
2012-03-09 22:51:28 -04:00
|
|
|
|
2014-01-08 23:26:55 -04:00
|
|
|
// if not yet found, get pointer to the SPI3 bus
|
|
|
|
if (!_flags.healthy) {
|
|
|
|
_spi = hal.spi->device(AP_HAL::SPIDevice_ADNS3080_SPI3);
|
|
|
|
if (_spi != NULL) {
|
|
|
|
// check 3 times on SPI3
|
|
|
|
retry = 0;
|
|
|
|
while (!_flags.healthy && retry < 3) {
|
|
|
|
if (read_register(ADNS3080_PRODUCT_ID) == 0x17) {
|
|
|
|
_flags.healthy = true;
|
|
|
|
}
|
|
|
|
retry++;
|
|
|
|
}
|
2012-09-14 09:01:33 -03:00
|
|
|
}
|
2012-08-17 03:20:51 -03:00
|
|
|
}
|
2011-09-17 00:38:18 -03:00
|
|
|
|
2014-01-08 23:26:55 -04:00
|
|
|
// configure the sensor
|
|
|
|
if (_flags.healthy) {
|
|
|
|
// set frame rate to manual
|
|
|
|
uint8_t regVal = read_register(ADNS3080_EXTENDED_CONFIG);
|
|
|
|
hal.scheduler->delay_microseconds(50);
|
|
|
|
regVal = (regVal & ~0x01) | 0x01;
|
|
|
|
write_register(ADNS3080_EXTENDED_CONFIG, regVal);
|
|
|
|
hal.scheduler->delay_microseconds(50);
|
2013-05-28 10:56:11 -03:00
|
|
|
|
2014-01-08 23:26:55 -04:00
|
|
|
// set frame period to 12000 (0x2EE0)
|
|
|
|
write_register(ADNS3080_FRAME_PERIOD_MAX_BOUND_LOWER,0xE0);
|
|
|
|
hal.scheduler->delay_microseconds(50);
|
|
|
|
write_register(ADNS3080_FRAME_PERIOD_MAX_BOUND_UPPER,0x2E);
|
|
|
|
hal.scheduler->delay_microseconds(50);
|
2013-05-28 10:56:11 -03:00
|
|
|
|
2014-01-08 23:26:55 -04:00
|
|
|
// set 1600 resolution bit
|
|
|
|
regVal = read_register(ADNS3080_CONFIGURATION_BITS);
|
|
|
|
hal.scheduler->delay_microseconds(50);
|
|
|
|
regVal |= 0x10;
|
|
|
|
write_register(ADNS3080_CONFIGURATION_BITS, regVal);
|
|
|
|
hal.scheduler->delay_microseconds(50);
|
2012-09-14 09:01:33 -03:00
|
|
|
|
2014-01-08 23:26:55 -04:00
|
|
|
// update scalers
|
|
|
|
update_conversion_factors();
|
|
|
|
|
|
|
|
// register the global static read function to be called at 1khz
|
2013-09-30 04:01:02 -03:00
|
|
|
hal.scheduler->register_timer_process(AP_HAL_MEMBERPROC(&AP_OpticalFlow_ADNS3080::read));
|
2014-01-08 23:26:55 -04:00
|
|
|
}else{
|
|
|
|
// no connection available.
|
|
|
|
_spi = NULL;
|
2012-09-14 09:01:33 -03:00
|
|
|
}
|
|
|
|
|
2013-01-03 17:32:56 -04:00
|
|
|
// resume timer
|
|
|
|
hal.scheduler->resume_timer_procs();
|
2012-03-09 22:51:28 -04:00
|
|
|
}
|
|
|
|
|
|
|
|
// Read a register from the sensor
|
2012-11-28 14:32:38 -04:00
|
|
|
uint8_t AP_OpticalFlow_ADNS3080::read_register(uint8_t address)
|
2012-03-09 22:51:28 -04:00
|
|
|
{
|
2013-07-11 02:14:37 -03:00
|
|
|
AP_HAL::Semaphore *spi_sem;
|
|
|
|
|
|
|
|
// check that we have an spi bus
|
|
|
|
if (_spi == NULL) {
|
|
|
|
return 0;
|
|
|
|
}
|
|
|
|
|
|
|
|
// get spi bus semaphore
|
|
|
|
spi_sem = _spi->get_semaphore();
|
2012-03-09 22:51:28 -04:00
|
|
|
|
2013-07-11 02:14:37 -03:00
|
|
|
// try to get control of the spi bus
|
|
|
|
if (spi_sem == NULL || !spi_sem->take_nonblocking()) {
|
2013-01-03 17:32:56 -04:00
|
|
|
return 0;
|
2012-10-04 10:46:09 -03:00
|
|
|
}
|
|
|
|
|
2012-11-28 14:32:38 -04:00
|
|
|
_spi->cs_assert();
|
|
|
|
// send the device the register you want to read:
|
|
|
|
_spi->transfer(address);
|
|
|
|
hal.scheduler->delay_microseconds(50);
|
|
|
|
// send a value of 0 to read the first byte returned:
|
|
|
|
uint8_t result = _spi->transfer(0x00);
|
2012-03-09 22:51:28 -04:00
|
|
|
|
2012-11-28 14:32:38 -04:00
|
|
|
_spi->cs_release();
|
2012-03-09 22:51:28 -04:00
|
|
|
|
2013-07-11 02:14:37 -03:00
|
|
|
// release the spi bus
|
|
|
|
spi_sem->give();
|
2012-10-04 10:46:09 -03:00
|
|
|
|
2012-08-17 03:20:51 -03:00
|
|
|
return result;
|
2012-03-09 22:51:28 -04:00
|
|
|
}
|
|
|
|
|
|
|
|
// write a value to one of the sensor's registers
|
2012-11-28 14:32:38 -04:00
|
|
|
void AP_OpticalFlow_ADNS3080::write_register(uint8_t address, uint8_t value)
|
2012-03-09 22:51:28 -04:00
|
|
|
{
|
2013-07-11 02:14:37 -03:00
|
|
|
AP_HAL::Semaphore *spi_sem;
|
|
|
|
|
|
|
|
// check that we have an spi bus
|
|
|
|
if (_spi == NULL) {
|
|
|
|
return;
|
|
|
|
}
|
|
|
|
|
|
|
|
// get spi bus semaphore
|
|
|
|
spi_sem = _spi->get_semaphore();
|
2012-11-28 14:32:38 -04:00
|
|
|
|
2013-07-11 02:14:37 -03:00
|
|
|
// try to get control of the spi bus
|
|
|
|
if (spi_sem == NULL || !spi_sem->take_nonblocking()) {
|
2013-01-03 17:32:56 -04:00
|
|
|
return;
|
2012-10-04 10:46:09 -03:00
|
|
|
}
|
|
|
|
|
2012-11-28 14:32:38 -04:00
|
|
|
_spi->cs_assert();
|
2012-03-09 22:51:28 -04:00
|
|
|
|
2012-11-28 14:32:38 -04:00
|
|
|
// send register address
|
|
|
|
_spi->transfer(address | 0x80 );
|
|
|
|
hal.scheduler->delay_microseconds(50);
|
|
|
|
// send data
|
|
|
|
_spi->transfer(value);
|
2012-10-04 10:46:09 -03:00
|
|
|
|
2012-11-28 14:32:38 -04:00
|
|
|
_spi->cs_release();
|
2013-01-03 17:32:56 -04:00
|
|
|
|
2013-07-11 02:14:37 -03:00
|
|
|
// release the spi bus
|
|
|
|
spi_sem->give();
|
2012-03-09 22:51:28 -04:00
|
|
|
}
|
|
|
|
|
|
|
|
// read latest values from sensor and fill in x,y and totals
|
2014-01-08 23:26:55 -04:00
|
|
|
void AP_OpticalFlow_ADNS3080::update(void)
|
2012-03-09 22:51:28 -04:00
|
|
|
{
|
2012-11-28 14:32:38 -04:00
|
|
|
uint8_t motion_reg;
|
2014-02-10 00:53:01 -04:00
|
|
|
int16_t raw_dx, raw_dy; // raw sensor change in x and y position (i.e. unrotated)
|
2013-01-13 02:53:54 -04:00
|
|
|
surface_quality = read_register(ADNS3080_SQUAL);
|
2012-11-28 14:32:38 -04:00
|
|
|
hal.scheduler->delay_microseconds(50);
|
2012-03-09 22:51:28 -04:00
|
|
|
|
|
|
|
// check for movement, update x,y values
|
2012-08-17 03:20:51 -03:00
|
|
|
motion_reg = read_register(ADNS3080_MOTION);
|
2014-01-08 23:26:55 -04:00
|
|
|
if ((motion_reg & 0x80) != 0) {
|
2012-09-14 09:01:33 -03:00
|
|
|
raw_dx = ((int8_t)read_register(ADNS3080_DELTA_X));
|
2012-11-28 14:32:38 -04:00
|
|
|
hal.scheduler->delay_microseconds(50);
|
2012-09-14 09:01:33 -03:00
|
|
|
raw_dy = ((int8_t)read_register(ADNS3080_DELTA_Y));
|
2012-08-17 03:20:51 -03:00
|
|
|
}else{
|
|
|
|
raw_dx = 0;
|
|
|
|
raw_dy = 0;
|
|
|
|
}
|
|
|
|
|
2012-11-28 14:32:38 -04:00
|
|
|
last_update = hal.scheduler->millis();
|
2012-08-17 03:20:51 -03:00
|
|
|
|
2014-01-08 23:26:55 -04:00
|
|
|
Vector3f rot_vector(raw_dx, raw_dy, 0);
|
2012-03-09 22:51:28 -04:00
|
|
|
|
2014-01-08 23:26:55 -04:00
|
|
|
// rotate dx and dy
|
|
|
|
rot_vector.rotate(_orientation);
|
|
|
|
dx = rot_vector.x;
|
|
|
|
dy = rot_vector.y;
|
2012-03-09 22:51:28 -04:00
|
|
|
}
|
|
|
|
|
2014-01-08 23:26:55 -04:00
|
|
|
// parent method called at 1khz by periodic process
|
|
|
|
// this is slowed down to 20hz and each instance's update function is called
|
|
|
|
// (only one instance is supported at the moment)
|
|
|
|
void AP_OpticalFlow_ADNS3080::read(void)
|
2012-03-09 22:51:28 -04:00
|
|
|
{
|
2014-01-08 23:26:55 -04:00
|
|
|
_num_calls++;
|
2012-03-09 22:51:28 -04:00
|
|
|
|
2014-01-08 23:26:55 -04:00
|
|
|
if (_num_calls >= AP_OPTICALFLOW_ADNS3080_NUM_CALLS_FOR_20HZ) {
|
|
|
|
_num_calls = 0;
|
|
|
|
update();
|
2012-08-17 03:20:51 -03:00
|
|
|
}
|
2014-01-08 23:26:55 -04:00
|
|
|
};
|
2012-03-09 22:51:28 -04:00
|
|
|
|
2012-11-28 14:32:38 -04:00
|
|
|
// clear_motion - will cause the Delta_X, Delta_Y, and internal motion
|
|
|
|
// registers to be cleared
|
|
|
|
void AP_OpticalFlow_ADNS3080::clear_motion()
|
2012-03-09 22:51:28 -04:00
|
|
|
{
|
2012-11-28 14:32:38 -04:00
|
|
|
// writing anything to this register will clear the sensor's motion
|
|
|
|
// registers
|
|
|
|
write_register(ADNS3080_MOTION_CLEAR,0xFF);
|
2014-01-08 23:26:55 -04:00
|
|
|
x_cm = 0;
|
|
|
|
y_cm = 0;
|
2012-08-17 03:20:51 -03:00
|
|
|
dx = 0;
|
|
|
|
dy = 0;
|
2012-03-09 22:51:28 -04:00
|
|
|
}
|
|
|
|
|
2012-11-28 14:32:38 -04:00
|
|
|
// get_pixel_data - captures an image from the sensor and stores it to the
|
|
|
|
// pixe_data array
|
|
|
|
void AP_OpticalFlow_ADNS3080::print_pixel_data()
|
2012-03-09 22:51:28 -04:00
|
|
|
{
|
2012-09-14 09:01:33 -03:00
|
|
|
int16_t i,j;
|
2012-08-17 03:20:51 -03:00
|
|
|
bool isFirstPixel = true;
|
2012-09-14 09:01:33 -03:00
|
|
|
uint8_t regValue;
|
|
|
|
uint8_t pixelValue;
|
2012-03-09 22:51:28 -04:00
|
|
|
|
|
|
|
// write to frame capture register to force capture of frame
|
2012-08-17 03:20:51 -03:00
|
|
|
write_register(ADNS3080_FRAME_CAPTURE,0x83);
|
2012-03-09 22:51:28 -04:00
|
|
|
|
2012-08-17 03:20:51 -03:00
|
|
|
// wait 3 frame periods + 10 nanoseconds for frame to be captured
|
2012-11-28 14:32:38 -04:00
|
|
|
// min frame speed is 2000 frames/second so 1 frame = 500 nano seconds.
|
|
|
|
// so 500 x 3 + 10 = 1510
|
|
|
|
hal.scheduler->delay_microseconds(1510);
|
2012-03-09 22:51:28 -04:00
|
|
|
|
|
|
|
// display the pixel data
|
2014-01-08 23:26:55 -04:00
|
|
|
for (i=0; i<ADNS3080_PIXELS_Y; i++) {
|
|
|
|
for (j=0; j<ADNS3080_PIXELS_X; j++) {
|
2012-08-17 03:20:51 -03:00
|
|
|
regValue = read_register(ADNS3080_FRAME_CAPTURE);
|
2014-01-08 23:26:55 -04:00
|
|
|
if (isFirstPixel && (regValue & 0x40) == 0) {
|
2012-11-28 14:32:38 -04:00
|
|
|
hal.console->println_P(
|
|
|
|
PSTR("Optflow: failed to find first pixel"));
|
2012-08-17 03:20:51 -03:00
|
|
|
}
|
|
|
|
isFirstPixel = false;
|
2012-11-28 14:32:38 -04:00
|
|
|
pixelValue = ( regValue << 2 );
|
2013-09-23 04:08:27 -03:00
|
|
|
hal.console->print(pixelValue,BASE_DEC);
|
2014-01-08 23:26:55 -04:00
|
|
|
if (j!= ADNS3080_PIXELS_X-1)
|
2012-11-28 14:32:38 -04:00
|
|
|
hal.console->print_P(PSTR(","));
|
|
|
|
hal.scheduler->delay_microseconds(50);
|
2012-08-17 03:20:51 -03:00
|
|
|
}
|
2012-11-28 14:32:38 -04:00
|
|
|
hal.console->println();
|
2012-08-17 03:20:51 -03:00
|
|
|
}
|
2014-01-08 23:26:55 -04:00
|
|
|
}
|
2012-08-17 03:20:51 -03:00
|
|
|
|
2014-01-08 23:26:55 -04:00
|
|
|
// updates conversion factors that are dependent upon field_of_view
|
|
|
|
void AP_OpticalFlow_ADNS3080::update_conversion_factors()
|
|
|
|
{
|
|
|
|
// multiply this number by altitude and pixel change to get horizontal
|
|
|
|
// move (in same units as altitude)
|
2014-02-10 00:53:01 -04:00
|
|
|
conv_factor = ((1.0f / (float)(ADNS3080_PIXELS_X * AP_OPTICALFLOW_ADNS3080_SCALER_1600))
|
2014-01-08 23:26:55 -04:00
|
|
|
* 2.0f * tanf(field_of_view / 2.0f));
|
|
|
|
// 0.00615
|
2014-02-10 00:53:01 -04:00
|
|
|
radians_to_pixels = (ADNS3080_PIXELS_X * AP_OPTICALFLOW_ADNS3080_SCALER_1600) / field_of_view;
|
2014-01-08 23:26:55 -04:00
|
|
|
// 162.99
|
2012-03-09 22:51:28 -04:00
|
|
|
}
|