2015-08-11 03:28:43 -03:00
# include <AP_HAL/AP_HAL.h>
2014-10-26 16:18:04 -03:00
2015-11-28 05:38:56 -04:00
# if CONFIG_HAL_BOARD_SUBTYPE == HAL_BOARD_SUBTYPE_LINUX_NAVIO || \
CONFIG_HAL_BOARD_SUBTYPE = = HAL_BOARD_SUBTYPE_LINUX_ERLEBRAIN2 | | \
2016-01-05 06:29:11 -04:00
CONFIG_HAL_BOARD_SUBTYPE = = HAL_BOARD_SUBTYPE_LINUX_BH | | \
2016-10-17 15:02:48 -03:00
CONFIG_HAL_BOARD_SUBTYPE = = HAL_BOARD_SUBTYPE_LINUX_DARK | | \
2016-07-10 00:26:27 -03:00
CONFIG_HAL_BOARD_SUBTYPE = = HAL_BOARD_SUBTYPE_LINUX_URUS | | \
2016-01-05 13:35:34 -04:00
CONFIG_HAL_BOARD_SUBTYPE = = HAL_BOARD_SUBTYPE_LINUX_PXFMINI
2016-05-17 23:26:57 -03:00
# include <assert.h>
# include <errno.h>
2014-10-26 16:18:04 -03:00
# include <fcntl.h>
2015-04-16 12:18:14 -03:00
# include <pthread.h>
# include <stdint.h>
2016-05-17 23:26:57 -03:00
# include <stdio.h>
# include <stdlib.h>
# include <string.h>
# include <sys/ioctl.h>
# include <sys/mman.h>
# include <sys/stat.h>
2015-04-16 12:18:14 -03:00
# include <sys/time.h>
# include <sys/types.h>
2016-05-17 23:26:57 -03:00
# include <time.h>
# include <unistd.h>
2015-09-23 12:52:07 -03:00
2016-05-17 23:26:57 -03:00
# include "GPIO.h"
# include "RCInput_RPI.h"
# include "Util_RPI.h"
2014-10-26 16:18:04 -03:00
2015-04-16 12:18:14 -03:00
//Parametres
2015-11-02 11:21:10 -04:00
# define RCIN_RPI_BUFFER_LENGTH 8
# define RCIN_RPI_SAMPLE_FREQ 500
# define RCIN_RPI_DMA_CHANNEL 0
2016-01-18 18:04:14 -04:00
# define RCIN_RPI_MAX_COUNTER 1300
2016-01-07 08:24:46 -04:00
# if CONFIG_HAL_BOARD_SUBTYPE == HAL_BOARD_SUBTYPE_LINUX_BH
2016-01-18 18:04:14 -04:00
# define PPM_INPUT_RPI RPI_GPIO_5
2016-01-07 08:24:46 -04:00
# else
2016-01-18 18:04:14 -04:00
# define PPM_INPUT_RPI RPI_GPIO_4
2016-01-13 09:08:30 -04:00
# endif
2016-01-18 18:04:14 -04:00
# define RCIN_RPI_MAX_SIZE_LINE 50
2015-04-16 12:18:14 -03:00
//Memory Addresses
2015-11-02 11:21:10 -04:00
# define RCIN_RPI_RPI1_DMA_BASE 0x20007000
# define RCIN_RPI_RPI1_CLK_BASE 0x20101000
# define RCIN_RPI_RPI1_PCM_BASE 0x20203000
# define RCIN_RPI_RPI2_DMA_BASE 0x3F007000
# define RCIN_RPI_RPI2_CLK_BASE 0x3F101000
# define RCIN_RPI_RPI2_PCM_BASE 0x3F203000
# define RCIN_RPI_GPIO_LEV0_ADDR 0x7e200034
# define RCIN_RPI_DMA_LEN 0x1000
# define RCIN_RPI_CLK_LEN 0xA8
# define RCIN_RPI_PCM_LEN 0x24
# define RCIN_RPI_TIMER_BASE 0x7e003004
# define RCIN_RPI_DMA_SRC_INC (1<<8)
2016-01-18 18:04:14 -04:00
# define RCIN_RPI_DMA_DEST_INC (1<<4)
2015-11-02 11:21:10 -04:00
# define RCIN_RPI_DMA_NO_WIDE_BURSTS (1<<26)
# define RCIN_RPI_DMA_WAIT_RESP (1<<3)
# define RCIN_RPI_DMA_D_DREQ (1<<6)
# define RCIN_RPI_DMA_PER_MAP(x) ((x)<<16)
# define RCIN_RPI_DMA_END (1<<1)
# define RCIN_RPI_DMA_RESET (1<<31)
# define RCIN_RPI_DMA_INT (1<<2)
# define RCIN_RPI_DMA_CS (0x00 / 4)
# define RCIN_RPI_DMA_CONBLK_AD (0x04 / 4)
# define RCIN_RPI_DMA_DEBUG (0x20 / 4)
# define RCIN_RPI_PCM_CS_A (0x00 / 4)
# define RCIN_RPI_PCM_FIFO_A (0x04 / 4)
# define RCIN_RPI_PCM_MODE_A (0x08 / 4)
# define RCIN_RPI_PCM_RXC_A (0x0c / 4)
# define RCIN_RPI_PCM_TXC_A (0x10 / 4)
# define RCIN_RPI_PCM_DREQ_A (0x14 / 4)
# define RCIN_RPI_PCM_INTEN_A (0x18 / 4)
# define RCIN_RPI_PCM_INT_STC_A (0x1c / 4)
# define RCIN_RPI_PCM_GRAY (0x20 / 4)
# define RCIN_RPI_PCMCLK_CNTL 38
# define RCIN_RPI_PCMCLK_DIV 39
2015-04-16 12:18:14 -03:00
2014-10-26 16:18:04 -03:00
extern const AP_HAL : : HAL & hal ;
using namespace Linux ;
2015-11-02 11:21:10 -04:00
volatile uint32_t * RCInput_RPI : : pcm_reg ;
volatile uint32_t * RCInput_RPI : : clk_reg ;
volatile uint32_t * RCInput_RPI : : dma_reg ;
2015-04-16 12:18:14 -03:00
Memory_table : : Memory_table ( )
2014-10-26 16:18:04 -03:00
{
2015-04-16 12:18:14 -03:00
_page_count = 0 ;
}
2016-11-18 13:53:57 -04:00
// Init Memory table
2015-04-16 12:18:14 -03:00
Memory_table : : Memory_table ( uint32_t page_count , int version )
{
uint32_t i ;
int fdMem , file ;
2016-11-18 13:53:57 -04:00
// Cache coherent adresses depends on RPI's version
2015-04-16 12:18:14 -03:00
uint32_t bus = version = = 1 ? 0x40000000 : 0xC0000000 ;
uint64_t pageInfo ;
2016-11-18 13:53:57 -04:00
void * offset ;
2015-04-16 12:18:14 -03:00
2016-11-18 13:53:57 -04:00
_virt_pages = ( void * * ) malloc ( page_count * sizeof ( void * ) ) ;
_phys_pages = ( void * * ) malloc ( page_count * sizeof ( void * ) ) ;
2015-04-16 12:18:14 -03:00
_page_count = page_count ;
2016-11-18 13:53:57 -04:00
2016-10-30 10:22:29 -03:00
if ( ( fdMem = open ( " /dev/mem " , O_RDWR | O_SYNC | O_CLOEXEC ) ) < 0 ) {
2016-11-18 13:53:57 -04:00
fprintf ( stderr , " Failed to open /dev/mem \n " ) ;
2015-04-16 12:18:14 -03:00
exit ( - 1 ) ;
}
2016-10-30 10:22:29 -03:00
if ( ( file = open ( " /proc/self/pagemap " , O_RDWR | O_SYNC | O_CLOEXEC ) ) < 0 ) {
2016-11-18 13:53:57 -04:00
fprintf ( stderr , " Failed to open /proc/self/pagemap \n " ) ;
2015-04-16 12:18:14 -03:00
exit ( - 1 ) ;
}
2016-11-18 13:53:57 -04:00
// Magic to determine the physical address for this page:
offset = mmap ( 0 , _page_count * PAGE_SIZE , PROT_READ | PROT_WRITE , MAP_SHARED | MAP_ANONYMOUS | MAP_NORESERVE | MAP_LOCKED , - 1 , 0 ) ;
lseek ( file , ( ( uintptr_t ) offset ) / PAGE_SIZE * 8 , SEEK_SET ) ;
2015-04-16 12:18:14 -03:00
2016-11-18 13:53:57 -04:00
// Get list of available cache coherent physical addresses
2015-04-16 12:18:14 -03:00
for ( i = 0 ; i < _page_count ; i + + ) {
2016-11-18 13:53:57 -04:00
_virt_pages [ i ] = mmap ( 0 , PAGE_SIZE , PROT_READ | PROT_WRITE , MAP_SHARED | MAP_ANONYMOUS | MAP_NORESERVE | MAP_LOCKED , - 1 , 0 ) ;
: : read ( file , & pageInfo , 8 ) ;
_phys_pages [ i ] = ( void * ) ( ( uintptr_t ) ( pageInfo * PAGE_SIZE ) | bus ) ;
2015-04-16 12:18:14 -03:00
}
2016-11-18 13:53:57 -04:00
// Map physical addresses to virtual memory
2015-04-16 12:18:14 -03:00
for ( i = 0 ; i < _page_count ; i + + ) {
munmap ( _virt_pages [ i ] , PAGE_SIZE ) ;
2016-11-18 13:53:57 -04:00
_virt_pages [ i ] = mmap ( _virt_pages [ i ] , PAGE_SIZE , PROT_READ | PROT_WRITE , MAP_SHARED | MAP_FIXED | MAP_NORESERVE | MAP_LOCKED , fdMem , ( ( uintptr_t ) _phys_pages [ i ] & ( version = = 1 ? 0xFFFFFFFF : ~ bus ) ) ) ;
2015-04-16 12:18:14 -03:00
memset ( _virt_pages [ i ] , 0xee , PAGE_SIZE ) ;
}
close ( file ) ;
close ( fdMem ) ;
}
Memory_table : : ~ Memory_table ( )
{
free ( _virt_pages ) ;
free ( _phys_pages ) ;
}
2016-11-18 13:53:57 -04:00
// This function returns physical address with help of pointer, which is offset
// from the beginning of the buffer.
void * Memory_table : : get_page ( void * * const pages , uint32_t addr ) const
2015-04-16 12:18:14 -03:00
{
2015-07-01 09:04:57 -03:00
if ( addr > = PAGE_SIZE * _page_count ) {
2016-10-30 02:24:21 -03:00
return nullptr ;
2015-04-16 12:18:14 -03:00
}
2016-11-18 13:53:57 -04:00
return ( uint8_t * ) pages [ ( uint32_t ) addr / 4096 ] + addr % 4096 ;
2015-04-16 12:18:14 -03:00
}
2016-01-18 18:04:14 -04:00
//Get virtual address from the corresponding physical address from memory_table.
2016-11-18 13:53:57 -04:00
void * Memory_table : : get_virt_addr ( const uint32_t phys_addr ) const
2015-04-16 12:18:14 -03:00
{
2016-01-18 18:04:14 -04:00
// FIXME: Can't the address be calculated directly?
2016-11-18 13:53:57 -04:00
// FIXME: if the address room in _phys_pages is not fragmented one may avoid
// a complete loop ..
2015-07-01 09:04:57 -03:00
uint32_t i = 0 ;
for ( ; i < _page_count ; i + + ) {
2016-11-18 13:53:57 -04:00
if ( ( uintptr_t ) _phys_pages [ i ] = = ( ( ( uintptr_t ) phys_addr ) & 0xFFFFF000 ) ) {
return ( void * ) ( ( uintptr_t ) _virt_pages [ i ] + ( phys_addr & 0xFFF ) ) ;
2015-04-16 12:18:14 -03:00
}
}
2016-10-30 02:24:21 -03:00
return nullptr ;
2015-04-16 12:18:14 -03:00
}
2016-11-18 13:53:57 -04:00
// This function returns offset from the beginning of the buffer using virtual
// address and memory_table.
2015-07-01 09:04:57 -03:00
uint32_t Memory_table : : get_offset ( void * * const pages , const uint32_t addr ) const
2015-04-16 12:18:14 -03:00
{
2015-07-01 09:04:57 -03:00
uint32_t i = 0 ;
for ( ; i < _page_count ; i + + ) {
2015-08-15 07:29:14 -03:00
if ( ( uintptr_t ) pages [ i ] = = ( addr & 0xFFFFF000 ) ) {
2016-01-18 18:04:14 -04:00
return ( i * PAGE_SIZE + ( addr & 0xFFF ) ) ;
2015-04-16 12:18:14 -03:00
}
}
return - 1 ;
}
2016-11-18 13:53:57 -04:00
// How many bytes are available for reading in circle buffer?
2015-07-01 09:04:57 -03:00
uint32_t Memory_table : : bytes_available ( const uint32_t read_addr , const uint32_t write_addr ) const
2015-04-16 12:18:14 -03:00
{
if ( write_addr > read_addr ) {
2015-07-01 09:04:57 -03:00
return ( write_addr - read_addr ) ;
2016-11-18 13:53:57 -04:00
} else {
2015-07-01 09:04:57 -03:00
return _page_count * PAGE_SIZE - ( read_addr - write_addr ) ;
2015-04-16 12:18:14 -03:00
}
}
2015-07-01 09:04:57 -03:00
uint32_t Memory_table : : get_page_count ( ) const
2015-04-16 12:18:14 -03:00
{
return _page_count ;
}
2016-11-18 13:53:57 -04:00
// Physical addresses of peripheral depends on Raspberry Pi's version
2015-11-02 11:21:10 -04:00
void RCInput_RPI : : set_physical_addresses ( int version )
2015-04-16 12:18:14 -03:00
{
if ( version = = 1 ) {
2015-11-02 11:21:10 -04:00
dma_base = RCIN_RPI_RPI1_DMA_BASE ;
clk_base = RCIN_RPI_RPI1_CLK_BASE ;
pcm_base = RCIN_RPI_RPI1_PCM_BASE ;
2016-11-18 13:53:57 -04:00
} else if ( version = = 2 ) {
2015-11-02 11:21:10 -04:00
dma_base = RCIN_RPI_RPI2_DMA_BASE ;
clk_base = RCIN_RPI_RPI2_CLK_BASE ;
pcm_base = RCIN_RPI_RPI2_PCM_BASE ;
2015-04-16 12:18:14 -03:00
}
}
2016-11-18 13:53:57 -04:00
// Map peripheral to virtual memory
void * RCInput_RPI : : map_peripheral ( uint32_t base , uint32_t len )
2015-04-16 12:18:14 -03:00
{
2016-10-30 10:22:29 -03:00
int fd = open ( " /dev/mem " , O_RDWR | O_CLOEXEC ) ;
2016-11-18 13:53:57 -04:00
void * vaddr ;
2015-04-16 12:18:14 -03:00
if ( fd < 0 ) {
printf ( " Failed to open /dev/mem: %m \n " ) ;
2016-10-30 02:24:21 -03:00
return nullptr ;
2015-04-16 12:18:14 -03:00
}
2016-11-18 13:53:57 -04:00
vaddr = mmap ( nullptr , len , PROT_READ | PROT_WRITE , MAP_SHARED , fd , base ) ;
2015-04-16 12:18:14 -03:00
if ( vaddr = = MAP_FAILED ) {
printf ( " rpio-pwm: Failed to map peripheral at 0x%08x: %m \n " , base ) ;
}
close ( fd ) ;
return vaddr ;
}
2016-11-18 13:53:57 -04:00
// Method to init DMA control block
void RCInput_RPI : : init_dma_cb ( dma_cb_t * * cbp , uint32_t mode , uint32_t source , uint32_t dest , uint32_t length , uint32_t stride , uint32_t next_cb )
2015-04-16 12:18:14 -03:00
{
( * cbp ) - > info = mode ;
( * cbp ) - > src = source ;
( * cbp ) - > dst = dest ;
( * cbp ) - > length = length ;
( * cbp ) - > next = next_cb ;
( * cbp ) - > stride = stride ;
}
2015-11-02 11:21:10 -04:00
void RCInput_RPI : : stop_dma ( )
2015-04-16 12:18:14 -03:00
{
2015-11-02 11:21:10 -04:00
dma_reg [ RCIN_RPI_DMA_CS | RCIN_RPI_DMA_CHANNEL < < 8 ] = 0 ;
2015-07-09 11:07:53 -03:00
}
/* We need to be sure that the DMA is stopped upon termination */
2015-11-02 11:21:10 -04:00
void RCInput_RPI : : termination_handler ( int signum )
2015-07-09 11:07:53 -03:00
{
stop_dma ( ) ;
2016-01-18 17:20:44 -04:00
AP_HAL : : panic ( " Interrupted: %s " , strsignal ( signum ) ) ;
2015-04-16 12:18:14 -03:00
}
2016-11-18 13:53:57 -04:00
// This function is used to init DMA control blocks (setting sampling GPIO
// register, destination adresses, synchronization)
2015-11-02 11:21:10 -04:00
void RCInput_RPI : : init_ctrl_data ( )
2015-04-16 12:18:14 -03:00
{
uint32_t phys_fifo_addr ;
uint32_t dest = 0 ;
uint32_t cbp = 0 ;
2016-11-18 13:53:57 -04:00
dma_cb_t * cbp_curr ;
// Set fifo addr (for delay)
phys_fifo_addr = ( ( pcm_base + 0x04 ) & 0x00FFFFFF ) | 0x7e000000 ;
// Init dma control blocks.
2016-01-18 18:04:14 -04:00
/*We are transferring 1 byte of GPIO register. Every 56th iteration we are
sampling TIMER register , which length is 8 bytes . So , for every 56 samples of GPIO we need
56 * 1 + 8 = 64 bytes of buffer . Value 56 was selected specially to have a 64 - byte " block "
TIMER - GPIO . So , we have integer count of such " blocks " at one virtual page . ( 4096 / 64 = 64
" blocks " per page . As minimum , we must have 2 virtual pages of buffer ( to have integer count of
vitual pages for control blocks ) : for every 56 iterations ( 64 bytes of buffer ) we need 56 control blocks for GPIO
sampling , 56 control blocks for setting frequency and 1 control block for sampling timer , so ,
we need 56 + 56 + 1 = 113 control blocks . For integer value , we need 113 pages of control blocks .
Each control block length is 32 bytes . In 113 pages we will have ( 113 * 4096 / 32 ) = 113 * 128 control
blocks . 113 * 128 control blocks = 64 * 128 bytes of buffer = 2 pages of buffer .
So , for 56 * 64 * 2 iteration we init DMA for sampling GPIO
and timer to ( 64 * 64 * 2 ) = 8192 bytes = 2 pages of buffer .
2015-04-16 12:18:14 -03:00
*/
2016-11-18 13:53:57 -04:00
for ( uint32_t i = 0 ; i < 56 * 128 * RCIN_RPI_BUFFER_LENGTH ; i + + ) {
//Transfer timer every 56th sample
if ( i % 56 = = 0 ) {
cbp_curr = ( dma_cb_t * ) con_blocks - > get_page ( con_blocks - > _virt_pages , cbp ) ;
init_dma_cb ( & cbp_curr , RCIN_RPI_DMA_NO_WIDE_BURSTS | RCIN_RPI_DMA_WAIT_RESP | RCIN_RPI_DMA_DEST_INC | RCIN_RPI_DMA_SRC_INC , RCIN_RPI_TIMER_BASE ,
( uintptr_t ) circle_buffer - > get_page ( circle_buffer - > _phys_pages , dest ) ,
8 ,
0 ,
( uintptr_t ) con_blocks - > get_page ( con_blocks - > _phys_pages ,
cbp + sizeof ( dma_cb_t ) ) ) ;
dest + = 8 ;
cbp + = sizeof ( dma_cb_t ) ;
}
// Transfer GPIO (1 byte)
cbp_curr = ( dma_cb_t * ) con_blocks - > get_page ( con_blocks - > _virt_pages , cbp ) ;
init_dma_cb ( & cbp_curr , RCIN_RPI_DMA_NO_WIDE_BURSTS | RCIN_RPI_DMA_WAIT_RESP , RCIN_RPI_GPIO_LEV0_ADDR ,
( uintptr_t ) circle_buffer - > get_page ( circle_buffer - > _phys_pages , dest ) ,
1 ,
0 ,
( uintptr_t ) con_blocks - > get_page ( con_blocks - > _phys_pages ,
cbp + sizeof ( dma_cb_t ) ) ) ;
dest + = 1 ;
cbp + = sizeof ( dma_cb_t ) ;
// Delay (for setting sampling frequency)
/* DMA is waiting data request signal (DREQ) from PCM. PCM is set for 1 MhZ freqency, so,
2016-01-18 18:04:14 -04:00
each sample of GPIO is limited by writing to PCA queue .
*/
2016-11-18 13:53:57 -04:00
cbp_curr = ( dma_cb_t * ) con_blocks - > get_page ( con_blocks - > _virt_pages , cbp ) ;
init_dma_cb ( & cbp_curr , RCIN_RPI_DMA_NO_WIDE_BURSTS | RCIN_RPI_DMA_WAIT_RESP | RCIN_RPI_DMA_D_DREQ | RCIN_RPI_DMA_PER_MAP ( 2 ) ,
RCIN_RPI_TIMER_BASE , phys_fifo_addr ,
4 ,
0 ,
( uintptr_t ) con_blocks - > get_page ( con_blocks - > _phys_pages ,
cbp + sizeof ( dma_cb_t ) ) ) ;
cbp + = sizeof ( dma_cb_t ) ;
}
//Make last control block point to the first (to make circle)
2015-04-16 12:18:14 -03:00
cbp - = sizeof ( dma_cb_t ) ;
2016-11-18 13:53:57 -04:00
( ( dma_cb_t * ) con_blocks - > get_page ( con_blocks - > _virt_pages , cbp ) ) - > next = ( uintptr_t ) con_blocks - > get_page ( con_blocks - > _phys_pages , 0 ) ;
2015-04-16 12:18:14 -03:00
}
/*Initialise PCM
See BCM2835 documentation :
http : //www.raspberrypi.org/wp-content/uploads/2012/02/BCM2835-ARM-Peripherals.pdf
2016-11-18 13:53:57 -04:00
*/
2015-11-02 11:21:10 -04:00
void RCInput_RPI : : init_PCM ( )
2015-04-16 12:18:14 -03:00
{
2015-11-02 11:21:10 -04:00
pcm_reg [ RCIN_RPI_PCM_CS_A ] = 1 ; // Disable Rx+Tx, Enable PCM block
2015-04-16 12:18:14 -03:00
hal . scheduler - > delay_microseconds ( 100 ) ;
2015-11-02 11:21:10 -04:00
clk_reg [ RCIN_RPI_PCMCLK_CNTL ] = 0x5A000006 ; // Source=PLLD (500MHz)
2015-04-16 12:18:14 -03:00
hal . scheduler - > delay_microseconds ( 100 ) ;
2015-11-02 11:21:10 -04:00
clk_reg [ RCIN_RPI_PCMCLK_DIV ] = 0x5A000000 | ( ( 50000 / RCIN_RPI_SAMPLE_FREQ ) < < 12 ) ; // Set pcm div. If we need to configure DMA frequency.
2015-04-16 12:18:14 -03:00
hal . scheduler - > delay_microseconds ( 100 ) ;
2015-11-02 11:21:10 -04:00
clk_reg [ RCIN_RPI_PCMCLK_CNTL ] = 0x5A000016 ; // Source=PLLD and enable
2015-04-16 12:18:14 -03:00
hal . scheduler - > delay_microseconds ( 100 ) ;
2015-11-02 11:21:10 -04:00
pcm_reg [ RCIN_RPI_PCM_TXC_A ] = 0 < < 31 | 1 < < 30 | 0 < < 20 | 0 < < 16 ; // 1 channel, 8 bits
2015-04-16 12:18:14 -03:00
hal . scheduler - > delay_microseconds ( 100 ) ;
2015-11-02 11:21:10 -04:00
pcm_reg [ RCIN_RPI_PCM_MODE_A ] = ( 10 - 1 ) < < 10 ; //PCM mode
2015-04-16 12:18:14 -03:00
hal . scheduler - > delay_microseconds ( 100 ) ;
2015-11-02 11:21:10 -04:00
pcm_reg [ RCIN_RPI_PCM_CS_A ] | = 1 < < 4 | 1 < < 3 ; // Clear FIFOs
2015-04-16 12:18:14 -03:00
hal . scheduler - > delay_microseconds ( 100 ) ;
2015-11-02 11:21:10 -04:00
pcm_reg [ RCIN_RPI_PCM_DREQ_A ] = 64 < < 24 | 64 < < 8 ; // DMA Req when one slot is free?
2015-04-16 12:18:14 -03:00
hal . scheduler - > delay_microseconds ( 100 ) ;
2015-11-02 11:21:10 -04:00
pcm_reg [ RCIN_RPI_PCM_CS_A ] | = 1 < < 9 ; // Enable DMA
2015-04-16 12:18:14 -03:00
hal . scheduler - > delay_microseconds ( 100 ) ;
2015-11-02 11:21:10 -04:00
pcm_reg [ RCIN_RPI_PCM_CS_A ] | = 1 < < 2 ; // Enable Tx
2015-04-16 12:18:14 -03:00
hal . scheduler - > delay_microseconds ( 100 ) ;
}
/*Initialise DMA
See BCM2835 documentation :
http : //www.raspberrypi.org/wp-content/uploads/2012/02/BCM2835-ARM-Peripherals.pdf
2016-11-18 13:53:57 -04:00
*/
2015-11-02 11:21:10 -04:00
void RCInput_RPI : : init_DMA ( )
2015-04-16 12:18:14 -03:00
{
2015-11-02 11:21:10 -04:00
dma_reg [ RCIN_RPI_DMA_CS | RCIN_RPI_DMA_CHANNEL < < 8 ] = RCIN_RPI_DMA_RESET ; //Reset DMA
2015-04-16 12:18:14 -03:00
hal . scheduler - > delay_microseconds ( 100 ) ;
2015-11-02 11:21:10 -04:00
dma_reg [ RCIN_RPI_DMA_CS | RCIN_RPI_DMA_CHANNEL < < 8 ] = RCIN_RPI_DMA_INT | RCIN_RPI_DMA_END ;
dma_reg [ RCIN_RPI_DMA_CONBLK_AD | RCIN_RPI_DMA_CHANNEL < < 8 ] = reinterpret_cast < uintptr_t > ( con_blocks - > get_page ( con_blocks - > _phys_pages , 0 ) ) ; //Set first control block address
dma_reg [ RCIN_RPI_DMA_DEBUG | RCIN_RPI_DMA_CHANNEL < < 8 ] = 7 ; // clear debug error flags
2016-01-18 18:04:14 -04:00
dma_reg [ RCIN_RPI_DMA_CS | RCIN_RPI_DMA_CHANNEL < < 8 ] = 0x10880001 ; // go, mid priority, wait for outstanding writes
2015-04-16 12:18:14 -03:00
}
2016-11-18 13:53:57 -04:00
// We must stop DMA when the process is killed
2015-11-02 11:21:10 -04:00
void RCInput_RPI : : set_sigaction ( )
2015-04-16 12:18:14 -03:00
{
2016-07-13 10:39:31 -03:00
for ( int i = 0 ; i < NSIG ; i + + ) {
2016-10-26 18:27:12 -03:00
// catch all signals to ensure DMA is disabled - some of them may
// already be handled elsewhere in cases we consider normal
// termination. In those cases the teardown() method must be called.
2016-07-13 10:51:44 -03:00
struct sigaction sa , sa_old ;
2015-04-16 12:18:14 -03:00
memset ( & sa , 0 , sizeof ( sa ) ) ;
2016-07-13 10:51:44 -03:00
sigaction ( i , nullptr , & sa_old ) ;
if ( sa_old . sa_handler = = nullptr ) {
sa . sa_handler = RCInput_RPI : : termination_handler ;
sigaction ( i , & sa , nullptr ) ;
}
2015-04-16 12:18:14 -03:00
}
}
2016-11-18 13:53:57 -04:00
// Initial setup of variables
2015-11-02 11:21:10 -04:00
RCInput_RPI : : RCInput_RPI ( ) :
2016-11-18 12:23:28 -04:00
circle_buffer { nullptr } ,
con_blocks { nullptr } ,
2016-01-18 18:04:14 -04:00
prev_tick ( 0 ) ,
delta_time ( 0 ) ,
2015-11-02 11:21:10 -04:00
curr_tick_inc ( 1000 / RCIN_RPI_SAMPLE_FREQ ) ,
2015-04-16 12:18:14 -03:00
curr_pointer ( 0 ) ,
2016-01-18 18:04:14 -04:00
curr_channel ( 0 ) ,
width_s0 ( 0 ) ,
curr_signal ( 0 ) ,
last_signal ( 228 ) ,
state ( RCIN_RPI_INITIAL_STATE )
2016-11-18 12:23:28 -04:00
{
2015-04-16 12:18:14 -03:00
}
2015-11-02 11:21:10 -04:00
RCInput_RPI : : ~ RCInput_RPI ( )
2015-04-16 12:18:14 -03:00
{
delete circle_buffer ;
delete con_blocks ;
}
2016-10-26 17:41:47 -03:00
void RCInput_RPI : : teardown ( )
2015-07-06 19:49:04 -03:00
{
2015-07-09 11:07:53 -03:00
stop_dma ( ) ;
2015-07-06 19:49:04 -03:00
}
2015-04-16 12:18:14 -03:00
//Initializing necessary registers
2015-11-02 11:21:10 -04:00
void RCInput_RPI : : init_registers ( )
2015-04-16 12:18:14 -03:00
{
2016-11-18 13:53:57 -04:00
dma_reg = ( uint32_t * ) map_peripheral ( dma_base , RCIN_RPI_DMA_LEN ) ;
pcm_reg = ( uint32_t * ) map_peripheral ( pcm_base , RCIN_RPI_PCM_LEN ) ;
clk_reg = ( uint32_t * ) map_peripheral ( clk_base , RCIN_RPI_CLK_LEN ) ;
2015-04-16 12:18:14 -03:00
}
2015-12-02 11:14:20 -04:00
void RCInput_RPI : : init ( )
2015-04-16 12:18:14 -03:00
{
2016-11-18 12:23:28 -04:00
# if CONFIG_HAL_BOARD_SUBTYPE == HAL_BOARD_SUBTYPE_LINUX_ERLEBRAIN2
int version = 2 ;
# else
int version = UtilRPI : : from ( hal . util ) - > get_rpi_version ( ) ;
# endif
set_physical_addresses ( version ) ;
circle_buffer = new Memory_table ( RCIN_RPI_BUFFER_LENGTH * 2 , version ) ;
con_blocks = new Memory_table ( RCIN_RPI_BUFFER_LENGTH * 113 , version ) ;
2015-04-16 12:18:14 -03:00
init_registers ( ) ;
2016-11-18 13:53:57 -04:00
// Enable PPM input
2016-01-18 18:04:14 -04:00
enable_pin = hal . gpio - > channel ( PPM_INPUT_RPI ) ;
enable_pin - > mode ( HAL_GPIO_INPUT ) ;
2015-04-16 12:18:14 -03:00
2016-11-18 13:53:57 -04:00
// Configuration
2015-04-16 12:18:14 -03:00
set_sigaction ( ) ;
init_ctrl_data ( ) ;
init_PCM ( ) ;
init_DMA ( ) ;
2016-11-18 13:53:57 -04:00
// Wait a bit to let DMA fill queues and come to stable sampling
2015-04-16 12:18:14 -03:00
hal . scheduler - > delay ( 300 ) ;
2016-11-18 13:53:57 -04:00
// Reading first sample
curr_tick = * ( ( uint64_t * ) circle_buffer - > get_page ( circle_buffer - > _virt_pages , curr_pointer ) ) ;
2016-01-18 18:04:14 -04:00
prev_tick = curr_tick ;
2015-04-16 12:18:14 -03:00
curr_pointer + = 8 ;
2016-11-18 13:53:57 -04:00
curr_signal = * ( ( uint8_t * ) circle_buffer - > get_page ( circle_buffer - > _virt_pages , curr_pointer ) ) & 0x10 ? 1 : 0 ;
2016-01-18 18:04:14 -04:00
last_signal = curr_signal ;
curr_pointer + + ;
2016-11-18 12:23:28 -04:00
_initialized = true ;
2014-10-26 16:18:04 -03:00
}
2016-11-18 13:53:57 -04:00
// Processing signal
2015-11-02 11:21:10 -04:00
void RCInput_RPI : : _timer_tick ( )
2014-10-26 16:18:04 -03:00
{
2016-11-18 13:53:57 -04:00
uint32_t counter = 0 ;
2015-04-16 12:18:14 -03:00
2016-11-18 12:23:28 -04:00
if ( ! _initialized ) {
return ;
}
2016-11-18 13:53:57 -04:00
// Now we are getting address in which DMAC is writing at current moment
dma_cb_t * ad = ( dma_cb_t * ) con_blocks - > get_virt_addr ( dma_reg [ RCIN_RPI_DMA_CONBLK_AD | RCIN_RPI_DMA_CHANNEL < < 8 ] ) ;
for ( int j = 1 ; j > = - 1 ; j - - ) {
void * x = circle_buffer - > get_virt_addr ( ( ad + j ) - > dst ) ;
if ( x ! = nullptr ) {
counter = circle_buffer - > bytes_available ( curr_pointer ,
circle_buffer - > get_offset ( circle_buffer - > _virt_pages , ( uintptr_t ) x ) ) ;
break ;
}
2015-04-16 12:18:14 -03:00
}
2016-11-18 13:53:57 -04:00
if ( counter = = 0 ) {
return ;
}
// How many bytes have DMA transferred (and we can process)?
// We can't stay in method for a long time, because it may lead to delays
2015-11-02 11:21:10 -04:00
if ( counter > RCIN_RPI_MAX_COUNTER ) {
counter = RCIN_RPI_MAX_COUNTER ;
2015-04-16 12:18:14 -03:00
}
2016-11-18 13:53:57 -04:00
// Processing ready bytes
for ( ; counter > 0x40 ; counter - - ) {
// Is it timer sample?
if ( curr_pointer % ( 64 ) = = 0 ) {
curr_tick = * ( ( uint64_t * ) circle_buffer - > get_page ( circle_buffer - > _virt_pages , curr_pointer ) ) ;
curr_pointer + = 8 ;
counter - = 8 ;
2014-10-28 11:37:25 -03:00
}
2016-11-18 13:53:57 -04:00
// Reading required bit
curr_signal = * ( ( uint8_t * ) circle_buffer - > get_page ( circle_buffer - > _virt_pages , curr_pointer ) ) & 0x10 ? 1 : 0 ;
// If the signal changed
2016-01-18 18:04:14 -04:00
if ( curr_signal ! = last_signal ) {
delta_time = curr_tick - prev_tick ;
prev_tick = curr_tick ;
switch ( state ) {
case RCIN_RPI_INITIAL_STATE :
state = RCIN_RPI_ZERO_STATE ;
break ;
case RCIN_RPI_ZERO_STATE :
if ( curr_signal = = 0 ) {
2016-11-18 13:53:57 -04:00
width_s0 = ( uint16_t ) delta_time ;
2016-01-18 18:04:14 -04:00
state = RCIN_RPI_ONE_STATE ;
}
2016-11-18 13:53:57 -04:00
break ;
2016-01-18 18:04:14 -04:00
case RCIN_RPI_ONE_STATE :
if ( curr_signal = = 1 ) {
2016-11-18 13:53:57 -04:00
width_s1 = ( uint16_t ) delta_time ;
2016-01-18 18:04:14 -04:00
state = RCIN_RPI_ZERO_STATE ;
_process_rc_pulse ( width_s0 , width_s1 ) ;
2015-04-16 12:18:14 -03:00
}
2016-11-18 13:53:57 -04:00
break ;
2015-04-16 12:18:14 -03:00
}
}
2016-11-18 13:53:57 -04:00
2016-01-18 18:04:14 -04:00
last_signal = curr_signal ;
curr_pointer + + ;
2016-11-18 13:53:57 -04:00
if ( curr_pointer > = circle_buffer - > get_page_count ( ) * PAGE_SIZE ) {
2015-04-16 12:18:14 -03:00
curr_pointer = 0 ;
}
2016-11-18 13:53:57 -04:00
curr_tick + = curr_tick_inc ;
2015-04-16 12:18:14 -03:00
}
2014-10-26 16:18:04 -03:00
}
2016-11-18 13:53:57 -04:00
# endif