aboutsummaryrefslogtreecommitdiffstats
path: root/firmware/libboard
diff options
context:
space:
mode:
authorKévin Redon <kredon@sysmocom.de>2018-07-08 13:26:15 +0200
committerKévin Redon <kredon@sysmocom.de>2018-07-11 22:01:58 +0200
commit93717e43b38348821b32cd476c1ab87b1bed9edb (patch)
tree204761383c84593fcce37eef76f922d342c5b009 /firmware/libboard
parent9a12d68c74a52f839bffa75ea7260f74bdf39292 (diff)
set linux end of line
Diffstat (limited to 'firmware/libboard')
-rw-r--r--firmware/libboard/common/source/board_cstartup_gnu.c416
-rw-r--r--firmware/libboard/common/source/board_lowlevel.c432
-rw-r--r--firmware/libboard/common/source/uart_console.c852
3 files changed, 850 insertions, 850 deletions
diff --git a/firmware/libboard/common/source/board_cstartup_gnu.c b/firmware/libboard/common/source/board_cstartup_gnu.c
index c46d42f..0e8bb87 100644
--- a/firmware/libboard/common/source/board_cstartup_gnu.c
+++ b/firmware/libboard/common/source/board_cstartup_gnu.c
@@ -1,208 +1,208 @@
-/* ----------------------------------------------------------------------------
- * ATMEL Microcontroller Software Support
- * ----------------------------------------------------------------------------
- * Copyright (c) 2010, Atmel Corporation
- * Copyright (c) 2017, Harald Welte <laforge@gnumonks.org>
- * Copyright (c) 2018, sysmocom -s.f.m.c. GmbH, Author: Kevin Redon <kredon@sysmocom.de>
- *
- * All rights reserved.
- *
- * Redistribution and use in source and binary forms, with or without
- * modification, are permitted provided that the following conditions are met:
- *
- * - Redistributions of source code must retain the above copyright notice,
- * this list of conditions and the disclaimer below.
- *
- * Atmel's name may not be used to endorse or promote products derived from
- * this software without specific prior written permission.
- *
- * DISCLAIMER: THIS SOFTWARE IS PROVIDED BY ATMEL "AS IS" AND ANY EXPRESS OR
- * IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
- * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT ARE
- * DISCLAIMED. IN NO EVENT SHALL ATMEL BE LIABLE FOR ANY DIRECT, INDIRECT,
- * INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT
- * LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA,
- * OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF
- * LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING
- * NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE,
- * EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
- * ----------------------------------------------------------------------------
- */
-
-/*----------------------------------------------------------------------------
- * Headers
- *----------------------------------------------------------------------------*/
-
-#include "board.h"
-#include "board_lowlevel.h"
-
-/*----------------------------------------------------------------------------
- * Exported variables
- *----------------------------------------------------------------------------*/
-
-/* Stack Configuration */
-#define STACK_SIZE 0x900 /** Stack size (in DWords) */
-__attribute__ ((aligned(8),section(".stack")))
-uint32_t pdwStack[STACK_SIZE] ;
-
-/* Initialize segments */
-extern uint32_t _sfixed;
-extern uint32_t _efixed;
-extern uint32_t _etext;
-extern uint32_t _srelocate;
-extern uint32_t _erelocate;
-extern uint32_t _szero;
-extern uint32_t _ezero;
-
-
-/*----------------------------------------------------------------------------
- * ProtoTypes
- *----------------------------------------------------------------------------*/
-
-/** \cond DOXYGEN_SHOULD_SKIP_THIS */
-extern int main( void ) ;
-/** \endcond */
-void ResetException( void ) ;
-
-/*------------------------------------------------------------------------------
- * Exception Table
- *------------------------------------------------------------------------------*/
-
-__attribute__((section(".vectors")))
-IntFunc exception_table[] = {
-
- /* Configure Initial Stack Pointer, using linker-generated symbols */
- (IntFunc)(&pdwStack[STACK_SIZE-1]),
- ResetException,
-
- NMI_Handler,
- HardFault_Handler,
- MemManage_Handler,
- BusFault_Handler,
- UsageFault_Handler,
- 0, 0, 0, 0, /* Reserved */
- SVC_Handler,
- DebugMon_Handler,
- 0, /* Reserved */
- PendSV_Handler,
- SysTick_Handler,
-
- /* Configurable interrupts */
- SUPC_IrqHandler, /* 0 Supply Controller */
- RSTC_IrqHandler, /* 1 Reset Controller */
- RTC_IrqHandler, /* 2 Real Time Clock */
- RTT_IrqHandler, /* 3 Real Time Timer */
- WDT_IrqHandler, /* 4 Watchdog Timer */
- PMC_IrqHandler, /* 5 PMC */
- EEFC_IrqHandler, /* 6 EEFC */
- IrqHandlerNotUsed, /* 7 Reserved */
- UART0_IrqHandler, /* 8 UART0 */
- UART1_IrqHandler, /* 9 UART1 */
- SMC_IrqHandler, /* 10 SMC */
- PIOA_IrqHandler, /* 11 Parallel IO Controller A */
- PIOB_IrqHandler, /* 12 Parallel IO Controller B */
- PIOC_IrqHandler, /* 13 Parallel IO Controller C */
- USART0_IrqHandler, /* 14 USART 0 */
- USART1_IrqHandler, /* 15 USART 1 */
- IrqHandlerNotUsed, /* 16 Reserved */
- IrqHandlerNotUsed, /* 17 Reserved */
- MCI_IrqHandler, /* 18 MCI */
- TWI0_IrqHandler, /* 19 TWI 0 */
- TWI1_IrqHandler, /* 20 TWI 1 */
- SPI_IrqHandler, /* 21 SPI */
- SSC_IrqHandler, /* 22 SSC */
- TC0_IrqHandler, /* 23 Timer Counter 0 */
- TC1_IrqHandler, /* 24 Timer Counter 1 */
- TC2_IrqHandler, /* 25 Timer Counter 2 */
- TC3_IrqHandler, /* 26 Timer Counter 3 */
- TC4_IrqHandler, /* 27 Timer Counter 4 */
- TC5_IrqHandler, /* 28 Timer Counter 5 */
- ADC_IrqHandler, /* 29 ADC controller */
- DAC_IrqHandler, /* 30 DAC controller */
- PWM_IrqHandler, /* 31 PWM */
- CRCCU_IrqHandler, /* 32 CRC Calculation Unit */
- ACC_IrqHandler, /* 33 Analog Comparator */
- USBD_IrqHandler, /* 34 USB Device Port */
- IrqHandlerNotUsed /* 35 not used */
-};
-
-#if defined(BOARD_USB_DFU) && defined(APPLICATION_dfu)
-#include "usb/device/dfu/dfu.h"
-static void BootIntoApp(void)
-{
- unsigned int *pSrc;
- void (*appReset)(void);
-
- pSrc = (unsigned int *) ((unsigned char *)IFLASH_ADDR + BOARD_DFU_BOOT_SIZE);
- /* set vector table to application vector table (store at the beginning of the application) */
- SCB->VTOR = (unsigned int)(pSrc);
- /* set stack pointer to address provided in the beginning of the application (loaded into a register first) */
- __asm__ volatile ("MSR msp,%0" : :"r"(*pSrc));
- /* start application (by jumping to the reset function which address is stored as second entry of the vector table) */
- appReset = (void(*)(void))pSrc[1];
-
- g_dfu->state = DFU_STATE_appIDLE;
-
- appReset();
-}
-#endif
-
-/**
- * \brief This is the code that gets called on processor reset.
- * To initialize the device, and call the main() routine.
- */
-void ResetException( void )
-{
- uint32_t *pSrc, *pDest ;
-
- /* Low level Initialize */
- LowLevelInit() ;
-
-
-#if defined(BOARD_USB_DFU) && defined(APPLICATION_dfu)
- if (!USBDFU_OverrideEnterDFU()) {
- UART_Exit();
- __disable_irq();
- BootIntoApp();
- /* Infinite loop */
- while ( 1 ) ;
- }
-#endif
-
- /* Initialize the relocate segment */
- pSrc = &_etext ;
- pDest = &_srelocate ;
-
- if ( pSrc != pDest )
- {
- for ( ; pDest < &_erelocate ; )
- {
- *pDest++ = *pSrc++ ;
- }
- }
-
- /* Clear the zero segment */
- for ( pDest = &_szero ; pDest < &_ezero ; )
- {
- *pDest++ = 0;
- }
-
- /* Set the vector table base address */
- pSrc = (uint32_t *)&_sfixed;
- SCB->VTOR = ( (uint32_t)pSrc & SCB_VTOR_TBLOFF_Msk ) ;
-
- if ( ((uint32_t)pSrc >= IRAM_ADDR) && ((uint32_t)pSrc < IRAM_ADDR+IRAM_SIZE) )
- {
- SCB->VTOR |= 1 << SCB_VTOR_TBLBASE_Pos ;
- }
-
- /* App should have disabled interrupts during the transition */
- __enable_irq();
-
- /* Branch to main function */
- main() ;
-
- /* Infinite loop */
- while ( 1 ) ;
-}
-
+/* ----------------------------------------------------------------------------
+ * ATMEL Microcontroller Software Support
+ * ----------------------------------------------------------------------------
+ * Copyright (c) 2010, Atmel Corporation
+ * Copyright (c) 2017, Harald Welte <laforge@gnumonks.org>
+ * Copyright (c) 2018, sysmocom -s.f.m.c. GmbH, Author: Kevin Redon <kredon@sysmocom.de>
+ *
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions are met:
+ *
+ * - Redistributions of source code must retain the above copyright notice,
+ * this list of conditions and the disclaimer below.
+ *
+ * Atmel's name may not be used to endorse or promote products derived from
+ * this software without specific prior written permission.
+ *
+ * DISCLAIMER: THIS SOFTWARE IS PROVIDED BY ATMEL "AS IS" AND ANY EXPRESS OR
+ * IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
+ * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT ARE
+ * DISCLAIMED. IN NO EVENT SHALL ATMEL BE LIABLE FOR ANY DIRECT, INDIRECT,
+ * INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT
+ * LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA,
+ * OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF
+ * LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING
+ * NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE,
+ * EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ * ----------------------------------------------------------------------------
+ */
+
+/*----------------------------------------------------------------------------
+ * Headers
+ *----------------------------------------------------------------------------*/
+
+#include "board.h"
+#include "board_lowlevel.h"
+
+/*----------------------------------------------------------------------------
+ * Exported variables
+ *----------------------------------------------------------------------------*/
+
+/* Stack Configuration */
+#define STACK_SIZE 0x900 /** Stack size (in DWords) */
+__attribute__ ((aligned(8),section(".stack")))
+uint32_t pdwStack[STACK_SIZE] ;
+
+/* Initialize segments */
+extern uint32_t _sfixed;
+extern uint32_t _efixed;
+extern uint32_t _etext;
+extern uint32_t _srelocate;
+extern uint32_t _erelocate;
+extern uint32_t _szero;
+extern uint32_t _ezero;
+
+
+/*----------------------------------------------------------------------------
+ * ProtoTypes
+ *----------------------------------------------------------------------------*/
+
+/** \cond DOXYGEN_SHOULD_SKIP_THIS */
+extern int main( void ) ;
+/** \endcond */
+void ResetException( void ) ;
+
+/*------------------------------------------------------------------------------
+ * Exception Table
+ *------------------------------------------------------------------------------*/
+
+__attribute__((section(".vectors")))
+IntFunc exception_table[] = {
+
+ /* Configure Initial Stack Pointer, using linker-generated symbols */
+ (IntFunc)(&pdwStack[STACK_SIZE-1]),
+ ResetException,
+
+ NMI_Handler,
+ HardFault_Handler,
+ MemManage_Handler,
+ BusFault_Handler,
+ UsageFault_Handler,
+ 0, 0, 0, 0, /* Reserved */
+ SVC_Handler,
+ DebugMon_Handler,
+ 0, /* Reserved */
+ PendSV_Handler,
+ SysTick_Handler,
+
+ /* Configurable interrupts */
+ SUPC_IrqHandler, /* 0 Supply Controller */
+ RSTC_IrqHandler, /* 1 Reset Controller */
+ RTC_IrqHandler, /* 2 Real Time Clock */
+ RTT_IrqHandler, /* 3 Real Time Timer */
+ WDT_IrqHandler, /* 4 Watchdog Timer */
+ PMC_IrqHandler, /* 5 PMC */
+ EEFC_IrqHandler, /* 6 EEFC */
+ IrqHandlerNotUsed, /* 7 Reserved */
+ UART0_IrqHandler, /* 8 UART0 */
+ UART1_IrqHandler, /* 9 UART1 */
+ SMC_IrqHandler, /* 10 SMC */
+ PIOA_IrqHandler, /* 11 Parallel IO Controller A */
+ PIOB_IrqHandler, /* 12 Parallel IO Controller B */
+ PIOC_IrqHandler, /* 13 Parallel IO Controller C */
+ USART0_IrqHandler, /* 14 USART 0 */
+ USART1_IrqHandler, /* 15 USART 1 */
+ IrqHandlerNotUsed, /* 16 Reserved */
+ IrqHandlerNotUsed, /* 17 Reserved */
+ MCI_IrqHandler, /* 18 MCI */
+ TWI0_IrqHandler, /* 19 TWI 0 */
+ TWI1_IrqHandler, /* 20 TWI 1 */
+ SPI_IrqHandler, /* 21 SPI */
+ SSC_IrqHandler, /* 22 SSC */
+ TC0_IrqHandler, /* 23 Timer Counter 0 */
+ TC1_IrqHandler, /* 24 Timer Counter 1 */
+ TC2_IrqHandler, /* 25 Timer Counter 2 */
+ TC3_IrqHandler, /* 26 Timer Counter 3 */
+ TC4_IrqHandler, /* 27 Timer Counter 4 */
+ TC5_IrqHandler, /* 28 Timer Counter 5 */
+ ADC_IrqHandler, /* 29 ADC controller */
+ DAC_IrqHandler, /* 30 DAC controller */
+ PWM_IrqHandler, /* 31 PWM */
+ CRCCU_IrqHandler, /* 32 CRC Calculation Unit */
+ ACC_IrqHandler, /* 33 Analog Comparator */
+ USBD_IrqHandler, /* 34 USB Device Port */
+ IrqHandlerNotUsed /* 35 not used */
+};
+
+#if defined(BOARD_USB_DFU) && defined(APPLICATION_dfu)
+#include "usb/device/dfu/dfu.h"
+static void BootIntoApp(void)
+{
+ unsigned int *pSrc;
+ void (*appReset)(void);
+
+ pSrc = (unsigned int *) ((unsigned char *)IFLASH_ADDR + BOARD_DFU_BOOT_SIZE);
+ /* set vector table to application vector table (store at the beginning of the application) */
+ SCB->VTOR = (unsigned int)(pSrc);
+ /* set stack pointer to address provided in the beginning of the application (loaded into a register first) */
+ __asm__ volatile ("MSR msp,%0" : :"r"(*pSrc));
+ /* start application (by jumping to the reset function which address is stored as second entry of the vector table) */
+ appReset = (void(*)(void))pSrc[1];
+
+ g_dfu->state = DFU_STATE_appIDLE;
+
+ appReset();
+}
+#endif
+
+/**
+ * \brief This is the code that gets called on processor reset.
+ * To initialize the device, and call the main() routine.
+ */
+void ResetException( void )
+{
+ uint32_t *pSrc, *pDest ;
+
+ /* Low level Initialize */
+ LowLevelInit() ;
+
+
+#if defined(BOARD_USB_DFU) && defined(APPLICATION_dfu)
+ if (!USBDFU_OverrideEnterDFU()) {
+ UART_Exit();
+ __disable_irq();
+ BootIntoApp();
+ /* Infinite loop */
+ while ( 1 ) ;
+ }
+#endif
+
+ /* Initialize the relocate segment */
+ pSrc = &_etext ;
+ pDest = &_srelocate ;
+
+ if ( pSrc != pDest )
+ {
+ for ( ; pDest < &_erelocate ; )
+ {
+ *pDest++ = *pSrc++ ;
+ }
+ }
+
+ /* Clear the zero segment */
+ for ( pDest = &_szero ; pDest < &_ezero ; )
+ {
+ *pDest++ = 0;
+ }
+
+ /* Set the vector table base address */
+ pSrc = (uint32_t *)&_sfixed;
+ SCB->VTOR = ( (uint32_t)pSrc & SCB_VTOR_TBLOFF_Msk ) ;
+
+ if ( ((uint32_t)pSrc >= IRAM_ADDR) && ((uint32_t)pSrc < IRAM_ADDR+IRAM_SIZE) )
+ {
+ SCB->VTOR |= 1 << SCB_VTOR_TBLBASE_Pos ;
+ }
+
+ /* App should have disabled interrupts during the transition */
+ __enable_irq();
+
+ /* Branch to main function */
+ main() ;
+
+ /* Infinite loop */
+ while ( 1 ) ;
+}
+
diff --git a/firmware/libboard/common/source/board_lowlevel.c b/firmware/libboard/common/source/board_lowlevel.c
index 98eb74d..b37719c 100644
--- a/firmware/libboard/common/source/board_lowlevel.c
+++ b/firmware/libboard/common/source/board_lowlevel.c
@@ -1,216 +1,216 @@
-/* ----------------------------------------------------------------------------
- * ATMEL Microcontroller Software Support
- * ----------------------------------------------------------------------------
- * Copyright (c) 2009, Atmel Corporation
- *
- * All rights reserved.
- *
- * Redistribution and use in source and binary forms, with or without
- * modification, are permitted provided that the following conditions are met:
- *
- * - Redistributions of source code must retain the above copyright notice,
- * this list of conditions and the disclaimer below.
- *
- * Atmel's name may not be used to endorse or promote products derived from
- * this software without specific prior written permission.
- *
- * DISCLAIMER: THIS SOFTWARE IS PROVIDED BY ATMEL "AS IS" AND ANY EXPRESS OR
- * IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
- * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT ARE
- * DISCLAIMED. IN NO EVENT SHALL ATMEL BE LIABLE FOR ANY DIRECT, INDIRECT,
- * INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT
- * LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA,
- * OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF
- * LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING
- * NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE,
- * EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
- * ----------------------------------------------------------------------------
- */
-
-/**
- * \file
- *
- * Provides the low-level initialization function that called on chip startup.
- */
-
-/*----------------------------------------------------------------------------
- * Headers
- *----------------------------------------------------------------------------*/
-
-#include "board.h"
-
-/*----------------------------------------------------------------------------
- * Local definitions
- *----------------------------------------------------------------------------*/
-
-#define BOARD_OSCOUNT (CKGR_MOR_MOSCXTST(0x8))
-#define BOARD_MCKR (PMC_MCKR_PRES_CLK | PMC_MCKR_CSS_PLLA_CLK)
-
-#if (BOARD_MCK == 48000000)
-#if (BOARD_MAINOSC == 18432000)
-/* Clock settings at 48MHz for 18 MHz crystal */
-#define BOARD_PLLAR (CKGR_PLLAR_STUCKTO1 \
- | CKGR_PLLAR_MULA(13-1) \
- | CKGR_PLLAR_PLLACOUNT(0x1) \
- | CKGR_PLLAR_DIVA(5))
-#elif (BOARD_MAINOSC == 12000000)
-/* QMod has 12 MHz clock, so multply by 8 (96 MHz) and divide by 2 */
-#define BOARD_PLLAR (CKGR_PLLAR_STUCKTO1 \
- | CKGR_PLLAR_MULA(8-1) \
- | CKGR_PLLAR_PLLACOUNT(0x1) \
- | CKGR_PLLAR_DIVA(2))
-#else
-#error "Please define PLLA config for your MAINOSC frequency"
-#endif /* MAINOSC */
-#elif (BOARD_MCK == 64000000)
-#if (BOARD_MAINOSC == 18432000)
-/* Clock settings at 64MHz for 18 MHz crystal: 64.512 MHz */
-#define BOARD_PLLAR (CKGR_PLLAR_STUCKTO1 \
- | CKGR_PLLAR_MULA(7-1) \
- | CKGR_PLLAR_PLLACOUNT(0x1) \
- | CKGR_PLLAR_DIVA(2))
-#elif (BOARD_MAINOSC == 12000000)
-/* QMod has 12 MHz clock, so multply by 10 / div by 2: 60 MHz */
-#define BOARD_PLLAR (CKGR_PLLAR_STUCKTO1 \
- | CKGR_PLLAR_MULA(10-1) \
- | CKGR_PLLAR_PLLACOUNT(0x1) \
- | CKGR_PLLAR_DIVA(2))
-#error "Please define PLLA config for your MAINOSC frequency"
-#endif /* MAINOSC */
-#else
- #error "No PLL settings for current BOARD_MCK."
-#endif
-
-#if (BOARD_MAINOSC == 12000000)
-#define PLLB_CFG (CKGR_PLLBR_DIVB(2)|CKGR_PLLBR_MULB(8-1)|CKGR_PLLBR_PLLBCOUNT_Msk)
-#elif (BOARD_MAINOSC == 18432000)
-#define PLLB_CFG (CKGR_PLLBR_DIVB(5)|CKGR_PLLBR_MULB(13-1)|CKGR_PLLBR_PLLBCOUNT_Msk)
-#else
-#error "Please configure PLLB for your MAINOSC freq"
-#endif
-
-/* Define clock timeout */
-#define CLOCK_TIMEOUT 0xFFFFFFFF
-
-/**
- * \brief Configure 48MHz Clock for USB
- */
-static void _ConfigureUsbClock(void)
-{
- /* Enable PLLB for USB */
- PMC->CKGR_PLLBR = PLLB_CFG;
- while ((PMC->PMC_SR & PMC_SR_LOCKB) == 0) ;
-
- /* USB Clock uses PLLB */
- PMC->PMC_USB = PMC_USB_USBDIV(0) /* /1 (no divider) */
- | PMC_USB_USBS; /* PLLB */
-}
-
-/*----------------------------------------------------------------------------
- * Exported functions
- *----------------------------------------------------------------------------*/
-
-/**
- * \brief Performs the low-level initialization of the chip.
- * This includes EFC and master clock configuration.
- * It also enable a low level on the pin NRST triggers a user reset.
- */
-extern WEAK void LowLevelInit( void )
-{
- uint32_t timeout = 0;
-
- /* Configure the Supply Monitor to reset the CPU in case VDDIO is
- * lower than 3.0V. As we run the board on 3.3V, any lower voltage
- * might be some kind of leakage that creeps in some way, but is not
- * the "official" power supply */
- SUPC->SUPC_SMMR = SUPC_SMMR_SMTH_3_0V | SUPC_SMMR_SMSMPL_CSM |
- SUPC_SMMR_SMRSTEN_ENABLE;
-
- /* enable both LED and green LED */
- PIOA->PIO_PER |= PIO_LED_RED | PIO_LED_GREEN;
- PIOA->PIO_OER |= PIO_LED_RED | PIO_LED_GREEN;
- PIOA->PIO_CODR |= PIO_LED_RED | PIO_LED_GREEN;
-
- /* Set 3 FWS for Embedded Flash Access */
- EFC->EEFC_FMR = EEFC_FMR_FWS(3);
-
- /* Select external slow clock */
-/* if ((SUPC->SUPC_SR & SUPC_SR_OSCSEL) != SUPC_SR_OSCSEL_CRYST)
- {
- SUPC->SUPC_CR = (uint32_t)(SUPC_CR_XTALSEL_CRYSTAL_SEL | SUPC_CR_KEY(0xA5));
- timeout = 0;
- while (!(SUPC->SUPC_SR & SUPC_SR_OSCSEL_CRYST) );
- }
-*/
-
-#ifndef qmod
- /* Initialize main oscillator */
- if ( !(PMC->CKGR_MOR & CKGR_MOR_MOSCSEL) )
- {
- PMC->CKGR_MOR = CKGR_MOR_KEY(0x37) | BOARD_OSCOUNT | CKGR_MOR_MOSCRCEN | CKGR_MOR_MOSCXTEN;
- timeout = 0;
- while (!(PMC->PMC_SR & PMC_SR_MOSCXTS) && (timeout++ < CLOCK_TIMEOUT));
- }
-
- /* Switch to 3-20MHz Xtal oscillator */
- PIOB->PIO_PDR = (1 << 8) | (1 << 9);
- PIOB->PIO_PUDR = (1 << 8) | (1 << 9);
- PIOB->PIO_PPDDR = (1 << 8) | (1 << 9);
- PMC->CKGR_MOR = CKGR_MOR_KEY(0x37) | BOARD_OSCOUNT | CKGR_MOR_MOSCRCEN | CKGR_MOR_MOSCXTEN | CKGR_MOR_MOSCSEL;
- /* wait for Main XTAL oscillator stabilization */
- timeout = 0;
- while (!(PMC->PMC_SR & PMC_SR_MOSCSELS) && (timeout++ < CLOCK_TIMEOUT));
-#else
- /* QMOD has external 12MHz clock source */
- PIOB->PIO_PDR = (1 << 9);
- PIOB->PIO_PUDR = (1 << 9);
- PIOB->PIO_PPDDR = (1 << 9);
- PMC->CKGR_MOR = CKGR_MOR_KEY(0x37) | CKGR_MOR_MOSCRCEN | CKGR_MOR_MOSCXTBY| CKGR_MOR_MOSCSEL;
-#endif
-
- /* disable the red LED after main clock initialization */
- PIOA->PIO_SODR = PIO_LED_RED;
-
- /* "switch" to main clock as master clock source (should already be the case */
- PMC->PMC_MCKR = (PMC->PMC_MCKR & ~(uint32_t)PMC_MCKR_CSS_Msk) | PMC_MCKR_CSS_MAIN_CLK;
- /* wait for master clock to be ready */
- for ( timeout = 0; !(PMC->PMC_SR & PMC_SR_MCKRDY) && (timeout++ < CLOCK_TIMEOUT) ; );
-
- /* Initialize PLLA */
- PMC->CKGR_PLLAR = BOARD_PLLAR;
- /* Wait for PLLA to lock */
- timeout = 0;
- while (!(PMC->PMC_SR & PMC_SR_LOCKA) && (timeout++ < CLOCK_TIMEOUT));
-
- /* Switch to main clock (again ?!?) */
- PMC->PMC_MCKR = (BOARD_MCKR & ~PMC_MCKR_CSS_Msk) | PMC_MCKR_CSS_MAIN_CLK;
- /* wait for master clock to be ready */
- for ( timeout = 0; !(PMC->PMC_SR & PMC_SR_MCKRDY) && (timeout++ < CLOCK_TIMEOUT) ; );
-
- /* switch to PLLA as master clock source */
- PMC->PMC_MCKR = BOARD_MCKR ;
- /* wait for master clock to be ready */
- for ( timeout = 0; !(PMC->PMC_SR & PMC_SR_MCKRDY) && (timeout++ < CLOCK_TIMEOUT) ; );
-
- /* Configure SysTick for 1ms */
- SysTick_Config(BOARD_MCK/1000);
-
- _ConfigureUsbClock();
-}
-
-/* SysTick based delay function */
-
-volatile uint32_t jiffies;
-
-/* Interrupt handler for SysTick interrupt */
-void SysTick_Handler(void)
-{
- jiffies++;
-}
-
-void mdelay(unsigned int msecs)
-{
- uint32_t jiffies_start = jiffies;
- do {
- } while ((jiffies - jiffies_start) < msecs);
-}
+/* ----------------------------------------------------------------------------
+ * ATMEL Microcontroller Software Support
+ * ----------------------------------------------------------------------------
+ * Copyright (c) 2009, Atmel Corporation
+ *
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions are met:
+ *
+ * - Redistributions of source code must retain the above copyright notice,
+ * this list of conditions and the disclaimer below.
+ *
+ * Atmel's name may not be used to endorse or promote products derived from
+ * this software without specific prior written permission.
+ *
+ * DISCLAIMER: THIS SOFTWARE IS PROVIDED BY ATMEL "AS IS" AND ANY EXPRESS OR
+ * IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
+ * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT ARE
+ * DISCLAIMED. IN NO EVENT SHALL ATMEL BE LIABLE FOR ANY DIRECT, INDIRECT,
+ * INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT
+ * LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA,
+ * OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF
+ * LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING
+ * NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE,
+ * EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ * ----------------------------------------------------------------------------
+ */
+
+/**
+ * \file
+ *
+ * Provides the low-level initialization function that called on chip startup.
+ */
+
+/*----------------------------------------------------------------------------
+ * Headers
+ *----------------------------------------------------------------------------*/
+
+#include "board.h"
+
+/*----------------------------------------------------------------------------
+ * Local definitions
+ *----------------------------------------------------------------------------*/
+
+#define BOARD_OSCOUNT (CKGR_MOR_MOSCXTST(0x8))
+#define BOARD_MCKR (PMC_MCKR_PRES_CLK | PMC_MCKR_CSS_PLLA_CLK)
+
+#if (BOARD_MCK == 48000000)
+#if (BOARD_MAINOSC == 18432000)
+/* Clock settings at 48MHz for 18 MHz crystal */
+#define BOARD_PLLAR (CKGR_PLLAR_STUCKTO1 \
+ | CKGR_PLLAR_MULA(13-1) \
+ | CKGR_PLLAR_PLLACOUNT(0x1) \
+ | CKGR_PLLAR_DIVA(5))
+#elif (BOARD_MAINOSC == 12000000)
+/* QMod has 12 MHz clock, so multply by 8 (96 MHz) and divide by 2 */
+#define BOARD_PLLAR (CKGR_PLLAR_STUCKTO1 \
+ | CKGR_PLLAR_MULA(8-1) \
+ | CKGR_PLLAR_PLLACOUNT(0x1) \
+ | CKGR_PLLAR_DIVA(2))
+#else
+#error "Please define PLLA config for your MAINOSC frequency"
+#endif /* MAINOSC */
+#elif (BOARD_MCK == 64000000)
+#if (BOARD_MAINOSC == 18432000)
+/* Clock settings at 64MHz for 18 MHz crystal: 64.512 MHz */
+#define BOARD_PLLAR (CKGR_PLLAR_STUCKTO1 \
+ | CKGR_PLLAR_MULA(7-1) \
+ | CKGR_PLLAR_PLLACOUNT(0x1) \
+ | CKGR_PLLAR_DIVA(2))
+#elif (BOARD_MAINOSC == 12000000)
+/* QMod has 12 MHz clock, so multply by 10 / div by 2: 60 MHz */
+#define BOARD_PLLAR (CKGR_PLLAR_STUCKTO1 \
+ | CKGR_PLLAR_MULA(10-1) \
+ | CKGR_PLLAR_PLLACOUNT(0x1) \
+ | CKGR_PLLAR_DIVA(2))
+#error "Please define PLLA config for your MAINOSC frequency"
+#endif /* MAINOSC */
+#else
+ #error "No PLL settings for current BOARD_MCK."
+#endif
+
+#if (BOARD_MAINOSC == 12000000)
+#define PLLB_CFG (CKGR_PLLBR_DIVB(2)|CKGR_PLLBR_MULB(8-1)|CKGR_PLLBR_PLLBCOUNT_Msk)
+#elif (BOARD_MAINOSC == 18432000)
+#define PLLB_CFG (CKGR_PLLBR_DIVB(5)|CKGR_PLLBR_MULB(13-1)|CKGR_PLLBR_PLLBCOUNT_Msk)
+#else
+#error "Please configure PLLB for your MAINOSC freq"
+#endif
+
+/* Define clock timeout */
+#define CLOCK_TIMEOUT 0xFFFFFFFF
+
+/**
+ * \brief Configure 48MHz Clock for USB
+ */
+static void _ConfigureUsbClock(void)
+{
+ /* Enable PLLB for USB */
+ PMC->CKGR_PLLBR = PLLB_CFG;
+ while ((PMC->PMC_SR & PMC_SR_LOCKB) == 0) ;
+
+ /* USB Clock uses PLLB */
+ PMC->PMC_USB = PMC_USB_USBDIV(0) /* /1 (no divider) */
+ | PMC_USB_USBS; /* PLLB */
+}
+
+/*----------------------------------------------------------------------------
+ * Exported functions
+ *----------------------------------------------------------------------------*/
+
+/**
+ * \brief Performs the low-level initialization of the chip.
+ * This includes EFC and master clock configuration.
+ * It also enable a low level on the pin NRST triggers a user reset.
+ */
+extern WEAK void LowLevelInit( void )
+{
+ uint32_t timeout = 0;
+
+ /* Configure the Supply Monitor to reset the CPU in case VDDIO is
+ * lower than 3.0V. As we run the board on 3.3V, any lower voltage
+ * might be some kind of leakage that creeps in some way, but is not
+ * the "official" power supply */
+ SUPC->SUPC_SMMR = SUPC_SMMR_SMTH_3_0V | SUPC_SMMR_SMSMPL_CSM |
+ SUPC_SMMR_SMRSTEN_ENABLE;
+
+ /* enable both LED and green LED */
+ PIOA->PIO_PER |= PIO_LED_RED | PIO_LED_GREEN;
+ PIOA->PIO_OER |= PIO_LED_RED | PIO_LED_GREEN;
+ PIOA->PIO_CODR |= PIO_LED_RED | PIO_LED_GREEN;
+
+ /* Set 3 FWS for Embedded Flash Access */
+ EFC->EEFC_FMR = EEFC_FMR_FWS(3);
+
+ /* Select external slow clock */
+/* if ((SUPC->SUPC_SR & SUPC_SR_OSCSEL) != SUPC_SR_OSCSEL_CRYST)
+ {
+ SUPC->SUPC_CR = (uint32_t)(SUPC_CR_XTALSEL_CRYSTAL_SEL | SUPC_CR_KEY(0xA5));
+ timeout = 0;
+ while (!(SUPC->SUPC_SR & SUPC_SR_OSCSEL_CRYST) );
+ }
+*/
+
+#ifndef qmod
+ /* Initialize main oscillator */
+ if ( !(PMC->CKGR_MOR & CKGR_MOR_MOSCSEL) )
+ {
+ PMC->CKGR_MOR = CKGR_MOR_KEY(0x37) | BOARD_OSCOUNT | CKGR_MOR_MOSCRCEN | CKGR_MOR_MOSCXTEN;
+ timeout = 0;
+ while (!(PMC->PMC_SR & PMC_SR_MOSCXTS) && (timeout++ < CLOCK_TIMEOUT));
+ }
+
+ /* Switch to 3-20MHz Xtal oscillator */
+ PIOB->PIO_PDR = (1 << 8) | (1 << 9);
+ PIOB->PIO_PUDR = (1 << 8) | (1 << 9);
+ PIOB->PIO_PPDDR = (1 << 8) | (1 << 9);
+ PMC->CKGR_MOR = CKGR_MOR_KEY(0x37) | BOARD_OSCOUNT | CKGR_MOR_MOSCRCEN | CKGR_MOR_MOSCXTEN | CKGR_MOR_MOSCSEL;
+ /* wait for Main XTAL oscillator stabilization */
+ timeout = 0;
+ while (!(PMC->PMC_SR & PMC_SR_MOSCSELS) && (timeout++ < CLOCK_TIMEOUT));
+#else
+ /* QMOD has external 12MHz clock source */
+ PIOB->PIO_PDR = (1 << 9);
+ PIOB->PIO_PUDR = (1 << 9);
+ PIOB->PIO_PPDDR = (1 << 9);
+ PMC->CKGR_MOR = CKGR_MOR_KEY(0x37) | CKGR_MOR_MOSCRCEN | CKGR_MOR_MOSCXTBY| CKGR_MOR_MOSCSEL;
+#endif
+
+ /* disable the red LED after main clock initialization */
+ PIOA->PIO_SODR = PIO_LED_RED;
+
+ /* "switch" to main clock as master clock source (should already be the case */
+ PMC->PMC_MCKR = (PMC->PMC_MCKR & ~(uint32_t)PMC_MCKR_CSS_Msk) | PMC_MCKR_CSS_MAIN_CLK;
+ /* wait for master clock to be ready */
+ for ( timeout = 0; !(PMC->PMC_SR & PMC_SR_MCKRDY) && (timeout++ < CLOCK_TIMEOUT) ; );
+
+ /* Initialize PLLA */
+ PMC->CKGR_PLLAR = BOARD_PLLAR;
+ /* Wait for PLLA to lock */
+ timeout = 0;
+ while (!(PMC->PMC_SR & PMC_SR_LOCKA) && (timeout++ < CLOCK_TIMEOUT));
+
+ /* Switch to main clock (again ?!?) */
+ PMC->PMC_MCKR = (BOARD_MCKR & ~PMC_MCKR_CSS_Msk) | PMC_MCKR_CSS_MAIN_CLK;
+ /* wait for master clock to be ready */
+ for ( timeout = 0; !(PMC->PMC_SR & PMC_SR_MCKRDY) && (timeout++ < CLOCK_TIMEOUT) ; );
+
+ /* switch to PLLA as master clock source */
+ PMC->PMC_MCKR = BOARD_MCKR ;
+ /* wait for master clock to be ready */
+ for ( timeout = 0; !(PMC->PMC_SR & PMC_SR_MCKRDY) && (timeout++ < CLOCK_TIMEOUT) ; );
+
+ /* Configure SysTick for 1ms */
+ SysTick_Config(BOARD_MCK/1000);
+
+ _ConfigureUsbClock();
+}
+
+/* SysTick based delay function */
+
+volatile uint32_t jiffies;
+
+/* Interrupt handler for SysTick interrupt */
+void SysTick_Handler(void)
+{
+ jiffies++;
+}
+
+void mdelay(unsigned int msecs)
+{
+ uint32_t jiffies_start = jiffies;
+ do {
+ } while ((jiffies - jiffies_start) < msecs);
+}
diff --git a/firmware/libboard/common/source/uart_console.c b/firmware/libboard/common/source/uart_console.c
index 07f41ed..88c9166 100644
--- a/firmware/libboard/common/source/uart_console.c
+++ b/firmware/libboard/common/source/uart_console.c
@@ -1,426 +1,426 @@
-/* ----------------------------------------------------------------------------
- * ATMEL Microcontroller Software Support
- * ----------------------------------------------------------------------------
- * Copyright (c) 2009, Atmel Corporation
- *
- * All rights reserved.
- *
- * Redistribution and use in source and binary forms, with or without
- * modification, are permitted provided that the following conditions are met:
- *
- * - Redistributions of source code must retain the above copyright notice,
- * this list of conditions and the disclaimer below.
- *
- * Atmel's name may not be used to endorse or promote products derived from
- * this software without specific prior written permission.
- *
- * DISCLAIMER: THIS SOFTWARE IS PROVIDED BY ATMEL "AS IS" AND ANY EXPRESS OR
- * IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
- * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT ARE
- * DISCLAIMED. IN NO EVENT SHALL ATMEL BE LIABLE FOR ANY DIRECT, INDIRECT,
- * INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT
- * LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA,
- * OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF
- * LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING
- * NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE,
- * EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
- * ----------------------------------------------------------------------------
- */
-
-/**
- * \file
- *
- * Implements UART console.
- *
- */
-
-/*----------------------------------------------------------------------------
- * Headers
- *----------------------------------------------------------------------------*/
-
-#include "board.h"
-
-#include <stdio.h>
-#include <stdint.h>
-
-#include "ringbuffer.h"
-
-/*----------------------------------------------------------------------------
- * Definitions
- *----------------------------------------------------------------------------*/
-
-/*----------------------------------------------------------------------------
- * Variables
- *----------------------------------------------------------------------------*/
-
-/** Is Console Initialized. */
-static uint8_t _ucIsConsoleInitialized=0;
-/** Ring buffer to queue data to be sent */
-static ringbuf uart_tx_buffer;
-
-/**
- * \brief Configures an USART peripheral with the specified parameters.
- *
- * \param baudrate Baudrate at which the USART should operate (in Hz).
- * \param masterClock Frequency of the system master clock (in Hz).
- */
-extern void UART_Configure( uint32_t baudrate, uint32_t masterClock)
-{
- const Pin pPins[] = CONSOLE_PINS;
- Uart *pUart = CONSOLE_UART;
-
- /* Configure PIO */
- PIO_Configure(pPins, PIO_LISTSIZE(pPins));
-
- /* Configure PMC */
- PMC->PMC_PCER0 = 1 << CONSOLE_ID;
-
- /* Reset and disable receiver & transmitter */
- pUart->UART_CR = UART_CR_RSTRX | UART_CR_RSTTX
- | UART_CR_RXDIS | UART_CR_TXDIS;
-
- /* Configure mode */
- pUart->UART_MR = UART_MR_PAR_NO;
-
- /* Configure baudrate */
- /* Asynchronous, no oversampling */
- pUart->UART_BRGR = (masterClock / baudrate) / 16;
-
- /* Disable PDC channel */
- pUart->UART_PTCR = UART_PTCR_RXTDIS | UART_PTCR_TXTDIS;
-
- /* Reset transmit ring buffer */
- rbuf_reset(&uart_tx_buffer);
-
- /* Enable TX interrupts */
- pUart->UART_IER = UART_IER_TXRDY;
- NVIC_EnableIRQ(CONSOLE_IRQ);
-
- /* Enable receiver and transmitter */
- pUart->UART_CR = UART_CR_RXEN | UART_CR_TXEN;
-
- /* Remember the configuration is complete */
- _ucIsConsoleInitialized=1 ;
-}
-
-/**
- * \brief Disables the USART peripheral and related IRQ
- */
-void UART_Exit(void)
-{
- if (!_ucIsConsoleInitialized) {
- return;
- }
-
- Uart *pUart = CONSOLE_UART;
- pUart->UART_IDR = UART_IDR_TXRDY;
- pUart->UART_CR = UART_CR_RSTRX | UART_CR_RSTTX | UART_CR_RXDIS | UART_CR_TXDIS | UART_CR_RSTSTA;
- PMC->PMC_PCDR0 = 1 << CONSOLE_ID;
- NVIC_DisableIRQ(CONSOLE_IRQ);
-}
-
-/** Interrupt Service routine to transmit queued data */
-void CONSOLE_ISR(void)
-{
- Uart *uart = CONSOLE_UART;
- if (uart->UART_SR & UART_SR_TXRDY) {
- if (!rbuf_is_empty(&uart_tx_buffer)) {
- uart->UART_THR = rbuf_read(&uart_tx_buffer);
- } else {
- uart->UART_IDR = UART_IER_TXRDY;
- }
- }
-}
-
-/**
- * \brief Outputs a character on the UART line.
- *
- * \note This function is synchronous (i.e. uses polling).
- * \param c Character to send.
- */
-extern void UART_PutChar( uint8_t c )
-{
- Uart *pUart = CONSOLE_UART ;
-
- /* Initialize console is not already done */
- if ( !_ucIsConsoleInitialized )
- {
- UART_Configure(CONSOLE_BAUDRATE, BOARD_MCK);
- }
-
- /* Only store input if buffer is not full, else drop it */
- if (!rbuf_is_full(&uart_tx_buffer)) {
- rbuf_write(&uart_tx_buffer, c);
- if (!(pUart->UART_IMR & UART_IMR_TXRDY)) {
- pUart->UART_IER = UART_IER_TXRDY;
- CONSOLE_ISR();
- }
- }
-}
-
-/**
- * \brief Input a character from the UART line.
- *
- * \note This function is synchronous
- * \return character received.
- */
-extern uint32_t UART_GetChar( void )
-{
- Uart *pUart = CONSOLE_UART ;
-
- if ( !_ucIsConsoleInitialized )
- {
- UART_Configure(CONSOLE_BAUDRATE, BOARD_MCK);
- }
-
- while ( (pUart->UART_SR & UART_SR_RXRDY) == 0 )
- WDT_Restart(WDT);
-
- return pUart->UART_RHR ;
-}
-
-/**
- * \brief Check if there is Input from UART line.
- *
- * \return true if there is Input.
- */
-extern uint32_t UART_IsRxReady( void )
-{
- Uart *pUart = CONSOLE_UART;
-
- if ( !_ucIsConsoleInitialized )
- {
- UART_Configure( CONSOLE_BAUDRATE, BOARD_MCK ) ;
- }
-
- return (pUart->UART_SR & UART_SR_RXRDY) > 0 ;
-}
-
-/**
- * Displays the content of the given frame on the UART0.
- *
- * \param pucFrame Pointer to the frame to dump.
- * \param dwSize Buffer size in bytes.
- */
-extern void UART_DumpFrame( uint8_t* pucFrame, uint32_t dwSize )
-{
- uint32_t dw ;
-
- for ( dw=0 ; dw < dwSize ; dw++ )
- {
- printf( "%02X ", pucFrame[dw] ) ;
- }
-
- printf( "\n\r" ) ;
-}
-
-/**
- * Displays the content of the given buffer on the UART0.
- *
- * \param pucBuffer Pointer to the buffer to dump.
- * \param dwSize Buffer size in bytes.
- * \param dwAddress Start address to display
- */
-extern void UART_DumpMemory( uint8_t* pucBuffer, uint32_t dwSize, uint32_t dwAddress )
-{
- uint32_t i ;
- uint32_t j ;
- uint32_t dwLastLineStart ;
- uint8_t* pucTmp ;
-
- for ( i=0 ; i < (dwSize / 16) ; i++ )
- {
- printf( "0x%08X: ", (unsigned int)(dwAddress + (i*16)) ) ;
- pucTmp = (uint8_t*)&pucBuffer[i*16] ;
-
- for ( j=0 ; j < 4 ; j++ )
- {
- printf( "%02X%02X%02X%02X ", pucTmp[0], pucTmp[1], pucTmp[2], pucTmp[3] ) ;
- pucTmp += 4 ;
- }
-
- pucTmp=(uint8_t*)&pucBuffer[i*16] ;
-
- for ( j=0 ; j < 16 ; j++ )
- {
- UART_PutChar( *pucTmp++ ) ;
- }
-
- printf( "\n\r" ) ;
- }
-
- if ( (dwSize%16) != 0 )
- {
- dwLastLineStart=dwSize - (dwSize%16) ;
-
- printf( "0x%08X: ", (unsigned int)(dwAddress + dwLastLineStart) ) ;
- for ( j=dwLastLineStart ; j < dwLastLineStart+16 ; j++ )
- {
- if ( (j!=dwLastLineStart) && (j%4 == 0) )
- {
- printf( " " ) ;
- }
-
- if ( j < dwSize )
- {
- printf( "%02X", pucBuffer[j] ) ;
- }
- else
- {
- printf(" ") ;
- }
- }
-
- printf( " " ) ;
- for ( j=dwLastLineStart ; j < dwSize ; j++ )
- {
- UART_PutChar( pucBuffer[j] ) ;
- }
-
- printf( "\n\r" ) ;
- }
-}
-
-/**
- * Reads an integer
- *
- * \param pdwValue Pointer to the uint32_t variable to contain the input value.
- */
-extern uint32_t UART_GetInteger( uint32_t* pdwValue )
-{
- uint8_t ucKey ;
- uint8_t ucNbNb=0 ;
- uint32_t dwValue=0 ;
-
- while ( 1 )
- {
- ucKey=UART_GetChar() ;
- UART_PutChar( ucKey ) ;
-
- if ( ucKey >= '0' && ucKey <= '9' )
- {
- dwValue = (dwValue * 10) + (ucKey - '0');
- ucNbNb++ ;
- }
- else
- {
- if ( ucKey == 0x0D || ucKey == ' ' )
- {
- if ( ucNbNb == 0 )
- {
- printf( "\n\rWrite a number and press ENTER or SPACE!\n\r" ) ;
- return 0 ;
- }
- else
- {
- printf( "\n\r" ) ;
- *pdwValue=dwValue ;
-
- return 1 ;
- }
- }
- else
- {
- printf( "\n\r'%c' not a number!\n\r", ucKey ) ;
-
- return 0 ;
- }
- }
- WDT_Restart(WDT);
- }
-}
-
-/**
- * Reads an integer and check the value
- *
- * \param pdwValue Pointer to the uint32_t variable to contain the input value.
- * \param dwMin Minimum value
- * \param dwMax Maximum value
- */
-extern uint32_t UART_GetIntegerMinMax( uint32_t* pdwValue, uint32_t dwMin, uint32_t dwMax )
-{
- uint32_t dwValue=0 ;
-
- if ( UART_GetInteger( &dwValue ) == 0 )
- {
- return 0 ;
- }
-
- if ( dwValue < dwMin || dwValue > dwMax )
- {
- printf( "\n\rThe number have to be between %d and %d\n\r", (int)dwMin, (int)dwMax ) ;
-
- return 0 ;
- }
-
- printf( "\n\r" ) ;
-
- *pdwValue = dwValue ;
-
- return 1 ;
-}
-
-/**
- * Reads an hexadecimal number
- *
- * \param pdwValue Pointer to the uint32_t variable to contain the input value.
- */
-extern uint32_t UART_GetHexa32( uint32_t* pdwValue )
-{
- uint8_t ucKey ;
- uint32_t dw = 0 ;
- uint32_t dwValue = 0 ;
-
- for ( dw=0 ; dw < 8 ; dw++ )
- {
- ucKey = UART_GetChar() ;
- UART_PutChar( ucKey ) ;
-
- if ( ucKey >= '0' && ucKey <= '9' )
- {
- dwValue = (dwValue * 16) + (ucKey - '0') ;
- }
- else
- {
- if ( ucKey >= 'A' && ucKey <= 'F' )
- {
- dwValue = (dwValue * 16) + (ucKey - 'A' + 10) ;
- }
- else
- {
- if ( ucKey >= 'a' && ucKey <= 'f' )
- {
- dwValue = (dwValue * 16) + (ucKey - 'a' + 10) ;
- }
- else
- {
- printf( "\n\rIt is not a hexa character!\n\r" ) ;
-
- return 0 ;
- }
- }
- }
- }
-
- printf("\n\r" ) ;
- *pdwValue = dwValue ;
-
- return 1 ;
-}
-
-#if defined __ICCARM__ /* IAR Ewarm 5.41+ */
-/**
- * \brief Outputs a character on the UART.
- *
- * \param c Character to output.
- *
- * \return The character that was output.
- */
-extern WEAK signed int putchar( signed int c )
-{
- UART_PutChar( c ) ;
-
- return c ;
-}
-#endif // defined __ICCARM__
-
+/* ----------------------------------------------------------------------------
+ * ATMEL Microcontroller Software Support
+ * ----------------------------------------------------------------------------
+ * Copyright (c) 2009, Atmel Corporation
+ *
+ * All rights reserved.
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions are met:
+ *
+ * - Redistributions of source code must retain the above copyright notice,
+ * this list of conditions and the disclaimer below.
+ *
+ * Atmel's name may not be used to endorse or promote products derived from
+ * this software without specific prior written permission.
+ *
+ * DISCLAIMER: THIS SOFTWARE IS PROVIDED BY ATMEL "AS IS" AND ANY EXPRESS OR
+ * IMPLIED WARRANTIES, INCLUDING, BUT NOT LIMITED TO, THE IMPLIED WARRANTIES OF
+ * MERCHANTABILITY, FITNESS FOR A PARTICULAR PURPOSE AND NON-INFRINGEMENT ARE
+ * DISCLAIMED. IN NO EVENT SHALL ATMEL BE LIABLE FOR ANY DIRECT, INDIRECT,
+ * INCIDENTAL, SPECIAL, EXEMPLARY, OR CONSEQUENTIAL DAMAGES (INCLUDING, BUT NOT
+ * LIMITED TO, PROCUREMENT OF SUBSTITUTE GOODS OR SERVICES; LOSS OF USE, DATA,
+ * OR PROFITS; OR BUSINESS INTERRUPTION) HOWEVER CAUSED AND ON ANY THEORY OF
+ * LIABILITY, WHETHER IN CONTRACT, STRICT LIABILITY, OR TORT (INCLUDING
+ * NEGLIGENCE OR OTHERWISE) ARISING IN ANY WAY OUT OF THE USE OF THIS SOFTWARE,
+ * EVEN IF ADVISED OF THE POSSIBILITY OF SUCH DAMAGE.
+ * ----------------------------------------------------------------------------
+ */
+
+/**
+ * \file
+ *
+ * Implements UART console.
+ *
+ */
+
+/*----------------------------------------------------------------------------
+ * Headers
+ *----------------------------------------------------------------------------*/
+
+#include "board.h"
+
+#include <stdio.h>
+#include <stdint.h>
+
+#include "ringbuffer.h"
+
+/*----------------------------------------------------------------------------
+ * Definitions
+ *----------------------------------------------------------------------------*/
+
+/*----------------------------------------------------------------------------
+ * Variables
+ *----------------------------------------------------------------------------*/
+
+/** Is Console Initialized. */
+static uint8_t _ucIsConsoleInitialized=0;
+/** Ring buffer to queue data to be sent */
+static ringbuf uart_tx_buffer;
+
+/**
+ * \brief Configures an USART peripheral with the specified parameters.
+ *
+ * \param baudrate Baudrate at which the USART should operate (in Hz).
+ * \param masterClock Frequency of the system master clock (in Hz).
+ */
+extern void UART_Configure( uint32_t baudrate, uint32_t masterClock)
+{
+ const Pin pPins[] = CONSOLE_PINS;
+ Uart *pUart = CONSOLE_UART;
+
+ /* Configure PIO */
+ PIO_Configure(pPins, PIO_LISTSIZE(pPins));
+
+ /* Configure PMC */
+ PMC->PMC_PCER0 = 1 << CONSOLE_ID;
+
+ /* Reset and disable receiver & transmitter */
+ pUart->UART_CR = UART_CR_RSTRX | UART_CR_RSTTX
+ | UART_CR_RXDIS | UART_CR_TXDIS;
+
+ /* Configure mode */
+ pUart->UART_MR = UART_MR_PAR_NO;
+
+ /* Configure baudrate */
+ /* Asynchronous, no oversampling */
+ pUart->UART_BRGR = (masterClock / baudrate) / 16;
+
+ /* Disable PDC channel */
+ pUart->UART_PTCR = UART_PTCR_RXTDIS | UART_PTCR_TXTDIS;
+
+ /* Reset transmit ring buffer */
+ rbuf_reset(&uart_tx_buffer);
+
+ /* Enable TX interrupts */
+ pUart->UART_IER = UART_IER_TXRDY;
+ NVIC_EnableIRQ(CONSOLE_IRQ);
+
+ /* Enable receiver and transmitter */
+ pUart->UART_CR = UART_CR_RXEN | UART_CR_TXEN;
+
+ /* Remember the configuration is complete */
+ _ucIsConsoleInitialized=1 ;
+}
+
+/**
+ * \brief Disables the USART peripheral and related IRQ
+ */
+void UART_Exit(void)
+{
+ if (!_ucIsConsoleInitialized) {
+ return;
+ }
+
+ Uart *pUart = CONSOLE_UART;
+ pUart->UART_IDR = UART_IDR_TXRDY;
+ pUart->UART_CR = UART_CR_RSTRX | UART_CR_RSTTX | UART_CR_RXDIS | UART_CR_TXDIS | UART_CR_RSTSTA;
+ PMC->PMC_PCDR0 = 1 << CONSOLE_ID;
+ NVIC_DisableIRQ(CONSOLE_IRQ);
+}
+
+/** Interrupt Service routine to transmit queued data */
+void CONSOLE_ISR(void)
+{
+ Uart *uart = CONSOLE_UART;
+ if (uart->UART_SR & UART_SR_TXRDY) {
+ if (!rbuf_is_empty(&uart_tx_buffer)) {
+ uart->UART_THR = rbuf_read(&uart_tx_buffer);
+ } else {
+ uart->UART_IDR = UART_IER_TXRDY;
+ }
+ }
+}
+
+/**
+ * \brief Outputs a character on the UART line.
+ *
+ * \note This function is synchronous (i.e. uses polling).
+ * \param c Character to send.
+ */
+extern void UART_PutChar( uint8_t c )
+{
+ Uart *pUart = CONSOLE_UART ;
+
+ /* Initialize console is not already done */
+ if ( !_ucIsConsoleInitialized )
+ {
+ UART_Configure(CONSOLE_BAUDRATE, BOARD_MCK);
+ }
+
+ /* Only store input if buffer is not full, else drop it */
+ if (!rbuf_is_full(&uart_tx_buffer)) {
+ rbuf_write(&uart_tx_buffer, c);
+ if (!(pUart->UART_IMR & UART_IMR_TXRDY)) {
+ pUart->UART_IER = UART_IER_TXRDY;
+ CONSOLE_ISR();
+ }
+ }
+}
+
+/**
+ * \brief Input a character from the UART line.
+ *
+ * \note This function is synchronous
+ * \return character received.
+ */
+extern uint32_t UART_GetChar( void )
+{
+ Uart *pUart = CONSOLE_UART ;
+
+ if ( !_ucIsConsoleInitialized )
+ {
+ UART_Configure(CONSOLE_BAUDRATE, BOARD_MCK);
+ }
+
+ while ( (pUart->UART_SR & UART_SR_RXRDY) == 0 )
+ WDT_Restart(WDT);
+
+ return pUart->UART_RHR ;
+}
+
+/**
+ * \brief Check if there is Input from UART line.
+ *
+ * \return true if there is Input.
+ */
+extern uint32_t UART_IsRxReady( void )
+{
+ Uart *pUart = CONSOLE_UART;
+
+ if ( !_ucIsConsoleInitialized )
+ {
+ UART_Configure( CONSOLE_BAUDRATE, BOARD_MCK ) ;
+ }
+
+ return (pUart->UART_SR & UART_SR_RXRDY) > 0 ;
+}
+
+/**
+ * Displays the content of the given frame on the UART0.
+ *
+ * \param pucFrame Pointer to the frame to dump.
+ * \param dwSize Buffer size in bytes.
+ */
+extern void UART_DumpFrame( uint8_t* pucFrame, uint32_t dwSize )
+{
+ uint32_t dw ;
+
+ for ( dw=0 ; dw < dwSize ; dw++ )
+ {
+ printf( "%02X ", pucFrame[dw] ) ;
+ }
+
+ printf( "\n\r" ) ;
+}
+
+/**
+ * Displays the content of the given buffer on the UART0.
+ *
+ * \param pucBuffer Pointer to the buffer to dump.
+ * \param dwSize Buffer size in bytes.
+ * \param dwAddress Start address to display
+ */
+extern void UART_DumpMemory( uint8_t* pucBuffer, uint32_t dwSize, uint32_t dwAddress )
+{
+ uint32_t i ;
+ uint32_t j ;
+ uint32_t dwLastLineStart ;
+ uint8_t* pucTmp ;
+
+ for ( i=0 ; i < (dwSize / 16) ; i++ )
+ {
+ printf( "0x%08X: ", (unsigned int)(dwAddress + (i*16)) ) ;
+ pucTmp = (uint8_t*)&pucBuffer[i*16] ;
+
+ for ( j=0 ; j < 4 ; j++ )
+ {
+ printf( "%02X%02X%02X%02X ", pucTmp[0], pucTmp[1], pucTmp[2], pucTmp[3] ) ;
+ pucTmp += 4 ;
+ }
+
+ pucTmp=(uint8_t*)&pucBuffer[i*16] ;
+
+ for ( j=0 ; j < 16 ; j++ )
+ {
+ UART_PutChar( *pucTmp++ ) ;
+ }
+
+ printf( "\n\r" ) ;
+ }
+
+ if ( (dwSize%16) != 0 )
+ {
+ dwLastLineStart=dwSize - (dwSize%16) ;
+
+ printf( "0x%08X: ", (unsigned int)(dwAddress + dwLastLineStart) ) ;
+ for ( j=dwLastLineStart ; j < dwLastLineStart+16 ; j++ )
+ {
+ if ( (j!=dwLastLineStart) && (j%4 == 0) )
+ {
+ printf( " " ) ;
+ }
+
+ if ( j < dwSize )
+ {
+ printf( "%02X", pucBuffer[j] ) ;
+ }
+ else
+ {
+ printf(" ") ;
+ }
+ }
+
+ printf( " " ) ;
+ for ( j=dwLastLineStart ; j < dwSize ; j++ )
+ {
+ UART_PutChar( pucBuffer[j] ) ;
+ }
+
+ printf( "\n\r" ) ;
+ }
+}
+
+/**
+ * Reads an integer
+ *
+ * \param pdwValue Pointer to the uint32_t variable to contain the input value.
+ */
+extern uint32_t UART_GetInteger( uint32_t* pdwValue )
+{
+ uint8_t ucKey ;
+ uint8_t ucNbNb=0 ;
+ uint32_t dwValue=0 ;
+
+ while ( 1 )
+ {
+ ucKey=UART_GetChar() ;
+ UART_PutChar( ucKey ) ;
+
+ if ( ucKey >= '0' && ucKey <= '9' )
+ {
+ dwValue = (dwValue * 10) + (ucKey - '0');
+ ucNbNb++ ;
+ }
+ else
+ {
+ if ( ucKey == 0x0D || ucKey == ' ' )
+ {
+ if ( ucNbNb == 0 )
+ {
+ printf( "\n\rWrite a number and press ENTER or SPACE!\n\r" ) ;
+ return 0 ;
+ }
+ else
+ {
+ printf( "\n\r" ) ;
+ *pdwValue=dwValue ;
+
+ return 1 ;
+ }
+ }
+ else
+ {
+ printf( "\n\r'%c' not a number!\n\r", ucKey ) ;
+
+ return 0 ;
+ }
+ }
+ WDT_Restart(WDT);
+ }
+}
+
+/**
+ * Reads an integer and check the value
+ *
+ * \param pdwValue Pointer to the uint32_t variable to contain the input value.
+ * \param dwMin Minimum value
+ * \param dwMax Maximum value
+ */
+extern uint32_t UART_GetIntegerMinMax( uint32_t* pdwValue, uint32_t dwMin, uint32_t dwMax )
+{
+ uint32_t dwValue=0 ;
+
+ if ( UART_GetInteger( &dwValue ) == 0 )
+ {
+ return 0 ;
+ }
+
+ if ( dwValue < dwMin || dwValue > dwMax )
+ {
+ printf( "\n\rThe number have to be between %d and %d\n\r", (int)dwMin, (int)dwMax ) ;
+
+ return 0 ;
+ }
+
+ printf( "\n\r" ) ;
+
+ *pdwValue = dwValue ;
+
+ return 1 ;
+}
+
+/**
+ * Reads an hexadecimal number
+ *
+ * \param pdwValue Pointer to the uint32_t variable to contain the input value.
+ */
+extern uint32_t UART_GetHexa32( uint32_t* pdwValue )
+{
+ uint8_t ucKey ;
+ uint32_t dw = 0 ;
+ uint32_t dwValue = 0 ;
+
+ for ( dw=0 ; dw < 8 ; dw++ )
+ {
+ ucKey = UART_GetChar() ;
+ UART_PutChar( ucKey ) ;
+
+ if ( ucKey >= '0' && ucKey <= '9' )
+ {
+ dwValue = (dwValue * 16) + (ucKey - '0') ;
+ }
+ else
+ {
+ if ( ucKey >= 'A' && ucKey <= 'F' )
+ {
+ dwValue = (dwValue * 16) + (ucKey - 'A' + 10) ;
+ }
+ else
+ {
+ if ( ucKey >= 'a' && ucKey <= 'f' )
+ {
+ dwValue = (dwValue * 16) + (ucKey - 'a' + 10) ;
+ }
+ else
+ {
+ printf( "\n\rIt is not a hexa character!\n\r" ) ;
+
+ return 0 ;
+ }
+ }
+ }
+ }
+
+ printf("\n\r" ) ;
+ *pdwValue = dwValue ;
+
+ return 1 ;
+}
+
+#if defined __ICCARM__ /* IAR Ewarm 5.41+ */
+/**
+ * \brief Outputs a character on the UART.
+ *
+ * \param c Character to output.
+ *
+ * \return The character that was output.
+ */
+extern WEAK signed int putchar( signed int c )
+{
+ UART_PutChar( c ) ;
+
+ return c ;
+}
+#endif // defined __ICCARM__
+