summaryrefslogtreecommitdiff
path: root/nuttx/configs
diff options
context:
space:
mode:
authorpatacongo <patacongo@42af7a65-404d-4744-a932-0658087f49c3>2011-03-06 15:39:02 +0000
committerpatacongo <patacongo@42af7a65-404d-4744-a932-0658087f49c3>2011-03-06 15:39:02 +0000
commit9fa76b36d2eb8b4c329e763e499675dee143d527 (patch)
tree189cfec40a0599ca60497ac94d137f9f1231dae2 /nuttx/configs
parent517ae43b4f1c1eaf64137a5a6d0d79f3e26608af (diff)
downloadpx4-nuttx-9fa76b36d2eb8b4c329e763e499675dee143d527.tar.gz
px4-nuttx-9fa76b36d2eb8b4c329e763e499675dee143d527.tar.bz2
px4-nuttx-9fa76b36d2eb8b4c329e763e499675dee143d527.zip
Add support for RAMTRON NVRAM devices
git-svn-id: svn://svn.code.sf.net/p/nuttx/code/trunk@3347 42af7a65-404d-4744-a932-0658087f49c3
Diffstat (limited to 'nuttx/configs')
-rw-r--r--nuttx/configs/README.txt2
-rwxr-xr-xnuttx/configs/stm3210e-eval/README.txt2
-rwxr-xr-xnuttx/configs/stm3210e-eval/src/up_nsh.c4
-rw-r--r--nuttx/configs/vsn/README.txt2
-rw-r--r--nuttx/configs/vsn/include/board.h54
-rwxr-xr-xnuttx/configs/vsn/nsh/defconfig26
-rw-r--r--nuttx/configs/vsn/src/Makefile7
-rw-r--r--nuttx/configs/vsn/src/README.txt12
-rw-r--r--nuttx/configs/vsn/src/boot.c (renamed from nuttx/configs/vsn/src/up_boot.c)31
-rw-r--r--nuttx/configs/vsn/src/buttons.c (renamed from nuttx/configs/vsn/src/up_buttons.c)4
-rw-r--r--nuttx/configs/vsn/src/leds.c (renamed from nuttx/configs/vsn/src/up_leds.c)6
-rw-r--r--nuttx/configs/vsn/src/nsh.c89
-rw-r--r--nuttx/configs/vsn/src/power.c57
-rw-r--r--nuttx/configs/vsn/src/ramtron.c87
-rw-r--r--nuttx/configs/vsn/src/sdcard.c120
-rw-r--r--nuttx/configs/vsn/src/spi.c (renamed from nuttx/configs/vsn/src/up_spi.c)37
-rw-r--r--nuttx/configs/vsn/src/sysclock.c (renamed from nuttx/configs/vsn/src/up_sysclock.c)2
-rw-r--r--nuttx/configs/vsn/src/up_nsh.c215
-rw-r--r--nuttx/configs/vsn/src/usbdev.c (renamed from nuttx/configs/vsn/src/up_usbdev.c)6
-rw-r--r--nuttx/configs/vsn/src/usbstrg.c (renamed from nuttx/configs/vsn/src/up_usbstrg.c)4
-rw-r--r--nuttx/configs/vsn/src/vsn.h (renamed from nuttx/configs/vsn/src/vsn-internal.h)55
21 files changed, 513 insertions, 309 deletions
diff --git a/nuttx/configs/README.txt b/nuttx/configs/README.txt
index 5dddb0c2f..860d2323a 100644
--- a/nuttx/configs/README.txt
+++ b/nuttx/configs/README.txt
@@ -530,6 +530,8 @@ defconfig -- This is a configuration file similar to the Linux
CONFIG_MMCSD_MMCSUPPORT - Enable support for MMC cards
CONFIG_MMCSD_HAVECARDDETECT - SDIO driver card detection is
100% accurate
+ CONFIG_SDIO_WIDTH_D1_ONLY - Select 1-bit transfer mode. Default:
+ 4-bit transfer mode.
RiT P14201 OLED driver
CONFIG_LCD_P14201 - Enable P14201 support
diff --git a/nuttx/configs/stm3210e-eval/README.txt b/nuttx/configs/stm3210e-eval/README.txt
index 2a58577f6..14d7b1ac3 100755
--- a/nuttx/configs/stm3210e-eval/README.txt
+++ b/nuttx/configs/stm3210e-eval/README.txt
@@ -400,6 +400,8 @@ STM3210E-EVAL-specific Configuration Options
CONFIG_SDIO_PRI - Select SDIO interrupt prority. Default: 128
CONFIG_SDIO_DMAPRIO - Select SDIO DMA interrupt priority.
Default: Medium
+ CONFIG_SDIO_WIDTH_D1_ONLY - Select 1-bit transfer mode. Default:
+ 4-bit transfer mode.
Configurations
^^^^^^^^^^^^^^
diff --git a/nuttx/configs/stm3210e-eval/src/up_nsh.c b/nuttx/configs/stm3210e-eval/src/up_nsh.c
index 6c908951f..db36946bd 100755
--- a/nuttx/configs/stm3210e-eval/src/up_nsh.c
+++ b/nuttx/configs/stm3210e-eval/src/up_nsh.c
@@ -148,8 +148,8 @@ int nsh_archinitialize(void)
#ifdef CONFIG_STM32_SPI1
/* Get the SPI port */
- message("nsh_archinitialize: Initializing SPI port 0\n");
- spi = up_spiinitialize(0);
+ message("nsh_archinitialize: Initializing SPI port 1\n");
+ spi = up_spiinitialize(1);
if (!spi)
{
message("nsh_archinitialize: Failed to initialize SPI port 0\n");
diff --git a/nuttx/configs/vsn/README.txt b/nuttx/configs/vsn/README.txt
index 5ade94d18..acdc9f236 100644
--- a/nuttx/configs/vsn/README.txt
+++ b/nuttx/configs/vsn/README.txt
@@ -399,6 +399,8 @@ VSN-specific Configuration Options
CONFIG_SDIO_PRI - Select SDIO interrupt prority. Default: 128
CONFIG_SDIO_DMAPRIO - Select SDIO DMA interrupt priority.
Default: Medium
+ CONFIG_SDIO_WIDTH_D1_ONLY - Select 1-bit transfer mode. Default:
+ 4-bit transfer mode.
Configurations
^^^^^^^^^^^^^^
diff --git a/nuttx/configs/vsn/include/board.h b/nuttx/configs/vsn/include/board.h
index 558dccd91..f4ad540c7 100644
--- a/nuttx/configs/vsn/include/board.h
+++ b/nuttx/configs/vsn/include/board.h
@@ -55,6 +55,16 @@
/************************************************************************************
* Definitions
************************************************************************************/
+
+/* Board Configuration:
+ * - USART1, is the default bootloader and console
+ * - SPI1 is wired to expansion port
+ * - SPI2 is used for radio module
+ * - SPI3 has direct connection with FRAM
+ * - SDCard, conencts the microSD and shares the control lines with Sensor Interface
+ * to select Amplifier Gain
+ * - ...
+ */
/* Clocking *************************************************************************/
@@ -103,33 +113,44 @@
/* SDIO dividers. Note that slower clocking is required when DMA is disabled
* in order to avoid RX overrun/TX underrun errors due to delayed responses
- * to service FIFOs in interrupt driven mode. These values have not been
- * tuned!!!
+ * to service FIFOs in interrupt driven mode.
+ *
+ * SDcard default speed has max SDIO_CK freq of 25 MHz (12.5 Mbps)
+ * After selection of high speed freq may be 50 MHz (25 Mbps)
+ * Recommended default voltage: 3.3 V
*
- * \todo Not checked yet! Uros.
- * HCLK=36MHz, SDIOCLK=? MHz, SDIO_CK=HCLK/(178+2)=400 KHz
+ * HCLK=36MHz, SDIOCLK=36 MHz, SDIO_CK=HCLK/(88+2)=400 KHz
*/
-#define SDIO_INIT_CLKDIV (178 << SDIO_CLKCR_CLKDIV_SHIFT)
+#define SDIO_INIT_CLKDIV (88 << SDIO_CLKCR_CLKDIV_SHIFT)
-/* DMA ON: HCLK=72 MHz, SDIOCLK=72MHz, SDIO_CK=HCLK/(2+2)=18 MHz
- * DMA OFF: HCLK=72 MHz, SDIOCLK=72MHz, SDIO_CK=HCLK/(3+2)=14.4 MHz
+/* DMA ON: HCLK=36 MHz, SDIOCLK=36MHz, SDIO_CK=HCLK/(0+2)=18 MHz
+ * DMA OFF: HCLK=36 MHz, SDIOCLK=36MHz, SDIO_CK=HCLK/(1+2)=12 MHz
*/
#ifdef CONFIG_SDIO_DMA
-# define SDIO_MMCXFR_CLKDIV (2 << SDIO_CLKCR_CLKDIV_SHIFT)
+# define SDIO_MMCXFR_CLKDIV (0 << SDIO_CLKCR_CLKDIV_SHIFT)
#else
-# define SDIO_MMCXFR_CLKDIV (3 << SDIO_CLKCR_CLKDIV_SHIFT)
+# ifndef CONFIG_DEBUG
+# define SDIO_MMCXFR_CLKDIV (1 << SDIO_CLKCR_CLKDIV_SHIFT)
+# else
+# define SDIO_MMCXFR_CLKDIV (10 << SDIO_CLKCR_CLKDIV_SHIFT)
+# endif
#endif
-/* DMA ON: HCLK=72 MHz, SDIOCLK=72MHz, SDIO_CK=HCLK/(1+2)=24 MHz
- * DMA OFF: HCLK=72 MHz, SDIOCLK=72MHz, SDIO_CK=HCLK/(3+2)=14.4 MHz
+/* DMA ON: HCLK=72 MHz, SDIOCLK=72MHz, SDIO_CK=HCLK/(0+2)=18 MHz
+ * DMA OFF: HCLK=72 MHz, SDIOCLK=72MHz, SDIO_CK=HCLK/(1+2)=12 MHz
+ * Extra slow down in debug mode to get rid of underruns.
*/
#ifdef CONFIG_SDIO_DMA
-# define SDIO_SDXFR_CLKDIV (1 << SDIO_CLKCR_CLKDIV_SHIFT)
+# define SDIO_SDXFR_CLKDIV (0 << SDIO_CLKCR_CLKDIV_SHIFT)
#else
-# define SDIO_SDXFR_CLKDIV (3 << SDIO_CLKCR_CLKDIV_SHIFT)
+# ifndef CONFIG_DEBUG
+# define SDIO_SDXFR_CLKDIV (1 << SDIO_CLKCR_CLKDIV_SHIFT)
+# else
+# define SDIO_SDXFR_CLKDIV (10 << SDIO_CLKCR_CLKDIV_SHIFT)
+# endif
#endif
/* LED definitions ******************************************************************/
@@ -146,8 +167,6 @@
#define LED_PANIC 7 /* ... */
#define LED_IDLE 8 /* shows idle state */
-/* eXternal connector pins */
-
/************************************************************************************
* Public Data
@@ -197,6 +216,11 @@ EXTERN void up_buttoninit(void);
EXTERN uint8_t up_buttons(void);
#endif
+/* Other peripherals startup routines, all returning OK on success */
+EXTERN int up_sdcard(void);
+EXTERN int up_ramtron(void);
+
+
#undef EXTERN
#if defined(__cplusplus)
}
diff --git a/nuttx/configs/vsn/nsh/defconfig b/nuttx/configs/vsn/nsh/defconfig
index ed95f617d..a1eb5ed94 100755
--- a/nuttx/configs/vsn/nsh/defconfig
+++ b/nuttx/configs/vsn/nsh/defconfig
@@ -89,7 +89,7 @@ CONFIG_ARCH_BOOTLOADER=n
CONFIG_ARCH_LEDS=y
CONFIG_ARCH_BUTTONS=y
CONFIG_ARCH_CALIBRATION=n
-CONFIG_ARCH_DMA=y
+CONFIG_ARCH_DMA=n
#
# Identify toolchain and linker options
@@ -105,7 +105,7 @@ CONFIG_STM32_DFU=n
# Individual subsystems can be enabled:
# AHB:
CONFIG_STM32_DMA1=n
-CONFIG_STM32_DMA2=y
+CONFIG_STM32_DMA2=n
CONFIG_STM32_CRC=n
CONFIG_STM32_FSMC=n
CONFIG_STM32_SDIO=y
@@ -117,8 +117,8 @@ CONFIG_STM32_TIM5=n
CONFIG_STM32_TIM6=n
CONFIG_STM32_TIM7=n
CONFIG_STM32_WWDG=n
-CONFIG_STM32_SPI2=n
-CONFIG_STM32_SPI4=n
+CONFIG_STM32_SPI2=y
+CONFIG_STM32_SPI3=y
CONFIG_STM32_USART2=n
CONFIG_STM32_USART3=n
CONFIG_STM32_UART4=n
@@ -329,8 +329,9 @@ CONFIG_HAVE_LIBM=n
#
CONFIG_APP_DIR=examples/nsh
CONFIG_DEBUG=n
-CONFIG_DEBUG_VERBOSE=n
+CONFIG_DEBUG_VERBOSE=y
CONFIG_DEBUG_SYMBOLS=n
+CONFIG_DEBUG_FS=y
CONFIG_MM_REGIONS=1
CONFIG_ARCH_LOWPUTC=y
CONFIG_RR_INTERVAL=200
@@ -465,7 +466,7 @@ CONFIG_PREALLOC_TIMERS=4
# CONFIG_FAT_SECTORSIZE - Max supported sector size
# CONFIG_FS_ROMFS - Enable ROMFS filesystem support
CONFIG_FS_FAT=y
-CONFIG_FS_ROMFS=n
+CONFIG_FS_ROMFS=y
#
# SPI-based MMC/SD driver
@@ -477,8 +478,8 @@ CONFIG_FS_ROMFS=n
# CONFIG_MMCSD_SPICLOCK - Maximum SPI clock to drive MMC/SD card.
# Default is 20MHz.
#
-CONFIG_MMCSD_NSLOTS=1
-CONFIG_MMCSD_READONLY=n
+CONFIG_MMCSD_NSLOTS=0
+CONFIG_MMCSD_READONLY=y
CONFIG_MMCSD_SPICLOCK=12500000
#
@@ -502,8 +503,9 @@ CONFIG_FS_WRITEBUFFER=n
# CONFIG_MMCSD_HAVECARDDETECT
# SDIO driver card detection is 100% accurate
#
-CONFIG_SDIO_DMA=y
-CONFIG_MMCSD_MMCSUPPORT=n
+CONFIG_SDIO_DMA=n
+CONFIG_SDIO_WIDTH_D1_ONLY=y # Added single width support
+CONFIG_MMCSD_MMCSUPPORT=y
CONFIG_MMCSD_HAVECARDDETECT=n
#
@@ -730,7 +732,7 @@ CONFIG_EXAMPLES_NSH_STACKSIZE=2048
CONFIG_EXAMPLES_NSH_NESTDEPTH=3
CONFIG_EXAMPLES_NSH_DISABLESCRIPT=n
CONFIG_EXAMPLES_NSH_DISABLEBG=n
-CONFIG_EXAMPLES_NSH_ROMFSETC=n
+CONFIG_EXAMPLES_NSH_ROMFSETC=y
CONFIG_EXAMPLES_NSH_CONSOLE=y
CONFIG_EXAMPLES_NSH_TELNET=n
CONFIG_EXAMPLES_NSH_ARCHINIT=y
@@ -746,7 +748,7 @@ CONFIG_EXAMPLES_NSH_ROMFSDEVNO=0
CONFIG_EXAMPLES_NSH_ROMFSSECTSIZE=64
CONFIG_EXAMPLES_NSH_FATDEVNO=1
CONFIG_EXAMPLES_NSH_FATSECTSIZE=512
-CONFIG_EXAMPLES_NSH_FATNSECTORS=1024
+CONFIG_EXAMPLES_NSH_FATNSECTORS=40
CONFIG_EXAMPLES_NSH_FATMOUNTPT=/tmp
#
diff --git a/nuttx/configs/vsn/src/Makefile b/nuttx/configs/vsn/src/Makefile
index f6d03d41f..1a2005d60 100644
--- a/nuttx/configs/vsn/src/Makefile
+++ b/nuttx/configs/vsn/src/Makefile
@@ -43,13 +43,14 @@ CFLAGS += -I$(TOPDIR)/sched
ASRCS =
AOBJS = $(ASRCS:.S=$(OBJEXT))
-CSRCS = up_sysclock.c up_boot.c up_leds.c up_buttons.c up_spi.c up_usbdev.c
+CSRCS = sysclock.c boot.c leds.c buttons.c spi.c \
+ usbdev.c sdcard.c ramtron.c power.c
ifeq ($(CONFIG_EXAMPLES_NSH_ARCHINIT),y)
-CSRCS += up_nsh.c
+CSRCS += nsh.c
endif
ifeq ($(CONFIG_APP_DIR),examples/usbstorage)
-CSRCS += up_usbstrg.c
+CSRCS += usbstrg.c
endif
COBJS = $(CSRCS:.c=$(OBJEXT))
diff --git a/nuttx/configs/vsn/src/README.txt b/nuttx/configs/vsn/src/README.txt
new file mode 100644
index 000000000..bacf82c17
--- /dev/null
+++ b/nuttx/configs/vsn/src/README.txt
@@ -0,0 +1,12 @@
+
+The directory contains start-up and board level functions.
+Execution starts in the following order:
+
+ - sysclock, immediately after reset stm32_rcc calls external
+ clock configuration when
+ CONFIG_ARCH_BOARD_STM32_CUSTOM_CLOCKCONFIG=y
+ is set. It must be set for the VSN board.
+
+ - boot, performs initial chip and board initialization
+ - ...
+ - nsh, as central application last.
diff --git a/nuttx/configs/vsn/src/up_boot.c b/nuttx/configs/vsn/src/boot.c
index df05a10bf..2f959333d 100644
--- a/nuttx/configs/vsn/src/up_boot.c
+++ b/nuttx/configs/vsn/src/boot.c
@@ -1,6 +1,6 @@
/************************************************************************************
- * configs/vsn/src/up_boot.c
- * arch/arm/src/board/up_boot.c
+ * configs/vsn/src/boot.c
+ * arch/arm/src/board/boot.c
*
* Copyright (C) 2009 Gregory Nutt. All rights reserved.
* Copyright (c) 2011 Uros Platise. All rights reserved.
@@ -47,8 +47,9 @@
#include <arch/board/board.h>
+#include "stm32_gpio.h"
#include "up_arch.h"
-#include "vsn-internal.h"
+#include "vsn.h"
/************************************************************************************
* Definitions
@@ -74,15 +75,24 @@
void stm32_boardinitialize(void)
{
+#ifdef CONFIG_STM32_SPI3
+#warning JTAG Port Disabled as SPI3 NVRAM/FRAM support is enabled
+
+ uint32_t val = getreg32(STM32_AFIO_MAPR);
+ val &= 0x00FFFFFF; // clear undefined readings ...
+ val |= AFIO_MAPR_DISAB; // set JTAG-DP and SW-DP Disabled
+ putreg32(val, STM32_AFIO_MAPR);
+#endif
+
+ // Set Board Voltage to 3.3 V
+ board_power_setbootvoltage();
+
/* Configure SPI chip selects if 1) SPI is not disabled, and 2) the weak function
* stm32_spiinitialize() has been brought into the link.
*/
-#if defined(CONFIG_STM32_SPI1) || defined(CONFIG_STM32_SPI2)
- if (stm32_spiinitialize)
- {
- stm32_spiinitialize();
- }
+#if defined(CONFIG_STM32_SPI1) || defined(CONFIG_STM32_SPI2) || defined(CONFIG_STM32_SPI3)
+ if (stm32_spiinitialize) stm32_spiinitialize();
#endif
/* Initialize USB is 1) USBDEV is selected, 2) the USB controller is not
@@ -91,10 +101,7 @@ void stm32_boardinitialize(void)
*/
#if defined(CONFIG_USBDEV) && defined(CONFIG_STM32_USB)
- if (stm32_usbinitialize)
- {
- stm32_usbinitialize();
- }
+ if (stm32_usbinitialize) stm32_usbinitialize();
#endif
/* Configure on-board LEDs if LED support has been selected. */
diff --git a/nuttx/configs/vsn/src/up_buttons.c b/nuttx/configs/vsn/src/buttons.c
index 27284a8d0..3025b373c 100644
--- a/nuttx/configs/vsn/src/up_buttons.c
+++ b/nuttx/configs/vsn/src/buttons.c
@@ -1,5 +1,5 @@
/****************************************************************************
- * configs/vsn-1.2/src/up_buttons.c
+ * configs/vsn/src/buttons.c
*
* Copyright (C) 2009 Gregory Nutt. All rights reserved.
* Copyright (C) 2011 Uros Platise. All rights reserved.
@@ -43,7 +43,7 @@
#include <nuttx/config.h>
#include <stdint.h>
#include <arch/board/board.h>
-#include "vsn-internal.h"
+#include "vsn.h"
#ifdef CONFIG_ARCH_BUTTONS
diff --git a/nuttx/configs/vsn/src/up_leds.c b/nuttx/configs/vsn/src/leds.c
index a936aac2e..ef3c87144 100644
--- a/nuttx/configs/vsn/src/up_leds.c
+++ b/nuttx/configs/vsn/src/leds.c
@@ -1,6 +1,6 @@
/****************************************************************************
- * configs/vsn-1.2/src/up_leds.c
- * arch/arm/src/board/up_leds.c
+ * configs/vsn/src/leds.c
+ * arch/arm/src/board/leds.c
*
* Copyright (C) 2009 Gregory Nutt. All rights reserved.
* Copyright (C) 2011 Uros Platise. All rights reserved.
@@ -48,7 +48,7 @@
#include <debug.h>
#include <arch/board/board.h>
-#include "vsn-internal.h"
+#include "vsn.h"
/****************************************************************************
* Definitions
diff --git a/nuttx/configs/vsn/src/nsh.c b/nuttx/configs/vsn/src/nsh.c
new file mode 100644
index 000000000..96f9f3d4d
--- /dev/null
+++ b/nuttx/configs/vsn/src/nsh.c
@@ -0,0 +1,89 @@
+/****************************************************************************
+ * config/vsn/src/nsh.c
+ * arch/arm/src/board/nsh.c
+ *
+ * Copyright (C) 2011 Uros Platise. All rights reserved.
+ * Copyright (C) 2009 Gregory Nutt. All rights reserved.
+ *
+ * Authors: Uros Platise <uros.platise@isotel.eu>
+ * Gregory Nutt <spudmonkey@racsa.co.cr>
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions
+ * are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright
+ * notice, this list of conditions and the following disclaimer.
+ * 2. Redistributions in binary form must reproduce the above copyright
+ * notice, this list of conditions and the following disclaimer in
+ * the documentation and/or other materials provided with the
+ * distribution.
+ * 3. Neither the name NuttX nor the names of its contributors may be
+ * used to endorse or promote products derived from this software
+ * without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
+ * "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
+ * LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
+ * FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
+ * COPYRIGHT OWNER OR CONTRIBUTORS 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.
+ *
+ ****************************************************************************/
+
+/****************************************************************************
+ * Included Files
+ ****************************************************************************/
+
+#include <nuttx/config.h>
+
+#include <stdbool.h>
+#include <stdio.h>
+#include <debug.h>
+#include <errno.h>
+
+#include "vsn.h"
+
+/****************************************************************************
+ * Pre-Processor Definitions
+ ****************************************************************************/
+
+/* Configuration ************************************************************/
+
+/* PORT and SLOT number probably depend on the board configuration */
+
+#define CONFIG_EXAMPLES_NSH_HAVEUSBDEV 1
+
+/* Can't support USB features if USB is not enabled */
+
+#ifndef CONFIG_USBDEV
+# undef CONFIG_EXAMPLES_NSH_HAVEUSBDEV
+#endif
+
+
+
+/****************************************************************************
+ * Public Functions
+ ****************************************************************************/
+
+/****************************************************************************
+ * Name: nsh_archinitialize
+ *
+ * Description:
+ * Perform architecture specific initialization
+ *
+ ****************************************************************************/
+
+int nsh_archinitialize(void)
+{
+ up_ramtron();
+ up_sdcard();
+
+ return OK;
+}
diff --git a/nuttx/configs/vsn/src/power.c b/nuttx/configs/vsn/src/power.c
new file mode 100644
index 000000000..2e23ed033
--- /dev/null
+++ b/nuttx/configs/vsn/src/power.c
@@ -0,0 +1,57 @@
+/****************************************************************************
+ * config/vsn/src/ramtron.c
+ * arch/arm/src/board/ramtron.c
+ *
+ * Copyright (C) 2011 Uros Platise. All rights reserved.
+ *
+ * Authors: Uros Platise <uros.platise@isotel.eu>
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions
+ * are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright
+ * notice, this list of conditions and the following disclaimer.
+ * 2. Redistributions in binary form must reproduce the above copyright
+ * notice, this list of conditions and the following disclaimer in
+ * the documentation and/or other materials provided with the
+ * distribution.
+ * 3. Neither the name NuttX nor the names of its contributors may be
+ * used to endorse or promote products derived from this software
+ * without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
+ * "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
+ * LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
+ * FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
+ * COPYRIGHT OWNER OR CONTRIBUTORS 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.
+ *
+ ****************************************************************************/
+
+#include <nuttx/config.h>
+
+#include <stdint.h>
+#include <stdbool.h>
+#include <debug.h>
+
+#include <arch/board/board.h>
+#include "vsn.h"
+
+void board_power_register(void);
+void board_power_adjust(void);
+void board_power_status(void);
+
+void board_power_setbootvoltage(void)
+{
+ stm32_configgpio(GPIO_PVS);
+}
+
+void board_power_reboot(void);
+void board_power_off(void);
diff --git a/nuttx/configs/vsn/src/ramtron.c b/nuttx/configs/vsn/src/ramtron.c
new file mode 100644
index 000000000..545289f7c
--- /dev/null
+++ b/nuttx/configs/vsn/src/ramtron.c
@@ -0,0 +1,87 @@
+/****************************************************************************
+ * config/vsn/src/ramtron.c
+ * arch/arm/src/board/ramtron.c
+ *
+ * Copyright (C) 2011 Uros Platise. All rights reserved.
+ * Copyright (C) 2009 Gregory Nutt. All rights reserved.
+ *
+ * Authors: Uros Platise <uros.platise@isotel.eu>
+ * Gregory Nutt <spudmonkey@racsa.co.cr>
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions
+ * are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright
+ * notice, this list of conditions and the following disclaimer.
+ * 2. Redistributions in binary form must reproduce the above copyright
+ * notice, this list of conditions and the following disclaimer in
+ * the documentation and/or other materials provided with the
+ * distribution.
+ * 3. Neither the name NuttX nor the names of its contributors may be
+ * used to endorse or promote products derived from this software
+ * without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
+ * "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
+ * LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
+ * FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
+ * COPYRIGHT OWNER OR CONTRIBUTORS 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.
+ *
+ ****************************************************************************/
+
+#include <nuttx/config.h>
+
+#include <stdbool.h>
+#include <stdio.h>
+#include <debug.h>
+#include <errno.h>
+
+#ifdef CONFIG_STM32_SPI3
+# include <nuttx/spi.h>
+# include <nuttx/mtd.h>
+#endif
+
+#include "vsn.h"
+
+
+
+int up_ramtron(void)
+{
+#ifdef CONFIG_STM32_SPI3
+ FAR struct spi_dev_s *spi;
+ FAR struct mtd_dev_s *mtd;
+ int retval;
+
+ /* Get the SPI port */
+
+ message("nsh_archinitialize: Initializing SPI port 3\n");
+ spi = up_spiinitialize(3);
+ if (!spi)
+ {
+ message("nsh_archinitialize: Failed to initialize SPI port 3\n");
+ return -ENODEV;
+ }
+ message("nsh_archinitialize: Successfully initialized SPI port 3\n");
+
+ message("nsh_archinitialize: Bind SPI to the SPI flash driver\n");
+ mtd = ramtron_initialize(spi);
+ if (!mtd)
+ {
+ message("nsh_archinitialize: Failed to bind SPI port 0 to the SPI FLASH driver\n");
+ return -ENODEV;
+ }
+ message("nsh_archinitialize: Successfully bound SPI port 0 to the SPI FLASH driver\n");
+
+ retval = ftl_initialize(0,NULL, mtd);
+ message("FTL returned with %d\n", retval);
+#endif
+ return OK;
+}
diff --git a/nuttx/configs/vsn/src/sdcard.c b/nuttx/configs/vsn/src/sdcard.c
new file mode 100644
index 000000000..3b20913df
--- /dev/null
+++ b/nuttx/configs/vsn/src/sdcard.c
@@ -0,0 +1,120 @@
+/****************************************************************************
+ * config/vsn/src/sdcard.c
+ * arch/arm/src/board/sdcard.c
+ *
+ * Copyright (C) 2011 Uros Platise. All rights reserved.
+ * Copyright (C) 2009 Gregory Nutt. All rights reserved.
+ *
+ * Authors: Uros Platise <uros.platise@isotel.eu>
+ * Gregory Nutt <spudmonkey@racsa.co.cr>
+ *
+ * Redistribution and use in source and binary forms, with or without
+ * modification, are permitted provided that the following conditions
+ * are met:
+ *
+ * 1. Redistributions of source code must retain the above copyright
+ * notice, this list of conditions and the following disclaimer.
+ * 2. Redistributions in binary form must reproduce the above copyright
+ * notice, this list of conditions and the following disclaimer in
+ * the documentation and/or other materials provided with the
+ * distribution.
+ * 3. Neither the name NuttX nor the names of its contributors may be
+ * used to endorse or promote products derived from this software
+ * without specific prior written permission.
+ *
+ * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
+ * "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
+ * LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
+ * FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
+ * COPYRIGHT OWNER OR CONTRIBUTORS 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.
+ *
+ ****************************************************************************/
+
+#include <nuttx/config.h>
+
+#include <stdbool.h>
+#include <stdio.h>
+#include <debug.h>
+#include <errno.h>
+
+#ifdef CONFIG_STM32_SDIO
+# include <nuttx/sdio.h>
+# include <nuttx/mmcsd.h>
+#endif
+
+#include "vsn.h"
+
+
+#define CONFIG_EXAMPLES_NSH_HAVEMMCSD 1
+#if defined(CONFIG_EXAMPLES_NSH_MMCSDSLOTNO) && CONFIG_EXAMPLES_NSH_MMCSDSLOTNO != 0
+# error "Only one MMC/SD slot"
+# undef CONFIG_EXAMPLES_NSH_MMCSDSLOTNO
+#endif
+#ifndef CONFIG_EXAMPLES_NSH_MMCSDSLOTNO
+# define CONFIG_EXAMPLES_NSH_MMCSDSLOTNO 0
+#endif
+
+/* Can't support MMC/SD features if mountpoints are disabled or if SDIO support
+ * is not enabled.
+ */
+
+#if defined(CONFIG_DISABLE_MOUNTPOINT) || !defined(CONFIG_STM32_SDIO)
+# undef CONFIG_EXAMPLES_NSH_HAVEMMCSD
+#endif
+
+#ifndef CONFIG_EXAMPLES_NSH_MMCSDMINOR
+# define CONFIG_EXAMPLES_NSH_MMCSDMINOR 0
+#endif
+
+
+
+int up_sdcard(void)
+{
+ /* Mount the SDIO-based MMC/SD block driver */
+
+#ifdef CONFIG_EXAMPLES_NSH_HAVEMMCSD
+
+ FAR struct sdio_dev_s *sdio;
+ int ret;
+
+ /* First, get an instance of the SDIO interface */
+
+ message("nsh_archinitialize: Initializing SDIO slot %d\n",
+ CONFIG_EXAMPLES_NSH_MMCSDSLOTNO);
+ sdio = sdio_initialize(CONFIG_EXAMPLES_NSH_MMCSDSLOTNO);
+ if (!sdio)
+ {
+ message("nsh_archinitialize: Failed to initialize SDIO slot %d\n",
+ CONFIG_EXAMPLES_NSH_MMCSDSLOTNO);
+ return -ENODEV;
+ }
+
+ /* Now bind the SPI interface to the MMC/SD driver */
+
+ message("nsh_archinitialize: Bind SDIO to the MMC/SD driver, minor=%d\n",
+ CONFIG_EXAMPLES_NSH_MMCSDMINOR);
+ ret = mmcsd_slotinitialize(CONFIG_EXAMPLES_NSH_MMCSDMINOR, sdio);
+ if (ret != OK)
+ {
+ message("nsh_archinitialize: Failed to bind SDIO to the MMC/SD driver: %d\n", ret);
+ return ret;
+ }
+ message("nsh_archinitialize: Successfully bound SDIO to the MMC/SD driver\n");
+
+ /* Then let's guess and say that there is a card in the slot. I need to check to
+ * see if the VSN board supports a GPIO to detect if there is a card in
+ * the slot.
+ */
+ sdio_mediachange(sdio, true);
+
+#endif
+ return OK;
+}
+
diff --git a/nuttx/configs/vsn/src/up_spi.c b/nuttx/configs/vsn/src/spi.c
index bfc5f8682..742fcfd41 100644
--- a/nuttx/configs/vsn/src/up_spi.c
+++ b/nuttx/configs/vsn/src/spi.c
@@ -1,6 +1,6 @@
/************************************************************************************
- * configs/vsn/src/up_spi.c
- * arch/arm/src/board/up_spi.c
+ * configs/vsn/src/spi.c
+ * arch/arm/src/board/spi.c
*
* Copyright (C) 2009 Gregory Nutt. All rights reserved.
* Copyright (C) 2011 Uros Platise. All rights reserved.
@@ -42,20 +42,20 @@
************************************************************************************/
#include <nuttx/config.h>
+#include <nuttx/spi.h>
+#include <arch/board/board.h>
#include <stdint.h>
#include <stdbool.h>
#include <debug.h>
-#include <nuttx/spi.h>
-#include <arch/board/board.h>
-
#include "up_arch.h"
#include "chip.h"
+#include "stm32_gpio.h"
#include "stm32_internal.h"
-#include "vsn-internal.h"
+#include "vsn.h"
-#if defined(CONFIG_STM32_SPI1) || defined(CONFIG_STM32_SPI2)
+#if defined(CONFIG_STM32_SPI1) || defined(CONFIG_STM32_SPI2) || defined(CONFIG_STM32_SPI3)
/************************************************************************************
* Definitions
@@ -97,16 +97,15 @@
void weak_function stm32_spiinitialize(void)
{
- /* NOTE: Clocking for SPI1 and/or SPI2 was already provided in stm32_rcc.c.
+ /* NOTE: Clocking for SPI1 and/or SPI2 and SPI3 was already provided in stm32_rcc.c.
* Configurations of SPI pins is performed in stm32_spi.c.
- * Here, we only initialize chip select pins unique to the board
- * architecture.
+ * Here, we only initialize chip select pins unique to the board architecture.
*/
-#ifdef CONFIG_STM32_SPI1
- /* Configure the SPI-based FLASH CS GPIO */
+#ifdef CONFIG_STM32_SPI3
- stm32_configgpio(GPIO_FLASH_CS);
+ // Configure the SPI-based FRAM CS GPIO
+ stm32_configgpio(GPIO_FRAM_CS);
#endif
}
@@ -139,13 +138,6 @@ void weak_function stm32_spiinitialize(void)
void stm32_spi1select(FAR struct spi_dev_s *dev, enum spi_dev_e devid, bool selected)
{
spidbg("devid: %d CS: %s\n", (int)devid, selected ? "assert" : "de-assert");
-
- if (devid == SPIDEV_FLASH)
- {
- /* Set the GPIO low to select and high to de-select */
-
- stm32_gpiowrite(GPIO_FLASH_CS, !selected);
- }
}
uint8_t stm32_spi1status(FAR struct spi_dev_s *dev, enum spi_dev_e devid)
@@ -170,6 +162,11 @@ uint8_t stm32_spi2status(FAR struct spi_dev_s *dev, enum spi_dev_e devid)
void stm32_spi3select(FAR struct spi_dev_s *dev, enum spi_dev_e devid, bool selected)
{
spidbg("devid: %d CS: %s\n", (int)devid, selected ? "assert" : "de-assert");
+ if (devid == SPIDEV_FLASH)
+ {
+ /* Set the GPIO low to select and high to de-select */
+ stm32_gpiowrite(GPIO_FRAM_CS, !selected);
+ }
}
uint8_t stm32_spi3status(FAR struct spi_dev_s *dev, enum spi_dev_e devid)
diff --git a/nuttx/configs/vsn/src/up_sysclock.c b/nuttx/configs/vsn/src/sysclock.c
index c93b251c1..f812dd2c1 100644
--- a/nuttx/configs/vsn/src/up_sysclock.c
+++ b/nuttx/configs/vsn/src/sysclock.c
@@ -1,5 +1,5 @@
/****************************************************************************
- * configs/vsn-1.2/src/up_sysclock.c
+ * configs/vsn/src/sysclock.c
*
* Copyright (C) 2011 Uros Platise. All rights reserved.
*
diff --git a/nuttx/configs/vsn/src/up_nsh.c b/nuttx/configs/vsn/src/up_nsh.c
deleted file mode 100644
index 323e91a44..000000000
--- a/nuttx/configs/vsn/src/up_nsh.c
+++ /dev/null
@@ -1,215 +0,0 @@
-/****************************************************************************
- * config/vsn/src/up_nsh.c
- * arch/arm/src/board/up_nsh.c
- *
- * Copyright (C) 2009 Gregory Nutt. All rights reserved.
- * Copyright (C) 2011 Uros Platise. All rights reserved.
- *
- * Authors: Gregory Nutt <spudmonkey@racsa.co.cr>
- * Uros Platise <uros.platise@isotel.eu>
- *
- * Redistribution and use in source and binary forms, with or without
- * modification, are permitted provided that the following conditions
- * are met:
- *
- * 1. Redistributions of source code must retain the above copyright
- * notice, this list of conditions and the following disclaimer.
- * 2. Redistributions in binary form must reproduce the above copyright
- * notice, this list of conditions and the following disclaimer in
- * the documentation and/or other materials provided with the
- * distribution.
- * 3. Neither the name NuttX nor the names of its contributors may be
- * used to endorse or promote products derived from this software
- * without specific prior written permission.
- *
- * THIS SOFTWARE IS PROVIDED BY THE COPYRIGHT HOLDERS AND CONTRIBUTORS
- * "AS IS" AND ANY EXPRESS OR IMPLIED WARRANTIES, INCLUDING, BUT NOT
- * LIMITED TO, THE IMPLIED WARRANTIES OF MERCHANTABILITY AND FITNESS
- * FOR A PARTICULAR PURPOSE ARE DISCLAIMED. IN NO EVENT SHALL THE
- * COPYRIGHT OWNER OR CONTRIBUTORS 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.
- *
- ****************************************************************************/
-
-/****************************************************************************
- * Included Files
- ****************************************************************************/
-
-#include <nuttx/config.h>
-
-#include <stdbool.h>
-#include <stdio.h>
-#include <debug.h>
-#include <errno.h>
-
-#ifdef CONFIG_STM32_SPI1
-# include <nuttx/spi.h>
-# include <nuttx/mtd.h>
-#endif
-
-#ifdef CONFIG_STM32_SDIO
-# include <nuttx/sdio.h>
-# include <nuttx/mmcsd.h>
-#endif
-
-#include "vsn-internal.h"
-
-/****************************************************************************
- * Pre-Processor Definitions
- ****************************************************************************/
-
-/* Configuration ************************************************************/
-
-/* For now, don't build in any SPI1 support -- NSH is not using it */
-
-#undef CONFIG_STM32_SPI1
-
-/* PORT and SLOT number probably depend on the board configuration */
-
-#ifdef CONFIG_ARCH_BOARD_VSN
-# define CONFIG_EXAMPLES_NSH_HAVEUSBDEV 1
-# define CONFIG_EXAMPLES_NSH_HAVEMMCSD 1
-# if defined(CONFIG_EXAMPLES_NSH_MMCSDSLOTNO) && CONFIG_EXAMPLES_NSH_MMCSDSLOTNO != 0
-# error "Only one MMC/SD slot"
-# undef CONFIG_EXAMPLES_NSH_MMCSDSLOTNO
-# endif
-# ifndef CONFIG_EXAMPLES_NSH_MMCSDSLOTNO
-# define CONFIG_EXAMPLES_NSH_MMCSDSLOTNO 0
-# endif
-#else
- /* Add configuration for new STM32 boards here */
-# undef CONFIG_EXAMPLES_NSH_HAVEUSBDEV
-# undef CONFIG_EXAMPLES_NSH_HAVEMMCSD
-#endif
-
-/* Can't support USB features if USB is not enabled */
-
-#ifndef CONFIG_USBDEV
-# undef CONFIG_EXAMPLES_NSH_HAVEUSBDEV
-#endif
-
-/* Can't support MMC/SD features if mountpoints are disabled or if SDIO support
- * is not enabled.
- */
-
-#if defined(CONFIG_DISABLE_MOUNTPOINT) || !defined(CONFIG_STM32_SDIO)
-# undef CONFIG_EXAMPLES_NSH_HAVEMMCSD
-#endif
-
-#ifndef CONFIG_EXAMPLES_NSH_MMCSDMINOR
-# define CONFIG_EXAMPLES_NSH_MMCSDMINOR 0
-#endif
-
-/* Debug ********************************************************************/
-
-#ifdef CONFIG_CPP_HAVE_VARARGS
-# ifdef CONFIG_DEBUG
-# define message(...) lib_lowprintf(__VA_ARGS__)
-# else
-# define message(...) printf(__VA_ARGS__)
-# endif
-#else
-# ifdef CONFIG_DEBUG
-# define message lib_lowprintf
-# else
-# define message printf
-# endif
-#endif
-
-/****************************************************************************
- * Public Functions
- ****************************************************************************/
-
-/****************************************************************************
- * Name: nsh_archinitialize
- *
- * Description:
- * Perform architecture specific initialization
- *
- ****************************************************************************/
-
-int nsh_archinitialize(void)
-{
-#ifdef CONFIG_STM32_SPI1
- FAR struct spi_dev_s *spi;
- FAR struct mtd_dev_s *mtd;
-#endif
-#ifdef CONFIG_EXAMPLES_NSH_HAVEMMCSD
- FAR struct sdio_dev_s *sdio;
- int ret;
-#endif
-
- /* Configure SPI-based devices */
-
-#ifdef CONFIG_STM32_SPI1
- /* Get the SPI port */
-
- message("nsh_archinitialize: Initializing SPI port 0\n");
- spi = up_spiinitialize(0);
- if (!spi)
- {
- message("nsh_archinitialize: Failed to initialize SPI port 0\n");
- return -ENODEV;
- }
- message("nsh_archinitialize: Successfully initialized SPI port 0\n");
-
- /* Now bind the SPI interface to the M25P64/128 SPI FLASH driver */
-
- message("nsh_archinitialize: Bind SPI to the SPI flash driver\n");
- mtd = m25p_initialize(spi);
- if (!mtd)
- {
- message("nsh_archinitialize: Failed to bind SPI port 0 to the SPI FLASH driver\n");
- return -ENODEV;
- }
- message("nsh_archinitialize: Successfully bound SPI port 0 to the SPI FLASH driver\n");
-#warning "Now what are we going to do with this SPI FLASH driver?"
-#endif
-
- /* Create the SPI FLASH MTD instance */
- /* The M25Pxx is not a give media to implement a file system..
- * its block sizes are too large
- */
-
- /* Mount the SDIO-based MMC/SD block driver */
-
-#ifdef CONFIG_EXAMPLES_NSH_HAVEMMCSD
- /* First, get an instance of the SDIO interface */
-
- message("nsh_archinitialize: Initializing SDIO slot %d\n",
- CONFIG_EXAMPLES_NSH_MMCSDSLOTNO);
- sdio = sdio_initialize(CONFIG_EXAMPLES_NSH_MMCSDSLOTNO);
- if (!sdio)
- {
- message("nsh_archinitialize: Failed to initialize SDIO slot %d\n",
- CONFIG_EXAMPLES_NSH_MMCSDSLOTNO);
- return -ENODEV;
- }
-
- /* Now bind the SPI interface to the MMC/SD driver */
-
- message("nsh_archinitialize: Bind SDIO to the MMC/SD driver, minor=%d\n",
- CONFIG_EXAMPLES_NSH_MMCSDMINOR);
- ret = mmcsd_slotinitialize(CONFIG_EXAMPLES_NSH_MMCSDMINOR, sdio);
- if (ret != OK)
- {
- message("nsh_archinitialize: Failed to bind SDIO to the MMC/SD driver: %d\n", ret);
- return ret;
- }
- message("nsh_archinitialize: Successfully bound SDIO to the MMC/SD driver\n");
-
- /* Then let's guess and say that there is a card in the slot. I need to check to
- * see if the VSN board supports a GPIO to detect if there is a card in
- * the slot.
- */
-
- sdio_mediachange(sdio, true);
-#endif
- return OK;
-}
diff --git a/nuttx/configs/vsn/src/up_usbdev.c b/nuttx/configs/vsn/src/usbdev.c
index a30a8f8a1..db7fd1d9a 100644
--- a/nuttx/configs/vsn/src/up_usbdev.c
+++ b/nuttx/configs/vsn/src/usbdev.c
@@ -1,6 +1,6 @@
/************************************************************************************
- * configs/svsn/src/up_usbdev.c
- * arch/arm/src/board/up_boot.c
+ * configs/svsn/src/usbdev.c
+ * arch/arm/src/board/boot.c
*
* Copyright (C) 2009-2010 Gregory Nutt. All rights reserved.
* Copyright (c) 2011 Uros Platise. All rights reserved.
@@ -53,7 +53,7 @@
#include "up_arch.h"
#include "stm32_internal.h"
-#include "vsn-internal.h"
+#include "vsn.h"
/************************************************************************************
* Definitions
diff --git a/nuttx/configs/vsn/src/up_usbstrg.c b/nuttx/configs/vsn/src/usbstrg.c
index 2a34bab40..0942ae8e5 100644
--- a/nuttx/configs/vsn/src/up_usbstrg.c
+++ b/nuttx/configs/vsn/src/usbstrg.c
@@ -1,5 +1,5 @@
/****************************************************************************
- * configs/vsn/src/up_usbstrg.c
+ * configs/vsn/src/usbstrg.c
*
* Copyright (C) 2009 Gregory Nutt. All rights reserved.
* Copyright (c) 2011 Uros Platise. All rights reserved.
@@ -51,7 +51,7 @@
#include <nuttx/sdio.h>
#include <nuttx/mmcsd.h>
-#include "vsn-internal.h"
+#include "vsn.h"
#ifdef CONFIG_STM32_SDIO
diff --git a/nuttx/configs/vsn/src/vsn-internal.h b/nuttx/configs/vsn/src/vsn.h
index 832dff146..c065e1e75 100644
--- a/nuttx/configs/vsn/src/vsn-internal.h
+++ b/nuttx/configs/vsn/src/vsn.h
@@ -1,6 +1,6 @@
/************************************************************************************
- * configs/vsn/src/vsn-internal.h
- * arch/arm/src/board/vsn-internal.n
+ * configs/vsn/src/vsn.h
+ * arch/arm/src/board/vsn.n
*
* Copyright (C) 2009 Gregory Nutt. All rights reserved.
* Copyright (c) 2011 Uros Platise. All rights reserved.
@@ -44,6 +44,7 @@
* Included Files
************************************************************************************/
+#include <arch/board/board.h>
#include <nuttx/config.h>
#include <nuttx/compiler.h>
#include <stdint.h>
@@ -52,20 +53,6 @@
* Definitions
************************************************************************************/
-/* How many SPI modules does this chip support? The LM3S6918 supports 2 SPI
- * modules (others may support more -- in such case, the following must be
- * expanded).
- */
-
-#if STM32_NSPI < 1
-# undef CONFIG_STM32_SPI1
-# undef CONFIG_STM32_SPI2
-#elif STM32_NSPI < 2
-# undef CONFIG_STM32_SPI2
-#endif
-
-/* VSN 1.2 GPIOs **************************************************************/
-
/* LED */
#define GPIO_LED (GPIO_OUTPUT|GPIO_CNF_OUTPP|GPIO_MODE_2MHz|GPIO_OUTPUT_CLEAR|GPIO_PORTB|GPIO_PIN2)
@@ -74,6 +61,32 @@
#define GPIO_PUSHBUTTON (GPIO_INPUT|GPIO_CNF_INFLOAT|GPIO_MODE_INPUT|GPIO_PORTC|GPIO_PIN5)
+/* Power Management Pins */
+
+#define GPIO_PVS (GPIO_OUTPUT|GPIO_CNF_OUTPP|GPIO_MODE_2MHz|GPIO_OUTPUT_CLEAR|GPIO_PORTC|GPIO_PIN7)
+
+/* FRAM */
+
+#define GPIO_FRAM_CS (GPIO_OUTPUT|GPIO_CNF_OUTPP|GPIO_MODE_50MHz|GPIO_OUTPUT_SET|GPIO_PORTA|GPIO_PIN15)
+
+
+/* Debug ********************************************************************/
+
+#ifdef CONFIG_CPP_HAVE_VARARGS
+# ifdef CONFIG_DEBUG
+# define message(...) lib_lowprintf(__VA_ARGS__)
+# else
+# define message(...) printf(__VA_ARGS__)
+# endif
+#else
+# ifdef CONFIG_DEBUG
+# define message lib_lowprintf
+# else
+# define message printf
+# endif
+#endif
+
+
/************************************************************************************
* Public Types
************************************************************************************/
@@ -108,14 +121,18 @@ extern void weak_function stm32_spiinitialize(void);
extern void weak_function stm32_usbinitialize(void);
+
/************************************************************************************
- * Name: stm32_extcontextsave
+ * Power Module
*
* Description:
- * Save current GPIOs that will used by external memory configurations
- *
+ * - Provides power related board operations, such as voltage selection,
+ * proper reboot sequence, and power-off
************************************************************************************/
+extern void board_power_setbootvoltage(void); // Default voltage at boot time
+
+
#endif /* __ASSEMBLY__ */
#endif /* __CONFIGS_VSN_1_2_SRC_VSN_INTERNAL_H */