summaryrefslogtreecommitdiff
path: root/nuttx
diff options
context:
space:
mode:
authorpatacongo <patacongo@42af7a65-404d-4744-a932-0658087f49c3>2012-01-02 12:34:31 +0000
committerpatacongo <patacongo@42af7a65-404d-4744-a932-0658087f49c3>2012-01-02 12:34:31 +0000
commit7d97849716500b2145ab3822c8b06407001ead48 (patch)
tree1c0dc29b21c4f04803183bce066cb91be678d30d /nuttx
parent51ee9040faf7124e75f41f2d35d6cf00f431c641 (diff)
downloadpx4-nuttx-7d97849716500b2145ab3822c8b06407001ead48.tar.gz
px4-nuttx-7d97849716500b2145ab3822c8b06407001ead48.tar.bz2
px4-nuttx-7d97849716500b2145ab3822c8b06407001ead48.zip
Remove references to the detron board
git-svn-id: svn://svn.code.sf.net/p/nuttx/code/trunk@4250 42af7a65-404d-4744-a932-0658087f49c3
Diffstat (limited to 'nuttx')
-rw-r--r--nuttx/Documentation/NuttxPortingGuide.html5
-rw-r--r--nuttx/Documentation/README.html2
-rwxr-xr-xnuttx/README.txt2
-rw-r--r--nuttx/configs/README.txt4
-rwxr-xr-xnuttx/configs/detron/README.txt404
-rwxr-xr-xnuttx/configs/detron/hidkbd/Make.defs163
-rw-r--r--nuttx/configs/detron/hidkbd/appconfig39
-rwxr-xr-xnuttx/configs/detron/hidkbd/defconfig894
-rwxr-xr-xnuttx/configs/detron/hidkbd/ld.script110
-rwxr-xr-xnuttx/configs/detron/hidkbd/setenv.sh47
-rwxr-xr-xnuttx/configs/detron/include/board.h207
-rwxr-xr-xnuttx/configs/detron/nsh/Make.defs162
-rw-r--r--nuttx/configs/detron/nsh/appconfig54
-rwxr-xr-xnuttx/configs/detron/nsh/defconfig907
-rwxr-xr-xnuttx/configs/detron/nsh/ld.script109
-rwxr-xr-xnuttx/configs/detron/nsh/setenv.sh46
-rwxr-xr-xnuttx/configs/detron/ostest/Make.defs162
-rw-r--r--nuttx/configs/detron/ostest/appconfig39
-rwxr-xr-xnuttx/configs/detron/ostest/defconfig828
-rwxr-xr-xnuttx/configs/detron/ostest/ld.script109
-rwxr-xr-xnuttx/configs/detron/ostest/setenv.sh46
-rwxr-xr-xnuttx/configs/detron/src/Makefile87
-rwxr-xr-xnuttx/configs/detron/src/detron_internal.h159
-rwxr-xr-xnuttx/configs/detron/src/up_boot.c77
-rw-r--r--nuttx/configs/detron/src/up_buttons.c180
-rwxr-xr-xnuttx/configs/detron/src/up_nsh.c324
-rwxr-xr-xnuttx/configs/detron/wlan/Make.defs163
-rw-r--r--nuttx/configs/detron/wlan/appconfig43
-rwxr-xr-xnuttx/configs/detron/wlan/defconfig919
-rwxr-xr-xnuttx/configs/detron/wlan/ld.script110
-rwxr-xr-xnuttx/configs/detron/wlan/setenv.sh47
31 files changed, 0 insertions, 6448 deletions
diff --git a/nuttx/Documentation/NuttxPortingGuide.html b/nuttx/Documentation/NuttxPortingGuide.html
index f24517503..b0a7a243c 100644
--- a/nuttx/Documentation/NuttxPortingGuide.html
+++ b/nuttx/Documentation/NuttxPortingGuide.html
@@ -775,11 +775,6 @@
is code complete but has not yet been verified.
</li>
- <li><code>configs/detron</code>:
- This is a NuttX port to the Detron LPC1768 board from Decio Renno
- (<a href="http://www.detroneletronica.com.br/">Detron Electronica</a>)
- </li>
-
<li><code>configs/ea3131</code>:
Embedded Artists EA3131 Development bard. This board is based on the
an NXP LPC3131 MCU. This OS is built with the arm-elf toolchain.
diff --git a/nuttx/Documentation/README.html b/nuttx/Documentation/README.html
index 38ebe0f65..5cb9e0d3e 100644
--- a/nuttx/Documentation/README.html
+++ b/nuttx/Documentation/README.html
@@ -60,8 +60,6 @@
| | | `- <a href="http://nuttx.svn.sourceforge.net/viewvc/nuttx/trunk/nuttx/configs/c5471evm/README.txt?view=log"><b><i>README.txt</i></b></a>
| | |- demo9s12ne64/
| | | `- <a href="http://nuttx.svn.sourceforge.net/viewvc/nuttx/trunk/nuttx/configs/demo9s12ne64/README.txt?view=log"><b><i>README.txt</i></b></a>
- | | |- detron/
- | | | `- <a href="http://nuttx.svn.sourceforge.net/viewvc/nuttx/trunk/nuttx/configs/detron/README.txt?view=log"><b><i>README.txt</i></b></a>
| | |- ea3131/
| | | `- <a href="http://nuttx.svn.sourceforge.net/viewvc/nuttx/trunk/nuttx/configs/ea3131/README.txt?view=log"><b><i>README.txt</i></b></a>
| | |- ea3152/
diff --git a/nuttx/README.txt b/nuttx/README.txt
index 87f870d96..5e8b42787 100755
--- a/nuttx/README.txt
+++ b/nuttx/README.txt
@@ -519,8 +519,6 @@ nuttx
| | `- README.txt
| |- demo0s12ne64/
| | `- README.txt
- | |- detron/
- | | `- README.txt
| |- ea3131/
| | `- README.txt
| |- ea3152/
diff --git a/nuttx/configs/README.txt b/nuttx/configs/README.txt
index 6bec1ca1c..ecbaaf51b 100644
--- a/nuttx/configs/README.txt
+++ b/nuttx/configs/README.txt
@@ -1224,10 +1224,6 @@ configs/demo9s12ne64
port uses the m9s12x GCC toolchain. STATUS: (Still) under development; it
is code complete but has not yet been verified.
-configs/detron
- This is a port of NuttX port to the Detron LPC1768 board from Decio Renno
- (http://www.detroneletronica.com.br/)
-
configs/ea3131
Embedded Artists EA3131 Development bard. This board is based on the
an NXP LPC3131 MCU. This OS is built with the arm-elf toolchain*.
diff --git a/nuttx/configs/detron/README.txt b/nuttx/configs/detron/README.txt
deleted file mode 100755
index 7a45a2ac1..000000000
--- a/nuttx/configs/detron/README.txt
+++ /dev/null
@@ -1,404 +0,0 @@
-README
-^^^^^^
-
-README for NuttX port to the Detron LPC1768 board from Decio Renno
-(http://www.detroneletronica.com.br/)
-
-Contents
-^^^^^^^^
-
- Internet Radio Detron Board
- Development Environment
- GNU Toolchain Options
- IDEs
- NuttX buildroot Toolchain
- Detron Configuration Options
- USB Host Configuration
- Configurations
-
-Internet Radio Detron Board
-^^^^^^^^^^^^^^^^^^^^^^^^^^^
-
- Graphic display
-
- Pin Port Function
- 58 P0(20) DI
- 59 P0(19) RW
- 49 P0(11) ENABLE
- 78 P0(7) D0
- 79 P0(6) D1
- 78 P0(5) D2
- 81 P0(4) D3
- 94 P1(1) D4
- 95 P1(0) D5
- 47 P0(1) D6
- 46 P0(0) D7
-
- VS1003
-
- Pin Port Function
- 65 P2(8) xreset
- 85 P4(29) dreq
- 82 P4(28) xdcs
- 63 P0(16) xcs
- 62 P0(15) sclk
- 60 P0(18) si
- 61 P0(17) so
-
- USB
-
- Pin Port Function
- 29 D+
- 30 D-
-
-Development Environment
-^^^^^^^^^^^^^^^^^^^^^^^
-
- Either Linux or Cygwin on Windows can be used for the development environment.
- The source has been built only using the GNU toolchain (see below). Other
- toolchains will likely cause problems. Testing was performed using the Cygwin
- environment.
-
-GNU Toolchain Options
-^^^^^^^^^^^^^^^^^^^^^
-
- The NuttX make system has been modified to support the following different
- toolchain options.
-
- 1. The CodeSourcery GNU toolchain,
- 2. The devkitARM GNU toolchain,
- 3. The NuttX buildroot Toolchain (see below).
-
- All testing has been conducted using the NuttX buildroot toolchain. However,
- the make system is setup to default to use the devkitARM toolchain. To use
- the CodeSourcery or devkitARM toolchain, you simply need add one of the
- following configuration options to your .config (or defconfig) file:
-
- CONFIG_LPC17_CODESOURCERYW=y : CodeSourcery under Windows
- CONFIG_LPC17_CODESOURCERYL=y : CodeSourcery under Linux
- CONFIG_LPC17_DEVKITARM=y : devkitARM under Windows
- CONFIG_LPC17_BUILDROOT=y : NuttX buildroot under Linux or Cygwin (default)
-
- If you are not using CONFIG_LPC17_BUILDROOT, then you may also have to modify
- the PATH in the setenv.h file if your make cannot find the tools.
-
- NOTE: the CodeSourcery (for Windows)and devkitARM are Windows native toolchains.
- The CodeSourcey (for Linux) and NuttX buildroot toolchains are Cygwin and/or
- Linux native toolchains. There are several limitations to using a Windows based
- toolchain in a Cygwin environment. The three biggest are:
-
- 1. The Windows toolchain cannot follow Cygwin paths. Path conversions are
- performed automatically in the Cygwin makefiles using the 'cygpath' utility
- but you might easily find some new path problems. If so, check out 'cygpath -w'
-
- 2. Windows toolchains cannot follow Cygwin symbolic links. Many symbolic links
- are used in Nuttx (e.g., include/arch). The make system works around these
- problems for the Windows tools by copying directories instead of linking them.
- But this can also cause some confusion for you: For example, you may edit
- a file in a "linked" directory and find that your changes had no effect.
- That is because you are building the copy of the file in the "fake" symbolic
- directory. If you use a Windows toolchain, you should get in the habit of
- making like this:
-
- make clean_context all
-
- An alias in your .bashrc file might make that less painful.
-
- 3. Dependencies are not made when using Windows versions of the GCC. This is
- because the dependencies are generated using Windows pathes which do not
- work with the Cygwin make.
-
- Support has been added for making dependencies with the windows-native toolchains.
- That support can be enabled by modifying your Make.defs file as follows:
-
- - MKDEP = $(TOPDIR)/tools/mknulldeps.sh
- + MKDEP = $(TOPDIR)/tools/mkdeps.sh --winpaths "$(TOPDIR)"
-
- If you have problems with the dependency build (for example, if you are not
- building on C:), then you may need to modify tools/mkdeps.sh
-
- NOTE 1: The CodeSourcery toolchain (2009q1) does not work with default optimization
- level of -Os (See Make.defs). It will work with -O0, -O1, or -O2, but not with
- -Os.
-
- NOTE 2: The devkitARM toolchain includes a version of MSYS make. Make sure that
- the paths to Cygwin's /bin and /usr/bin directories appear BEFORE the devkitARM
- path or will get the wrong version of make.
-
-IDEs
-^^^^
-
- NuttX is built using command-line make. It can be used with an IDE, but some
- effort will be required to create the project (There is a simple RIDE project
- in the RIDE subdirectory).
-
- Makefile Build
- --------------
- Under Eclipse, it is pretty easy to set up an "empty makefile project" and
- simply use the NuttX makefile to build the system. That is almost for free
- under Linux. Under Windows, you will need to set up the "Cygwin GCC" empty
- makefile project in order to work with Windows (Google for "Eclipse Cygwin" -
- there is a lot of help on the internet).
-
- Native Build
- ------------
- Here are a few tips before you start that effort:
-
- 1) Select the toolchain that you will be using in your .config file
- 2) Start the NuttX build at least one time from the Cygwin command line
- before trying to create your project. This is necessary to create
- certain auto-generated files and directories that will be needed.
- 3) Set up include pathes: You will need include/, arch/arm/src/lpc17xx,
- arch/arm/src/common, arch/arm/src/armv7-m, and sched/.
- 4) All assembly files need to have the definition option -D __ASSEMBLY__
- on the command line.
-
- Startup files will probably cause you some headaches. The NuttX startup file
- is arch/arm/src/lpc17x/lpc17_vectors.S.
-
-NuttX buildroot Toolchain
-^^^^^^^^^^^^^^^^^^^^^^^^^
-
- A GNU GCC-based toolchain is assumed. The files */setenv.sh should
- be modified to point to the correct path to the Cortex-M3 GCC toolchain (if
- different from the default in your PATH variable).
-
- If you have no Cortex-M3 toolchain, one can be downloaded from the NuttX
- SourceForge download site (https://sourceforge.net/project/showfiles.php?group_id=189573).
- This GNU toolchain builds and executes in the Linux or Cygwin environment.
-
- 1. You must have already configured Nuttx in <some-dir>/nuttx.
-
- cd tools
- ./configure.sh detron/<sub-dir>
-
- 2. Download the latest buildroot package into <some-dir>
-
- 3. unpack the buildroot tarball. The resulting directory may
- have versioning information on it like buildroot-x.y.z. If so,
- rename <some-dir>/buildroot-x.y.z to <some-dir>/buildroot.
-
- 4. cd <some-dir>/buildroot
-
- 5. cp configs/cortexm3-defconfig-4.3.3 .config
-
- 6. make oldconfig
-
- 7. make
-
- 8. Edit setenv.h, if necessary, so that the PATH variable includes
- the path to the newly built binaries.
-
- See the file configs/README.txt in the buildroot source tree. That has more
- detailed PLUS some special instructions that you will need to follow if you
- are building a Cortex-M3 toolchain for Cygwin under Windows.
-
- NOTE: This is an OABI toolchain.
-
-Detron Configuration Options
-^^^^^^^^^^^^^^^^^^^^^^^^^^^^
-
- CONFIG_ARCH - Identifies the arch/ subdirectory. This should
- be set to:
-
- CONFIG_ARCH=arm
-
- CONFIG_ARCH_family - For use in C code:
-
- CONFIG_ARCH_ARM=y
-
- CONFIG_ARCH_architecture - For use in C code:
-
- CONFIG_ARCH_CORTEXM3=y
-
- CONFIG_ARCH_CHIP - Identifies the arch/*/chip subdirectory
-
- CONFIG_ARCH_CHIP=lpc17xx
-
- CONFIG_ARCH_CHIP_name - For use in C code to identify the exact
- chip:
-
- CONFIG_ARCH_CHIP_LPC1768=y
-
- CONFIG_ARCH_BOARD - Identifies the configs subdirectory and
- hence, the board that supports the particular chip or SoC.
-
- CONFIG_ARCH_BOARD=detron (for the Detron board)
-
- CONFIG_ARCH_BOARD_name - For use in C code
-
- CONFIG_ARCH_BOARD_DETRON=y
-
- CONFIG_ARCH_LOOPSPERMSEC - Must be calibrated for correct operation
- of delay loops
-
- CONFIG_ENDIAN_BIG - define if big endian (default is little
- endian)
-
- CONFIG_DRAM_SIZE - Describes the installed DRAM (CPU SRAM in this case):
-
- CONFIG_DRAM_SIZE=(32*1024) (32Kb)
-
- There is an additional 32Kb of SRAM in AHB SRAM banks 0 and 1.
-
- CONFIG_DRAM_START - The start address of installed DRAM
-
- CONFIG_DRAM_START=0x10000000
-
- CONFIG_DRAM_END - Last address+1 of installed RAM
-
- CONFIG_DRAM_END=(CONFIG_DRAM_START+CONFIG_DRAM_SIZE)
-
- CONFIG_ARCH_IRQPRIO - The LPC17xx supports interrupt prioritization
-
- CONFIG_ARCH_IRQPRIO=y
-
- CONFIG_ARCH_LEDS - Use LEDs to show state. Unique to boards that
- have LEDs
-
- CONFIG_ARCH_INTERRUPTSTACK - This architecture supports an interrupt
- stack. If defined, this symbol is the size of the interrupt
- stack in bytes. If not defined, the user task stacks will be
- used during interrupt handling.
-
- CONFIG_ARCH_STACKDUMP - Do stack dumps after assertions
-
- CONFIG_ARCH_LEDS - Use LEDs to show state. Unique to board architecture.
-
- CONFIG_ARCH_CALIBRATION - Enables some build in instrumentation that
- cause a 100 second delay during boot-up. This 100 second delay
- serves no purpose other than it allows you to calibratre
- CONFIG_ARCH_LOOPSPERMSEC. You simply use a stop watch to measure
- the 100 second delay then adjust CONFIG_ARCH_LOOPSPERMSEC until
- the delay actually is 100 seconds.
-
- Individual subsystems can be enabled:
- CONFIG_LPC17_MAINOSC=y
- CONFIG_LPC17_PLL0=y
- CONFIG_LPC17_PLL1=n
- CONFIG_LPC17_ETHERNET=n
- CONFIG_LPC17_USBHOST=n
- CONFIG_LPC17_USBOTG=n
- CONFIG_LPC17_USBDEV=n
- CONFIG_LPC17_UART0=y
- CONFIG_LPC17_UART1=n
- CONFIG_LPC17_UART2=n
- CONFIG_LPC17_UART3=n
- CONFIG_LPC17_CAN1=n
- CONFIG_LPC17_CAN2=n
- CONFIG_LPC17_SPI=n
- CONFIG_LPC17_SSP0=n
- CONFIG_LPC17_SSP1=n
- CONFIG_LPC17_I2C0=n
- CONFIG_LPC17_I2C1=n
- CONFIG_LPC17_I2S=n
- CONFIG_LPC17_TMR0=n
- CONFIG_LPC17_TMR1=n
- CONFIG_LPC17_TMR2=n
- CONFIG_LPC17_TMR3=n
- CONFIG_LPC17_RIT=n
- CONFIG_LPC17_PWM=n
- CONFIG_LPC17_MCPWM=n
- CONFIG_LPC17_QEI=n
- CONFIG_LPC17_RTC=n
- CONFIG_LPC17_WDT=n
- CONFIG_LPC17_ADC=n
- CONFIG_LPC17_DAC=n
- CONFIG_LPC17_GPDMA=n
- CONFIG_LPC17_FLASH=n
-
- LPC17xx specific device driver settings
-
- CONFIG_UARTn_SERIAL_CONSOLE - selects the UARTn for the
- console and ttys0 (default is the UART0).
- CONFIG_UARTn_RXBUFSIZE - Characters are buffered as received.
- This specific the size of the receive buffer
- CONFIG_UARTn_TXBUFSIZE - Characters are buffered before
- being sent. This specific the size of the transmit buffer
- CONFIG_UARTn_BAUD - The configure BAUD of the UART. Must be
- CONFIG_UARTn_BITS - The number of bits. Must be either 7 or 8.
- CONFIG_UARTn_PARTIY - 0=no parity, 1=odd parity, 2=even parity
- CONFIG_UARTn_2STOP - Two stop bits
-
- LPC17xx specific PHY/Ethernet device driver settings. These setting
- also require CONFIG_NET and CONFIG_LPC17_ETHERNET.
-
- CONFIG_PHY_KS8721 - Selects Micrel KS8721 PHY
- CONFIG_PHY_AUTONEG - Enable auto-negotion
- CONFIG_PHY_SPEED100 - Select 100Mbit vs. 10Mbit speed.
- CONFIG_PHY_FDUPLEX - Select full (vs. half) duplex
-
- CONFIG_NET_EMACRAM_SIZE - Size of EMAC RAM. Default: 16Kb
- CONFIG_NET_NTXDESC - Configured number of Tx descriptors. Default: 18
- CONFIG_NET_NRXDESC - Configured number of Rx descriptors. Default: 18
- CONFIG_NET_PRIORITY - Ethernet interrupt priority. The is default is
- the higest priority.
- CONFIG_NET_WOL - Enable Wake-up on Lan (not fully implemented).
- CONFIG_NET_REGDEBUG - Enabled low level register debug. Also needs
- CONFIG_DEBUG.
- CONFIG_NET_DUMPPACKET - Dump all received and transmitted packets.
- Also needs CONFIG_DEBUG.
- CONFIG_NET_HASH - Enable receipt of near-perfect match frames.
- CONFIG_NET_MULTICAST - Enable receipt of multicast (and unicast) frames.
- Automatically set if CONFIG_NET_IGMP is selected.
-
- LPC17xx USB Device Configuration
-
- CONFIG_LPC17_USBDEV_FRAME_INTERRUPT
- Handle USB Start-Of-Frame events.
- Enable reading SOF from interrupt handler vs. simply reading on demand.
- Probably a bad idea... Unless there is some issue with sampling the SOF
- from hardware asynchronously.
- CONFIG_LPC17_USBDEV_EPFAST_INTERRUPT
- Enable high priority interrupts. I have no idea why you might want to
- do that
- CONFIG_LPC17_USBDEV_NDMADESCRIPTORS
- Number of DMA descriptors to allocate in SRAM.
- CONFIG_LPC17_USBDEV_DMA
- Enable lpc17xx-specific DMA support
- CONFIG_LPC17_USBDEV_NOVBUS
- Define if the hardware implementation does not support the VBUS signal
- CONFIG_LPC17_USBDEV_NOLED
- Define if the hardware implementation does not support the LED output
-
- LPC17xx USB Host Configuration
-
- CONFIG_USBHOST_OHCIRAM_SIZE
- Total size of OHCI RAM (in AHB SRAM Bank 1)
- CONFIG_USBHOST_NEDS
- Number of endpoint descriptors
- CONFIG_USBHOST_NTDS
- Number of transfer descriptors
- CONFIG_USBHOST_TDBUFFERS
- Number of transfer descriptor buffers
- CONFIG_USBHOST_TDBUFSIZE
- Size of one transfer descriptor buffer
- CONFIG_USBHOST_IOBUFSIZE
- Size of one end-user I/O buffer. This can be zero if the
- application can guarantee that all end-user I/O buffers
- reside in AHB SRAM.
-
-Configurations
-^^^^^^^^^^^^^^
-
-Each Detron configuration is maintained in a sudirectory and can be
-selected as follow:
-
- cd tools
- ./configure.sh detron/<subdir>
- cd -
- . ./setenv.sh
-
-Where <subdir> is one of the following:
-
- hidkbd:
- This configuration directory, performs a simple test of the USB host
- HID keyboard class driver using the test logic in examples/hidkbd.
-
- nsh:
- Configures the NuttShell (nsh) located at examples/nsh. The
- Configuration enables only the serial NSH interfaces.
-
- ostest:
- This configuration directory, performs a simple OS test using
- examples/ostest.
diff --git a/nuttx/configs/detron/hidkbd/Make.defs b/nuttx/configs/detron/hidkbd/Make.defs
deleted file mode 100755
index d5470a685..000000000
--- a/nuttx/configs/detron/hidkbd/Make.defs
+++ /dev/null
@@ -1,163 +0,0 @@
-############################################################################
-# configs/detron/hidkbd/Make.defs
-#
-# Copyright (C) 2011 Gregory Nutt. All rights reserved.
-# Authors: Gregory Nutt <spudmonkey@racsa.co.cr>
-# Rafael Noronha <rafael@pdsolucoes.com.br>
-#
-# 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 ${TOPDIR}/.config
-
-# Setup for the selected toolchain
-
-ifeq ($(CONFIG_LPC17_CODESOURCERYW),y)
- # CodeSourcery under Windows
- CROSSDEV = arm-none-eabi-
- WINTOOL = y
- ARCHCPUFLAGS = -mcpu=cortex-m3 -mthumb -mfloat-abi=soft
-endif
-ifeq ($(CONFIG_LPC17_CODESOURCERYL),y)
- # CodeSourcery under Linux
- CROSSDEV = arm-none-eabi-
- ARCHCPUFLAGS = -mcpu=cortex-m3 -mthumb -mfloat-abi=soft
- MAXOPTIMIZATION = -O2
-endif
-ifeq ($(CONFIG_LPC17_DEVKITARM),y)
- # devkitARM under Windows
- CROSSDEV = arm-eabi-
- WINTOOL = y
- ARCHCPUFLAGS = -mcpu=cortex-m3 -mthumb -mfloat-abi=soft
-endif
-ifeq ($(CONFIG_LPC17_BUILDROOT),y)
- # NuttX buildroot under Linux or Cygwin
- CROSSDEV = arm-elf-
- ARCHCPUFLAGS = -mtune=cortex-m3 -march=armv7-m -mfloat-abi=soft
- MAXOPTIMIZATION = -Os
-endif
-
-ifeq ($(WINTOOL),y)
- # Windows-native toolchains
- DIRLINK = $(TOPDIR)/tools/winlink.sh
- DIRUNLINK = $(TOPDIR)/tools/unlink.sh
- MKDEP = $(TOPDIR)/tools/mknulldeps.sh
- ARCHINCLUDES = -I. -isystem "${shell cygpath -w $(TOPDIR)/include}"
- ARCHXXINCLUDES = -I. -isystem "${shell cygpath -w $(TOPDIR)/include}" -isystem "${shell cygpath -w $(TOPDIR)/include/cxx}"
- ARCHSCRIPT = -T "${shell cygpath -w $(TOPDIR)/configs/$(CONFIG_ARCH_BOARD)/hidkbd/ld.script}"
- MAXOPTIMIZATION = -O2
-else
- # Linux/Cygwin-native toolchain
- MKDEP = $(TOPDIR)/tools/mkdeps.sh
- ARCHINCLUDES = -I. -isystem $(TOPDIR)/include
- ARCHXXINCLUDES = -I. -isystem $(TOPDIR)/include -isystem $(TOPDIR)/include/cxx
- ARCHSCRIPT = -T$(TOPDIR)/configs/$(CONFIG_ARCH_BOARD)/hidkbd/ld.script
-endif
-
-CC = $(CROSSDEV)gcc
-CXX = $(CROSSDEV)g++
-CPP = $(CROSSDEV)gcc -E
-LD = $(CROSSDEV)ld
-AR = $(CROSSDEV)ar rcs
-NM = $(CROSSDEV)nm
-OBJCOPY = $(CROSSDEV)objcopy
-OBJDUMP = $(CROSSDEV)objdump
-
-ARCHCCVERSION = ${shell $(CC) -v 2>&1 | sed -n '/^gcc version/p' | sed -e 's/^gcc version \([0-9\.]\)/\1/g' -e 's/[-\ ].*//g' -e '1q'}
-ARCHCCMAJOR = ${shell echo $(ARCHCCVERSION) | cut -d'.' -f1}
-
-ifeq ("${CONFIG_DEBUG_SYMBOLS}","y")
- ARCHOPTIMIZATION = -g
-else
- ARCHOPTIMIZATION = $(MAXOPTIMIZATION) -fno-strict-aliasing -fno-strength-reduce -fomit-frame-pointer
-endif
-
-ARCHCFLAGS = -fno-builtin
-ARCHCXXFLAGS = -fno-builtin -fno-exceptions
-ARCHWARNINGS = -Wall -Wstrict-prototypes -Wshadow
-ARCHWARNINGSXX = -Wall -Wshadow
-ARCHDEFINES =
-ARCHPICFLAGS = -fpic -msingle-pic-base -mpic-register=r10
-
-CFLAGS = $(ARCHCFLAGS) $(ARCHWARNINGS) $(ARCHOPTIMIZATION) $(ARCHCPUFLAGS) $(ARCHINCLUDES) $(ARCHDEFINES) $(EXTRADEFINES) -pipe
-CPICFLAGS = $(ARCHPICFLAGS) $(CFLAGS)
-CXXFLAGS = $(ARCHCXXFLAGS) $(ARCHWARNINGSXX) $(ARCHOPTIMIZATION) $(ARCHCPUFLAGS) $(ARCHXXINCLUDES) $(ARCHDEFINES) $(EXTRADEFINES) -pipe
-CXXPICFLAGS = $(ARCHPICFLAGS) $(CXXFLAGS)
-CPPFLAGS = $(ARCHINCLUDES) $(ARCHDEFINES) $(EXTRADEFINES)
-AFLAGS = $(CFLAGS) -D__ASSEMBLY__
-
-NXFLATLDFLAGS1 = -r -d -warn-common
-NXFLATLDFLAGS2 = $(NXFLATLDFLAGS1) -T$(TOPDIR)/binfmt/libnxflat/gnu-nxflat.ld -no-check-sections
-LDNXFLATFLAGS = -e main -s 2048
-
-OBJEXT = .o
-LIBEXT = .a
-EXEEXT =
-
-ifneq ($(CROSSDEV),arm-elf-)
- LDFLAGS += -nostartfiles -nodefaultlibs
-endif
-ifeq ($(CONFIG_DEBUG_SYMBOLS),y)
- LDFLAGS += -g
-endif
-
-define PREPROCESS
- @echo "CPP: $1->$2"
- @$(CPP) $(CPPFLAGS) $1 -o $2
-endef
-
-define COMPILE
- @echo "CC: $1"
- @$(CC) -c $(CFLAGS) $1 -o $2
-endef
-
-define COMPILEXX
- @echo "CXX: $1"
- @$(CXX) -c $(CXXFLAGS) $1 -o $2
-endef
-
-define ASSEMBLE
- @echo "AS: $1"
- @$(CC) -c $(AFLAGS) $1 -o $2
-endef
-
-define ARCHIVE
- echo "AR: $2"; \
- $(AR) $1 $2 || { echo "$(AR) $1 $2 FAILED!" ; exit 1 ; }
-endef
-
-define CLEAN
- @rm -f *.o *.a
-endef
-
-HOSTCC = gcc
-HOSTINCLUDES = -I.
-HOSTCFLAGS = -Wall -Wstrict-prototypes -Wshadow -g -pipe
-HOSTLDFLAGS =
-
diff --git a/nuttx/configs/detron/hidkbd/appconfig b/nuttx/configs/detron/hidkbd/appconfig
deleted file mode 100644
index ee9ea1277..000000000
--- a/nuttx/configs/detron/hidkbd/appconfig
+++ /dev/null
@@ -1,39 +0,0 @@
-############################################################################
-# configs/detron/hidkbd/appconfig
-#
-# Copyright (C) 2011 Gregory Nutt. All rights reserved.
-# Author: 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.
-#
-############################################################################
-
-# Path to example in apps/examples containing the user_start entry point
-
-CONFIGURED_APPS += examples/hidkbd
-
diff --git a/nuttx/configs/detron/hidkbd/defconfig b/nuttx/configs/detron/hidkbd/defconfig
deleted file mode 100755
index 00b6503f9..000000000
--- a/nuttx/configs/detron/hidkbd/defconfig
+++ /dev/null
@@ -1,894 +0,0 @@
-############################################################################
-# configs/detron/hidkbd/defconfig
-#
-# Copyright (C) 2011 Gregory Nutt. All rights reserved.
-# Authors: Gregory Nutt <spudmonkey@racsa.co.cr>
-# Rafael Noronha <rafael@pdsolucoes.com.br>
-#
-# 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.
-#
-############################################################################
-#
-# architecture selection
-#
-# CONFIG_ARCH - identifies the arch subdirectory and, hence, the
-# processor architecture.
-# CONFIG_ARCH_family - for use in C code. This identifies the
-# particular chip family that the architecture is implemented
-# in.
-# CONFIG_ARCH_architecture - for use in C code. This identifies the
-# specific architecture within the chip familyl.
-# CONFIG_ARCH_CHIP - Identifies the arch/*/chip subdirectory
-# CONFIG_ARCH_CHIP_name - For use in C code
-# CONFIG_ARCH_BOARD - identifies the configs subdirectory and, hence,
-# the board that supports the particular chip or SoC.
-# CONFIG_ARCH_BOARD_name - for use in C code
-# CONFIG_ENDIAN_BIG - define if big endian (default is little endian)
-# CONFIG_BOARD_LOOPSPERMSEC - for delay loops
-# CONFIG_DRAM_SIZE - Describes the installed DRAM.
-# CONFIG_DRAM_START - The start address of DRAM (physical)
-# CONFIG_DRAM_END - Last address+1 of installed RAM
-# CONFIG_ARCH_IRQPRIO - The ST32F103Z supports interrupt prioritization
-# CONFIG_ARCH_INTERRUPTSTACK - This architecture supports an interrupt
-# stack. If defined, this symbol is the size of the interrupt
-# stack in bytes. If not defined, the user task stacks will be
-# used during interrupt handling.
-# CONFIG_ARCH_STACKDUMP - Do stack dumps after assertions
-# CONFIG_ARCH_BOOTLOADER - Set if you are using a bootloader.
-# CONFIG_ARCH_LEDS - Use LEDs to show state. Unique to board architecture.
-# CONFIG_ARCH_BUTTONS - Enable support for buttons. Unique to board architecture.
-# CONFIG_ARCH_CALIBRATION - Enables some build in instrumentation that
-# cause a 100 second delay during boot-up. This 100 second delay
-# serves no purpose other than it allows you to calibrate
-# CONFIG_BOARD_LOOPSPERMSEC. You simply use a stop watch to measure
-# the 100 second delay then adjust CONFIG_BOARD_LOOPSPERMSEC until
-# the delay actually is 100 seconds.
-# CONFIG_ARCH_DMA - Support DMA initialization
-#
-CONFIG_ARCH=arm
-CONFIG_ARCH_ARM=y
-CONFIG_ARCH_CORTEXM3=y
-CONFIG_ARCH_CHIP=lpc17xx
-CONFIG_ARCH_CHIP_LPC1768=y
-CONFIG_ARCH_BOARD=detron
-CONFIG_ARCH_BOARD_DETRON=y
-CONFIG_BOARD_LOOPSPERMSEC=7982
-CONFIG_DRAM_SIZE=(32*1024)
-CONFIG_DRAM_START=0x10000000
-CONFIG_DRAM_END=(CONFIG_DRAM_START+CONFIG_DRAM_SIZE)
-CONFIG_ARCH_IRQPRIO=y
-CONFIG_ARCH_INTERRUPTSTACK=n
-CONFIG_ARCH_STACKDUMP=y
-CONFIG_ARCH_BOOTLOADER=n
-CONFIG_ARCH_LEDS=n
-CONFIG_ARCH_BUTTONS=n
-CONFIG_ARCH_CALIBRATION=n
-CONFIG_ARCH_DMA=n
-
-#
-# Identify toolchain and linker options
-#
-CONFIG_LPC17_CODESOURCERYW=n
-CONFIG_LPC17_CODESOURCERYL=n
-CONFIG_LPC17_DEVKITARM=n
-CONFIG_LPC17_BUILDROOT=y
-
-#
-# Individual subsystems can be enabled:
-#
-# Individual subsystems can be enabled:
-# (MAINOSC, PLL0, PLL1 and FLASH are controlled in board.h)
-#
-CONFIG_LPC17_ETHERNET=n
-CONFIG_LPC17_USBHOST=y
-CONFIG_LPC17_USBOTG=n
-CONFIG_LPC17_USBDEV=n
-CONFIG_LPC17_UART0=y
-CONFIG_LPC17_UART1=n
-CONFIG_LPC17_UART2=n
-CONFIG_LPC17_UART3=n
-CONFIG_LPC17_CAN1=n
-CONFIG_LPC17_CAN2=n
-CONFIG_LPC17_SPI=n
-CONFIG_LPC17_SSP0=n
-CONFIG_LPC17_SSP1=n
-CONFIG_LPC17_I2C0=n
-CONFIG_LPC17_I2C1=n
-CONFIG_LPC17_I2S=n
-CONFIG_LPC17_TMR0=n
-CONFIG_LPC17_TMR1=n
-CONFIG_LPC17_TMR2=n
-CONFIG_LPC17_TMR3=n
-CONFIG_LPC17_RIT=n
-CONFIG_LPC17_PWM=n
-CONFIG_LPC17_MCPWM=n
-CONFIG_LPC17_QEI=n
-CONFIG_LPC17_RTC=n
-CONFIG_LPC17_WDT=n
-CONFIG_LPC17_ADC=n
-CONFIG_LPC17_DAC=n
-CONFIG_LPC17_GPDMA=n
-
-#
-# LPC17xx specific serial device driver settings
-#
-# CONFIG_UARTn_SERIAL_CONSOLE - selects the UARTn for the
-# console and ttys0 (default is the UART1).
-# CONFIG_UARTn_RXBUFSIZE - Characters are buffered as received.
-# This specific the size of the receive buffer
-# CONFIG_UARTn_TXBUFSIZE - Characters are buffered before
-# being sent. This specific the size of the transmit buffer
-# CONFIG_UARTn_BAUD - The configure BAUD of the UART. Must be
-# CONFIG_UARTn_BITS - The number of bits. Must be either 7 or 8.
-# CONFIG_UARTn_PARTIY - 0=no parity, 1=odd parity, 2=even parity
-# CONFIG_UARTn_2STOP - Two stop bits
-#
-CONFIG_UART0_SERIAL_CONSOLE=y
-CONFIG_UART1_SERIAL_CONSOLE=n
-CONFIG_UART2_SERIAL_CONSOLE=n
-CONFIG_UART3_SERIAL_CONSOLE=n
-
-CONFIG_UART0_TXBUFSIZE=256
-CONFIG_UART1_TXBUFSIZE=256
-CONFIG_UART2_TXBUFSIZE=256
-CONFIG_UART3_TXBUFSIZE=256
-
-CONFIG_UART0_RXBUFSIZE=256
-CONFIG_UART1_RXBUFSIZE=256
-CONFIG_UART2_RXBUFSIZE=256
-CONFIG_UART3_RXBUFSIZE=256
-
-CONFIG_UART0_BAUD=115200
-CONFIG_UART2_BAUD=115200
-CONFIG_UART3_BAUD=115200
-CONFIG_UART1_BAUD=115200
-
-CONFIG_UART0_BITS=8
-CONFIG_UART1_BITS=8
-CONFIG_UART2_BITS=8
-CONFIG_UART3_BITS=8
-
-CONFIG_UART0_PARITY=0
-CONFIG_UART1_PARITY=0
-CONFIG_UART2_PARITY=0
-CONFIG_UART3_PARITY=0
-
-CONFIG_UART0_2STOP=0
-CONFIG_UART1_2STOP=0
-CONFIG_UART2_2STOP=0
-CONFIG_UART3_2STOP=0
-
-#
-# LPC17xx specific PHY/Ethernet device driver settings
-#
-# CONFIG_PHY_KS8721 - Selects Micrel KS8721 PHY
-# CONFIG_PHY_AUTONEG - Enable auto-negotion
-# CONFIG_PHY_SPEED100 - Select 100Mbit vs. 10Mbit speed.
-# CONFIG_PHY_FDUPLEX - Select full (vs. half) duplex
-# CONFIG_NET_EMACRAM_SIZE - Size of EMAC RAM. Default: 16Kb
-# CONFIG_NET_NTXDESC - Configured number of Tx descriptors. Default: 18
-# CONFIG_NET_NRXDESC - Configured number of Rx descriptors. Default: 18
-# CONFIG_NET_PRIORITY - Ethernet interrupt priority. The is default is
-# the higest priority.
-# CONFIG_NET_WOL - Enable Wake-up on Lan (not fully implemented).
-# CONFIG_NET_DUMPPACKET - Dump all received and transmitted packets.
-# Also needs CONFIG_DEBUG.
-# CONFIG_NET_REGDEBUG - Enabled low level register debug. Also needs
-# CONFIG_DEBUG.
-# CONFIG_NET_HASH - Enable receipt of near-perfect match frames.
-# CONFIG_NET_MULTICAST - Enable receipt of multicast (and unicast) frames.
-# Automatically set if CONFIG_NET_IGMP is selected.
-#
-CONFIG_PHY_KS8721=y
-CONFIG_PHY_AUTONEG=y
-CONFIG_PHY_SPEED100=n
-CONFIG_PHY_FDUPLEX=y
-
-#
-# General build options
-#
-# CONFIG_RRLOAD_BINARY - make the rrload binary format used with
-# BSPs from www.ridgerun.com using the tools/mkimage.sh script
-# CONFIG_INTELHEX_BINARY - make the Intel HEX binary format
-# used with many different loaders using the GNU objcopy program
-# Should not be selected if you are not using the GNU toolchain.
-# CONFIG_MOTOROLA_SREC - make the Motorola S-Record binary format
-# used with many different loaders using the GNU objcopy program
-# Should not be selected if you are not using the GNU toolchain.
-# CONFIG_RAW_BINARY - make a raw binary format file used with many
-# different loaders using the GNU objcopy program. This option
-# should not be selected if you are not using the GNU toolchain.
-# CONFIG_HAVE_LIBM - toolchain supports libm.a
-#
-CONFIG_RRLOAD_BINARY=n
-CONFIG_INTELHEX_BINARY=y
-CONFIG_MOTOROLA_SREC=n
-CONFIG_RAW_BINARY=n
-CONFIG_HAVE_LIBM=n
-
-#
-# General OS setup
-#
-# CONFIG_APPS_DIR - Identifies the relative path to the directory
-# that builds the application to link with NuttX. Default: ../apps
-# CONFIG_DEBUG - enables built-in debug options
-# CONFIG_DEBUG_VERBOSE - enables verbose debug output
-# CONFIG_DEBUG_SYMBOLS - build without optimization and with
-# debug symbols (needed for use with a debugger).
-# CONFIG_MM_REGIONS - If the architecture includes multiple
-# regions of memory to allocate from, this specifies the
-# number of memory regions that the memory manager must
-# handle and enables the API mm_addregion(start, end);
-# CONFIG_ARCH_LOWPUTC - architecture supports low-level, boot
-# time console output
-# CONFIG_MSEC_PER_TICK - The default system timer is 100Hz
-# or MSEC_PER_TICK=10. This setting may be defined to
-# inform NuttX that the processor hardware is providing
-# system timer interrupts at some interrupt interval other
-# than 10 msec.
-# CONFIG_RR_INTERVAL - The round robin timeslice will be set
-# this number of milliseconds; Round robin scheduling can
-# be disabled by setting this value to zero.
-# CONFIG_SCHED_INSTRUMENTATION - enables instrumentation in
-# scheduler to monitor system performance
-# CONFIG_TASK_NAME_SIZE - Spcifies that maximum size of a
-# task name to save in the TCB. Useful if scheduler
-# instrumentation is selected. Set to zero to disable.
-# CONFIG_START_YEAR, CONFIG_START_MONTH, CONFIG_START_DAY -
-# Used to initialize the internal time logic.
-# CONFIG_GREGORIAN_TIME - Enables Gregorian time conversions.
-# You would only need this if you are concerned about accurate
-# time conversions in the past or in the distant future.
-# CONFIG_JULIAN_TIME - Enables Julian time conversions. You
-# would only need this if you are concerned about accurate
-# time conversion in the distand past. You must also define
-# CONFIG_GREGORIAN_TIME in order to use Julian time.
-# CONFIG_DEV_CONSOLE - Set if architecture-specific logic
-# provides /dev/console. Enables stdout, stderr, stdin.
-# CONFIG_DEV_LOWCONSOLE - Use the simple, low-level serial console
-# driver (minimul support)
-# CONFIG_MUTEX_TYPES: Set to enable support for recursive and
-# errorcheck mutexes. Enables pthread_mutexattr_settype().
-# CONFIG_PRIORITY_INHERITANCE : Set to enable support for priority
-# inheritance on mutexes and semaphores.
-# CONFIG_SEM_PREALLOCHOLDERS: This setting is only used if priority
-# inheritance is enabled. It defines the maximum number of
-# different threads (minus one) that can take counts on a
-# semaphore with priority inheritance support. This may be
-# set to zero if priority inheritance is disabled OR if you
-# are only using semaphores as mutexes (only one holder) OR
-# if no more than two threads participate using a counting
-# semaphore.
-# CONFIG_SEM_NNESTPRIO. If priority inheritance is enabled,
-# then this setting is the maximum number of higher priority
-# threads (minus 1) than can be waiting for another thread
-# to release a count on a semaphore. This value may be set
-# to zero if no more than one thread is expected to wait for
-# a semaphore.
-# CONFIG_FDCLONE_DISABLE. Disable cloning of all file descriptors
-# by task_create() when a new task is started. If set, all
-# files/drivers will appear to be closed in the new task.
-# CONFIG_FDCLONE_STDIO. Disable cloning of all but the first
-# three file descriptors (stdin, stdout, stderr) by task_create()
-# when a new task is started. If set, all files/drivers will
-# appear to be closed in the new task except for stdin, stdout,
-# and stderr.
-# CONFIG_SDCLONE_DISABLE. Disable cloning of all socket
-# desciptors by task_create() when a new task is started. If
-# set, all sockets will appear to be closed in the new task.
-# CONFIG_NXFLAT. Enable support for the NXFLAT binary format.
-# This format will support execution of NuttX binaries located
-# in a ROMFS filesystem (see examples/nxflat).
-# CONFIG_SCHED_WORKQUEUE. Create a dedicated "worker" thread to
-# handle delayed processing from interrupt handlers. This feature
-# is required for some drivers but, if there are not complaints,
-# can be safely disabled. The worker thread also performs
-# garbage collection -- completing any delayed memory deallocations
-# from interrupt handlers. If the worker thread is disabled,
-# then that clean will be performed by the IDLE thread instead
-# (which runs at the lowest of priority and may not be appropriate
-# if memory reclamation is of high priority). If CONFIG_SCHED_WORKQUEUE
-# is enabled, then the following options can also be used:
-# CONFIG_SCHED_WORKPRIORITY - The execution priority of the worker
-# thread. Default: 50
-# CONFIG_SCHED_WORKPERIOD - How often the worker thread checks for
-# work in units of microseconds. Default: 50*1000 (50 MS).
-# CONFIG_SCHED_WORKSTACKSIZE - The stack size allocated for the worker
-# thread. Default: CONFIG_IDLETHREAD_STACKSIZE.
-# CONFIG_SIG_SIGWORK - The signal number that will be used to wake-up
-# the worker thread. Default: 4
-#
-#CONFIG_APPS_DIR=
-CONFIG_DEBUG=n
-CONFIG_DEBUG_VERBOSE=n
-CONFIG_DEBUG_SYMBOLS=n
-CONFIG_DEBUG_USB=n
-CONFIG_MM_REGIONS=2
-CONFIG_ARCH_LOWPUTC=y
-CONFIG_RR_INTERVAL=200
-CONFIG_SCHED_INSTRUMENTATION=n
-CONFIG_TASK_NAME_SIZE=0
-CONFIG_START_YEAR=2010
-CONFIG_START_MONTH=12
-CONFIG_START_DAY=22
-CONFIG_GREGORIAN_TIME=n
-CONFIG_JULIAN_TIME=n
-CONFIG_DEV_CONSOLE=y
-CONFIG_DEV_LOWCONSOLE=n
-CONFIG_MUTEX_TYPES=n
-CONFIG_PRIORITY_INHERITANCE=n
-CONFIG_SEM_PREALLOCHOLDERS=0
-CONFIG_SEM_NNESTPRIO=0
-CONFIG_FDCLONE_DISABLE=n
-CONFIG_FDCLONE_STDIO=n
-CONFIG_SDCLONE_DISABLE=y
-CONFIG_NXFLAT=n
-CONFIG_SCHED_WORKQUEUE=y
-CONFIG_SCHED_WORKPRIORITY=50
-CONFIG_SCHED_WORKPERIOD=(50*1000)
-CONFIG_SCHED_WORKSTACKSIZE=1024
-CONFIG_SIG_SIGWORK=4
-
-#
-# The following can be used to disable categories of
-# APIs supported by the OS. If the compiler supports
-# weak functions, then it should not be necessary to
-# disable functions unless you want to restrict usage
-# of those APIs.
-#
-# There are certain dependency relationships in these
-# features.
-#
-# o mq_notify logic depends on signals to awaken tasks
-# waiting for queues to become full or empty.
-# o pthread_condtimedwait() depends on signals to wake
-# up waiting tasks.
-#
-CONFIG_DISABLE_CLOCK=n
-CONFIG_DISABLE_POSIX_TIMERS=n
-CONFIG_DISABLE_PTHREAD=n
-CONFIG_DISABLE_SIGNALS=n
-CONFIG_DISABLE_MQUEUE=n
-CONFIG_DISABLE_MOUNTPOINT=n
-CONFIG_DISABLE_ENVIRON=n
-CONFIG_DISABLE_POLL=n
-
-#
-# Misc libc settings
-#
-# CONFIG_NOPRINTF_FIELDWIDTH - sprintf-related logic is a
-# little smaller if we do not support fieldwidthes
-#
-CONFIG_NOPRINTF_FIELDWIDTH=n
-
-#
-# Allow for architecture optimized implementations
-#
-# The architecture can provide optimized versions of the
-# following to improve system performance
-#
-CONFIG_ARCH_MEMCPY=n
-CONFIG_ARCH_MEMCMP=n
-CONFIG_ARCH_MEMMOVE=n
-CONFIG_ARCH_MEMSET=n
-CONFIG_ARCH_STRCMP=n
-CONFIG_ARCH_STRCPY=n
-CONFIG_ARCH_STRNCPY=n
-CONFIG_ARCH_STRLEN=n
-CONFIG_ARCH_STRNLEN=n
-CONFIG_ARCH_BZERO=n
-
-#
-# Sizes of configurable things (0 disables)
-#
-# CONFIG_MAX_TASKS - The maximum number of simultaneously
-# active tasks. This value must be a power of two.
-# CONFIG_MAX_TASK_ARGS - This controls the maximum number of
-# of parameters that a task may receive (i.e., maxmum value
-# of 'argc')
-# CONFIG_NPTHREAD_KEYS - The number of items of thread-
-# specific data that can be retained
-# CONFIG_NFILE_DESCRIPTORS - The maximum number of file
-# descriptors (one for each open)
-# CONFIG_NFILE_STREAMS - The maximum number of streams that
-# can be fopen'ed
-# CONFIG_NAME_MAX - The maximum size of a file name.
-# CONFIG_STDIO_BUFFER_SIZE - Size of the buffer to allocate
-# on fopen. (Only if CONFIG_NFILE_STREAMS > 0)
-# CONFIG_NUNGET_CHARS - Number of characters that can be
-# buffered by ungetc() (Only if CONFIG_NFILE_STREAMS > 0)
-# CONFIG_PREALLOC_MQ_MSGS - The number of pre-allocated message
-# structures. The system manages a pool of preallocated
-# message structures to minimize dynamic allocations
-# CONFIG_MQ_MAXMSGSIZE - Message structures are allocated with
-# a fixed payload size given by this settin (does not include
-# other message structure overhead.
-# CONFIG_MAX_WDOGPARMS - Maximum number of parameters that
-# can be passed to a watchdog handler
-# CONFIG_PREALLOC_WDOGS - The number of pre-allocated watchdog
-# structures. The system manages a pool of preallocated
-# watchdog structures to minimize dynamic allocations
-# CONFIG_PREALLOC_TIMERS - The number of pre-allocated POSIX
-# timer structures. The system manages a pool of preallocated
-# timer structures to minimize dynamic allocations. Set to
-# zero for all dynamic allocations.
-#
-CONFIG_MAX_TASKS=16
-CONFIG_MAX_TASK_ARGS=4
-CONFIG_NPTHREAD_KEYS=4
-CONFIG_NFILE_DESCRIPTORS=8
-CONFIG_NFILE_STREAMS=8
-CONFIG_NAME_MAX=32
-CONFIG_STDIO_BUFFER_SIZE=256
-CONFIG_NUNGET_CHARS=2
-CONFIG_PREALLOC_MQ_MSGS=4
-CONFIG_MQ_MAXMSGSIZE=32
-CONFIG_MAX_WDOGPARMS=2
-CONFIG_PREALLOC_WDOGS=4
-CONFIG_PREALLOC_TIMERS=4
-
-#
-# Filesystem configuration
-#
-# CONFIG_FS_FAT - Enable FAT filesystem support
-# CONFIG_FAT_SECTORSIZE - Max supported sector size
-# CONFIG_FS_ROMFS - Enable ROMFS filesystem support
-#
-CONFIG_FS_FAT=n
-CONFIG_FS_ROMFS=n
-
-#
-# SPI-based MMC/SD driver
-#
-# CONFIG_MMCSD_NSLOTS
-# Number of MMC/SD slots supported by the driver
-# CONFIG_MMCSD_READONLY
-# Provide read-only access (default is read/write)
-# CONFIG_MMCSD_SPICLOCK - Maximum SPI clock to drive MMC/SD card.
-# Default is 20MHz.
-#
-CONFIG_MMCSD_NSLOTS=1
-CONFIG_MMCSD_READONLY=n
-CONFIG_MMCSD_SPICLOCK=12500000
-
-#
-# Block driver buffering
-#
-# CONFIG_FS_READAHEAD
-# Enable read-ahead buffering
-# CONFIG_FS_WRITEBUFFER
-# Enable write buffering
-#
-CONFIG_FS_READAHEAD=n
-CONFIG_FS_WRITEBUFFER=n
-
-#
-# SDIO-based MMC/SD driver
-#
-# CONFIG_SDIO_DMA
-# SDIO driver supports DMA
-# CONFIG_MMCSD_MMCSUPPORT
-# Enable support for MMC cards
-# CONFIG_MMCSD_HAVECARDDETECT
-# SDIO driver card detection is 100% accurate
-#
-CONFIG_SDIO_DMA=n
-CONFIG_MMCSD_MMCSUPPORT=n
-CONFIG_MMCSD_HAVECARDDETECT=n
-
-#
-# TCP/IP and UDP support via uIP
-# CONFIG_NET - Enable or disable all network features
-# CONFIG_NET_IPv6 - Build in support for IPv6
-# CONFIG_NSOCKET_DESCRIPTORS - Maximum number of socket descriptors per task/thread.
-# CONFIG_NET_SOCKOPTS - Enable or disable support for socket options
-# CONFIG_NET_BUFSIZE - uIP buffer size
-# CONFIG_NET_TCP - TCP support on or off
-# CONFIG_NET_TCP_CONNS - Maximum number of TCP connections (all tasks)
-# CONFIG_NET_TCP_READAHEAD_BUFSIZE - Size of TCP read-ahead buffers
-# CONFIG_NET_NTCP_READAHEAD_BUFFERS - Number of TCP read-ahead buffers (may be zero)
-# CONFIG_NET_TCPBACKLOG - Incoming connections pend in a backlog until
-# accept() is called. The size of the backlog is selected when listen() is called.
-# CONFIG_NET_MAX_LISTENPORTS - Maximum number of listening TCP ports (all tasks)
-# CONFIG_NET_UDP - UDP support on or off
-# CONFIG_NET_UDP_CHECKSUMS - UDP checksums on or off
-# CONFIG_NET_UDP_CONNS - The maximum amount of concurrent UDP connections
-# CONFIG_NET_ICMP - ICMP ping response support on or off
-# CONFIG_NET_ICMP_PING - ICMP ping request support on or off
-# CONFIG_NET_PINGADDRCONF - Use "ping" packet for setting IP address
-# CONFIG_NET_STATISTICS - uIP statistics on or off
-# CONFIG_NET_RECEIVE_WINDOW - The size of the advertised receiver's window
-# CONFIG_NET_ARPTAB_SIZE - The size of the ARP table
-# CONFIG_NET_BROADCAST - Broadcast support
-# CONFIG_NET_FWCACHE_SIZE - number of packets to remember when looking for duplicates
-#
-CONFIG_NET=n
-CONFIG_NET_IPv6=n
-CONFIG_NSOCKET_DESCRIPTORS=0
-CONFIG_NET_SOCKOPTS=y
-CONFIG_NET_BUFSIZE=420
-CONFIG_NET_TCP=n
-CONFIG_NET_TCP_CONNS=40
-CONFIG_NET_MAX_LISTENPORTS=40
-CONFIG_NET_UDP=n
-CONFIG_NET_UDP_CHECKSUMS=y
-#CONFIG_NET_UDP_CONNS=10
-CONFIG_NET_ICMP=n
-CONFIG_NET_ICMP_PING=n
-#CONFIG_NET_PINGADDRCONF=0
-CONFIG_NET_STATISTICS=y
-#CONFIG_NET_RECEIVE_WINDOW=
-#CONFIG_NET_ARPTAB_SIZE=8
-CONFIG_NET_BROADCAST=n
-#CONFIG_NET_FWCACHE_SIZE=2
-
-#
-# UIP Network Utilities
-# CONFIG_NET_DHCP_LIGHT - Reduces size of DHCP
-# CONFIG_NET_RESOLV_ENTRIES - Number of resolver entries
-#
-CONFIG_NET_DHCP_LIGHT=n
-CONFIG_NET_RESOLV_ENTRIES=4
-
-#
-# USB Device Configuration
-#
-# CONFIG_USBDEV
-# Enables USB device support
-# CONFIG_USBDEV_ISOCHRONOUS
-# Build in extra support for isochronous endpoints
-# CONFIG_USBDEV_DUALSPEED
-# Hardware handles high and full speed operation (USB 2.0)
-# CONFIG_USBDEV_SELFPOWERED
-# Will cause USB features to indicate that the device is
-# self-powered
-# CONFIG_USBDEV_MAXPOWER
-# Maximum power consumption in mA
-# CONFIG_USBDEV_TRACE
-# Enables USB tracing for debug
-# CONFIG_USBDEV_TRACE_NRECORDS
-# Number of trace entries to remember
-#
-CONFIG_USBDEV=n
-CONFIG_USBDEV_ISOCHRONOUS=n
-CONFIG_USBDEV_DUALSPEED=n
-CONFIG_USBDEV_SELFPOWERED=y
-CONFIG_USBDEV_REMOTEWAKEUP=n
-CONFIG_USBDEV_MAXPOWER=100
-CONFIG_USBDEV_TRACE=n
-CONFIG_USBDEV_TRACE_NRECORDS=128
-
-#
-# USB Host Configuration
-#
-# CONFIG_USBHOST
-# Enables USB host support
-# CONFIG_USBHOST_NPREALLOC
-# Number of pre-allocated class instances
-# CONFIG_USBHOST_BULK_DISABLE
-# On some architectures, selecting this setting will reduce driver size
-# by disabling bulk endpoint support
-# CONFIG_USBHOST_INT_DISABLE
-# On some architectures, selecting this setting will reduce driver size
-# by disabling interrupt endpoint support
-# CONFIG_USBHOST_ISOC_DISABLE
-# On some architectures, selecting this setting will reduce driver size
-# by disabling isochronous endpoint support
-#
-CONFIG_USBHOST=y
-CONFIG_USBHOST_NPREALLOC=0
-CONFIG_USBHOST_BULK_DISABLE=y
-CONFIG_USBHOST_INT_DISABLE=n
-CONFIG_USBHOST_ISOC_DISABLE=y
-
-#
-# LPC17xx USB Device Configuration
-#
-# CONFIG_LPC17_USBDEV_FRAME_INTERRUPT
-# Handle USB Start-Of-Frame events.
-# Enable reading SOF from interrupt handler vs. simply reading on demand.
-# Probably a bad idea... Unless there is some issue with sampling the SOF
-# from hardware asynchronously.
-# CONFIG_LPC17_USBDEV_EPFAST_INTERRUPT
-# Enable high priority interrupts. I have no idea why you might want to
-# do that
-# CONFIG_LPC17_USBDEV_NDMADESCRIPTORS
-# Number of DMA descriptors to allocate in SRAM.
-# CONFIG_LPC17_USBDEV_DMA
-# Enable lpc17xx-specific DMA support
-#
-CONFIG_LPC17_USBDEV_FRAME_INTERRUPT=n
-CONFIG_LPC17_USBDEV_EPFAST_INTERRUPT=n
-CONFIG_LPC17_USBDEV_DMA=n
-CONFIG_LPC17_USBDEV_NDMADESCRIPTORS=0
-CONFIG_LPC17_USBDEV_DMAINTMASK=0
-
-#
-# LPC17xx USB Host Configuration
-#
-# OHCI RAM layout:
-# CONFIG_USBHOST_OHCIRAM_SIZE
-# Total size of OHCI RAM (in AHB SRAM Bank 1)
-# CONFIG_USBHOST_NEDS
-# Number of endpoint descriptors
-# CONFIG_USBHOST_NTDS
-# Number of transfer descriptors
-# CONFIG_USBHOST_TDBUFFERS
-# Number of transfer descriptor buffers
-# CONFIG_USBHOST_TDBUFSIZE
-# Size of one transfer descriptor buffer
-# CONFIG_USBHOST_IOBUFSIZE
-# Size of one end-user I/O buffer
-#
-CONFIG_USBHOST_OHCIRAM_SIZE=1536
-CONFIG_USBHOST_NEDS=2
-CONFIG_USBHOST_NTDS=2
-CONFIG_USBHOST_TDBUFFERS=3
-CONFIG_USBHOST_TDBUFSIZE=128
-CONFIG_USBHOST_IOBUFSIZE=512
-
-#
-# USB Serial Device Configuration
-#
-# CONFIG_USBSER
-# Enable compilation of the USB serial driver
-# CONFIG_USBSER_EPINTIN
-# The logical 7-bit address of a hardware endpoint that supports
-# interrupt IN operation
-# CONFIG_USBSER_EPBULKOUT
-# The logical 7-bit address of a hardware endpoint that supports
-# bulk OUT operation
-# CONFIG_USBSER_EPBULKIN
-# The logical 7-bit address of a hardware endpoint that supports
-# bulk IN operation
-# # CONFIG_USBSER_NWRREQS and CONFIG_USBSER_NRDREQS
-# The number of write/read requests that can be in flight
-# CONFIG_USBSER_VENDORID and CONFIG_USBSER_VENDORSTR
-# The vendor ID code/string
-# CONFIG_USBSER_PRODUCTID and CONFIG_USBSER_PRODUCTSTR
-# The product ID code/string
-# CONFIG_USBSER_RXBUFSIZE and CONFIG_USBSER_TXBUFSIZE
-# Size of the serial receive/transmit buffers
-#
-CONFIG_USBSER=n
-CONFIG_USBSER_EPINTIN=1
-CONFIG_USBSER_EPBULKOUT=2
-CONFIG_USBSER_EPBULKIN=5
-CONFIG_USBSER_NWRREQS=4
-CONFIG_USBSER_NRDREQS=4
-CONFIG_USBSER_VENDORID=0x067b
-CONFIG_USBSER_PRODUCTID=0x2303
-CONFIG_USBSER_VENDORSTR="Nuttx"
-CONFIG_USBSER_PRODUCTSTR="USBdev Serial"
-CONFIG_USBSER_RXBUFSIZE=512
-CONFIG_USBSER_TXBUFSIZE=512
-
-#
-# USB Storage Device Configuration
-#
-# CONFIG_USBSTRG
-# Enable compilation of the USB storage driver
-# CONFIG_USBSTRG_EP0MAXPACKET
-# Max packet size for endpoint 0
-# CONFIG_USBSTRG_EPBULKOUT and CONFIG_USBSTRG_EPBULKIN
-# The logical 7-bit address of a hardware endpoints that support
-# bulk OUT and IN operations
-# CONFIG_USBSTRG_NWRREQS and CONFIG_USBSTRG_NRDREQS
-# The number of write/read requests that can be in flight
-# CONFIG_USBSTRG_BULKINREQLEN and CONFIG_USBSTRG_BULKOUTREQLEN
-# The size of the buffer in each write/read request. This
-# value needs to be at least as large as the endpoint
-# maxpacket and ideally as large as a block device sector.
-# CONFIG_USBSTRG_VENDORID and CONFIG_USBSTRG_VENDORSTR
-# The vendor ID code/string
-# CONFIG_USBSTRG_PRODUCTID and CONFIG_USBSTRG_PRODUCTSTR
-# The product ID code/string
-# CONFIG_USBSTRG_REMOVABLE
-# Select if the media is removable
-#
-CONFIG_USBSTRG=n
-CONFIG_USBSTRG_EP0MAXPACKET=64
-CONFIG_USBSTRG_EPBULKOUT=2
-CONFIG_USBSTRG_EPBULKIN=5
-CONFIG_USBSTRG_NRDREQS=2
-CONFIG_USBSTRG_NWRREQS=2
-CONFIG_USBSTRG_BULKINREQLEN=256
-CONFIG_USBSTRG_BULKOUTREQLEN=256
-CONFIG_USBSTRG_VENDORID=0x584e
-CONFIG_USBSTRG_VENDORSTR="NuttX"
-CONFIG_USBSTRG_PRODUCTID=0x5342
-CONFIG_USBSTRG_PRODUCTSTR="USBdev Storage"
-CONFIG_USBSTRG_VERSIONNO=0x0399
-CONFIG_USBSTRG_REMOVABLE=y
-
-#
-# Settings for examples/uip
-#
-CONFIG_EXAMPLE_UIP_IPADDR=(10<<24|0<<16|0<<8|2)
-CONFIG_EXAMPLE_UIP_DRIPADDR=(10<<24|0<<16|0<<8|1)
-CONFIG_EXAMPLE_UIP_NETMASK=(255<<24|255<<16|255<<8|0)
-CONFIG_EXAMPLE_UIP_DHCPC=n
-
-#
-# Settings for examples/nettest
-# CONFIG_EXAMPLE_NETTEST_SERVER - The target board can act
-# as either the client side or server side of the test
-# CONFIG_EXAMPLE_NETTEST_PERFORMANCE - If set, then the
-# client side simply receives messages forever, allowing
-# measurement of throughput
-# CONFIG_EXAMPLE_NETTEST_NOMAC - Set if the hardware has
-# no MAC address; one will be assigned
-# CONFIG_EXAMPLE_NETTEST_IPADDR - Target board IP address
-# CONFIG_EXAMPLE_NETTEST_DRIPADDR - Default router address
-# CONFIG_EXAMPLE_NETTEST_NETMASK - Network mask
-# CONFIG_EXAMPLE_NETTEST_CLIENTIP - IP address of the
-# client side of the test (may be target or host)
-#
-CONFIG_EXAMPLE_NETTEST_SERVER=n
-CONFIG_EXAMPLE_NETTEST_PERFORMANCE=n
-CONFIG_EXAMPLE_NETTEST_NOMAC=n
-CONFIG_EXAMPLE_NETTEST_IPADDR=(10<<24|0<<16|0<<8|2)
-CONFIG_EXAMPLE_NETTEST_DRIPADDR=(10<<24|0<<16|0<<8|1)
-CONFIG_EXAMPLE_NETTEST_NETMASK=(255<<24|255<<16|255<<8|0)
-CONFIG_EXAMPLE_NETTEST_CLIENTIP=(10<<24|0<<16|0<<8|1)
-
-#
-# Settings for examples/ostest
-#
-CONFIG_EXAMPLES_OSTEST_LOOPS=1
-CONFIG_EXAMPLES_OSTEST_STACKSIZE=2048
-CONFIG_EXAMPLES_OSTEST_NBARRIER_THREADS=3
-
-#
-# Settings for apps/nshlib
-#
-# CONFIG_NSH_FILEIOSIZE - Size of a static I/O buffer
-# CONFIG_NSH_STRERROR - Use strerror(errno)
-# CONFIG_NSH_LINELEN - Maximum length of one command line
-# CONFIG_NSH_STACKSIZE - Stack size to use for new threads.
-# CONFIG_NSH_NESTDEPTH - Max number of nested if-then[-else]-fi
-# CONFIG_NSH_DISABLESCRIPT - Disable scripting support
-# CONFIG_NSH_DISABLEBG - Disable background commands
-# CONFIG_NSH_ROMFSETC - Use startup script in /etc
-# CONFIG_NSH_CONSOLE - Use serial console front end
-# CONFIG_NSH_TELNET - Use telnetd console front end
-# CONFIG_NSH_ARCHINIT - Platform provides architecture
-# specific initialization (nsh_archinitialize()).
-#
-# If CONFIG_NSH_TELNET is selected:
-# CONFIG_NSH_IOBUFFER_SIZE -- Telnetd I/O buffer size
-# CONFIG_NSH_DHCPC - Obtain address using DHCP
-# CONFIG_NSH_IPADDR - Provides static IP address
-# CONFIG_NSH_DRIPADDR - Provides static router IP address
-# CONFIG_NSH_NETMASK - Provides static network mask
-# CONFIG_NSH_NOMAC - Use a bogus MAC address
-#
-# If CONFIG_NSH_ROMFSETC is selected:
-# CONFIG_NSH_ROMFSMOUNTPT - ROMFS mountpoint
-# CONFIG_NSH_INITSCRIPT - Relative path to init script
-# CONFIG_NSH_ROMFSDEVNO - ROMFS RAM device minor
-# CONFIG_NSH_ROMFSSECTSIZE - ROMF sector size
-# CONFIG_NSH_FATDEVNO - FAT FS RAM device minor
-# CONFIG_NSH_FATSECTSIZE - FAT FS sector size
-# CONFIG_NSH_FATNSECTORS - FAT FS number of sectors
-# CONFIG_NSH_FATMOUNTPT - FAT FS mountpoint
-#
-CONFIG_NSH_FILEIOSIZE=512
-CONFIG_NSH_STRERROR=n
-CONFIG_NSH_LINELEN=64
-CONFIG_NSH_STACKSIZE=2048
-CONFIG_NSH_NESTDEPTH=3
-CONFIG_NSH_DISABLESCRIPT=n
-CONFIG_NSH_DISABLEBG=n
-CONFIG_NSH_ROMFSETC=n
-CONFIG_NSH_CONSOLE=y
-CONFIG_NSH_TELNET=n
-CONFIG_NSH_ARCHINIT=y
-CONFIG_NSH_IOBUFFER_SIZE=512
-CONFIG_NSH_DHCPC=n
-CONFIG_NSH_NOMAC=n
-CONFIG_NSH_IPADDR=(10<<24|0<<16|0<<8|2)
-CONFIG_NSH_DRIPADDR=(10<<24|0<<16|0<<8|1)
-CONFIG_NSH_NETMASK=(255<<24|255<<16|255<<8|0)
-CONFIG_NSH_ROMFSMOUNTPT="/etc"
-CONFIG_NSH_INITSCRIPT="init.d/rcS"
-CONFIG_NSH_ROMFSDEVNO=0
-CONFIG_NSH_ROMFSSECTSIZE=64
-CONFIG_NSH_FATDEVNO=1
-CONFIG_NSH_FATSECTSIZE=512
-CONFIG_NSH_FATNSECTORS=1024
-CONFIG_NSH_FATMOUNTPT=/tmp
-
-#
-# Architecture-specific NSH options
-#
-CONFIG_NSH_MMCSDSPIPORTNO=0
-CONFIG_NSH_MMCSDSLOTNO=0
-CONFIG_NSH_MMCSDMINOR=0
-
-#
-# Settings for examples/usbserial
-#
-# CONFIG_EXAMPLES_USBSERIAL_INONLY
-# Only verify IN (device-to-host) data transfers. Default: both
-# CONFIG_EXAMPLES_USBSERIAL_OUTONLY
-# Only verify OUT (host-to-device) data transfers. Default: both
-# CONFIG_EXAMPLES_USBSERIAL_ONLYSMALL
-# Send only small, single packet messages. Default: Send large and small.
-# CONFIG_EXAMPLES_USBSERIAL_ONLYBIG
-# Send only large, multi-packet messages. Default: Send large and small.
-#
-CONFIG_EXAMPLES_USBSERIAL_INONLY=n
-CONFIG_EXAMPLES_USBSERIAL_OUTONLY=n
-CONFIG_EXAMPLES_USBSERIAL_ONLYSMALL=n
-CONFIG_EXAMPLES_USBSERIAL_ONLYBIG=n
-
-CONFIG_EXAMPLES_USBSERIAL_TRACEINIT=n
-CONFIG_EXAMPLES_USBSERIAL_TRACECLASS=n
-CONFIG_EXAMPLES_USBSERIAL_TRACETRANSFERS=n
-CONFIG_EXAMPLES_USBSERIAL_TRACECONTROLLER=n
-CONFIG_EXAMPLES_USBSERIAL_TRACEINTERRUPTS=n
-
-#
-# Settings for internet_radio by Decio
-#
-CONFIG_INTERNETRADIO_ARCHINIT=n
-
-#
-# Stack and heap information
-#
-# CONFIG_BOOT_RUNFROMFLASH - Some configurations support XIP
-# operation from FLASH but must copy initialized .data sections to RAM.
-# (should also be =n for the LPC17xx which always runs from flash)
-# CONFIG_BOOT_COPYTORAM - Some configurations boot in FLASH
-# but copy themselves entirely into RAM for better performance.
-# CONFIG_CUSTOM_STACK - The up_ implementation will handle
-# all stack operations outside of the nuttx model.
-# CONFIG_STACK_POINTER - The initial stack pointer (arm7tdmi only)
-# CONFIG_IDLETHREAD_STACKSIZE - The size of the initial stack.
-# This is the thread that (1) performs the inital boot of the system up
-# to the point where user_start() is spawned, and (2) there after is the
-# IDLE thread that executes only when there is no other thread ready to
-# run.
-# CONFIG_USERMAIN_STACKSIZE - The size of the stack to allocate
-# for the main user thread that begins at the user_start() entry point.
-# CONFIG_PTHREAD_STACK_MIN - Minimum pthread stack size
-# CONFIG_PTHREAD_STACK_DEFAULT - Default pthread stack size
-# CONFIG_HEAP_BASE - The beginning of the heap
-# CONFIG_HEAP_SIZE - The size of the heap
-#
-CONFIG_BOOT_RUNFROMFLASH=n
-CONFIG_BOOT_COPYTORAM=n
-CONFIG_CUSTOM_STACK=n
-CONFIG_STACK_POINTER=
-CONFIG_IDLETHREAD_STACKSIZE=1024
-CONFIG_USERMAIN_STACKSIZE=2048
-CONFIG_PTHREAD_STACK_MIN=256
-CONFIG_PTHREAD_STACK_DEFAULT=2048
-CONFIG_HEAP_BASE=
-CONFIG_HEAP_SIZE=
diff --git a/nuttx/configs/detron/hidkbd/ld.script b/nuttx/configs/detron/hidkbd/ld.script
deleted file mode 100755
index 92963f09b..000000000
--- a/nuttx/configs/detron/hidkbd/ld.script
+++ /dev/null
@@ -1,110 +0,0 @@
-/****************************************************************************
- * configs/detron/hidkbd/ld.script
- *
- * Copyright (C) 2011 Gregory Nutt. All rights reserved.
- * Authors: Gregory Nutt <spudmonkey@racsa.co.cr>
- * Rafael Noronha <rafael@pdsolucoes.com.br>
- *
- * 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.
- *
- ****************************************************************************/
-
-/* The LPC1768 has 512Kb of FLASH beginning at address 0x0000:0000 and
- * 64Kb of total SRAM: 32Kb of SRAM in the CPU block beginning at address
- * 0x10000000 and 32Kb of AHB SRAM in two banks of 16Kb beginning at addresses
- * 0x20070000 and 0x20080000. Here we assume that .data and .bss will all fit
- * into the 32Kb CPU SRAM address range.
- */
-
-MEMORY
-{
- flash (rx) : ORIGIN = 0x00000000, LENGTH = 512K
- sram (rwx) : ORIGIN = 0x10000000, LENGTH = 32K
-}
-
-OUTPUT_ARCH(arm)
-ENTRY(_stext)
-SECTIONS
-{
- .text : {
- _stext = ABSOLUTE(.);
- *(.vectors)
- *(.text .text.*)
- *(.fixup)
- *(.gnu.warning)
- *(.rodata .rodata.*)
- *(.gnu.linkonce.t.*)
- *(.glue_7)
- *(.glue_7t)
- *(.got)
- *(.gcc_except_table)
- *(.gnu.linkonce.r.*)
- _etext = ABSOLUTE(.);
- } > flash
-
- _eronly = ABSOLUTE(.); /* See below */
-
- .data : {
- _sdata = ABSOLUTE(.);
- *(.data .data.*)
- *(.gnu.linkonce.d.*)
- CONSTRUCTORS
- _edata = ABSOLUTE(.);
- } > sram AT > flash
-
- .ARM.extab : {
- *(.ARM.extab*)
- } >sram
-
- .ARM.exidx : {
- __exidx_start = ABSOLUTE(.);
- *(.ARM.exidx*)
- __exidx_end = ABSOLUTE(.);
- } >sram
-
- .bss : { /* BSS */
- _sbss = ABSOLUTE(.);
- *(.bss .bss.*)
- *(.gnu.linkonce.b.*)
- *(COMMON)
- _ebss = ABSOLUTE(.);
- } > sram
- /* Stabs debugging sections. */
- .stab 0 : { *(.stab) }
- .stabstr 0 : { *(.stabstr) }
- .stab.excl 0 : { *(.stab.excl) }
- .stab.exclstr 0 : { *(.stab.exclstr) }
- .stab.index 0 : { *(.stab.index) }
- .stab.indexstr 0 : { *(.stab.indexstr) }
- .comment 0 : { *(.comment) }
- .debug_abbrev 0 : { *(.debug_abbrev) }
- .debug_info 0 : { *(.debug_info) }
- .debug_line 0 : { *(.debug_line) }
- .debug_pubnames 0 : { *(.debug_pubnames) }
- .debug_aranges 0 : { *(.debug_aranges) }
-}
diff --git a/nuttx/configs/detron/hidkbd/setenv.sh b/nuttx/configs/detron/hidkbd/setenv.sh
deleted file mode 100755
index 1464c414d..000000000
--- a/nuttx/configs/detron/hidkbd/setenv.sh
+++ /dev/null
@@ -1,47 +0,0 @@
-#!/bin/bash
-# configs/detron/hidkbd/setenv.sh
-#
-# Copyright (C) 2011 Gregory Nutt. All rights reserved.
-# Authors: Gregory Nutt <spudmonkey@racsa.co.cr>
-# Rafael Noronha <rafael@pdsolucoes.com.br>
-#
-# 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.
-#
-
-if [ "$(basename $0)" = "setenv.sh" ] ; then
- echo "You must source this script, not run it!" 1>&2
- exit 1
-fi
-
-if [ -z "${PATH_ORIG}" ]; then export PATH_ORIG="${PATH}"; fi
-
-WD=`pwd`
-export BUILDROOT_BIN="${WD}/../buildroot/build_arm_nofpu/staging_dir/bin"
-export PATH="${BUILDROOT_BIN}:/sbin:/usr/sbin:${PATH_ORIG}"
-
-echo "PATH : ${PATH}"
diff --git a/nuttx/configs/detron/include/board.h b/nuttx/configs/detron/include/board.h
deleted file mode 100755
index 0b8df9e5d..000000000
--- a/nuttx/configs/detron/include/board.h
+++ /dev/null
@@ -1,207 +0,0 @@
-/************************************************************************************
- * configs/detron/include/board.h
- * include/arch/board/board.h
- *
- * Copyright (C) 2011 Gregory Nutt. All rights reserved.
- * Authors:
- * Decio Renno <http://www.detroneletronica.com.br>
- * 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.
- *
- ************************************************************************************/
-
-#ifndef __ARCH_BOARD_BOARD_H
-#define __ARCH_BOARD_BOARD_H
-
-/************************************************************************************
- * Included Files
- ************************************************************************************/
-
-#include <nuttx/config.h>
-#include <arch/irq.h> //GPIO IRQ
-#include <arch/lpc17xx/irq.h>
-
-/************************************************************************************
- * Definitions
- ************************************************************************************/
-
-/* Clocking *************************************************************************/
-/* NOTE: The following definitions require lpc17_syscon.h. It is not included here
- * because the including C file may not have that file in its include path.
- */
-
-#define BOARD_XTAL_FREQUENCY (12000000) /* XTAL oscillator frequency */
-#define BOARD_OSCCLK_FREQUENCY BOARD_XTAL_FREQUENCY /* Main oscillator frequency */
-#define BOARD_RTCCLK_FREQUENCY (32000) /* RTC oscillator frequency */
-#define BOARD_INTRCOSC_FREQUENCY (4000000) /* Internal RC oscillator frequency */
-
-/* This is the clock setup we configure for:
- *
- * SYSCLK = BOARD_OSCCLK_FREQUENCY = 12MHz -> Select Main oscillator for source
- * PLL0CLK = (2 * 20 * SYSCLK) / 1 = 480MHz -> PLL0 multipler=20, pre-divider=1
- * CCLCK = 480MHz / 6 = 80MHz -> CCLK divider = 6
- */
-
-#define LPC17_CCLK 80000000 /* 80Mhz */
-
-/* Select the main oscillator as the frequency source. SYSCLK is then the frequency
- * of the main oscillator.
- */
-
-#undef CONFIG_LPC17_MAINOSC
-#define CONFIG_LPC17_MAINOSC 1
-#define BOARD_SCS_VALUE SYSCON_SCS_OSCEN
-
-/* Select the main oscillator and CCLK divider. The output of the divider is CCLK.
- * The input to the divider (PLLCLK) will be determined by the PLL output.
- */
-
-#define BOARD_CCLKCFG_DIVIDER 6
-#define BOARD_CCLKCFG_VALUE ((BOARD_CCLKCFG_DIVIDER-1) << SYSCON_CCLKCFG_SHIFT)
-
-/* PLL0. PLL0 is used to generate the CPU clock divider input (PLLCLK).
- *
- * Source clock: Main oscillator
- * PLL0 Multiplier value (M): 20
- * PLL0 Pre-divider value (N): 1
- *
- * PLL0CLK = (2 * 20 * SYSCLK) / 1 = 480MHz
- */
-
-#undef CONFIG_LPC17_PLL0
-#define CONFIG_LPC17_PLL0 1
-#define BOARD_CLKSRCSEL_VALUE SYSCON_CLKSRCSEL_MAIN
-
-#define BOARD_PLL0CFG_MSEL 20
-#define BOARD_PLL0CFG_NSEL 1
-#define BOARD_PLL0CFG_VALUE \
- (((BOARD_PLL0CFG_MSEL-1) << SYSCON_PLL0CFG_MSEL_SHIFT) | \
- ((BOARD_PLL0CFG_NSEL-1) << SYSCON_PLL0CFG_NSEL_SHIFT))
-
-/* PLL1 -- Not used. */
-
-#undef CONFIG_LPC17_PLL1
-#define BOARD_PLL1CFG_MSEL 36
-#define BOARD_PLL1CFG_NSEL 1
-#define BOARD_PLL1CFG_VALUE \
- (((BOARD_PLL1CFG_MSEL-1) << SYSCON_PLL1CFG_MSEL_SHIFT) | \
- ((BOARD_PLL1CFG_NSEL-1) << SYSCON_PLL1CFG_NSEL_SHIFT))
-
-/* USB divider. This divider is used when PLL1 is not enabled to get the
- * USB clock from PLL0:
- *
- * USBCLK = PLL0CLK / 10 = 48MHz
- */
-
-#define BOARD_USBCLKCFG_VALUE SYSCON_USBCLKCFG_DIV10
-
-/* FLASH Configuration */
-
-#undef CONFIG_LP17_FLASH
-#define CONFIG_LP17_FLASH 1
-#define BOARD_FLASHCFG_VALUE 0x0000303a
-
-
-/* Button definitions ***************************************************************/
-
-#define panel_pulse_up 1 /* Bit 0: painel_pulsada_up */
-#define panel_pulse_down 2 /* Bit 1: painel_pulsada_down */
-#define panel_center 4 /* Bit 2: painel_pulsada_centro */
-
-/************************************************************************************
- * Public Types
- ************************************************************************************/
-
-#ifndef __ASSEMBLY__
-
-/************************************************************************************
- * Public Data
- ************************************************************************************/
-
-#undef EXTERN
-#if defined(__cplusplus)
-#define EXTERN extern "C"
-extern "C" {
-#else
-#define EXTERN extern
-#endif
-
-/************************************************************************************
- * Public Function Prototypes
- ************************************************************************************/
-/************************************************************************************
- * Name: lpc17_boardinitialize
- *
- * Description:
- * All LPC17xx architectures must provide the following entry point. This entry point
- * is called early in the intitialization -- after all memory has been configured
- * and mapped but before any devices have been initialized.
- *
- ************************************************************************************/
-
-EXTERN void lpc17_boardinitialize(void);
-
-
-EXTERN void up_buttoninit(void);
-
-/************************************************************************************
- * Name: up_buttons
- *
- * Description:
- * After up_buttoninit() has been called, up_buttons() may be called to collect
- * the state of all buttons. up_buttons() returns an 8-bit bit set with each bit
- * associated with a button. See the BUTTON* definitions above for the meaning of
- * each bit in the returned value.
- *
- ************************************************************************************/
-
-EXTERN uint8_t up_buttons(void);
-
-/************************************************************************************
- * Name: up_up_irq_pin_panel_pulse_up/down/center
- *
- * Description:
- * These functions may be called to register an interrupt handler that will be
- * called when BUTTON UP/DOWN/CENTER is depressed. The previous interrupt handler value is
- * returned (so that it may restored, if so desired).
- *
- ************************************************************************************/
-
-
-EXTERN xcpt_t up_irq_pin_panel_pulse_up(xcpt_t irqhandler);
-EXTERN xcpt_t up_irq_pin_panel_pulse_down(xcpt_t irqhandler);
-EXTERN xcpt_t up_irq_pin_panel_center(xcpt_t irqhandler);
-
-#undef EXTERN
-#if defined(__cplusplus)
-}
-#endif
-
-#endif /* __ASSEMBLY__ */
-#endif /* __ARCH_BOARD_BOARD_H */
diff --git a/nuttx/configs/detron/nsh/Make.defs b/nuttx/configs/detron/nsh/Make.defs
deleted file mode 100755
index 9e25b4dc4..000000000
--- a/nuttx/configs/detron/nsh/Make.defs
+++ /dev/null
@@ -1,162 +0,0 @@
-############################################################################
-# configs/detron/nsh/Make.defs
-#
-# Copyright (C) 2011 Gregory Nutt. All rights reserved.
-# Author: 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 ${TOPDIR}/.config
-
-# Setup for the selected toolchain
-
-ifeq ($(CONFIG_LPC17_CODESOURCERYW),y)
- # CodeSourcery under Windows
- CROSSDEV = arm-none-eabi-
- WINTOOL = y
- ARCHCPUFLAGS = -mcpu=cortex-m3 -mthumb -mfloat-abi=soft
-endif
-ifeq ($(CONFIG_LPC17_CODESOURCERYL),y)
- # CodeSourcery under Linux
- CROSSDEV = arm-none-eabi-
- ARCHCPUFLAGS = -mcpu=cortex-m3 -mthumb -mfloat-abi=soft
- MAXOPTIMIZATION = -O2
-endif
-ifeq ($(CONFIG_LPC17_DEVKITARM),y)
- # devkitARM under Windows
- CROSSDEV = arm-eabi-
- WINTOOL = y
- ARCHCPUFLAGS = -mcpu=cortex-m3 -mthumb -mfloat-abi=soft
-endif
-ifeq ($(CONFIG_LPC17_BUILDROOT),y)
- # NuttX buildroot under Linux or Cygwin
- CROSSDEV = arm-elf-
- ARCHCPUFLAGS = -mtune=cortex-m3 -march=armv7-m -mfloat-abi=soft
- MAXOPTIMIZATION = -Os
-endif
-
-ifeq ($(WINTOOL),y)
- # Windows-native toolchains
- DIRLINK = $(TOPDIR)/tools/winlink.sh
- DIRUNLINK = $(TOPDIR)/tools/unlink.sh
- MKDEP = $(TOPDIR)/tools/mknulldeps.sh
- ARCHINCLUDES = -I. -isystem "${shell cygpath -w $(TOPDIR)/include}"
- ARCHXXINCLUDES = -I. -isystem "${shell cygpath -w $(TOPDIR)/include}" -isystem "${shell cygpath -w $(TOPDIR)/include/cxx}"
- ARCHSCRIPT = -T "${shell cygpath -w $(TOPDIR)/configs/$(CONFIG_ARCH_BOARD)/nsh/ld.script}"
- MAXOPTIMIZATION = -O2
-else
- # Linux/Cygwin-native toolchain
- MKDEP = $(TOPDIR)/tools/mkdeps.sh
- ARCHINCLUDES = -I. -isystem $(TOPDIR)/include
- ARCHXXINCLUDES = -I. -isystem $(TOPDIR)/include -isystem $(TOPDIR)/include/cxx
- ARCHSCRIPT = -T$(TOPDIR)/configs/$(CONFIG_ARCH_BOARD)/nsh/ld.script
-endif
-
-CC = $(CROSSDEV)gcc
-CXX = $(CROSSDEV)g++
-CPP = $(CROSSDEV)gcc -E
-LD = $(CROSSDEV)ld
-AR = $(CROSSDEV)ar rcs
-NM = $(CROSSDEV)nm
-OBJCOPY = $(CROSSDEV)objcopy
-OBJDUMP = $(CROSSDEV)objdump
-
-ARCHCCVERSION = ${shell $(CC) -v 2>&1 | sed -n '/^gcc version/p' | sed -e 's/^gcc version \([0-9\.]\)/\1/g' -e 's/[-\ ].*//g' -e '1q'}
-ARCHCCMAJOR = ${shell echo $(ARCHCCVERSION) | cut -d'.' -f1}
-
-ifeq ("${CONFIG_DEBUG_SYMBOLS}","y")
- ARCHOPTIMIZATION = -g
-else
- ARCHOPTIMIZATION = $(MAXOPTIMIZATION) -fno-strict-aliasing -fno-strength-reduce -fomit-frame-pointer
-endif
-
-ARCHCFLAGS = -fno-builtin
-ARCHCXXFLAGS = -fno-builtin -fno-exceptions
-ARCHWARNINGS = -Wall -Wstrict-prototypes -Wshadow
-ARCHWARNINGSXX = -Wall -Wshadow
-ARCHDEFINES =
-ARCHPICFLAGS = -fpic -msingle-pic-base -mpic-register=r10
-
-CFLAGS = $(ARCHCFLAGS) $(ARCHWARNINGS) $(ARCHOPTIMIZATION) $(ARCHCPUFLAGS) $(ARCHINCLUDES) $(ARCHDEFINES) $(EXTRADEFINES) -pipe
-CPICFLAGS = $(ARCHPICFLAGS) $(CFLAGS)
-CXXFLAGS = $(ARCHCXXFLAGS) $(ARCHWARNINGSXX) $(ARCHOPTIMIZATION) $(ARCHCPUFLAGS) $(ARCHXXINCLUDES) $(ARCHDEFINES) $(EXTRADEFINES) -pipe
-CXXPICFLAGS = $(ARCHPICFLAGS) $(CXXFLAGS)
-CPPFLAGS = $(ARCHINCLUDES) $(ARCHDEFINES) $(EXTRADEFINES)
-AFLAGS = $(CFLAGS) -D__ASSEMBLY__
-
-NXFLATLDFLAGS1 = -r -d -warn-common
-NXFLATLDFLAGS2 = $(NXFLATLDFLAGS1) -T$(TOPDIR)/binfmt/libnxflat/gnu-nxflat.ld -no-check-sections
-LDNXFLATFLAGS = -e main -s 2048
-
-OBJEXT = .o
-LIBEXT = .a
-EXEEXT =
-
-ifneq ($(CROSSDEV),arm-elf-)
- LDFLAGS += -nostartfiles -nodefaultlibs
-endif
-ifeq ($(CONFIG_DEBUG_SYMBOLS),y)
- LDFLAGS += -g
-endif
-
-define PREPROCESS
- @echo "CPP: $1->$2"
- @$(CPP) $(CPPFLAGS) $1 -o $2
-endef
-
-define COMPILE
- @echo "CC: $1"
- @$(CC) -c $(CFLAGS) $1 -o $2
-endef
-
-define COMPILEXX
- @echo "CXX: $1"
- @$(CXX) -c $(CXXFLAGS) $1 -o $2
-endef
-
-define ASSEMBLE
- @echo "AS: $1"
- @$(CC) -c $(AFLAGS) $1 -o $2
-endef
-
-define ARCHIVE
- echo "AR: $2"; \
- $(AR) $1 $2 || { echo "$(AR) $1 $2 FAILED!" ; exit 1 ; }
-endef
-
-define CLEAN
- @rm -f *.o *.a
-endef
-
-HOSTCC = gcc
-HOSTINCLUDES = -I.
-HOSTCFLAGS = -Wall -Wstrict-prototypes -Wshadow -g -pipe
-HOSTLDFLAGS =
-
diff --git a/nuttx/configs/detron/nsh/appconfig b/nuttx/configs/detron/nsh/appconfig
deleted file mode 100644
index 37b8a87fa..000000000
--- a/nuttx/configs/detron/nsh/appconfig
+++ /dev/null
@@ -1,54 +0,0 @@
-############################################################################
-# configs/detron/nsh/appconfig
-#
-# Copyright (C) 2011 Gregory Nutt. All rights reserved.
-# Author: 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.
-#
-############################################################################
-
-# Path to example in apps/examples containing the user_start entry point
-
-CONFIGURED_APPS += examples/nsh
-
-# NSH library
-
-CONFIGURED_APPS += nshlib
-
-# Networking support
-
-ifeq ($(CONFIG_NET),y)
-CONFIGURED_APPS += netutils/uiplib
-CONFIGURED_APPS += netutils/dhcpc
-CONFIGURED_APPS += netutils/resolv
-CONFIGURED_APPS += netutils/tftpc
-CONFIGURED_APPS += netutils/webclient
-endif
-
-
diff --git a/nuttx/configs/detron/nsh/defconfig b/nuttx/configs/detron/nsh/defconfig
deleted file mode 100755
index dc0952198..000000000
--- a/nuttx/configs/detron/nsh/defconfig
+++ /dev/null
@@ -1,907 +0,0 @@
-############################################################################
-# configs/detron/nsh/defconfig
-#
-# Copyright (C) 2011 Gregory Nutt. All rights reserved.
-# Authors:
-# Decio Renno <http://www.detroneletronica.com.br>
-# 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.
-#
-############################################################################
-#
-# architecture selection
-#
-# CONFIG_ARCH - identifies the arch subdirectory and, hence, the
-# processor architecture.
-# CONFIG_ARCH_family - for use in C code. This identifies the
-# particular chip family that the architecture is implemented
-# in.
-# CONFIG_ARCH_architecture - for use in C code. This identifies the
-# specific architecture within the chip familyl.
-# CONFIG_ARCH_CHIP - Identifies the arch/*/chip subdirectory
-# CONFIG_ARCH_CHIP_name - For use in C code
-# CONFIG_ARCH_BOARD - identifies the configs subdirectory and, hence,
-# the board that supports the particular chip or SoC.
-# CONFIG_ARCH_BOARD_name - for use in C code
-# CONFIG_ENDIAN_BIG - define if big endian (default is little endian)
-# CONFIG_BOARD_LOOPSPERMSEC - for delay loops
-# CONFIG_DRAM_SIZE - Describes the installed DRAM.
-# CONFIG_DRAM_START - The start address of DRAM (physical)
-# CONFIG_DRAM_END - Last address+1 of installed RAM
-# CONFIG_ARCH_IRQPRIO - The LPC17xx supports interrupt prioritization
-# CONFIG_ARCH_INTERRUPTSTACK - This architecture supports an interrupt
-# stack. If defined, this symbol is the size of the interrupt
-# stack in bytes. If not defined, the user task stacks will be
-# used during interrupt handling.
-# CONFIG_ARCH_STACKDUMP - Do stack dumps after assertions
-# CONFIG_ARCH_BOOTLOADER - Set if you are using a bootloader.
-# CONFIG_ARCH_LEDS - Use LEDs to show state. Unique to board architecture.
-# CONFIG_ARCH_BUTTONS - Enable support for buttons. Unique to board architecture.
-# CONFIG_ARCH_CALIBRATION - Enables some build in instrumentation that
-# cause a 100 second delay during boot-up. This 100 second delay
-# serves no purpose other than it allows you to calibrate
-# CONFIG_BOARD_LOOPSPERMSEC. You simply use a stop watch to measure
-# the 100 second delay then adjust CONFIG_BOARD_LOOPSPERMSEC until
-# the delay actually is 100 seconds.
-# CONFIG_ARCH_DMA - Support DMA initialization
-#
-CONFIG_ARCH=arm
-CONFIG_ARCH_ARM=y
-CONFIG_ARCH_CORTEXM3=y
-CONFIG_ARCH_CHIP=lpc17xx
-CONFIG_ARCH_CHIP_LPC1768=y
-CONFIG_ARCH_BOARD=detron
-CONFIG_ARCH_BOARD_DETRON=y
-CONFIG_BOARD_LOOPSPERMSEC=7982
-CONFIG_DRAM_SIZE=(32*1024)
-CONFIG_DRAM_START=0x10000000
-CONFIG_DRAM_END=(CONFIG_DRAM_START+CONFIG_DRAM_SIZE)
-CONFIG_ARCH_IRQPRIO=y
-CONFIG_ARCH_INTERRUPTSTACK=n
-CONFIG_ARCH_STACKDUMP=y
-CONFIG_ARCH_BOOTLOADER=n
-CONFIG_ARCH_LEDS=n
-CONFIG_ARCH_BUTTONS=n
-CONFIG_ARCH_CALIBRATION=n
-CONFIG_ARCH_DMA=n
-
-#
-# Identify toolchain and linker options
-#
-CONFIG_LPC17_CODESOURCERYW=n
-CONFIG_LPC17_CODESOURCERYL=n
-CONFIG_LPC17_DEVKITARM=n
-CONFIG_LPC17_BUILDROOT=y
-
-#
-# Individual subsystems can be enabled:
-#
-# Individual subsystems can be enabled:
-# (MAINOSC, PLL0, PLL1 and FLASH are controlled in board.h)
-#
-CONFIG_LPC17_ETHERNET=n
-CONFIG_LPC17_USBHOST=y
-CONFIG_LPC17_USBOTG=n
-CONFIG_LPC17_USBDEV=n
-CONFIG_LPC17_UART0=y
-CONFIG_LPC17_UART1=n
-CONFIG_LPC17_UART2=n
-CONFIG_LPC17_UART3=n
-CONFIG_LPC17_CAN1=n
-CONFIG_LPC17_CAN2=n
-CONFIG_LPC17_SPI=n
-CONFIG_LPC17_SSP0=n
-CONFIG_LPC17_SSP1=n
-CONFIG_LPC17_I2C0=n
-CONFIG_LPC17_I2C1=n
-CONFIG_LPC17_I2S=n
-CONFIG_LPC17_TMR0=n
-CONFIG_LPC17_TMR1=n
-CONFIG_LPC17_TMR2=n
-CONFIG_LPC17_TMR3=n
-CONFIG_LPC17_RIT=n
-CONFIG_LPC17_PWM=n
-CONFIG_LPC17_MCPWM=n
-CONFIG_LPC17_QEI=n
-CONFIG_LPC17_RTC=n
-CONFIG_LPC17_WDT=n
-CONFIG_LPC17_ADC=n
-CONFIG_LPC17_DAC=n
-CONFIG_LPC17_GPDMA=n
-
-#
-# LPC17xx specific serial device driver settings
-#
-# CONFIG_UARTn_SERIAL_CONSOLE - selects the UARTn for the
-# console and ttys0 (default is the UART1).
-# CONFIG_UARTn_RXBUFSIZE - Characters are buffered as received.
-# This specific the size of the receive buffer
-# CONFIG_UARTn_TXBUFSIZE - Characters are buffered before
-# being sent. This specific the size of the transmit buffer
-# CONFIG_UARTn_BAUD - The configure BAUD of the UART. Must be
-# CONFIG_UARTn_BITS - The number of bits. Must be either 7 or 8.
-# CONFIG_UARTn_PARTIY - 0=no parity, 1=odd parity, 2=even parity
-# CONFIG_UARTn_2STOP - Two stop bits
-#
-CONFIG_UART0_SERIAL_CONSOLE=y
-CONFIG_UART1_SERIAL_CONSOLE=n
-CONFIG_UART2_SERIAL_CONSOLE=n
-CONFIG_UART3_SERIAL_CONSOLE=n
-
-CONFIG_UART0_TXBUFSIZE=256
-CONFIG_UART1_TXBUFSIZE=256
-CONFIG_UART2_TXBUFSIZE=256
-CONFIG_UART3_TXBUFSIZE=256
-
-CONFIG_UART0_RXBUFSIZE=256
-CONFIG_UART1_RXBUFSIZE=256
-CONFIG_UART2_RXBUFSIZE=256
-CONFIG_UART3_RXBUFSIZE=256
-
-CONFIG_UART0_BAUD=115200
-CONFIG_UART2_BAUD=115200
-CONFIG_UART3_BAUD=115200
-CONFIG_UART1_BAUD=115200
-
-CONFIG_UART0_BITS=8
-CONFIG_UART1_BITS=8
-CONFIG_UART2_BITS=8
-CONFIG_UART3_BITS=8
-
-CONFIG_UART0_PARITY=0
-CONFIG_UART1_PARITY=0
-CONFIG_UART2_PARITY=0
-CONFIG_UART3_PARITY=0
-
-CONFIG_UART0_2STOP=0
-CONFIG_UART1_2STOP=0
-CONFIG_UART2_2STOP=0
-CONFIG_UART3_2STOP=0
-
-#
-# LPC17xx specific PHY/Ethernet device driver settings
-#
-# CONFIG_PHY_KS8721 - Selects Micrel KS8721 PHY
-# CONFIG_PHY_AUTONEG - Enable auto-negotion
-# CONFIG_PHY_SPEED100 - Select 100Mbit vs. 10Mbit speed.
-# CONFIG_PHY_FDUPLEX - Select full (vs. half) duplex
-# CONFIG_NET_EMACRAM_SIZE - Size of EMAC RAM. Default: 16Kb
-# CONFIG_NET_NTXDESC - Configured number of Tx descriptors. Default: 18
-# CONFIG_NET_NRXDESC - Configured number of Rx descriptors. Default: 18
-# CONFIG_NET_PRIORITY - Ethernet interrupt priority. The is default is
-# the higest priority.
-# CONFIG_NET_WOL - Enable Wake-up on Lan (not fully implemented).
-# CONFIG_NET_DUMPPACKET - Dump all received and transmitted packets.
-# Also needs CONFIG_DEBUG.
-# CONFIG_NET_REGDEBUG - Enabled low level register debug. Also needs
-# CONFIG_DEBUG.
-# CONFIG_NET_HASH - Enable receipt of near-perfect match frames.
-# CONFIG_NET_MULTICAST - Enable receipt of multicast (and unicast) frames.
-# Automatically set if CONFIG_NET_IGMP is selected.
-#
-CONFIG_PHY_KS8721=y
-CONFIG_PHY_AUTONEG=y
-CONFIG_PHY_SPEED100=n
-CONFIG_PHY_FDUPLEX=y
-CONFIG_NET_REGDEBUG=n
-
-#
-# General build options
-#
-# CONFIG_RRLOAD_BINARY - make the rrload binary format used with
-# BSPs from www.ridgerun.com using the tools/mkimage.sh script
-# CONFIG_INTELHEX_BINARY - make the Intel HEX binary format
-# used with many different loaders using the GNU objcopy program
-# Should not be selected if you are not using the GNU toolchain.
-# CONFIG_MOTOROLA_SREC - make the Motorola S-Record binary format
-# used with many different loaders using the GNU objcopy program
-# Should not be selected if you are not using the GNU toolchain.
-# CONFIG_RAW_BINARY - make a raw binary format file used with many
-# different loaders using the GNU objcopy program. This option
-# should not be selected if you are not using the GNU toolchain.
-# CONFIG_HAVE_LIBM - toolchain supports libm.a
-#
-CONFIG_RRLOAD_BINARY=n
-CONFIG_INTELHEX_BINARY=y
-CONFIG_MOTOROLA_SREC=n
-CONFIG_RAW_BINARY=n
-CONFIG_HAVE_LIBM=n
-
-#
-# General OS setup
-#
-# CONFIG_APPS_DIR - Identifies the relative path to the directory
-# that builds the application to link with NuttX. Default: ../apps
-# CONFIG_DEBUG - enables built-in debug options
-# CONFIG_DEBUG_VERBOSE - enables verbose debug output
-# CONFIG_DEBUG_SYMBOLS - build without optimization and with
-# debug symbols (needed for use with a debugger).
-# CONFIG_DEBUG_NET - enable network debug output
-# CONFIG_DEBUG_USB - enable usb debug output
-# CONFIG_MM_REGIONS - If the architecture includes multiple
-# regions of memory to allocate from, this specifies the
-# number of memory regions that the memory manager must
-# handle and enables the API mm_addregion(start, end);
-# CONFIG_ARCH_LOWPUTC - architecture supports low-level, boot
-# time console output
-# CONFIG_MSEC_PER_TICK - The default system timer is 100Hz
-# or MSEC_PER_TICK=10. This setting may be defined to
-# inform NuttX that the processor hardware is providing
-# system timer interrupts at some interrupt interval other
-# than 10 msec.
-# CONFIG_RR_INTERVAL - The round robin timeslice will be set
-# this number of milliseconds; Round robin scheduling can
-# be disabled by setting this value to zero.
-# CONFIG_SCHED_INSTRUMENTATION - enables instrumentation in
-# scheduler to monitor system performance
-# CONFIG_TASK_NAME_SIZE - Spcifies that maximum size of a
-# task name to save in the TCB. Useful if scheduler
-# instrumentation is selected. Set to zero to disable.
-# CONFIG_START_YEAR, CONFIG_START_MONTH, CONFIG_START_DAY -
-# Used to initialize the internal time logic.
-# CONFIG_GREGORIAN_TIME - Enables Gregorian time conversions.
-# You would only need this if you are concerned about accurate
-# time conversions in the past or in the distant future.
-# CONFIG_JULIAN_TIME - Enables Julian time conversions. You
-# would only need this if you are concerned about accurate
-# time conversion in the distand past. You must also define
-# CONFIG_GREGORIAN_TIME in order to use Julian time.
-# CONFIG_DEV_CONSOLE - Set if architecture-specific logic
-# provides /dev/console. Enables stdout, stderr, stdin.
-# CONFIG_DEV_LOWCONSOLE - Use the simple, low-level serial console
-# driver (minimul support)
-# CONFIG_MUTEX_TYPES: Set to enable support for recursive and
-# errorcheck mutexes. Enables pthread_mutexattr_settype().
-# CONFIG_PRIORITY_INHERITANCE : Set to enable support for priority
-# inheritance on mutexes and semaphores.
-# CONFIG_SEM_PREALLOCHOLDERS: This setting is only used if priority
-# inheritance is enabled. It defines the maximum number of
-# different threads (minus one) that can take counts on a
-# semaphore with priority inheritance support. This may be
-# set to zero if priority inheritance is disabled OR if you
-# are only using semaphores as mutexes (only one holder) OR
-# if no more than two threads participate using a counting
-# semaphore.
-# CONFIG_SEM_NNESTPRIO. If priority inheritance is enabled,
-# then this setting is the maximum number of higher priority
-# threads (minus 1) than can be waiting for another thread
-# to release a count on a semaphore. This value may be set
-# to zero if no more than one thread is expected to wait for
-# a semaphore.
-# CONFIG_FDCLONE_DISABLE. Disable cloning of all file descriptors
-# by task_create() when a new task is started. If set, all
-# files/drivers will appear to be closed in the new task.
-# CONFIG_FDCLONE_STDIO. Disable cloning of all but the first
-# three file descriptors (stdin, stdout, stderr) by task_create()
-# when a new task is started. If set, all files/drivers will
-# appear to be closed in the new task except for stdin, stdout,
-# and stderr.
-# CONFIG_SDCLONE_DISABLE. Disable cloning of all socket
-# desciptors by task_create() when a new task is started. If
-# set, all sockets will appear to be closed in the new task.
-# CONFIG_NXFLAT. Enable support for the NXFLAT binary format.
-# This format will support execution of NuttX binaries located
-# in a ROMFS filesystem (see examples/nxflat).
-# CONFIG_SCHED_WORKQUEUE. Create a dedicated "worker" thread to
-# handle delayed processing from interrupt handlers. This feature
-# is required for some drivers but, if there are not complaints,
-# can be safely disabled. The worker thread also performs
-# garbage collection -- completing any delayed memory deallocations
-# from interrupt handlers. If the worker thread is disabled,
-# then that clean will be performed by the IDLE thread instead
-# (which runs at the lowest of priority and may not be appropriate
-# if memory reclamation is of high priority). If CONFIG_SCHED_WORKQUEUE
-# is enabled, then the following options can also be used:
-# CONFIG_SCHED_WORKPRIORITY - The execution priority of the worker
-# thread. Default: 50
-# CONFIG_SCHED_WORKPERIOD - How often the worker thread checks for
-# work in units of microseconds. Default: 50*1000 (50 MS).
-# CONFIG_SCHED_WORKSTACKSIZE - The stack size allocated for the worker
-# thread. Default: CONFIG_IDLETHREAD_STACKSIZE.
-# CONFIG_SIG_SIGWORK - The signal number that will be used to wake-up
-# the worker thread. Default: 4
-#
-#CONFIG_APPS_DIR=
-CONFIG_DEBUG=n
-CONFIG_DEBUG_VERBOSE=n
-CONFIG_DEBUG_SYMBOLS=n
-CONFIG_DEBUG_NET=n
-CONFIG_DEBUG_USB=n
-CONFIG_MM_REGIONS=2
-CONFIG_ARCH_LOWPUTC=y
-CONFIG_RR_INTERVAL=200
-CONFIG_SCHED_INSTRUMENTATION=n
-CONFIG_TASK_NAME_SIZE=0
-CONFIG_START_YEAR=2011
-CONFIG_START_MONTH=3
-CONFIG_START_DAY=8
-CONFIG_GREGORIAN_TIME=n
-CONFIG_JULIAN_TIME=n
-CONFIG_DEV_CONSOLE=y
-CONFIG_DEV_LOWCONSOLE=n
-CONFIG_MUTEX_TYPES=n
-CONFIG_PRIORITY_INHERITANCE=n
-CONFIG_SEM_PREALLOCHOLDERS=0
-CONFIG_SEM_NNESTPRIO=0
-CONFIG_FDCLONE_DISABLE=n
-CONFIG_FDCLONE_STDIO=n
-CONFIG_SDCLONE_DISABLE=y
-CONFIG_NXFLAT=n
-CONFIG_SCHED_WORKQUEUE=y
-CONFIG_SCHED_WORKPRIORITY=50
-CONFIG_SCHED_WORKPERIOD=(50*1000)
-CONFIG_SCHED_WORKSTACKSIZE=1024
-CONFIG_SIG_SIGWORK=4
-
-#
-# The following can be used to disable categories of
-# APIs supported by the OS. If the compiler supports
-# weak functions, then it should not be necessary to
-# disable functions unless you want to restrict usage
-# of those APIs.
-#
-# There are certain dependency relationships in these
-# features.
-#
-# o mq_notify logic depends on signals to awaken tasks
-# waiting for queues to become full or empty.
-# o pthread_condtimedwait() depends on signals to wake
-# up waiting tasks.
-#
-CONFIG_DISABLE_CLOCK=n
-CONFIG_DISABLE_POSIX_TIMERS=n
-CONFIG_DISABLE_PTHREAD=n
-CONFIG_DISABLE_SIGNALS=n
-CONFIG_DISABLE_MQUEUE=n
-CONFIG_DISABLE_MOUNTPOINT=n
-CONFIG_DISABLE_ENVIRON=n
-CONFIG_DISABLE_POLL=y
-
-#
-# Misc libc settings
-#
-# CONFIG_NOPRINTF_FIELDWIDTH - sprintf-related logic is a
-# little smaller if we do not support fieldwidthes
-#
-CONFIG_NOPRINTF_FIELDWIDTH=n
-
-#
-# Allow for architecture optimized implementations
-#
-# The architecture can provide optimized versions of the
-# following to improve system performance
-#
-CONFIG_ARCH_MEMCPY=n
-CONFIG_ARCH_MEMCMP=n
-CONFIG_ARCH_MEMMOVE=n
-CONFIG_ARCH_MEMSET=n
-CONFIG_ARCH_STRCMP=n
-CONFIG_ARCH_STRCPY=n
-CONFIG_ARCH_STRNCPY=n
-CONFIG_ARCH_STRLEN=n
-CONFIG_ARCH_STRNLEN=n
-CONFIG_ARCH_BZERO=n
-
-#
-# Sizes of configurable things (0 disables)
-#
-# CONFIG_MAX_TASKS - The maximum number of simultaneously
-# active tasks. This value must be a power of two.
-# CONFIG_MAX_TASK_ARGS - This controls the maximum number of
-# of parameters that a task may receive (i.e., maxmum value
-# of 'argc')
-# CONFIG_NPTHREAD_KEYS - The number of items of thread-
-# specific data that can be retained
-# CONFIG_NFILE_DESCRIPTORS - The maximum number of file
-# descriptors (one for each open)
-# CONFIG_NFILE_STREAMS - The maximum number of streams that
-# can be fopen'ed
-# CONFIG_NAME_MAX - The maximum size of a file name.
-# CONFIG_STDIO_BUFFER_SIZE - Size of the buffer to allocate
-# on fopen. (Only if CONFIG_NFILE_STREAMS > 0)
-# CONFIG_NUNGET_CHARS - Number of characters that can be
-# buffered by ungetc() (Only if CONFIG_NFILE_STREAMS > 0)
-# CONFIG_PREALLOC_MQ_MSGS - The number of pre-allocated message
-# structures. The system manages a pool of preallocated
-# message structures to minimize dynamic allocations
-# CONFIG_MQ_MAXMSGSIZE - Message structures are allocated with
-# a fixed payload size given by this settin (does not include
-# other message structure overhead.
-# CONFIG_MAX_WDOGPARMS - Maximum number of parameters that
-# can be passed to a watchdog handler
-# CONFIG_PREALLOC_WDOGS - The number of pre-allocated watchdog
-# structures. The system manages a pool of preallocated
-# watchdog structures to minimize dynamic allocations
-# CONFIG_PREALLOC_TIMERS - The number of pre-allocated POSIX
-# timer structures. The system manages a pool of preallocated
-# timer structures to minimize dynamic allocations. Set to
-# zero for all dynamic allocations.
-#
-CONFIG_MAX_TASKS=16
-CONFIG_MAX_TASK_ARGS=4
-CONFIG_NPTHREAD_KEYS=4
-CONFIG_NFILE_DESCRIPTORS=8
-CONFIG_NFILE_STREAMS=8
-CONFIG_NAME_MAX=32
-CONFIG_STDIO_BUFFER_SIZE=256
-CONFIG_NUNGET_CHARS=2
-CONFIG_PREALLOC_MQ_MSGS=4
-CONFIG_MQ_MAXMSGSIZE=32
-CONFIG_MAX_WDOGPARMS=2
-CONFIG_PREALLOC_WDOGS=4
-CONFIG_PREALLOC_TIMERS=4
-
-#
-# Filesystem configuration
-#
-# CONFIG_FS_FAT - Enable FAT filesystem support
-# CONFIG_FAT_SECTORSIZE - Max supported sector size
-# CONFIG_FS_ROMFS - Enable ROMFS filesystem support
-#
-CONFIG_FS_FAT=y
-CONFIG_FS_ROMFS=n
-
-#
-# SPI-based MMC/SD driver
-#
-# CONFIG_MMCSD_NSLOTS
-# Number of MMC/SD slots supported by the driver
-# CONFIG_MMCSD_READONLY
-# Provide read-only access (default is read/write)
-# CONFIG_MMCSD_SPICLOCK - Maximum SPI clock to drive MMC/SD card.
-# Default is 20MHz.
-#
-CONFIG_MMCSD_NSLOTS=1
-CONFIG_MMCSD_READONLY=n
-CONFIG_MMCSD_SPICLOCK=12500000
-
-#
-# Block driver buffering
-#
-# CONFIG_FS_READAHEAD
-# Enable read-ahead buffering
-# CONFIG_FS_WRITEBUFFER
-# Enable write buffering
-#
-CONFIG_FS_READAHEAD=n
-CONFIG_FS_WRITEBUFFER=n
-
-#
-# SDIO-based MMC/SD driver
-#
-# CONFIG_SDIO_DMA
-# SDIO driver supports DMA
-# CONFIG_MMCSD_MMCSUPPORT
-# Enable support for MMC cards
-# CONFIG_MMCSD_HAVECARDDETECT
-# SDIO driver card detection is 100% accurate
-#
-CONFIG_SDIO_DMA=n
-CONFIG_MMCSD_MMCSUPPORT=n
-CONFIG_MMCSD_HAVECARDDETECT=n
-
-#
-# TCP/IP and UDP support via uIP
-# CONFIG_NET - Enable or disable all network features
-# CONFIG_NET_IPv6 - Build in support for IPv6
-# CONFIG_NSOCKET_DESCRIPTORS - Maximum number of socket descriptors per task/thread.
-# CONFIG_NET_SOCKOPTS - Enable or disable support for socket options
-# CONFIG_NET_BUFSIZE - uIP buffer size
-# CONFIG_NET_TCP - TCP support on or off
-# CONFIG_NET_TCP_CONNS - Maximum number of TCP connections (all tasks)
-# CONFIG_NET_TCP_READAHEAD_BUFSIZE - Size of TCP read-ahead buffers
-# CONFIG_NET_NTCP_READAHEAD_BUFFERS - Number of TCP read-ahead buffers (may be zero)
-# CONFIG_NET_TCPBACKLOG - Incoming connections pend in a backlog until
-# accept() is called. The size of the backlog is selected when listen() is called.
-# CONFIG_NET_MAX_LISTENPORTS - Maximum number of listening TCP ports (all tasks)
-# CONFIG_NET_UDP - UDP support on or off
-# CONFIG_NET_UDP_CHECKSUMS - UDP checksums on or off
-# CONFIG_NET_UDP_CONNS - The maximum amount of concurrent UDP connections
-# CONFIG_NET_ICMP - ICMP ping response support on or off
-# CONFIG_NET_ICMP_PING - ICMP ping request support on or off
-# CONFIG_NET_PINGADDRCONF - Use "ping" packet for setting IP address
-# CONFIG_NET_STATISTICS - uIP statistics on or off
-# CONFIG_NET_RECEIVE_WINDOW - The size of the advertised receiver's window
-# CONFIG_NET_ARPTAB_SIZE - The size of the ARP table
-# CONFIG_NET_BROADCAST - Broadcast support
-# CONFIG_NET_FWCACHE_SIZE - number of packets to remember when looking for duplicates
-# CONFIG_NET_WLAN - Enable or disable WLAN network interface
-#
-CONFIG_NET=y
-CONFIG_NET_IPv6=n
-CONFIG_NSOCKET_DESCRIPTORS=2
-CONFIG_NET_SOCKOPTS=y
-CONFIG_NET_BUFSIZE=420
-CONFIG_NET_TCP=y
-CONFIG_NET_TCP_CONNS=40
-CONFIG_NET_MAX_LISTENPORTS=40
-CONFIG_NET_UDP=y
-CONFIG_NET_UDP_CHECKSUMS=y
-#CONFIG_NET_UDP_CONNS=10
-CONFIG_NET_ICMP=n
-CONFIG_NET_ICMP_PING=n
-#CONFIG_NET_PINGADDRCONF=0
-CONFIG_NET_STATISTICS=y
-#CONFIG_NET_RECEIVE_WINDOW=
-#CONFIG_NET_ARPTAB_SIZE=8
-CONFIG_NET_BROADCAST=n
-#CONFIG_NET_FWCACHE_SIZE=2
-CONFIG_NET_WLAN=y
-
-#
-# UIP Network Utilities
-# CONFIG_NET_DHCP_LIGHT - Reduces size of DHCP
-# CONFIG_NET_RESOLV_ENTRIES - Number of resolver entries
-#
-CONFIG_NET_DHCP_LIGHT=n
-CONFIG_NET_RESOLV_ENTRIES=4
-
-#
-# USB Device Configuration
-#
-# CONFIG_USBDEV
-# Enables USB device support
-# CONFIG_USBDEV_ISOCHRONOUS
-# Build in extra support for isochronous endpoints
-# CONFIG_USBDEV_DUALSPEED
-# Hardware handles high and full speed operation (USB 2.0)
-# CONFIG_USBDEV_SELFPOWERED
-# Will cause USB features to indicate that the device is
-# self-powered
-# CONFIG_USBDEV_MAXPOWER
-# Maximum power consumption in mA
-# CONFIG_USBDEV_TRACE
-# Enables USB tracing for debug
-# CONFIG_USBDEV_TRACE_NRECORDS
-# Number of trace entries to remember
-#
-CONFIG_USBDEV=n
-CONFIG_USBDEV_ISOCHRONOUS=n
-CONFIG_USBDEV_DUALSPEED=n
-CONFIG_USBDEV_SELFPOWERED=y
-CONFIG_USBDEV_REMOTEWAKEUP=n
-CONFIG_USBDEV_MAXPOWER=100
-CONFIG_USBDEV_TRACE=n
-CONFIG_USBDEV_TRACE_NRECORDS=128
-
-#
-# USB Host Configuration
-#
-# CONFIG_USBHOST
-# Enables USB host support
-# CONFIG_USBHOST_NPREALLOC
-# Number of pre-allocated class instances
-# CONFIG_USBHOST_BULK_DISABLE
-# On some architectures, selecting this setting will reduce driver size
-# by disabling bulk endpoint support
-# CONFIG_USBHOST_INT_DISABLE
-# On some architectures, selecting this setting will reduce driver size
-# by disabling interrupt endpoint support
-# CONFIG_USBHOST_ISOC_DISABLE
-# On some architectures, selecting this setting will reduce driver size
-# by disabling isochronous endpoint support
-#
-CONFIG_USBHOST=y
-CONFIG_USBHOST_NPREALLOC=0
-CONFIG_USBHOST_BULK_DISABLE=n
-CONFIG_USBHOST_INT_DISABLE=y
-CONFIG_USBHOST_ISOC_DISABLE=y
-
-#
-# LPC17xx USB Device Configuration
-#
-# CONFIG_LPC17_USBDEV_FRAME_INTERRUPT
-# Handle USB Start-Of-Frame events.
-# Enable reading SOF from interrupt handler vs. simply reading on demand.
-# Probably a bad idea... Unless there is some issue with sampling the SOF
-# from hardware asynchronously.
-# CONFIG_LPC17_USBDEV_EPFAST_INTERRUPT
-# Enable high priority interrupts. I have no idea why you might want to
-# do that
-# CONFIG_LPC17_USBDEV_NDMADESCRIPTORS
-# Number of DMA descriptors to allocate in SRAM.
-# CONFIG_LPC17_USBDEV_DMA
-# Enable lpc17xx-specific DMA support
-#
-CONFIG_LPC17_USBDEV_FRAME_INTERRUPT=n
-CONFIG_LPC17_USBDEV_EPFAST_INTERRUPT=n
-CONFIG_LPC17_USBDEV_DMA=n
-CONFIG_LPC17_USBDEV_NDMADESCRIPTORS=0
-CONFIG_LPC17_USBDEV_DMAINTMASK=0
-
-#
-# LPC17xx USB Host Configuration
-#
-# OHCI RAM layout:
-# CONFIG_USBHOST_OHCIRAM_SIZE
-# Total size of OHCI RAM (in AHB SRAM Bank 1)
-# CONFIG_USBHOST_NEDS
-# Number of endpoint descriptors
-# CONFIG_USBHOST_NTDS
-# Number of transfer descriptors
-# CONFIG_USBHOST_TDBUFFERS
-# Number of transfer descriptor buffers
-# CONFIG_USBHOST_TDBUFSIZE
-# Size of one transfer descriptor buffer
-# CONFIG_USBHOST_IOBUFSIZE
-# Size of one end-user I/O buffer
-#
-CONFIG_USBHOST_OHCIRAM_SIZE=2048
-CONFIG_USBHOST_NEDS=2
-CONFIG_USBHOST_NTDS=2
-CONFIG_USBHOST_TDBUFFERS=3
-CONFIG_USBHOST_TDBUFSIZE=128
-CONFIG_USBHOST_IOBUFSIZE=512
-
-#
-# USB Serial Device Configuration
-#
-# CONFIG_USBSER
-# Enable compilation of the USB serial driver
-# CONFIG_USBSER_EPINTIN
-# The logical 7-bit address of a hardware endpoint that supports
-# interrupt IN operation
-# CONFIG_USBSER_EPBULKOUT
-# The logical 7-bit address of a hardware endpoint that supports
-# bulk OUT operation
-# CONFIG_USBSER_EPBULKIN
-# The logical 7-bit address of a hardware endpoint that supports
-# bulk IN operation
-# # CONFIG_USBSER_NWRREQS and CONFIG_USBSER_NRDREQS
-# The number of write/read requests that can be in flight
-# CONFIG_USBSER_VENDORID and CONFIG_USBSER_VENDORSTR
-# The vendor ID code/string
-# CONFIG_USBSER_PRODUCTID and CONFIG_USBSER_PRODUCTSTR
-# The product ID code/string
-# CONFIG_USBSER_RXBUFSIZE and CONFIG_USBSER_TXBUFSIZE
-# Size of the serial receive/transmit buffers
-#
-CONFIG_USBSER=n
-CONFIG_USBSER_EPINTIN=1
-CONFIG_USBSER_EPBULKOUT=2
-CONFIG_USBSER_EPBULKIN=5
-CONFIG_USBSER_NWRREQS=4
-CONFIG_USBSER_NRDREQS=4
-CONFIG_USBSER_VENDORID=0x067b
-CONFIG_USBSER_PRODUCTID=0x2303
-CONFIG_USBSER_VENDORSTR="Nuttx"
-CONFIG_USBSER_PRODUCTSTR="USBdev Serial"
-CONFIG_USBSER_RXBUFSIZE=512
-CONFIG_USBSER_TXBUFSIZE=512
-
-#
-# USB Storage Device Configuration
-#
-# CONFIG_USBSTRG
-# Enable compilation of the USB storage driver
-# CONFIG_USBSTRG_EP0MAXPACKET
-# Max packet size for endpoint 0
-# CONFIG_USBSTRG_EPBULKOUT and CONFIG_USBSTRG_EPBULKIN
-# The logical 7-bit address of a hardware endpoints that support
-# bulk OUT and IN operations
-# CONFIG_USBSTRG_NWRREQS and CONFIG_USBSTRG_NRDREQS
-# The number of write/read requests that can be in flight
-# CONFIG_USBSTRG_BULKINREQLEN and CONFIG_USBSTRG_BULKOUTREQLEN
-# The size of the buffer in each write/read request. This
-# value needs to be at least as large as the endpoint
-# maxpacket and ideally as large as a block device sector.
-# CONFIG_USBSTRG_VENDORID and CONFIG_USBSTRG_VENDORSTR
-# The vendor ID code/string
-# CONFIG_USBSTRG_PRODUCTID and CONFIG_USBSTRG_PRODUCTSTR
-# The product ID code/string
-# CONFIG_USBSTRG_REMOVABLE
-# Select if the media is removable
-#
-CONFIG_USBSTRG=n
-CONFIG_USBSTRG_EP0MAXPACKET=64
-CONFIG_USBSTRG_EPBULKOUT=2
-CONFIG_USBSTRG_EPBULKIN=5
-CONFIG_USBSTRG_NRDREQS=2
-CONFIG_USBSTRG_NWRREQS=2
-CONFIG_USBSTRG_BULKINREQLEN=256
-CONFIG_USBSTRG_BULKOUTREQLEN=256
-CONFIG_USBSTRG_VENDORID=0x584e
-CONFIG_USBSTRG_VENDORSTR="NuttX"
-CONFIG_USBSTRG_PRODUCTID=0x5342
-CONFIG_USBSTRG_PRODUCTSTR="USBdev Storage"
-CONFIG_USBSTRG_VERSIONNO=0x0399
-CONFIG_USBSTRG_REMOVABLE=y
-
-#
-# Settings for examples/uip
-#
-CONFIG_EXAMPLE_UIP_IPADDR=(10<<24|0<<16|0<<8|2)
-CONFIG_EXAMPLE_UIP_DRIPADDR=(10<<24|0<<16|0<<8|1)
-CONFIG_EXAMPLE_UIP_NETMASK=(255<<24|255<<16|255<<8|0)
-CONFIG_EXAMPLE_UIP_DHCPC=n
-
-#
-# Settings for examples/nettest
-# CONFIG_EXAMPLE_NETTEST_SERVER - The target board can act
-# as either the client side or server side of the test
-# CONFIG_EXAMPLE_NETTEST_PERFORMANCE - If set, then the
-# client side simply receives messages forever, allowing
-# measurement of throughput
-# CONFIG_EXAMPLE_NETTEST_NOMAC - Set if the hardware has
-# no MAC address; one will be assigned
-# CONFIG_EXAMPLE_NETTEST_IPADDR - Target board IP address
-# CONFIG_EXAMPLE_NETTEST_DRIPADDR - Default router address
-# CONFIG_EXAMPLE_NETTEST_NETMASK - Network mask
-# CONFIG_EXAMPLE_NETTEST_CLIENTIP - IP address of the
-# client side of the test (may be target or host)
-#
-CONFIG_EXAMPLE_NETTEST_SERVER=n
-CONFIG_EXAMPLE_NETTEST_PERFORMANCE=n
-CONFIG_EXAMPLE_NETTEST_NOMAC=n
-CONFIG_EXAMPLE_NETTEST_IPADDR=(10<<24|0<<16|0<<8|2)
-CONFIG_EXAMPLE_NETTEST_DRIPADDR=(10<<24|0<<16|0<<8|1)
-CONFIG_EXAMPLE_NETTEST_NETMASK=(255<<24|255<<16|255<<8|0)
-CONFIG_EXAMPLE_NETTEST_CLIENTIP=(10<<24|0<<16|0<<8|1)
-
-#
-# Settings for examples/ostest
-#
-CONFIG_EXAMPLES_OSTEST_LOOPS=1
-CONFIG_EXAMPLES_OSTEST_STACKSIZE=2048
-CONFIG_EXAMPLES_OSTEST_NBARRIER_THREADS=3
-
-#
-# Settings for apps/nshlib
-#
-# CONFIG_NSH_FILEIOSIZE - Size of a static I/O buffer
-# CONFIG_NSH_STRERROR - Use strerror(errno)
-# CONFIG_NSH_LINELEN - Maximum length of one command line
-# CONFIG_NSH_STACKSIZE - Stack size to use for new threads.
-# CONFIG_NSH_NESTDEPTH - Max number of nested if-then[-else]-fi
-# CONFIG_NSH_DISABLESCRIPT - Disable scripting support
-# CONFIG_NSH_DISABLEBG - Disable background commands
-# CONFIG_NSH_ROMFSETC - Use startup script in /etc
-# CONFIG_NSH_CONSOLE - Use serial console front end
-# CONFIG_NSH_TELNET - Use telnetd console front end
-# CONFIG_NSH_ARCHINIT - Platform provides architecture
-# specific initialization (nsh_archinitialize()).
-#
-# If CONFIG_NSH_TELNET is selected:
-# CONFIG_NSH_IOBUFFER_SIZE -- Telnetd I/O buffer size
-# CONFIG_NSH_DHCPC - Obtain address using DHCP
-# CONFIG_NSH_IPADDR - Provides static IP address
-# CONFIG_NSH_DRIPADDR - Provides static router IP address
-# CONFIG_NSH_NETMASK - Provides static network mask
-# CONFIG_NSH_NOMAC - Use a bogus MAC address
-#
-# If CONFIG_NSH_ROMFSETC is selected:
-# CONFIG_NSH_ROMFSMOUNTPT - ROMFS mountpoint
-# CONFIG_NSH_INITSCRIPT - Relative path to init script
-# CONFIG_NSH_ROMFSDEVNO - ROMFS RAM device minor
-# CONFIG_NSH_ROMFSSECTSIZE - ROMF sector size
-# CONFIG_NSH_FATDEVNO - FAT FS RAM device minor
-# CONFIG_NSH_FATSECTSIZE - FAT FS sector size
-# CONFIG_NSH_FATNSECTORS - FAT FS number of sectors
-# CONFIG_NSH_FATMOUNTPT - FAT FS mountpoint
-#
-CONFIG_NSH_FILEIOSIZE=512
-CONFIG_NSH_STRERROR=n
-CONFIG_NSH_LINELEN=64
-CONFIG_NSH_STACKSIZE=2048
-CONFIG_NSH_NESTDEPTH=3
-CONFIG_NSH_DISABLESCRIPT=n
-CONFIG_NSH_DISABLEBG=n
-CONFIG_NSH_ROMFSETC=n
-CONFIG_NSH_CONSOLE=y
-CONFIG_NSH_TELNET=n
-CONFIG_NSH_ARCHINIT=y
-CONFIG_NSH_IOBUFFER_SIZE=512
-CONFIG_NSH_DHCPC=n
-CONFIG_NSH_NOMAC=n
-CONFIG_NSH_IPADDR=(10<<24|0<<16|0<<8|2)
-CONFIG_NSH_DRIPADDR=(10<<24|0<<16|0<<8|1)
-CONFIG_NSH_NETMASK=(255<<24|255<<16|255<<8|0)
-CONFIG_NSH_ROMFSMOUNTPT="/etc"
-CONFIG_NSH_INITSCRIPT="init.d/rcS"
-CONFIG_NSH_ROMFSDEVNO=0
-CONFIG_NSH_ROMFSSECTSIZE=64
-CONFIG_NSH_FATDEVNO=1
-CONFIG_NSH_FATSECTSIZE=512
-CONFIG_NSH_FATNSECTORS=1024
-CONFIG_NSH_FATMOUNTPT=/tmp
-
-#
-# Architecture-specific NSH options
-#
-CONFIG_NSH_MMCSDSPIPORTNO=0
-CONFIG_NSH_MMCSDSLOTNO=0
-CONFIG_NSH_MMCSDMINOR=0
-
-#
-# Settings for examples/usbserial
-#
-# CONFIG_EXAMPLES_USBSERIAL_INONLY
-# Only verify IN (device-to-host) data transfers. Default: both
-# CONFIG_EXAMPLES_USBSERIAL_OUTONLY
-# Only verify OUT (host-to-device) data transfers. Default: both
-# CONFIG_EXAMPLES_USBSERIAL_ONLYSMALL
-# Send only small, single packet messages. Default: Send large and small.
-# CONFIG_EXAMPLES_USBSERIAL_ONLYBIG
-# Send only large, multi-packet messages. Default: Send large and small.
-#
-CONFIG_EXAMPLES_USBSERIAL_INONLY=n
-CONFIG_EXAMPLES_USBSERIAL_OUTONLY=n
-CONFIG_EXAMPLES_USBSERIAL_ONLYSMALL=n
-CONFIG_EXAMPLES_USBSERIAL_ONLYBIG=n
-
-CONFIG_EXAMPLES_USBSERIAL_TRACEINIT=n
-CONFIG_EXAMPLES_USBSERIAL_TRACECLASS=n
-CONFIG_EXAMPLES_USBSERIAL_TRACETRANSFERS=n
-CONFIG_EXAMPLES_USBSERIAL_TRACECONTROLLER=n
-CONFIG_EXAMPLES_USBSERIAL_TRACEINTERRUPTS=n
-
-#
-# Settings for internet_radio by Decio
-#
-CONFIG_INTERNETRADIO_ARCHINIT=n
-
-#
-# Stack and heap information
-#
-# CONFIG_BOOT_RUNFROMFLASH - Some configurations support XIP
-# operation from FLASH but must copy initialized .data sections to RAM.
-# (should also be =n for the LPC17xx which always runs from flash)
-# CONFIG_BOOT_COPYTORAM - Some configurations boot in FLASH
-# but copy themselves entirely into RAM for better performance.
-# CONFIG_CUSTOM_STACK - The up_ implementation will handle
-# all stack operations outside of the nuttx model.
-# CONFIG_STACK_POINTER - The initial stack pointer (arm7tdmi only)
-# CONFIG_IDLETHREAD_STACKSIZE - The size of the initial stack.
-# This is the thread that (1) performs the inital boot of the system up
-# to the point where user_start() is spawned, and (2) there after is the
-# IDLE thread that executes only when there is no other thread ready to
-# run.
-# CONFIG_USERMAIN_STACKSIZE - The size of the stack to allocate
-# for the main user thread that begins at the user_start() entry point.
-# CONFIG_PTHREAD_STACK_MIN - Minimum pthread stack size
-# CONFIG_PTHREAD_STACK_DEFAULT - Default pthread stack size
-# CONFIG_HEAP_BASE - The beginning of the heap
-# CONFIG_HEAP_SIZE - The size of the heap
-#
-CONFIG_BOOT_RUNFROMFLASH=n
-CONFIG_BOOT_COPYTORAM=n
-CONFIG_CUSTOM_STACK=n
-CONFIG_STACK_POINTER=
-CONFIG_IDLETHREAD_STACKSIZE=1024
-CONFIG_USERMAIN_STACKSIZE=2048
-CONFIG_PTHREAD_STACK_MIN=256
-CONFIG_PTHREAD_STACK_DEFAULT=2048
-CONFIG_HEAP_BASE=
-CONFIG_HEAP_SIZE=
-
-#
-# USB WLAN device identification
-#
-CONFIG_USB_WLAN_VID=0x0bda
-CONFIG_USB_WLAN_PID=0x8189
diff --git a/nuttx/configs/detron/nsh/ld.script b/nuttx/configs/detron/nsh/ld.script
deleted file mode 100755
index 74add6930..000000000
--- a/nuttx/configs/detron/nsh/ld.script
+++ /dev/null
@@ -1,109 +0,0 @@
-/****************************************************************************
- * configs/detron/nsh/ld.script
- *
- * Copyright (C) 2011 Gregory Nutt. All rights reserved.
- * Author: 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.
- *
- ****************************************************************************/
-
-/* The LPC1768 has 512Kb of FLASH beginning at address 0x0000:0000 and
- * 64Kb of total SRAM: 32Kb of SRAM in the CPU block beginning at address
- * 0x10000000 and 32Kb of AHB SRAM in two banks of 16Kb beginning at addresses
- * 0x20070000 and 0x20080000. Here we assume that .data and .bss will all fit
- * into the 32Kb CPU SRAM address range.
- */
-
-MEMORY
-{
- flash (rx) : ORIGIN = 0x00000000, LENGTH = 512K
- sram (rwx) : ORIGIN = 0x10000000, LENGTH = 32K
-}
-
-OUTPUT_ARCH(arm)
-ENTRY(_stext)
-SECTIONS
-{
- .text : {
- _stext = ABSOLUTE(.);
- *(.vectors)
- *(.text .text.*)
- *(.fixup)
- *(.gnu.warning)
- *(.rodata .rodata.*)
- *(.gnu.linkonce.t.*)
- *(.glue_7)
- *(.glue_7t)
- *(.got)
- *(.gcc_except_table)
- *(.gnu.linkonce.r.*)
- _etext = ABSOLUTE(.);
- } > flash
-
- _eronly = ABSOLUTE(.); /* See below */
-
- .data : {
- _sdata = ABSOLUTE(.);
- *(.data .data.*)
- *(.gnu.linkonce.d.*)
- CONSTRUCTORS
- _edata = ABSOLUTE(.);
- } > sram AT > flash
-
- .ARM.extab : {
- *(.ARM.extab*)
- } >sram
-
- .ARM.exidx : {
- __exidx_start = ABSOLUTE(.);
- *(.ARM.exidx*)
- __exidx_end = ABSOLUTE(.);
- } >sram
-
- .bss : { /* BSS */
- _sbss = ABSOLUTE(.);
- *(.bss .bss.*)
- *(.gnu.linkonce.b.*)
- *(COMMON)
- _ebss = ABSOLUTE(.);
- } > sram
- /* Stabs debugging sections. */
- .stab 0 : { *(.stab) }
- .stabstr 0 : { *(.stabstr) }
- .stab.excl 0 : { *(.stab.excl) }
- .stab.exclstr 0 : { *(.stab.exclstr) }
- .stab.index 0 : { *(.stab.index) }
- .stab.indexstr 0 : { *(.stab.indexstr) }
- .comment 0 : { *(.comment) }
- .debug_abbrev 0 : { *(.debug_abbrev) }
- .debug_info 0 : { *(.debug_info) }
- .debug_line 0 : { *(.debug_line) }
- .debug_pubnames 0 : { *(.debug_pubnames) }
- .debug_aranges 0 : { *(.debug_aranges) }
-}
diff --git a/nuttx/configs/detron/nsh/setenv.sh b/nuttx/configs/detron/nsh/setenv.sh
deleted file mode 100755
index 5971509ba..000000000
--- a/nuttx/configs/detron/nsh/setenv.sh
+++ /dev/null
@@ -1,46 +0,0 @@
-#!/bin/bash
-# configs/detron/nsh/setenv.sh
-#
-# Copyright (C) 2011 Gregory Nutt. All rights reserved.
-# Author: 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.
-#
-
-if [ "$(basename $0)" = "setenv.sh" ] ; then
- echo "You must source this script, not run it!" 1>&2
- exit 1
-fi
-
-if [ -z "${PATH_ORIG}" ]; then export PATH_ORIG="${PATH}"; fi
-
-WD=`pwd`
-export BUILDROOT_BIN="${WD}/../buildroot/build_arm_nofpu/staging_dir/bin"
-export PATH="${BUILDROOT_BIN}:/sbin:/usr/sbin:${PATH_ORIG}"
-
-echo "PATH : ${PATH}"
diff --git a/nuttx/configs/detron/ostest/Make.defs b/nuttx/configs/detron/ostest/Make.defs
deleted file mode 100755
index f3426f0bc..000000000
--- a/nuttx/configs/detron/ostest/Make.defs
+++ /dev/null
@@ -1,162 +0,0 @@
-############################################################################
-# configs/detron/ostest/Make.defs
-#
-# Copyright (C) 2011 Gregory Nutt. All rights reserved.
-# Author: 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 ${TOPDIR}/.config
-
-# Setup for the selected toolchain
-
-ifeq ($(CONFIG_LPC17_CODESOURCERYW),y)
- # CodeSourcery under Windows
- CROSSDEV = arm-none-eabi-
- WINTOOL = y
- ARCHCPUFLAGS = -mcpu=cortex-m3 -mthumb -mfloat-abi=soft
-endif
-ifeq ($(CONFIG_LPC17_CODESOURCERYL),y)
- # CodeSourcery under Linux
- CROSSDEV = arm-none-eabi-
- ARCHCPUFLAGS = -mcpu=cortex-m3 -mthumb -mfloat-abi=soft
- MAXOPTIMIZATION = -O2
-endif
-ifeq ($(CONFIG_LPC17_DEVKITARM),y)
- # devkitARM under Windows
- CROSSDEV = arm-eabi-
- WINTOOL = y
- ARCHCPUFLAGS = -mcpu=cortex-m3 -mthumb -mfloat-abi=soft
-endif
-ifeq ($(CONFIG_LPC17_BUILDROOT),y)
- # NuttX buildroot under Linux or Cygwin
- CROSSDEV = arm-elf-
- ARCHCPUFLAGS = -mtune=cortex-m3 -march=armv7-m -mfloat-abi=soft
- MAXOPTIMIZATION = -Os
-endif
-
-ifeq ($(WINTOOL),y)
- # Windows-native toolchains
- DIRLINK = $(TOPDIR)/tools/winlink.sh
- DIRUNLINK = $(TOPDIR)/tools/unlink.sh
- MKDEP = $(TOPDIR)/tools/mknulldeps.sh
- ARCHINCLUDES = -I. -isystem "${shell cygpath -w $(TOPDIR)/include}"
- ARCHXXINCLUDES = -I. -isystem "${shell cygpath -w $(TOPDIR)/include}" -isystem "${shell cygpath -w $(TOPDIR)/include/cxx}"
- ARCHSCRIPT = -T "${shell cygpath -w $(TOPDIR)/configs/$(CONFIG_ARCH_BOARD)/ostest/ld.script}"
- MAXOPTIMIZATION = -O2
-else
- # Linux/Cygwin-native toolchain
- MKDEP = $(TOPDIR)/tools/mkdeps.sh
- ARCHINCLUDES = -I. -isystem $(TOPDIR)/include
- ARCHXXINCLUDES = -I. -isystem $(TOPDIR)/include -isystem $(TOPDIR)/include/cxx
- ARCHSCRIPT = -T$(TOPDIR)/configs/$(CONFIG_ARCH_BOARD)/ostest/ld.script
-endif
-
-CC = $(CROSSDEV)gcc
-CXX = $(CROSSDEV)g++
-CPP = $(CROSSDEV)gcc -E
-LD = $(CROSSDEV)ld
-AR = $(CROSSDEV)ar rcs
-NM = $(CROSSDEV)nm
-OBJCOPY = $(CROSSDEV)objcopy
-OBJDUMP = $(CROSSDEV)objdump
-
-ARCHCCVERSION = ${shell $(CC) -v 2>&1 | sed -n '/^gcc version/p' | sed -e 's/^gcc version \([0-9\.]\)/\1/g' -e 's/[-\ ].*//g' -e '1q'}
-ARCHCCMAJOR = ${shell echo $(ARCHCCVERSION) | cut -d'.' -f1}
-
-ifeq ("${CONFIG_DEBUG_SYMBOLS}","y")
- ARCHOPTIMIZATION = -g
-else
- ARCHOPTIMIZATION = $(MAXOPTIMIZATION) -fno-strict-aliasing -fno-strength-reduce -fomit-frame-pointer
-endif
-
-ARCHCFLAGS = -fno-builtin
-ARCHCXXFLAGS = -fno-builtin -fno-exceptions
-ARCHWARNINGS = -Wall -Wstrict-prototypes -Wshadow
-ARCHWARNINGSXX = -Wall -Wshadow
-ARCHDEFINES =
-ARCHPICFLAGS = -fpic -msingle-pic-base -mpic-register=r10
-
-CFLAGS = $(ARCHCFLAGS) $(ARCHWARNINGS) $(ARCHOPTIMIZATION) $(ARCHCPUFLAGS) $(ARCHINCLUDES) $(ARCHDEFINES) $(EXTRADEFINES) -pipe
-CPICFLAGS = $(ARCHPICFLAGS) $(CFLAGS)
-CXXFLAGS = $(ARCHCXXFLAGS) $(ARCHWARNINGSXX) $(ARCHOPTIMIZATION) $(ARCHCPUFLAGS) $(ARCHXXINCLUDES) $(ARCHDEFINES) $(EXTRADEFINES) -pipe
-CXXPICFLAGS = $(ARCHPICFLAGS) $(CXXFLAGS)
-CPPFLAGS = $(ARCHINCLUDES) $(ARCHDEFINES) $(EXTRADEFINES)
-AFLAGS = $(CFLAGS) -D__ASSEMBLY__
-
-NXFLATLDFLAGS1 = -r -d -warn-common
-NXFLATLDFLAGS2 = $(NXFLATLDFLAGS1) -T$(TOPDIR)/binfmt/libnxflat/gnu-nxflat.ld -no-check-sections
-LDNXFLATFLAGS = -e main -s 2048
-
-OBJEXT = .o
-LIBEXT = .a
-EXEEXT =
-
-ifneq ($(CROSSDEV),arm-elf-)
- LDFLAGS += -nostartfiles -nodefaultlibs
-endif
-ifeq ($(CONFIG_DEBUG_SYMBOLS),y)
- LDFLAGS += -g
-endif
-
-define PREPROCESS
- @echo "CPP: $1->$2"
- @$(CPP) $(CPPFLAGS) $1 -o $2
-endef
-
-define COMPILE
- @echo "CC: $1"
- @$(CC) -c $(CFLAGS) $1 -o $2
-endef
-
-define COMPILEXX
- @echo "CXX: $1"
- @$(CXX) -c $(CXXFLAGS) $1 -o $2
-endef
-
-define ASSEMBLE
- @echo "AS: $1"
- @$(CC) -c $(AFLAGS) $1 -o $2
-endef
-
-define ARCHIVE
- echo "AR: $2"; \
- $(AR) $1 $2 || { echo "$(AR) $1 $2 FAILED!" ; exit 1 ; }
-endef
-
-define CLEAN
- @rm -f *.o *.a
-endef
-
-HOSTCC = gcc
-HOSTINCLUDES = -I.
-HOSTCFLAGS = -Wall -Wstrict-prototypes -Wshadow -g -pipe
-HOSTLDFLAGS =
-
diff --git a/nuttx/configs/detron/ostest/appconfig b/nuttx/configs/detron/ostest/appconfig
deleted file mode 100644
index c3525c0ae..000000000
--- a/nuttx/configs/detron/ostest/appconfig
+++ /dev/null
@@ -1,39 +0,0 @@
-############################################################################
-# configs/detron/ostest/appconfig
-#
-# Copyright (C) 2011 Gregory Nutt. All rights reserved.
-# Author: 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.
-#
-############################################################################
-
-# Path to example in apps/examples containing the user_start entry point
-
-CONFIGURED_APPS += examples/ostest
-
diff --git a/nuttx/configs/detron/ostest/defconfig b/nuttx/configs/detron/ostest/defconfig
deleted file mode 100755
index 4b8ef06cf..000000000
--- a/nuttx/configs/detron/ostest/defconfig
+++ /dev/null
@@ -1,828 +0,0 @@
-############################################################################
-# configs/detron/ostest/defconfig
-#
-# Copyright (C) 2011 Gregory Nutt. All rights reserved.
-# Author: 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.
-#
-############################################################################
-#
-# architecture selection
-#
-# CONFIG_ARCH - identifies the arch subdirectory and, hence, the
-# processor architecture.
-# CONFIG_ARCH_family - for use in C code. This identifies the
-# particular chip family that the architecture is implemented
-# in.
-# CONFIG_ARCH_architecture - for use in C code. This identifies the
-# specific architecture within the chip familyl.
-# CONFIG_ARCH_CHIP - Identifies the arch/*/chip subdirectory
-# CONFIG_ARCH_CHIP_name - For use in C code
-# CONFIG_ARCH_BOARD - identifies the configs subdirectory and, hence,
-# the board that supports the particular chip or SoC.
-# CONFIG_ARCH_BOARD_name - for use in C code
-# CONFIG_ENDIAN_BIG - define if big endian (default is little endian)
-# CONFIG_BOARD_LOOPSPERMSEC - for delay loops
-# CONFIG_DRAM_SIZE - Describes the installed DRAM.
-# CONFIG_DRAM_START - The start address of DRAM (physical)
-# CONFIG_DRAM_END - Last address+1 of installed RAM
-# CONFIG_ARCH_IRQPRIO - The ST32F103Z supports interrupt prioritization
-# CONFIG_ARCH_INTERRUPTSTACK - This architecture supports an interrupt
-# stack. If defined, this symbol is the size of the interrupt
-# stack in bytes. If not defined, the user task stacks will be
-# used during interrupt handling.
-# CONFIG_ARCH_STACKDUMP - Do stack dumps after assertions
-# CONFIG_ARCH_BOOTLOADER - Set if you are using a bootloader.
-# CONFIG_ARCH_LEDS - Use LEDs to show state. Unique to board architecture.
-# CONFIG_ARCH_BUTTONS - Enable support for buttons. Unique to board architecture.
-# CONFIG_ARCH_CALIBRATION - Enables some build in instrumentation that
-# cause a 100 second delay during boot-up. This 100 second delay
-# serves no purpose other than it allows you to calibrate
-# CONFIG_BOARD_LOOPSPERMSEC. You simply use a stop watch to measure
-# the 100 second delay then adjust CONFIG_BOARD_LOOPSPERMSEC until
-# the delay actually is 100 seconds.
-# CONFIG_ARCH_DMA - Support DMA initialization
-#
-CONFIG_ARCH=arm
-CONFIG_ARCH_ARM=y
-CONFIG_ARCH_CORTEXM3=y
-CONFIG_ARCH_CHIP=lpc17xx
-CONFIG_ARCH_CHIP_LPC1768=y
-CONFIG_ARCH_BOARD=detron
-CONFIG_ARCH_BOARD_DETRON=y
-CONFIG_BOARD_LOOPSPERMSEC=7982
-CONFIG_DRAM_SIZE=(32*1024)
-CONFIG_DRAM_START=0x10000000
-CONFIG_DRAM_END=(CONFIG_DRAM_START+CONFIG_DRAM_SIZE)
-CONFIG_ARCH_IRQPRIO=y
-CONFIG_ARCH_INTERRUPTSTACK=n
-CONFIG_ARCH_STACKDUMP=y
-CONFIG_ARCH_BOOTLOADER=n
-CONFIG_ARCH_LEDS=n
-CONFIG_ARCH_BUTTONS=n
-CONFIG_ARCH_CALIBRATION=n
-CONFIG_ARCH_DMA=n
-
-#
-# Identify toolchain and linker options
-#
-CONFIG_LPC17_CODESOURCERYW=n
-CONFIG_LPC17_CODESOURCERYL=n
-CONFIG_LPC17_DEVKITARM=n
-CONFIG_LPC17_BUILDROOT=y
-
-#
-# Individual subsystems can be enabled:
-#
-# Individual subsystems can be enabled:
-# (MAINOSC, PLL0, PLL1 and FLASH are controlled in board.h)
-CONFIG_LPC17_ETHERNET=n
-CONFIG_LPC17_USBHOST=n
-CONFIG_LPC17_USBOTG=n
-CONFIG_LPC17_USBDEV=n
-CONFIG_LPC17_UART0=y
-CONFIG_LPC17_UART1=n
-CONFIG_LPC17_UART2=n
-CONFIG_LPC17_UART3=n
-CONFIG_LPC17_CAN1=n
-CONFIG_LPC17_CAN2=n
-CONFIG_LPC17_SPI=n
-CONFIG_LPC17_SSP0=n
-CONFIG_LPC17_SSP1=n
-CONFIG_LPC17_I2C0=n
-CONFIG_LPC17_I2C1=n
-CONFIG_LPC17_I2S=n
-CONFIG_LPC17_TMR0=n
-CONFIG_LPC17_TMR1=n
-CONFIG_LPC17_TMR2=n
-CONFIG_LPC17_TMR3=n
-CONFIG_LPC17_RIT=n
-CONFIG_LPC17_PWM=n
-CONFIG_LPC17_MCPWM=n
-CONFIG_LPC17_QEI=n
-CONFIG_LPC17_RTC=n
-CONFIG_LPC17_WDT=n
-CONFIG_LPC17_ADC=n
-CONFIG_LPC17_DAC=n
-CONFIG_LPC17_GPDMA=n
-
-#
-# LPC17xx specific serial device driver settings
-#
-# CONFIG_UARTn_SERIAL_CONSOLE - selects the UARTn for the
-# console and ttys0 (default is the UART1).
-# CONFIG_UARTn_RXBUFSIZE - Characters are buffered as received.
-# This specific the size of the receive buffer
-# CONFIG_UARTn_TXBUFSIZE - Characters are buffered before
-# being sent. This specific the size of the transmit buffer
-# CONFIG_UARTn_BAUD - The configure BAUD of the UART. Must be
-# CONFIG_UARTn_BITS - The number of bits. Must be either 7 or 8.
-# CONFIG_UARTn_PARTIY - 0=no parity, 1=odd parity, 2=even parity
-# CONFIG_UARTn_2STOP - Two stop bits
-#
-CONFIG_UART0_SERIAL_CONSOLE=y
-CONFIG_UART1_SERIAL_CONSOLE=n
-CONFIG_UART2_SERIAL_CONSOLE=n
-CONFIG_UART3_SERIAL_CONSOLE=n
-
-CONFIG_UART0_TXBUFSIZE=256
-CONFIG_UART1_TXBUFSIZE=256
-CONFIG_UART2_TXBUFSIZE=256
-CONFIG_UART3_TXBUFSIZE=256
-
-CONFIG_UART0_RXBUFSIZE=256
-CONFIG_UART1_RXBUFSIZE=256
-CONFIG_UART2_RXBUFSIZE=256
-CONFIG_UART3_RXBUFSIZE=256
-
-CONFIG_UART0_BAUD=115200
-CONFIG_UART2_BAUD=115200
-CONFIG_UART3_BAUD=115200
-CONFIG_UART1_BAUD=115200
-
-CONFIG_UART0_BITS=8
-CONFIG_UART1_BITS=8
-CONFIG_UART2_BITS=8
-CONFIG_UART3_BITS=8
-
-CONFIG_UART0_PARITY=0
-CONFIG_UART1_PARITY=0
-CONFIG_UART2_PARITY=0
-CONFIG_UART3_PARITY=0
-
-CONFIG_UART0_2STOP=0
-CONFIG_UART1_2STOP=0
-CONFIG_UART2_2STOP=0
-CONFIG_UART3_2STOP=0
-
-#
-# LPC17xx specific PHY/Ethernet device driver settings
-#
-# CONFIG_PHY_KS8721 - Selects Micrel KS8721 PHY
-# CONFIG_PHY_AUTONEG - Enable auto-negotion
-# CONFIG_PHY_SPEED100 - Select 100Mbit vs. 10Mbit speed.
-# CONFIG_PHY_FDUPLEX - Select full (vs. half) duplex
-# CONFIG_NET_EMACRAM_SIZE - Size of EMAC RAM. Default: 16Kb
-# CONFIG_NET_NTXDESC - Configured number of Tx descriptors. Default: 18
-# CONFIG_NET_NRXDESC - Configured number of Rx descriptors. Default: 18
-# CONFIG_NET_PRIORITY - Ethernet interrupt priority. The is default is
-# the higest priority.
-# CONFIG_NET_WOL - Enable Wake-up on Lan (not fully implemented).
-# CONFIG_NET_REGDEBUG - Enabled low level register debug. Also needs
-# CONFIG_DEBUG.
-# CONFIG_NET_HASH - Enable receipt of near-perfect match frames.
-# CONFIG_NET_MULTICAST - Enable receipt of multicast (and unicast) frames.
-# Automatically set if CONFIG_NET_IGMP is selected.
-#
-CONFIG_PHY_KS8721=y
-CONFIG_PHY_AUTONEG=y
-CONFIG_PHY_SPEED100=n
-CONFIG_PHY_FDUPLEX=y
-
-#
-# General build options
-#
-# CONFIG_RRLOAD_BINARY - make the rrload binary format used with
-# BSPs from www.ridgerun.com using the tools/mkimage.sh script
-# CONFIG_INTELHEX_BINARY - make the Intel HEX binary format
-# used with many different loaders using the GNU objcopy program
-# Should not be selected if you are not using the GNU toolchain.
-# CONFIG_MOTOROLA_SREC - make the Motorola S-Record binary format
-# used with many different loaders using the GNU objcopy program
-# Should not be selected if you are not using the GNU toolchain.
-# CONFIG_RAW_BINARY - make a raw binary format file used with many
-# different loaders using the GNU objcopy program. This option
-# should not be selected if you are not using the GNU toolchain.
-# CONFIG_HAVE_LIBM - toolchain supports libm.a
-#
-CONFIG_RRLOAD_BINARY=n
-CONFIG_INTELHEX_BINARY=y
-CONFIG_MOTOROLA_SREC=n
-CONFIG_RAW_BINARY=n
-CONFIG_HAVE_LIBM=n
-
-#
-# General OS setup
-#
-# CONFIG_APPS_DIR - Identifies the relative path to the directory
-# that builds the application to link with NuttX. Default: ../apps
-# CONFIG_DEBUG - enables built-in debug options
-# CONFIG_DEBUG_VERBOSE - enables verbose debug output
-# CONFIG_DEBUG_SYMBOLS - build without optimization and with
-# debug symbols (needed for use with a debugger).
-# CONFIG_MM_REGIONS - If the architecture includes multiple
-# regions of memory to allocate from, this specifies the
-# number of memory regions that the memory manager must
-# handle and enables the API mm_addregion(start, end);
-# CONFIG_ARCH_LOWPUTC - architecture supports low-level, boot
-# time console output
-# CONFIG_MSEC_PER_TICK - The default system timer is 100Hz
-# or MSEC_PER_TICK=10. This setting may be defined to
-# inform NuttX that the processor hardware is providing
-# system timer interrupts at some interrupt interval other
-# than 10 msec.
-# CONFIG_RR_INTERVAL - The round robin timeslice will be set
-# this number of milliseconds; Round robin scheduling can
-# be disabled by setting this value to zero.
-# CONFIG_SCHED_INSTRUMENTATION - enables instrumentation in
-# scheduler to monitor system performance
-# CONFIG_TASK_NAME_SIZE - Spcifies that maximum size of a
-# task name to save in the TCB. Useful if scheduler
-# instrumentation is selected. Set to zero to disable.
-# CONFIG_START_YEAR, CONFIG_START_MONTH, CONFIG_START_DAY -
-# Used to initialize the internal time logic.
-# CONFIG_GREGORIAN_TIME - Enables Gregorian time conversions.
-# You would only need this if you are concerned about accurate
-# time conversions in the past or in the distant future.
-# CONFIG_JULIAN_TIME - Enables Julian time conversions. You
-# would only need this if you are concerned about accurate
-# time conversion in the distand past. You must also define
-# CONFIG_GREGORIAN_TIME in order to use Julian time.
-# CONFIG_DEV_CONSOLE - Set if architecture-specific logic
-# provides /dev/console. Enables stdout, stderr, stdin.
-# CONFIG_DEV_LOWCONSOLE - Use the simple, low-level serial console
-# driver (minimul support)
-# CONFIG_MUTEX_TYPES: Set to enable support for recursive and
-# errorcheck mutexes. Enables pthread_mutexattr_settype().
-# CONFIG_PRIORITY_INHERITANCE : Set to enable support for priority
-# inheritance on mutexes and semaphores.
-# CONFIG_SEM_PREALLOCHOLDERS: This setting is only used if priority
-# inheritance is enabled. It defines the maximum number of
-# different threads (minus one) that can take counts on a
-# semaphore with priority inheritance support. This may be
-# set to zero if priority inheritance is disabled OR if you
-# are only using semaphores as mutexes (only one holder) OR
-# if no more than two threads participate using a counting
-# semaphore.
-# CONFIG_SEM_NNESTPRIO. If priority inheritance is enabled,
-# then this setting is the maximum number of higher priority
-# threads (minus 1) than can be waiting for another thread
-# to release a count on a semaphore. This value may be set
-# to zero if no more than one thread is expected to wait for
-# a semaphore.
-# CONFIG_FDCLONE_DISABLE. Disable cloning of all file descriptors
-# by task_create() when a new task is started. If set, all
-# files/drivers will appear to be closed in the new task.
-# CONFIG_FDCLONE_STDIO. Disable cloning of all but the first
-# three file descriptors (stdin, stdout, stderr) by task_create()
-# when a new task is started. If set, all files/drivers will
-# appear to be closed in the new task except for stdin, stdout,
-# and stderr.
-# CONFIG_SDCLONE_DISABLE. Disable cloning of all socket
-# desciptors by task_create() when a new task is started. If
-# set, all sockets will appear to be closed in the new task.
-# CONFIG_NXFLAT. Enable support for the NXFLAT binary format.
-# This format will support execution of NuttX binaries located
-# in a ROMFS filesystem (see examples/nxflat).
-# CONFIG_SCHED_WORKQUEUE. Create a dedicated "worker" thread to
-# handle delayed processing from interrupt handlers. This feature
-# is required for some drivers but, if there are not complaints,
-# can be safely disabled. The worker thread also performs
-# garbage collection -- completing any delayed memory deallocations
-# from interrupt handlers. If the worker thread is disabled,
-# then that clean will be performed by the IDLE thread instead
-# (which runs at the lowest of priority and may not be appropriate
-# if memory reclamation is of high priority). If CONFIG_SCHED_WORKQUEUE
-# is enabled, then the following options can also be used:
-# CONFIG_SCHED_WORKPRIORITY - The execution priority of the worker
-# thread. Default: 50
-# CONFIG_SCHED_WORKPERIOD - How often the worker thread checks for
-# work in units of microseconds. Default: 50*1000 (50 MS).
-# CONFIG_SCHED_WORKSTACKSIZE - The stack size allocated for the worker
-# thread. Default: CONFIG_IDLETHREAD_STACKSIZE.
-# CONFIG_SIG_SIGWORK - The signal number that will be used to wake-up
-# the worker thread. Default: 4
-#
-#CONFIG_APPS_DIR=
-CONFIG_DEBUG=n
-CONFIG_DEBUG_VERBOSE=n
-CONFIG_DEBUG_SYMBOLS=n
-CONFIG_MM_REGIONS=2
-CONFIG_ARCH_LOWPUTC=y
-CONFIG_RR_INTERVAL=200
-CONFIG_SCHED_INSTRUMENTATION=n
-CONFIG_TASK_NAME_SIZE=0
-CONFIG_START_YEAR=2010
-CONFIG_START_MONTH=6
-CONFIG_START_DAY=20
-CONFIG_GREGORIAN_TIME=n
-CONFIG_JULIAN_TIME=n
-CONFIG_DEV_CONSOLE=y
-CONFIG_DEV_LOWCONSOLE=y
-CONFIG_MUTEX_TYPES=n
-CONFIG_PRIORITY_INHERITANCE=n
-CONFIG_SEM_PREALLOCHOLDERS=0
-CONFIG_SEM_NNESTPRIO=0
-CONFIG_FDCLONE_DISABLE=n
-CONFIG_FDCLONE_STDIO=n
-CONFIG_SDCLONE_DISABLE=y
-CONFIG_NXFLAT=n
-CONFIG_SCHED_WORKQUEUE=n
-CONFIG_SCHED_WORKPRIORITY=50
-CONFIG_SCHED_WORKPERIOD=(50*1000)
-CONFIG_SCHED_WORKSTACKSIZE=1024
-CONFIG_SIG_SIGWORK=4
-
-#
-# The following can be used to disable categories of
-# APIs supported by the OS. If the compiler supports
-# weak functions, then it should not be necessary to
-# disable functions unless you want to restrict usage
-# of those APIs.
-#
-# There are certain dependency relationships in these
-# features.
-#
-# o mq_notify logic depends on signals to awaken tasks
-# waiting for queues to become full or empty.
-# o pthread_condtimedwait() depends on signals to wake
-# up waiting tasks.
-#
-CONFIG_DISABLE_CLOCK=n
-CONFIG_DISABLE_POSIX_TIMERS=n
-CONFIG_DISABLE_PTHREAD=n
-CONFIG_DISABLE_SIGNALS=n
-CONFIG_DISABLE_MQUEUE=n
-CONFIG_DISABLE_MOUNTPOINT=y
-CONFIG_DISABLE_ENVIRON=y
-CONFIG_DISABLE_POLL=y
-
-#
-# Misc libc settings
-#
-# CONFIG_NOPRINTF_FIELDWIDTH - sprintf-related logic is a
-# little smaller if we do not support fieldwidthes
-#
-CONFIG_NOPRINTF_FIELDWIDTH=n
-
-#
-# Allow for architecture optimized implementations
-#
-# The architecture can provide optimized versions of the
-# following to improve system performance
-#
-CONFIG_ARCH_MEMCPY=n
-CONFIG_ARCH_MEMCMP=n
-CONFIG_ARCH_MEMMOVE=n
-CONFIG_ARCH_MEMSET=n
-CONFIG_ARCH_STRCMP=n
-CONFIG_ARCH_STRCPY=n
-CONFIG_ARCH_STRNCPY=n
-CONFIG_ARCH_STRLEN=n
-CONFIG_ARCH_STRNLEN=n
-CONFIG_ARCH_BZERO=n
-
-#
-# Sizes of configurable things (0 disables)
-#
-# CONFIG_MAX_TASKS - The maximum number of simultaneously
-# active tasks. This value must be a power of two.
-# CONFIG_MAX_TASK_ARGS - This controls the maximum number of
-# of parameters that a task may receive (i.e., maxmum value
-# of 'argc')
-# CONFIG_NPTHREAD_KEYS - The number of items of thread-
-# specific data that can be retained
-# CONFIG_NFILE_DESCRIPTORS - The maximum number of file
-# descriptors (one for each open)
-# CONFIG_NFILE_STREAMS - The maximum number of streams that
-# can be fopen'ed
-# CONFIG_NAME_MAX - The maximum size of a file name.
-# CONFIG_STDIO_BUFFER_SIZE - Size of the buffer to allocate
-# on fopen. (Only if CONFIG_NFILE_STREAMS > 0)
-# CONFIG_NUNGET_CHARS - Number of characters that can be
-# buffered by ungetc() (Only if CONFIG_NFILE_STREAMS > 0)
-# CONFIG_PREALLOC_MQ_MSGS - The number of pre-allocated message
-# structures. The system manages a pool of preallocated
-# message structures to minimize dynamic allocations
-# CONFIG_MQ_MAXMSGSIZE - Message structures are allocated with
-# a fixed payload size given by this settin (does not include
-# other message structure overhead.
-# CONFIG_MAX_WDOGPARMS - Maximum number of parameters that
-# can be passed to a watchdog handler
-# CONFIG_PREALLOC_WDOGS - The number of pre-allocated watchdog
-# structures. The system manages a pool of preallocated
-# watchdog structures to minimize dynamic allocations
-# CONFIG_PREALLOC_TIMERS - The number of pre-allocated POSIX
-# timer structures. The system manages a pool of preallocated
-# timer structures to minimize dynamic allocations. Set to
-# zero for all dynamic allocations.
-#
-CONFIG_MAX_TASKS=16
-CONFIG_MAX_TASK_ARGS=4
-CONFIG_NPTHREAD_KEYS=4
-CONFIG_NFILE_DESCRIPTORS=8
-CONFIG_NFILE_STREAMS=8
-CONFIG_NAME_MAX=32
-CONFIG_STDIO_BUFFER_SIZE=256
-CONFIG_NUNGET_CHARS=2
-CONFIG_PREALLOC_MQ_MSGS=4
-CONFIG_MQ_MAXMSGSIZE=32
-CONFIG_MAX_WDOGPARMS=2
-CONFIG_PREALLOC_WDOGS=4
-CONFIG_PREALLOC_TIMERS=4
-
-#
-# Filesystem configuration
-#
-# CONFIG_FS_FAT - Enable FAT filesystem support
-# CONFIG_FAT_SECTORSIZE - Max supported sector size
-# CONFIG_FS_ROMFS - Enable ROMFS filesystem support
-CONFIG_FS_FAT=n
-CONFIG_FS_ROMFS=n
-
-#
-# SPI-based MMC/SD driver
-#
-# CONFIG_MMCSD_NSLOTS
-# Number of MMC/SD slots supported by the driver
-# CONFIG_MMCSD_READONLY
-# Provide read-only access (default is read/write)
-# CONFIG_MMCSD_SPICLOCK - Maximum SPI clock to drive MMC/SD card.
-# Default is 20MHz.
-#
-CONFIG_MMCSD_NSLOTS=1
-CONFIG_MMCSD_READONLY=n
-CONFIG_MMCSD_SPICLOCK=12500000
-
-#
-# Block driver buffering
-#
-# CONFIG_FS_READAHEAD
-# Enable read-ahead buffering
-# CONFIG_FS_WRITEBUFFER
-# Enable write buffering
-#
-CONFIG_FS_READAHEAD=n
-CONFIG_FS_WRITEBUFFER=n
-
-#
-# SDIO-based MMC/SD driver
-#
-# CONFIG_SDIO_DMA
-# SDIO driver supports DMA
-# CONFIG_MMCSD_MMCSUPPORT
-# Enable support for MMC cards
-# CONFIG_MMCSD_HAVECARDDETECT
-# SDIO driver card detection is 100% accurate
-#
-CONFIG_SDIO_DMA=n
-CONFIG_MMCSD_MMCSUPPORT=n
-CONFIG_MMCSD_HAVECARDDETECT=n
-
-#
-# TCP/IP and UDP support via uIP
-# CONFIG_NET - Enable or disable all network features
-# CONFIG_NET_IPv6 - Build in support for IPv6
-# CONFIG_NSOCKET_DESCRIPTORS - Maximum number of socket descriptors per task/thread.
-# CONFIG_NET_SOCKOPTS - Enable or disable support for socket options
-# CONFIG_NET_BUFSIZE - uIP buffer size
-# CONFIG_NET_TCP - TCP support on or off
-# CONFIG_NET_TCP_CONNS - Maximum number of TCP connections (all tasks)
-# CONFIG_NET_TCP_READAHEAD_BUFSIZE - Size of TCP read-ahead buffers
-# CONFIG_NET_NTCP_READAHEAD_BUFFERS - Number of TCP read-ahead buffers (may be zero)
-# CONFIG_NET_TCPBACKLOG - Incoming connections pend in a backlog until
-# accept() is called. The size of the backlog is selected when listen() is called.
-# CONFIG_NET_MAX_LISTENPORTS - Maximum number of listening TCP ports (all tasks)
-# CONFIG_NET_UDP - UDP support on or off
-# CONFIG_NET_UDP_CHECKSUMS - UDP checksums on or off
-# CONFIG_NET_UDP_CONNS - The maximum amount of concurrent UDP connections
-# CONFIG_NET_ICMP - ICMP ping response support on or off
-# CONFIG_NET_ICMP_PING - ICMP ping request support on or off
-# CONFIG_NET_PINGADDRCONF - Use "ping" packet for setting IP address
-# CONFIG_NET_STATISTICS - uIP statistics on or off
-# CONFIG_NET_RECEIVE_WINDOW - The size of the advertised receiver's window
-# CONFIG_NET_ARPTAB_SIZE - The size of the ARP table
-# CONFIG_NET_BROADCAST - Broadcast support
-# CONFIG_NET_FWCACHE_SIZE - number of packets to remember when looking for duplicates
-#
-CONFIG_NET=n
-CONFIG_NET_IPv6=n
-CONFIG_NSOCKET_DESCRIPTORS=0
-CONFIG_NET_SOCKOPTS=y
-CONFIG_NET_BUFSIZE=420
-CONFIG_NET_TCP=n
-CONFIG_NET_TCP_CONNS=40
-CONFIG_NET_MAX_LISTENPORTS=40
-CONFIG_NET_UDP=n
-CONFIG_NET_UDP_CHECKSUMS=y
-#CONFIG_NET_UDP_CONNS=10
-CONFIG_NET_ICMP=n
-CONFIG_NET_ICMP_PING=n
-#CONFIG_NET_PINGADDRCONF=0
-CONFIG_NET_STATISTICS=y
-#CONFIG_NET_RECEIVE_WINDOW=
-#CONFIG_NET_ARPTAB_SIZE=8
-CONFIG_NET_BROADCAST=n
-#CONFIG_NET_FWCACHE_SIZE=2
-
-#
-# UIP Network Utilities
-# CONFIG_NET_DHCP_LIGHT - Reduces size of DHCP
-# CONFIG_NET_RESOLV_ENTRIES - Number of resolver entries
-#
-CONFIG_NET_DHCP_LIGHT=n
-CONFIG_NET_RESOLV_ENTRIES=4
-
-#
-# USB Device Configuration
-#
-# CONFIG_USBDEV
-# Enables USB device support
-# CONFIG_USBDEV_ISOCHRONOUS
-# Build in extra support for isochronous endpoints
-# CONFIG_USBDEV_DUALSPEED
-# Hardware handles high and full speed operation (USB 2.0)
-# CONFIG_USBDEV_SELFPOWERED
-# Will cause USB features to indicate that the device is
-# self-powered
-# CONFIG_USBDEV_MAXPOWER
-# Maximum power consumption in mA
-# CONFIG_USBDEV_TRACE
-# Enables USB tracing for debug
-# CONFIG_USBDEV_TRACE_NRECORDS
-# Number of trace entries to remember
-#
-CONFIG_USBDEV=n
-CONFIG_USBDEV_ISOCHRONOUS=n
-CONFIG_USBDEV_DUALSPEED=n
-CONFIG_USBDEV_SELFPOWERED=y
-CONFIG_USBDEV_REMOTEWAKEUP=n
-CONFIG_USBDEV_MAXPOWER=100
-CONFIG_USBDEV_TRACE=n
-CONFIG_USBDEV_TRACE_NRECORDS=128
-
-#
-# LPC17xx USB Configuration
-#
-# CONFIG_LPC17_USBDEV_FRAME_INTERRUPT
-# Handle USB Start-Of-Frame events.
-# Enable reading SOF from interrupt handler vs. simply reading on demand.
-# Probably a bad idea... Unless there is some issue with sampling the SOF
-# from hardware asynchronously.
-# CONFIG_LPC17_USBDEV_EPFAST_INTERRUPT
-# Enable high priority interrupts. I have no idea why you might want to
-# do that
-# CONFIG_LPC17_USBDEV_NDMADESCRIPTORS
-# Number of DMA descriptors to allocate in SRAM.
-# CONFIG_LPC17_USBDEV_DMA
-# Enable lpc17xx-specific DMA support
-#
-CONFIG_LPC17_USBDEV_FRAME_INTERRUPT=n
-CONFIG_LPC17_USBDEV_EPFAST_INTERRUPT=n
-CONFIG_LPC17_USBDEV_DMA=n
-CONFIG_LPC17_USBDEV_NDMADESCRIPTORS=0
-CONFIG_LPC17_USBDEV_DMAINTMASK=0
-
-#
-# USB Serial Device Configuration
-#
-# CONFIG_USBSER
-# Enable compilation of the USB serial driver
-# CONFIG_USBSER_EPINTIN
-# The logical 7-bit address of a hardware endpoint that supports
-# interrupt IN operation
-# CONFIG_USBSER_EPBULKOUT
-# The logical 7-bit address of a hardware endpoint that supports
-# bulk OUT operation
-# CONFIG_USBSER_EPBULKIN
-# The logical 7-bit address of a hardware endpoint that supports
-# bulk IN operation
-# # CONFIG_USBSER_NWRREQS and CONFIG_USBSER_NRDREQS
-# The number of write/read requests that can be in flight
-# CONFIG_USBSER_VENDORID and CONFIG_USBSER_VENDORSTR
-# The vendor ID code/string
-# CONFIG_USBSER_PRODUCTID and CONFIG_USBSER_PRODUCTSTR
-# The product ID code/string
-# CONFIG_USBSER_RXBUFSIZE and CONFIG_USBSER_TXBUFSIZE
-# Size of the serial receive/transmit buffers
-#
-CONFIG_USBSER=n
-CONFIG_USBSER_EPINTIN=1
-CONFIG_USBSER_EPBULKOUT=2
-CONFIG_USBSER_EPBULKIN=5
-CONFIG_USBSER_NWRREQS=4
-CONFIG_USBSER_NRDREQS=4
-CONFIG_USBSER_VENDORID=0x067b
-CONFIG_USBSER_PRODUCTID=0x2303
-CONFIG_USBSER_VENDORSTR="Nuttx"
-CONFIG_USBSER_PRODUCTSTR="USBdev Serial"
-CONFIG_USBSER_RXBUFSIZE=512
-CONFIG_USBSER_TXBUFSIZE=512
-
-#
-# USB Storage Device Configuration
-#
-# CONFIG_USBSTRG
-# Enable compilation of the USB storage driver
-# CONFIG_USBSTRG_EP0MAXPACKET
-# Max packet size for endpoint 0
-# CONFIG_USBSTRG_EPBULKOUT and CONFIG_USBSTRG_EPBULKIN
-# The logical 7-bit address of a hardware endpoints that support
-# bulk OUT and IN operations
-# CONFIG_USBSTRG_NWRREQS and CONFIG_USBSTRG_NRDREQS
-# The number of write/read requests that can be in flight
-# CONFIG_USBSTRG_BULKINREQLEN and CONFIG_USBSTRG_BULKOUTREQLEN
-# The size of the buffer in each write/read request. This
-# value needs to be at least as large as the endpoint
-# maxpacket and ideally as large as a block device sector.
-# CONFIG_USBSTRG_VENDORID and CONFIG_USBSTRG_VENDORSTR
-# The vendor ID code/string
-# CONFIG_USBSTRG_PRODUCTID and CONFIG_USBSTRG_PRODUCTSTR
-# The product ID code/string
-# CONFIG_USBSTRG_REMOVABLE
-# Select if the media is removable
-#
-CONFIG_USBSTRG=n
-CONFIG_USBSTRG_EP0MAXPACKET=64
-CONFIG_USBSTRG_EPBULKOUT=2
-CONFIG_USBSTRG_EPBULKIN=5
-CONFIG_USBSTRG_NRDREQS=2
-CONFIG_USBSTRG_NWRREQS=2
-CONFIG_USBSTRG_BULKINREQLEN=256
-CONFIG_USBSTRG_BULKOUTREQLEN=256
-CONFIG_USBSTRG_VENDORID=0x584e
-CONFIG_USBSTRG_VENDORSTR="NuttX"
-CONFIG_USBSTRG_PRODUCTID=0x5342
-CONFIG_USBSTRG_PRODUCTSTR="USBdev Storage"
-CONFIG_USBSTRG_VERSIONNO=0x0399
-CONFIG_USBSTRG_REMOVABLE=y
-
-#
-# Settings for examples/uip
-#
-CONFIG_EXAMPLE_UIP_IPADDR=(10<<24|0<<16|0<<8|2)
-CONFIG_EXAMPLE_UIP_DRIPADDR=(10<<24|0<<16|0<<8|1)
-CONFIG_EXAMPLE_UIP_NETMASK=(255<<24|255<<16|255<<8|0)
-CONFIG_EXAMPLE_UIP_DHCPC=n
-
-#
-# Settings for examples/nettest
-CONFIG_EXAMPLE_NETTEST_SERVER=n
-CONFIG_EXAMPLE_NETTEST_PERFORMANCE=n
-CONFIG_EXAMPLE_NETTEST_NOMAC=n
-CONFIG_EXAMPLE_NETTEST_IPADDR=(10<<24|0<<16|0<<8|2)
-CONFIG_EXAMPLE_NETTEST_DRIPADDR=(10<<24|0<<16|0<<8|1)
-CONFIG_EXAMPLE_NETTEST_NETMASK=(255<<24|255<<16|255<<8|0)
-CONFIG_EXAMPLE_NETTEST_CLIENTIP=(10<<24|0<<16|0<<8|1)
-
-#
-# Settings for examples/ostest
-#
-CONFIG_EXAMPLES_OSTEST_LOOPS=1
-CONFIG_EXAMPLES_OSTEST_STACKSIZE=2048
-CONFIG_EXAMPLES_OSTEST_NBARRIER_THREADS=3
-
-#
-# Settings for apps/nshlib
-#
-# CONFIG_NSH_FILEIOSIZE - Size of a static I/O buffer
-# CONFIG_NSH_STRERROR - Use strerror(errno)
-# CONFIG_NSH_LINELEN - Maximum length of one command line
-# CONFIG_NSH_STACKSIZE - Stack size to use for new threads.
-# CONFIG_NSH_NESTDEPTH - Max number of nested if-then[-else]-fi
-# CONFIG_NSH_DISABLESCRIPT - Disable scripting support
-# CONFIG_NSH_DISABLEBG - Disable background commands
-# CONFIG_NSH_ROMFSETC - Use startup script in /etc
-# CONFIG_NSH_CONSOLE - Use serial console front end
-# CONFIG_NSH_TELNET - Use telnetd console front end
-# CONFIG_NSH_ARCHINIT - Platform provides architecture
-# specific initialization (nsh_archinitialize()).
-#
-# If CONFIG_NSH_TELNET is selected:
-# CONFIG_NSH_IOBUFFER_SIZE -- Telnetd I/O buffer size
-# CONFIG_NSH_DHCPC - Obtain address using DHCP
-# CONFIG_NSH_IPADDR - Provides static IP address
-# CONFIG_NSH_DRIPADDR - Provides static router IP address
-# CONFIG_NSH_NETMASK - Provides static network mask
-# CONFIG_NSH_NOMAC - Use a bogus MAC address
-#
-# If CONFIG_NSH_ROMFSETC is selected:
-# CONFIG_NSH_ROMFSMOUNTPT - ROMFS mountpoint
-# CONFIG_NSH_INITSCRIPT - Relative path to init script
-# CONFIG_NSH_ROMFSDEVNO - ROMFS RAM device minor
-# CONFIG_NSH_ROMFSSECTSIZE - ROMF sector size
-# CONFIG_NSH_FATDEVNO - FAT FS RAM device minor
-# CONFIG_NSH_FATSECTSIZE - FAT FS sector size
-# CONFIG_NSH_FATNSECTORS - FAT FS number of sectors
-# CONFIG_NSH_FATMOUNTPT - FAT FS mountpoint
-#
-CONFIG_NSH_FILEIOSIZE=512
-CONFIG_NSH_STRERROR=n
-CONFIG_NSH_LINELEN=64
-CONFIG_NSH_STACKSIZE=2048
-CONFIG_NSH_NESTDEPTH=3
-CONFIG_NSH_DISABLESCRIPT=n
-CONFIG_NSH_DISABLEBG=n
-CONFIG_NSH_ROMFSETC=n
-CONFIG_NSH_CONSOLE=y
-CONFIG_NSH_TELNET=n
-CONFIG_NSH_ARCHINIT=n
-CONFIG_NSH_IOBUFFER_SIZE=512
-CONFIG_NSH_DHCPC=n
-CONFIG_NSH_NOMAC=n
-CONFIG_NSH_IPADDR=(10<<24|0<<16|0<<8|2)
-CONFIG_NSH_DRIPADDR=(10<<24|0<<16|0<<8|1)
-CONFIG_NSH_NETMASK=(255<<24|255<<16|255<<8|0)
-CONFIG_NSH_ROMFSMOUNTPT="/etc"
-CONFIG_NSH_INITSCRIPT="init.d/rcS"
-CONFIG_NSH_ROMFSDEVNO=0
-CONFIG_NSH_ROMFSSECTSIZE=64
-CONFIG_NSH_FATDEVNO=1
-CONFIG_NSH_FATSECTSIZE=512
-CONFIG_NSH_FATNSECTORS=1024
-CONFIG_NSH_FATMOUNTPT=/tmp
-
-#
-# Architecture-specific NSH options
-#
-CONFIG_NSH_MMCSDSPIPORTNO=0
-CONFIG_NSH_MMCSDSLOTNO=0
-CONFIG_NSH_MMCSDMINOR=0
-
-#
-# Settings for examples/usbserial
-#
-# CONFIG_EXAMPLES_USBSERIAL_INONLY
-# Only verify IN (device-to-host) data transfers. Default: both
-# CONFIG_EXAMPLES_USBSERIAL_OUTONLY
-# Only verify OUT (host-to-device) data transfers. Default: both
-# CONFIG_EXAMPLES_USBSERIAL_ONLYSMALL
-# Send only small, single packet messages. Default: Send large and small.
-# CONFIG_EXAMPLES_USBSERIAL_ONLYBIG
-# Send only large, multi-packet messages. Default: Send large and small.
-#
-CONFIG_EXAMPLES_USBSERIAL_INONLY=n
-CONFIG_EXAMPLES_USBSERIAL_OUTONLY=n
-CONFIG_EXAMPLES_USBSERIAL_ONLYSMALL=n
-CONFIG_EXAMPLES_USBSERIAL_ONLYBIG=n
-
-CONFIG_EXAMPLES_USBSERIAL_TRACEINIT=n
-CONFIG_EXAMPLES_USBSERIAL_TRACECLASS=n
-CONFIG_EXAMPLES_USBSERIAL_TRACETRANSFERS=n
-CONFIG_EXAMPLES_USBSERIAL_TRACECONTROLLER=n
-CONFIG_EXAMPLES_USBSERIAL_TRACEINTERRUPTS=n
-
-#
-# Settings for internet_radio by Decio
-#
-CONFIG_INTERNETRADIO_ARCHINIT=n
-
-#
-# Stack and heap information
-#
-# CONFIG_BOOT_RUNFROMFLASH - Some configurations support XIP
-# operation from FLASH but must copy initialized .data sections to RAM.
-# (should also be =n for the LPC17xx which always runs from flash)
-# CONFIG_BOOT_COPYTORAM - Some configurations boot in FLASH
-# but copy themselves entirely into RAM for better performance.
-# CONFIG_CUSTOM_STACK - The up_ implementation will handle
-# all stack operations outside of the nuttx model.
-# CONFIG_STACK_POINTER - The initial stack pointer (arm7tdmi only)
-# CONFIG_IDLETHREAD_STACKSIZE - The size of the initial stack.
-# This is the thread that (1) performs the inital boot of the system up
-# to the point where user_start() is spawned, and (2) there after is the
-# IDLE thread that executes only when there is no other thread ready to
-# run.
-# CONFIG_USERMAIN_STACKSIZE - The size of the stack to allocate
-# for the main user thread that begins at the user_start() entry point.
-# CONFIG_PTHREAD_STACK_MIN - Minimum pthread stack size
-# CONFIG_PTHREAD_STACK_DEFAULT - Default pthread stack size
-# CONFIG_HEAP_BASE - The beginning of the heap
-# CONFIG_HEAP_SIZE - The size of the heap
-#
-CONFIG_BOOT_RUNFROMFLASH=n
-CONFIG_BOOT_COPYTORAM=n
-CONFIG_CUSTOM_STACK=n
-CONFIG_STACK_POINTER=
-CONFIG_IDLETHREAD_STACKSIZE=1024
-CONFIG_USERMAIN_STACKSIZE=2048
-CONFIG_PTHREAD_STACK_MIN=256
-CONFIG_PTHREAD_STACK_DEFAULT=2048
-CONFIG_HEAP_BASE=
-CONFIG_HEAP_SIZE=
diff --git a/nuttx/configs/detron/ostest/ld.script b/nuttx/configs/detron/ostest/ld.script
deleted file mode 100755
index d789905a3..000000000
--- a/nuttx/configs/detron/ostest/ld.script
+++ /dev/null
@@ -1,109 +0,0 @@
-/****************************************************************************
- * configs/detron/ostest/ld.script
- *
- * Copyright (C) 2011 Gregory Nutt. All rights reserved.
- * Author: 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.
- *
- ****************************************************************************/
-
-/* The LPC1768 has 512Kb of FLASH beginning at address 0x0000:0000 and
- * 64Kb of total SRAM: 32Kb of SRAM in the CPU block beginning at address
- * 0x10000000 and 32Kb of AHB SRAM in two banks of 16Kb beginning at addresses
- * 0x20070000 and 0x20080000. Here we assume that .data and .bss will all fit
- * into the 32Kb CPU SRAM address range.
- */
-
-MEMORY
-{
- flash (rx) : ORIGIN = 0x00000000, LENGTH = 512K
- sram (rwx) : ORIGIN = 0x10000000, LENGTH = 32K
-}
-
-OUTPUT_ARCH(arm)
-ENTRY(_stext)
-SECTIONS
-{
- .text : {
- _stext = ABSOLUTE(.);
- *(.vectors)
- *(.text .text.*)
- *(.fixup)
- *(.gnu.warning)
- *(.rodata .rodata.*)
- *(.gnu.linkonce.t.*)
- *(.glue_7)
- *(.glue_7t)
- *(.got)
- *(.gcc_except_table)
- *(.gnu.linkonce.r.*)
- _etext = ABSOLUTE(.);
- } > flash
-
- _eronly = ABSOLUTE(.); /* See below */
-
- .data : {
- _sdata = ABSOLUTE(.);
- *(.data .data.*)
- *(.gnu.linkonce.d.*)
- CONSTRUCTORS
- _edata = ABSOLUTE(.);
- } > sram AT > flash
-
- .ARM.extab : {
- *(.ARM.extab*)
- } >sram
-
- .ARM.exidx : {
- __exidx_start = ABSOLUTE(.);
- *(.ARM.exidx*)
- __exidx_end = ABSOLUTE(.);
- } >sram
-
- .bss : { /* BSS */
- _sbss = ABSOLUTE(.);
- *(.bss .bss.*)
- *(.gnu.linkonce.b.*)
- *(COMMON)
- _ebss = ABSOLUTE(.);
- } > sram
- /* Stabs debugging sections. */
- .stab 0 : { *(.stab) }
- .stabstr 0 : { *(.stabstr) }
- .stab.excl 0 : { *(.stab.excl) }
- .stab.exclstr 0 : { *(.stab.exclstr) }
- .stab.index 0 : { *(.stab.index) }
- .stab.indexstr 0 : { *(.stab.indexstr) }
- .comment 0 : { *(.comment) }
- .debug_abbrev 0 : { *(.debug_abbrev) }
- .debug_info 0 : { *(.debug_info) }
- .debug_line 0 : { *(.debug_line) }
- .debug_pubnames 0 : { *(.debug_pubnames) }
- .debug_aranges 0 : { *(.debug_aranges) }
-}
diff --git a/nuttx/configs/detron/ostest/setenv.sh b/nuttx/configs/detron/ostest/setenv.sh
deleted file mode 100755
index ed5ee3796..000000000
--- a/nuttx/configs/detron/ostest/setenv.sh
+++ /dev/null
@@ -1,46 +0,0 @@
-#!/bin/bash
-# configs/detron/ostest/setenv.sh
-#
-# Copyright (C) 2011 Gregory Nutt. All rights reserved.
-# Author: 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.
-#
-
-if [ "$(basename $0)" = "setenv.sh" ] ; then
- echo "You must source this script, not run it!" 1>&2
- exit 1
-fi
-
-if [ -z "${PATH_ORIG}" ]; then export PATH_ORIG="${PATH}"; fi
-
-WD=`pwd`
-export BUILDROOT_BIN="${WD}/../buildroot/build_arm_nofpu/staging_dir/bin"
-export PATH="${BUILDROOT_BIN}:/sbin:/usr/sbin:${PATH_ORIG}"
-
-echo "PATH : ${PATH}"
diff --git a/nuttx/configs/detron/src/Makefile b/nuttx/configs/detron/src/Makefile
deleted file mode 100755
index 41719d4ee..000000000
--- a/nuttx/configs/detron/src/Makefile
+++ /dev/null
@@ -1,87 +0,0 @@
-############################################################################
-# configs/detron/src/Makefile
-#
-# Copyright (C) 2011 Gregory Nutt. All rights reserved.
-# Author: 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 $(TOPDIR)/Make.defs
-
-CFLAGS += -I$(TOPDIR)/sched
-
-ASRCS =
-CSRCS = up_boot.c
-ifeq ($(CONFIG_NSH_ARCHINIT),y)
-CSRCS += up_nsh.c
-endif
-
-AOBJS = $(ASRCS:.S=$(OBJEXT))
-COBJS = $(CSRCS:.c=$(OBJEXT))
-
-SRCS = $(ASRCS) $(CSRCS)
-OBJS = $(AOBJS) $(COBJS)
-
-ARCH_SRCDIR = $(TOPDIR)/arch/$(CONFIG_ARCH)/src
-ifeq ($(WINTOOL),y)
- CFLAGS += -I "${shell cygpath -w $(ARCH_SRCDIR)/chip}" \
- -I "${shell cygpath -w $(ARCH_SRCDIR)/common}" \
- -I "${shell cygpath -w $(ARCH_SRCDIR)/armv7-m}"
-else
- CFLAGS += -I$(ARCH_SRCDIR)/chip -I$(ARCH_SRCDIR)/common -I$(ARCH_SRCDIR)/armv7-m
-endif
-
-all: libboard$(LIBEXT)
-
-$(AOBJS): %$(OBJEXT): %.S
- $(call ASSEMBLE, $<, $@)
-
-$(COBJS) $(LINKOBJS): %$(OBJEXT): %.c
- $(call COMPILE, $<, $@)
-
-libboard$(LIBEXT): $(OBJS)
- @( for obj in $(OBJS) ; do \
- $(call ARCHIVE, $@, $${obj}); \
- done ; )
-
-.depend: Makefile $(SRCS)
- @$(MKDEP) $(CC) -- $(CFLAGS) -- $(SRCS) >Make.dep
- @touch $@
-
-depend: .depend
-
-clean:
- @rm -f libboard$(LIBEXT) *~ .*.swp
- $(call CLEAN)
-
-distclean: clean
- @rm -f Make.dep .depend
-
--include Make.dep
diff --git a/nuttx/configs/detron/src/detron_internal.h b/nuttx/configs/detron/src/detron_internal.h
deleted file mode 100755
index 10ffc0076..000000000
--- a/nuttx/configs/detron/src/detron_internal.h
+++ /dev/null
@@ -1,159 +0,0 @@
-/************************************************************************************
- * configs/detron/src/detron_internal.h
- * arch/arm/src/board/detron_internal.n
- *
- * Copyright (C) 2010 Gregory Nutt. All rights reserved.
- * Author: 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.
- *
- ************************************************************************************/
-
-/************************************************************************************
- *
- * Pin used in the Internet Radio Detron Board
- *
- * Graphic Display
- *
- * Pin Port Function
- * 58 P0(20) DI
- * 59 P0(19) RW
- * 49 P0(11) ENABLE
- * 78 P0(7) D0
- * 79 P0(6) D1
- * 78 P0(5) D2
- * 81 P0(4) D3
- * 94 P1(1) D4
- * 95 P1(0) D5
- * 47 P0(1) D6
- * 46 P0(0) D7
- *
- * VS1003
- *
- * Pin Port Function
- * 65 P2(8) xreset
- * 85 P4(29) dreq
- * 82 P4(28) xdcs
- * 63 P0(16) xcs
- * 62 P0(15) sclk
- * 60 P0(18) si
- * 61 P0(17) so
- *
- * Botoes do painel
- *
- * 85 Chave pulsada 1 P4(29)
- * 87 Chave Pulsada 2 P1(16)
- * 88 Chave pulsada centro P1(15)
- *
- * USB
- *
- * Pin Port Function
- * 29 D+
- * 30 D-
- */
-
-#ifndef _CONFIGS_DETRON_SRC_DETRON_INTERNAL_H
-#define _CONFIGS_DETRON_SRC_DETRON_INTERNAL_H
-
-/************************************************************************************
- * Included Files
- ************************************************************************************/
-
-#include <nuttx/config.h>
-#include <nuttx/compiler.h>
-#include <arch/lpc17xx/irq.h>
-
-/************************************************************************************
- * Definitions
- ************************************************************************************/
-
-/* Detron GPIO Pin Definitions ******************************************************/
-/* Pinos do Display grafico */
-
-#define pin_di (GPIO_OUTPUT | GPIO_VALUE_ZERO | GPIO_PORT0 | GPIO_PIN20)
-#define pin_rw (GPIO_OUTPUT | GPIO_VALUE_ZERO | GPIO_PORT0 | GPIO_PIN19)
-#define pin_enable (GPIO_OUTPUT | GPIO_VALUE_ZERO | GPIO_PORT0 | GPIO_PIN11)
-#define pin_d0 (GPIO_OUTPUT | GPIO_VALUE_ZERO | GPIO_PORT0 | GPIO_PIN7)
-#define pin_d1 (GPIO_OUTPUT | GPIO_VALUE_ZERO | GPIO_PORT0 | GPIO_PIN6)
-#define pin_d2 (GPIO_OUTPUT | GPIO_VALUE_ZERO | GPIO_PORT0 | GPIO_PIN5)
-#define pin_d3 (GPIO_OUTPUT | GPIO_VALUE_ZERO | GPIO_PORT0 | GPIO_PIN4)
-#define pin_d4 (GPIO_OUTPUT | GPIO_VALUE_ZERO | GPIO_PORT1 | GPIO_PIN1)
-#define pin_d5 (GPIO_OUTPUT | GPIO_VALUE_ZERO | GPIO_PORT1 | GPIO_PIN0)
-#define pin_d6 (GPIO_OUTPUT | GPIO_VALUE_ZERO | GPIO_PORT0 | GPIO_PIN1)
-#define pin_d7 (GPIO_OUTPUT | GPIO_VALUE_ZERO | GPIO_PORT0 | GPIO_PIN0)
-#define pin_cs1 (GPIO_OUTPUT | GPIO_VALUE_ZERO | GPIO_PORT0 | GPIO_PIN10)
-#define pin_cs2 (GPIO_OUTPUT | GPIO_VALUE_ZERO | GPIO_PORT0 | GPIO_PIN9)
-#define pin_rst (GPIO_OUTPUT | GPIO_VALUE_ZERO | GPIO_PORT0 | GPIO_PIN8)
-
-/* VS1003 pins
- * xdcs = SPI in mode SDI (data)
- * xcs = SPI in mode SCI (comand)
- *
- * sclk = SPI clock
- * si = SPI in
- * so = SPI out
- *
- * dreq = SPI status 1 - free 0 - busy
- * xreset = hardware reset
- */
-
-#define pin_vs1003_xreset (GPIO_OUTPUT | GPIO_VALUE_ZERO | GPIO_PORT2 | GPIO_PIN8)
-#define pin_vs1003_dreq (GPIO_INPUT | GPIO_VALUE_ZERO | GPIO_PORT4 | GPIO_PIN29)
-#define pin_vs1003_xdcs (GPIO_OUTPUT | GPIO_VALUE_ZERO | GPIO_PORT4 | GPIO_PIN28)
-#define pin_vs1003_xcs (GPIO_OUTPUT | GPIO_VALUE_ZERO | GPIO_PORT0 | GPIO_PIN16)
-#define pin_vs1003_sclk (GPIO_OUTPUT | GPIO_VALUE_ZERO | GPIO_PORT0 | GPIO_PIN15)
-#define pin_vs1003_si (GPIO_OUTPUT | GPIO_VALUE_ZERO | GPIO_PORT0 | GPIO_PIN18)
-#define pin_vs1003_so (GPIO_INPUT | GPIO_VALUE_ZERO | GPIO_PORT0 | GPIO_PIN17)
-
-/* Pinos do painel */
-
-#define pin_panel_center (GPIO_INPUT | GPIO_VALUE_ZERO | GPIO_PORT2 | GPIO_PIN3)
-#define pin_panel_pulse_up (GPIO_INPUT | GPIO_VALUE_ZERO | GPIO_PORT2 | GPIO_PIN4)
-#define pin_panel_pulse_down (GPIO_INPUT | GPIO_VALUE_ZERO | GPIO_PORT2 | GPIO_PIN5)
-
-#define IRQ_pin_panel_center LPC17_IRQ_P2p3
-#define IRQ_pin_panel_pulse_up LPC17_IRQ_P2p4
-#define IRQ_pin_panel_pulse_down LPC17_IRQ_P2p5
-
-/************************************************************************************
- * Public Types
- ************************************************************************************/
-
-/************************************************************************************
- * Public data
- ************************************************************************************/
-
-#ifndef __ASSEMBLY__
-
-/************************************************************************************
- * Public Functions
- ************************************************************************************/
-
-#endif /* __ASSEMBLY__ */
-#endif /* _CONFIGS_DETRON_SRC_DETRON_INTERNAL_H */
-
diff --git a/nuttx/configs/detron/src/up_boot.c b/nuttx/configs/detron/src/up_boot.c
deleted file mode 100755
index 3719c8635..000000000
--- a/nuttx/configs/detron/src/up_boot.c
+++ /dev/null
@@ -1,77 +0,0 @@
-/************************************************************************************
- * configs/detron/src/up_boot.c
- * arch/arm/src/board/up_boot.c
- *
- * Copyright (C) 2011 Gregory Nutt. All rights reserved.
- * Author: 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 <debug.h>
-
-#include <arch/board/board.h>
-
-#include "up_arch.h"
-#include "up_internal.h"
-
-#include "lpc17_internal.h"
-#include "detron_internal.h"
-
-/************************************************************************************
- * Definitions
- ************************************************************************************/
-
-/************************************************************************************
- * Private Functions
- ************************************************************************************/
-
-/************************************************************************************
- * Public Functions
- ************************************************************************************/
-
-/************************************************************************************
- * Name: lpc17_boardinitialize
- *
- * Description:
- * All LPC17xx architectures must provide the following entry point. This entry point
- * is called early in the intitialization -- after all memory has been configured
- * and mapped but before any devices have been initialized.
- *
- ************************************************************************************/
-
-void lpc17_boardinitialize(void)
-{
-}
diff --git a/nuttx/configs/detron/src/up_buttons.c b/nuttx/configs/detron/src/up_buttons.c
deleted file mode 100644
index 66c1f5351..000000000
--- a/nuttx/configs/detron/src/up_buttons.c
+++ /dev/null
@@ -1,180 +0,0 @@
-/****************************************************************************
- * configs/detron/src/up_buttons.c
- *
- * Copyright (C) 2010 Gregory Nutt. All rights reserved.
- * Author: 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 <stdint.h>
-
-#include <nuttx/irq.h>
-
-#include <arch/irq.h>
-#include <arch/board/board.h>
-
-#include "lpc17_internal.h"
-#include "detron_internal.h"
-
-/****************************************************************************
- * Definitions
- ****************************************************************************/
-
-/****************************************************************************
- * Private Data
- ****************************************************************************/
-
-static xcpt_t g_irq_pin_panel_pulse_up;
-static xcpt_t g_irq_pin_panel_pulse_down;
-static xcpt_t g_irq_pin_panel_center;
-
-/****************************************************************************
- * Private Functions
- ****************************************************************************/
-
-/****************************************************************************
- * Public Functions
- ****************************************************************************/
-
-/****************************************************************************
- * Name: up_buttoninit
- ****************************************************************************/
-
-void up_buttoninit(void)
-{
- lpc17_configgpio(pin_panel_pulse_up);
- lpc17_configgpio(pin_panel_pulse_down);
- lpc17_configgpio(pin_panel_center);
-}
-
-/****************************************************************************
- * Name: up_buttons
- ****************************************************************************/
-
-uint8_t up_buttons(void)
-{
- uint8_t retval;
-
- retval = lpc17_gpioread(pin_panel_pulse_up) ? 0 : pin_panel_pulse_up;
- retval |= lpc17_gpioread(pin_panel_pulse_down) ? 0 : pin_panel_pulse_down;
- retval |= lpc17_gpioread(pin_panel_center) ? 0 : pin_panel_center;
- return retval;
-}
-
-/****************************************************************************
- * Name: up_irq_pin_panel_pulse_up
- ****************************************************************************/
-
-xcpt_t up_irq_pin_panel_pulse_up(xcpt_t irqhandler)
-{
- xcpt_t oldhandler;
- irqstate_t flags;
-
- /* Get the old button interrupt handler and save the new one */
-
- oldhandler = g_irq_pin_panel_pulse_up;
- g_irq_pin_panel_pulse_up = irqhandler;
-
- /* Disable interrupts until we are done */
-
- flags = irqsave();
-
- /* Configure the interrupt */
-
- (void)irq_attach(IRQ_pin_panel_pulse_up, irqhandler);
- up_enable_irq(IRQ_pin_panel_pulse_up);
-
- irqrestore(flags);
-
- return oldhandler;
-}
-
-/****************************************************************************
- * Name: up_irq_pin_panel_pulse_down
- * ****************************************************************************/
-
-xcpt_t up_irq_pin_panel_pulse_down(xcpt_t irqhandler)
-{
- xcpt_t oldhandler;
- irqstate_t flags;
-
- /* Get the old button interrupt handler and save the new one */
-
- oldhandler = g_irq_pin_panel_pulse_down;
- g_irq_pin_panel_pulse_down = irqhandler;
-
- /* Disable interrupts until we are done */
-
- flags = irqsave();
-
- /* Configure the interrupt */
-
- (void)irq_attach(IRQ_pin_panel_pulse_down, irqhandler);
- up_enable_irq(IRQ_pin_panel_pulse_down);
-
- irqrestore(flags);
-
- return oldhandler;
-}
-
-/****************************************************************************
- * Name: up_irq_pin_panel_center
- * ****************************************************************************/
-
-xcpt_t up_irq_pin_panel_center(xcpt_t irqhandler)
-{
- xcpt_t oldhandler;
- irqstate_t flags;
-
- /* Get the old button interrupt handler and save the new one */
-
- oldhandler = g_irq_pin_panel_center;
- g_irq_pin_panel_center = irqhandler;
-
- /* Disable interrupts until we are done */
-
- flags = irqsave();
-
- /* Configure the interrupt */
-
- (void)irq_attach(IRQ_pin_panel_center, irqhandler);
- up_enable_irq(IRQ_pin_panel_center);
-
- irqrestore(flags);
-
- return oldhandler;
-}
-
diff --git a/nuttx/configs/detron/src/up_nsh.c b/nuttx/configs/detron/src/up_nsh.c
deleted file mode 100755
index 5a74f8d73..000000000
--- a/nuttx/configs/detron/src/up_nsh.c
+++ /dev/null
@@ -1,324 +0,0 @@
-/****************************************************************************
- * config/detron/src/up_nsh.c
- * arch/arm/src/board/up_nsh.c
- *
- * Copyright (C) 2011 Gregory Nutt. All rights reserved.
- * Author: 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 <stdio.h>
-#include <unistd.h>
-#include <debug.h>
-#include <errno.h>
-
-#include <nuttx/spi.h>
-#include <nuttx/mmcsd.h>
-#include <nuttx/usb/usbhost.h>
-
-#include "lpc17_internal.h"
-#include "detron_internal.h"
-
-/****************************************************************************
- * Pre-Processor Definitions
- ****************************************************************************/
-
-/* Configuration ************************************************************/
-
-#ifdef CONFIG_ARCH_BOARD_DETRON
-# undef CONFIG_NSH_HAVEMMCSD
-# define CONFIG_NSH_HAVEUSBHOST 1
-#else
-# error "Unrecognized board"
-# undef CONFIG_NSH_HAVEMMCSD
-# undef CONFIG_NSH_HAVEUSBHOST
-#endif
-
-/* Can't support MMC/SD features if mountpoints are disabled */
-
-#if defined(CONFIG_DISABLE_MOUNTPOINT)
-# undef CONFIG_NSH_HAVEMMCSD
-#endif
-
-/* MMC/SD PORT and SLOT number probably depend on the board configuration */
-
-#ifdef CONFIG_NSH_HAVEMMCSD
-# if !defined(CONFIG_NSH_MMCSDSPIPORTNO) || CONFIG_NSH_MMCSDSPIPORTNO != 0
-# error "The Detron MMC/SD is on SSP0"
-# undef CONFIG_NSH_MMCSDSPIPORTNO
-# define CONFIG_NSH_MMCSDSPIPORTNO 0
-# endif
-# if !defined(CONFIG_NSH_MMCSDSLOTNO) || CONFIG_NSH_MMCSDSLOTNO != 0
-# error "The Detron MMC/SD is only one slot (0)"
-# undef CONFIG_NSH_MMCSDSLOTNO
-# define CONFIG_NSH_MMCSDSLOTNO 0
-# endif
-#endif
-
-#ifndef CONFIG_NSH_MMCSDMINOR
-# define CONFIG_NSH_MMCSDMINOR 0
-#endif
-
-/* USB Host */
-
-#ifdef CONFIG_USBHOST
-# ifndef CONFIG_LPC17_USBHOST
-# error "CONFIG_LPC17_USBHOST is not selected"
-# endif
-#endif
-
-#ifdef CONFIG_LPC17_USBHOST
-# ifndef CONFIG_USBHOST
-# warning "CONFIG_USBHOST is not selected"
-# endif
-#endif
-
-#if !defined(CONFIG_USBHOST) || !defined(CONFIG_LPC17_USBHOST)
-# undef CONFIG_NSH_HAVEUSBHOST
-#endif
-
-#ifdef CONFIG_NSH_HAVEUSBHOST
-# ifndef CONFIG_USBHOST_DEFPRIO
-# define CONFIG_USBHOST_DEFPRIO 50
-# endif
-# ifndef CONFIG_USBHOST_STACKSIZE
-# define CONFIG_USBHOST_STACKSIZE 1024
-# endif
-#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
-
-/****************************************************************************
- * Private Data
- ****************************************************************************/
-
-#ifdef CONFIG_NSH_HAVEUSBHOST
-static struct usbhost_driver_s *g_drvr;
-#endif
-
-/****************************************************************************
- * Private Functions
- ****************************************************************************/
-
-/****************************************************************************
- * Name: nsh_waiter
- *
- * Description:
- * Wait for USB devices to be connected.
- *
- ****************************************************************************/
-
-#ifdef CONFIG_NSH_HAVEUSBHOST
-static int nsh_waiter(int argc, char *argv[])
-{
- bool connected = false;
- int ret;
-
- message("nsh_waiter: Running\n");
- for (;;)
- {
- /* Wait for the device to change state */
-
- ret = DRVR_WAIT(g_drvr, connected);
- DEBUGASSERT(ret == OK);
-
- connected = !connected;
- message("nsh_waiter: %s\n", connected ? "connected" : "disconnected");
-
- /* Did we just become connected? */
-
- if (connected)
- {
- /* Yes.. enumerate the newly connected device */
-
- (void)DRVR_ENUMERATE(g_drvr);
- }
- }
-
- /* Keep the compiler from complaining */
-
- return 0;
-}
-#endif
-
-/****************************************************************************
- * Name: nsh_usbhostinitialize
- *
- * Description:
- * Initialize SPI-based microSD.
- *
- ****************************************************************************/
-
-#ifdef CONFIG_NSH_HAVEUSBHOST
-static int nsh_usbhostinitialize(void)
-{
- int pid;
- int ret;
-
- /* First, register all of the class drivers needed to support the drivers
- * that we care about:
- */
-
- message("nsh_usbhostinitialize: Register class drivers\n");
- ret = usbhost_storageinit();
- if (ret != OK)
- {
- message("nsh_usbhostinitialize: Failed to register the mass storage class\n");
- }
-
- message("nsh_usbhostinitialize: Register device specific drivers\n");
- ret = usbhost_wlaninit();
- if (ret != OK)
- {
- message("nsh_usbhostinitialize: Failed to register the WLAN device\n");
- }
-
- /* Then get an instance of the USB host interface */
-
- message("nsh_usbhostinitialize: Initialize USB host\n");
- g_drvr = usbhost_initialize(0);
- if (g_drvr)
- {
- /* Start a thread to handle device connection. */
-
- message("nsh_usbhostinitialize: Start nsh_waiter\n");
-
-#ifndef CONFIG_CUSTOM_STACK
- pid = task_create("usbhost", CONFIG_USBHOST_DEFPRIO,
- CONFIG_USBHOST_STACKSIZE,
- (main_t)nsh_waiter, (const char **)NULL);
-#else
- pid = task_create("usbhost", CONFIG_USBHOST_DEFPRIO,
- (main_t)nsh_waiter, (const char **)NULL);
-#endif
- return pid < 0 ? -ENOEXEC : OK;
- }
- return -ENODEV;
-}
-#else
-# define nsh_usbhostinitialize() (OK)
-#endif
-
-/****************************************************************************
- * Name: nsh_sdinitialize
- *
- * Description:
- * Initialize SPI-based microSD.
- *
- ****************************************************************************/
-
-#ifdef CONFIG_NSH_HAVEMMCSD
-int nsh_sdinitialize(void)
-{
- FAR struct spi_dev_s *ssp;
- int ret;
-
- /* Get the SSP port */
-
- ssp = up_spiinitialize(CONFIG_NSH_MMCSDSPIPORTNO);
- if (!ssp)
- {
- message("nsh_archinitialize: Failed to initialize SSP port %d\n",
- CONFIG_NSH_MMCSDSPIPORTNO);
- return -ENODEV;
- }
-
- message("Successfully initialized SSP port %d\n",
- CONFIG_NSH_MMCSDSPIPORTNO);
-
- /* Bind the SSP port to the slot */
-
- ret = mmcsd_spislotinitialize(CONFIG_NSH_MMCSDMINOR, CONFIG_NSH_MMCSDSLOTNO, ssp);
- if (ret < 0)
- {
- message("nsh_archinitialize: Failed to bind SSP port %d to MMC/SD slot %d: %d\n",
- CONFIG_NSH_MMCSDSPIPORTNO, CONFIG_NSH_MMCSDSLOTNO, ret);
- return ret;
- }
-
- message("Successfuly bound SSP port %d to MMC/SD slot %d\n",
- CONFIG_NSH_MMCSDSPIPORTNO, CONFIG_NSH_MMCSDSLOTNO);
- return OK;
-}
-#else
-# define nsh_sdinitialize() (OK)
-#endif
-
-/****************************************************************************
- * Public Functions
- ****************************************************************************/
-
-/****************************************************************************
- * Name: nsh_archinitialize
- *
- * Description:
- * Perform architecture specific initialization
- *
- ****************************************************************************/
-
-int nsh_archinitialize(void)
-{
- int ret;
-
- /* Initialize SPI-based microSD */
-
- ret = nsh_sdinitialize();
- if (ret == OK)
- {
- /* Initialize USB host */
-
- ret = nsh_usbhostinitialize();
- if (ret == OK)
- {
- message("USB host successfuly initialized!\n");
- }
- }
- return ret;
-}
diff --git a/nuttx/configs/detron/wlan/Make.defs b/nuttx/configs/detron/wlan/Make.defs
deleted file mode 100755
index ff8e24eae..000000000
--- a/nuttx/configs/detron/wlan/Make.defs
+++ /dev/null
@@ -1,163 +0,0 @@
-############################################################################
-# configs/detron/wlan/Make.defs
-#
-# Copyright (C) 2011 Gregory Nutt. All rights reserved.
-# Authors: Gregory Nutt <spudmonkey@racsa.co.cr>
-# Rafael Noronha <rafael@pdsolucoes.com.br>
-#
-# 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 ${TOPDIR}/.config
-
-# Setup for the selected toolchain
-
-ifeq ($(CONFIG_LPC17_CODESOURCERYW),y)
- # CodeSourcery under Windows
- CROSSDEV = arm-none-eabi-
- WINTOOL = y
- ARCHCPUFLAGS = -mcpu=cortex-m3 -mthumb -mfloat-abi=soft
-endif
-ifeq ($(CONFIG_LPC17_CODESOURCERYL),y)
- # CodeSourcery under Linux
- CROSSDEV = arm-none-eabi-
- ARCHCPUFLAGS = -mcpu=cortex-m3 -mthumb -mfloat-abi=soft
- MAXOPTIMIZATION = -O2
-endif
-ifeq ($(CONFIG_LPC17_DEVKITARM),y)
- # devkitARM under Windows
- CROSSDEV = arm-eabi-
- WINTOOL = y
- ARCHCPUFLAGS = -mcpu=cortex-m3 -mthumb -mfloat-abi=soft
-endif
-ifeq ($(CONFIG_LPC17_BUILDROOT),y)
- # NuttX buildroot under Linux or Cygwin
- CROSSDEV = arm-elf-
- ARCHCPUFLAGS = -mtune=cortex-m3 -march=armv7-m -mfloat-abi=soft
- MAXOPTIMIZATION = -Os
-endif
-
-ifeq ($(WINTOOL),y)
- # Windows-native toolchains
- DIRLINK = $(TOPDIR)/tools/winlink.sh
- DIRUNLINK = $(TOPDIR)/tools/unlink.sh
- MKDEP = $(TOPDIR)/tools/mknulldeps.sh
- ARCHINCLUDES = -I. -isystem "${shell cygpath -w $(TOPDIR)/include}"
- ARCHXXINCLUDES = -I. -isystem "${shell cygpath -w $(TOPDIR)/include}" -isystem "${shell cygpath -w $(TOPDIR)/include/cxx}"
- ARCHSCRIPT = -T "${shell cygpath -w $(TOPDIR)/configs/$(CONFIG_ARCH_BOARD)/wlan/ld.script}"
- MAXOPTIMIZATION = -O2
-else
- # Linux/Cygwin-native toolchain
- MKDEP = $(TOPDIR)/tools/mkdeps.sh
- ARCHINCLUDES = -I. -isystem $(TOPDIR)/include
- ARCHXXINCLUDES = -I. -isystem $(TOPDIR)/include -isystem $(TOPDIR)/include/cxx
- ARCHSCRIPT = -T$(TOPDIR)/configs/$(CONFIG_ARCH_BOARD)/wlan/ld.script
-endif
-
-CC = $(CROSSDEV)gcc
-CXX = $(CROSSDEV)g++
-CPP = $(CROSSDEV)gcc -E
-LD = $(CROSSDEV)ld
-AR = $(CROSSDEV)ar rcs
-NM = $(CROSSDEV)nm
-OBJCOPY = $(CROSSDEV)objcopy
-OBJDUMP = $(CROSSDEV)objdump
-
-ARCHCCVERSION = ${shell $(CC) -v 2>&1 | sed -n '/^gcc version/p' | sed -e 's/^gcc version \([0-9\.]\)/\1/g' -e 's/[-\ ].*//g' -e '1q'}
-ARCHCCMAJOR = ${shell echo $(ARCHCCVERSION) | cut -d'.' -f1}
-
-ifeq ("${CONFIG_DEBUG_SYMBOLS}","y")
- ARCHOPTIMIZATION = -g
-else
- ARCHOPTIMIZATION = $(MAXOPTIMIZATION) -fno-strict-aliasing -fno-strength-reduce -fomit-frame-pointer
-endif
-
-ARCHCFLAGS = -fno-builtin
-ARCHCXXFLAGS = -fno-builtin -fno-exceptions
-ARCHWARNINGS = -Wall -Wstrict-prototypes -Wshadow
-ARCHWARNINGSXX = -Wall -Wshadow
-ARCHDEFINES =
-ARCHPICFLAGS = -fpic -msingle-pic-base -mpic-register=r10
-
-CFLAGS = $(ARCHCFLAGS) $(ARCHWARNINGS) $(ARCHOPTIMIZATION) $(ARCHCPUFLAGS) $(ARCHINCLUDES) $(ARCHDEFINES) $(EXTRADEFINES) -pipe
-CPICFLAGS = $(ARCHPICFLAGS) $(CFLAGS)
-CXXFLAGS = $(ARCHCXXFLAGS) $(ARCHWARNINGSXX) $(ARCHOPTIMIZATION) $(ARCHCPUFLAGS) $(ARCHXXINCLUDES) $(ARCHDEFINES) $(EXTRADEFINES) -pipe
-CXXPICFLAGS = $(ARCHPICFLAGS) $(CXXFLAGS)
-CPPFLAGS = $(ARCHINCLUDES) $(ARCHDEFINES) $(EXTRADEFINES)
-AFLAGS = $(CFLAGS) -D__ASSEMBLY__
-
-NXFLATLDFLAGS1 = -r -d -warn-common
-NXFLATLDFLAGS2 = $(NXFLATLDFLAGS1) -T$(TOPDIR)/binfmt/libnxflat/gnu-nxflat.ld -no-check-sections
-LDNXFLATFLAGS = -e main -s 2048
-
-OBJEXT = .o
-LIBEXT = .a
-EXEEXT =
-
-ifneq ($(CROSSDEV),arm-elf-)
- LDFLAGS += -nostartfiles -nodefaultlibs
-endif
-ifeq ($(CONFIG_DEBUG_SYMBOLS),y)
- LDFLAGS += -g
-endif
-
-define PREPROCESS
- @echo "CPP: $1->$2"
- @$(CPP) $(CPPFLAGS) $1 -o $2
-endef
-
-define COMPILE
- @echo "CC: $1"
- @$(CC) -c $(CFLAGS) $1 -o $2
-endef
-
-define COMPILEXX
- @echo "CXX: $1"
- @$(CXX) -c $(CXXFLAGS) $1 -o $2
-endef
-
-define ASSEMBLE
- @echo "AS: $1"
- @$(CC) -c $(AFLAGS) $1 -o $2
-endef
-
-define ARCHIVE
- echo "AR: $2"; \
- $(AR) $1 $2 || { echo "$(AR) $1 $2 FAILED!" ; exit 1 ; }
-endef
-
-define CLEAN
- @rm -f *.o *.a
-endef
-
-HOSTCC = gcc
-HOSTINCLUDES = -I.
-HOSTCFLAGS = -Wall -Wstrict-prototypes -Wshadow -g -pipe
-HOSTLDFLAGS =
-
diff --git a/nuttx/configs/detron/wlan/appconfig b/nuttx/configs/detron/wlan/appconfig
deleted file mode 100644
index d08f73002..000000000
--- a/nuttx/configs/detron/wlan/appconfig
+++ /dev/null
@@ -1,43 +0,0 @@
-############################################################################
-# configs/detron/wlan/appconfig
-#
-# Copyright (C) 2011 Gregory Nutt. All rights reserved.
-# Author: 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.
-#
-############################################################################
-
-# Path to example in apps/examples containing the user_start entry point
-
-CONFIGURED_APPS += examples/wlan
-
-# Networking support
-
-CONFIGURED_APPS += netutils/uiplib
-
diff --git a/nuttx/configs/detron/wlan/defconfig b/nuttx/configs/detron/wlan/defconfig
deleted file mode 100755
index 3eb7d82d5..000000000
--- a/nuttx/configs/detron/wlan/defconfig
+++ /dev/null
@@ -1,919 +0,0 @@
-############################################################################
-# configs/detron/wlan/defconfig
-#
-# Copyright (C) 2011 Gregory Nutt. All rights reserved.
-# Authors: Gregory Nutt <spudmonkey@racsa.co.cr>
-# Rafael Noronha <rafael@pdsolucoes.com.br>
-#
-# 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.
-#
-############################################################################
-#
-# architecture selection
-#
-# CONFIG_ARCH - identifies the arch subdirectory and, hence, the
-# processor architecture.
-# CONFIG_ARCH_family - for use in C code. This identifies the
-# particular chip family that the architecture is implemented
-# in.
-# CONFIG_ARCH_architecture - for use in C code. This identifies the
-# specific architecture within the chip familyl.
-# CONFIG_ARCH_CHIP - Identifies the arch/*/chip subdirectory
-# CONFIG_ARCH_CHIP_name - For use in C code
-# CONFIG_ARCH_BOARD - identifies the configs subdirectory and, hence,
-# the board that supports the particular chip or SoC.
-# CONFIG_ARCH_BOARD_name - for use in C code
-# CONFIG_ENDIAN_BIG - define if big endian (default is little endian)
-# CONFIG_BOARD_LOOPSPERMSEC - for delay loops
-# CONFIG_DRAM_SIZE - Describes the installed DRAM.
-# CONFIG_DRAM_START - The start address of DRAM (physical)
-# CONFIG_DRAM_END - Last address+1 of installed RAM
-# CONFIG_ARCH_IRQPRIO - The LPC17xx supports interrupt prioritization
-# CONFIG_ARCH_INTERRUPTSTACK - This architecture supports an interrupt
-# stack. If defined, this symbol is the size of the interrupt
-# stack in bytes. If not defined, the user task stacks will be
-# used during interrupt handling.
-# CONFIG_ARCH_STACKDUMP - Do stack dumps after assertions
-# CONFIG_ARCH_BOOTLOADER - Set if you are using a bootloader.
-# CONFIG_ARCH_LEDS - Use LEDs to show state. Unique to board architecture.
-# CONFIG_ARCH_BUTTONS - Enable support for buttons. Unique to board architecture.
-# CONFIG_ARCH_CALIBRATION - Enables some build in instrumentation that
-# cause a 100 second delay during boot-up. This 100 second delay
-# serves no purpose other than it allows you to calibrate
-# CONFIG_BOARD_LOOPSPERMSEC. You simply use a stop watch to measure
-# the 100 second delay then adjust CONFIG_BOARD_LOOPSPERMSEC until
-# the delay actually is 100 seconds.
-# CONFIG_ARCH_DMA - Support DMA initialization
-#
-CONFIG_ARCH=arm
-CONFIG_ARCH_ARM=y
-CONFIG_ARCH_CORTEXM3=y
-CONFIG_ARCH_CHIP=lpc17xx
-CONFIG_ARCH_CHIP_LPC1768=y
-CONFIG_ARCH_BOARD=detron
-CONFIG_ARCH_BOARD_DETRON=y
-CONFIG_BOARD_LOOPSPERMSEC=7982
-CONFIG_DRAM_SIZE=(32*1024)
-CONFIG_DRAM_START=0x10000000
-CONFIG_DRAM_END=(CONFIG_DRAM_START+CONFIG_DRAM_SIZE)
-CONFIG_ARCH_IRQPRIO=y
-CONFIG_ARCH_INTERRUPTSTACK=n
-CONFIG_ARCH_STACKDUMP=y
-CONFIG_ARCH_BOOTLOADER=n
-CONFIG_ARCH_LEDS=n
-CONFIG_ARCH_BUTTONS=n
-CONFIG_ARCH_CALIBRATION=n
-CONFIG_ARCH_DMA=n
-
-#
-# Identify toolchain and linker options
-#
-CONFIG_LPC17_CODESOURCERYW=n
-CONFIG_LPC17_CODESOURCERYL=n
-CONFIG_LPC17_DEVKITARM=n
-CONFIG_LPC17_BUILDROOT=y
-
-#
-# Individual subsystems can be enabled:
-#
-# Individual subsystems can be enabled:
-# (MAINOSC, PLL0, PLL1 and FLASH are controlled in board.h)
-#
-CONFIG_LPC17_ETHERNET=n
-CONFIG_LPC17_USBHOST=y
-CONFIG_LPC17_USBOTG=n
-CONFIG_LPC17_USBDEV=n
-CONFIG_LPC17_UART0=y
-CONFIG_LPC17_UART1=n
-CONFIG_LPC17_UART2=n
-CONFIG_LPC17_UART3=n
-CONFIG_LPC17_CAN1=n
-CONFIG_LPC17_CAN2=n
-CONFIG_LPC17_SPI=n
-CONFIG_LPC17_SSP0=n
-CONFIG_LPC17_SSP1=n
-CONFIG_LPC17_I2C0=n
-CONFIG_LPC17_I2C1=n
-CONFIG_LPC17_I2S=n
-CONFIG_LPC17_TMR0=n
-CONFIG_LPC17_TMR1=n
-CONFIG_LPC17_TMR2=n
-CONFIG_LPC17_TMR3=n
-CONFIG_LPC17_RIT=n
-CONFIG_LPC17_PWM=n
-CONFIG_LPC17_MCPWM=n
-CONFIG_LPC17_QEI=n
-CONFIG_LPC17_RTC=n
-CONFIG_LPC17_WDT=n
-CONFIG_LPC17_ADC=n
-CONFIG_LPC17_DAC=n
-CONFIG_LPC17_GPDMA=n
-
-#
-# LPC17xx specific serial device driver settings
-#
-# CONFIG_UARTn_SERIAL_CONSOLE - selects the UARTn for the
-# console and ttys0 (default is the UART1).
-# CONFIG_UARTn_RXBUFSIZE - Characters are buffered as received.
-# This specific the size of the receive buffer
-# CONFIG_UARTn_TXBUFSIZE - Characters are buffered before
-# being sent. This specific the size of the transmit buffer
-# CONFIG_UARTn_BAUD - The configure BAUD of the UART. Must be
-# CONFIG_UARTn_BITS - The number of bits. Must be either 7 or 8.
-# CONFIG_UARTn_PARTIY - 0=no parity, 1=odd parity, 2=even parity
-# CONFIG_UARTn_2STOP - Two stop bits
-#
-CONFIG_UART0_SERIAL_CONSOLE=y
-CONFIG_UART1_SERIAL_CONSOLE=n
-CONFIG_UART2_SERIAL_CONSOLE=n
-CONFIG_UART3_SERIAL_CONSOLE=n
-
-CONFIG_UART0_TXBUFSIZE=256
-CONFIG_UART1_TXBUFSIZE=256
-CONFIG_UART2_TXBUFSIZE=256
-CONFIG_UART3_TXBUFSIZE=256
-
-CONFIG_UART0_RXBUFSIZE=256
-CONFIG_UART1_RXBUFSIZE=256
-CONFIG_UART2_RXBUFSIZE=256
-CONFIG_UART3_RXBUFSIZE=256
-
-CONFIG_UART0_BAUD=115200
-CONFIG_UART2_BAUD=115200
-CONFIG_UART3_BAUD=115200
-CONFIG_UART1_BAUD=115200
-
-CONFIG_UART0_BITS=8
-CONFIG_UART1_BITS=8
-CONFIG_UART2_BITS=8
-CONFIG_UART3_BITS=8
-
-CONFIG_UART0_PARITY=0
-CONFIG_UART1_PARITY=0
-CONFIG_UART2_PARITY=0
-CONFIG_UART3_PARITY=0
-
-CONFIG_UART0_2STOP=0
-CONFIG_UART1_2STOP=0
-CONFIG_UART2_2STOP=0
-CONFIG_UART3_2STOP=0
-
-#
-# LPC17xx specific PHY/Ethernet device driver settings
-#
-# CONFIG_PHY_KS8721 - Selects Micrel KS8721 PHY
-# CONFIG_PHY_AUTONEG - Enable auto-negotion
-# CONFIG_PHY_SPEED100 - Select 100Mbit vs. 10Mbit speed.
-# CONFIG_PHY_FDUPLEX - Select full (vs. half) duplex
-# CONFIG_NET_EMACRAM_SIZE - Size of EMAC RAM. Default: 16Kb
-# CONFIG_NET_NTXDESC - Configured number of Tx descriptors. Default: 18
-# CONFIG_NET_NRXDESC - Configured number of Rx descriptors. Default: 18
-# CONFIG_NET_PRIORITY - Ethernet interrupt priority. The is default is
-# the higest priority.
-# CONFIG_NET_WOL - Enable Wake-up on Lan (not fully implemented).
-# CONFIG_NET_DUMPPACKET - Dump all received and transmitted packets.
-# Also needs CONFIG_DEBUG.
-# CONFIG_NET_REGDEBUG - Enabled low level register debug. Also needs
-# CONFIG_DEBUG.
-# CONFIG_NET_HASH - Enable receipt of near-perfect match frames.
-# CONFIG_NET_MULTICAST - Enable receipt of multicast (and unicast) frames.
-# Automatically set if CONFIG_NET_IGMP is selected.
-#
-CONFIG_PHY_KS8721=y
-CONFIG_PHY_AUTONEG=y
-CONFIG_PHY_SPEED100=n
-CONFIG_PHY_FDUPLEX=y
-CONFIG_NET_REGDEBUG=n
-
-#
-# General build options
-#
-# CONFIG_RRLOAD_BINARY - make the rrload binary format used with
-# BSPs from www.ridgerun.com using the tools/mkimage.sh script
-# CONFIG_INTELHEX_BINARY - make the Intel HEX binary format
-# used with many different loaders using the GNU objcopy program
-# Should not be selected if you are not using the GNU toolchain.
-# CONFIG_MOTOROLA_SREC - make the Motorola S-Record binary format
-# used with many different loaders using the GNU objcopy program
-# Should not be selected if you are not using the GNU toolchain.
-# CONFIG_RAW_BINARY - make a raw binary format file used with many
-# different loaders using the GNU objcopy program. This option
-# should not be selected if you are not using the GNU toolchain.
-# CONFIG_HAVE_LIBM - toolchain supports libm.a
-#
-CONFIG_RRLOAD_BINARY=n
-CONFIG_INTELHEX_BINARY=y
-CONFIG_MOTOROLA_SREC=n
-CONFIG_RAW_BINARY=n
-CONFIG_HAVE_LIBM=n
-
-#
-# General OS setup
-#
-# CONFIG_APPS_DIR - Identifies the relative path to the directory
-# that builds the application to link with NuttX. Default: ../apps
-# CONFIG_DEBUG - enables built-in debug options
-# CONFIG_DEBUG_VERBOSE - enables verbose debug output
-# CONFIG_DEBUG_SYMBOLS - build without optimization and with
-# debug symbols (needed for use with a debugger).
-# CONFIG_DEBUG_NET - enable network debug output
-# CONFIG_DEBUG_USB - enable usb debug output
-# CONFIG_MM_REGIONS - If the architecture includes multiple
-# regions of memory to allocate from, this specifies the
-# number of memory regions that the memory manager must
-# handle and enables the API mm_addregion(start, end);
-# CONFIG_ARCH_LOWPUTC - architecture supports low-level, boot
-# time console output
-# CONFIG_MSEC_PER_TICK - The default system timer is 100Hz
-# or MSEC_PER_TICK=10. This setting may be defined to
-# inform NuttX that the processor hardware is providing
-# system timer interrupts at some interrupt interval other
-# than 10 msec.
-# CONFIG_RR_INTERVAL - The round robin timeslice will be set
-# this number of milliseconds; Round robin scheduling can
-# be disabled by setting this value to zero.
-# CONFIG_SCHED_INSTRUMENTATION - enables instrumentation in
-# scheduler to monitor system performance
-# CONFIG_TASK_NAME_SIZE - Spcifies that maximum size of a
-# task name to save in the TCB. Useful if scheduler
-# instrumentation is selected. Set to zero to disable.
-# CONFIG_START_YEAR, CONFIG_START_MONTH, CONFIG_START_DAY -
-# Used to initialize the internal time logic.
-# CONFIG_GREGORIAN_TIME - Enables Gregorian time conversions.
-# You would only need this if you are concerned about accurate
-# time conversions in the past or in the distant future.
-# CONFIG_JULIAN_TIME - Enables Julian time conversions. You
-# would only need this if you are concerned about accurate
-# time conversion in the distand past. You must also define
-# CONFIG_GREGORIAN_TIME in order to use Julian time.
-# CONFIG_DEV_CONSOLE - Set if architecture-specific logic
-# provides /dev/console. Enables stdout, stderr, stdin.
-# CONFIG_DEV_LOWCONSOLE - Use the simple, low-level serial console
-# driver (minimul support)
-# CONFIG_MUTEX_TYPES: Set to enable support for recursive and
-# errorcheck mutexes. Enables pthread_mutexattr_settype().
-# CONFIG_PRIORITY_INHERITANCE : Set to enable support for priority
-# inheritance on mutexes and semaphores.
-# CONFIG_SEM_PREALLOCHOLDERS: This setting is only used if priority
-# inheritance is enabled. It defines the maximum number of
-# different threads (minus one) that can take counts on a
-# semaphore with priority inheritance support. This may be
-# set to zero if priority inheritance is disabled OR if you
-# are only using semaphores as mutexes (only one holder) OR
-# if no more than two threads participate using a counting
-# semaphore.
-# CONFIG_SEM_NNESTPRIO. If priority inheritance is enabled,
-# then this setting is the maximum number of higher priority
-# threads (minus 1) than can be waiting for another thread
-# to release a count on a semaphore. This value may be set
-# to zero if no more than one thread is expected to wait for
-# a semaphore.
-# CONFIG_FDCLONE_DISABLE. Disable cloning of all file descriptors
-# by task_create() when a new task is started. If set, all
-# files/drivers will appear to be closed in the new task.
-# CONFIG_FDCLONE_STDIO. Disable cloning of all but the first
-# three file descriptors (stdin, stdout, stderr) by task_create()
-# when a new task is started. If set, all files/drivers will
-# appear to be closed in the new task except for stdin, stdout,
-# and stderr.
-# CONFIG_SDCLONE_DISABLE. Disable cloning of all socket
-# desciptors by task_create() when a new task is started. If
-# set, all sockets will appear to be closed in the new task.
-# CONFIG_NXFLAT. Enable support for the NXFLAT binary format.
-# This format will support execution of NuttX binaries located
-# in a ROMFS filesystem (see examples/nxflat).
-# CONFIG_SCHED_WORKQUEUE. Create a dedicated "worker" thread to
-# handle delayed processing from interrupt handlers. This feature
-# is required for some drivers but, if there are not complaints,
-# can be safely disabled. The worker thread also performs
-# garbage collection -- completing any delayed memory deallocations
-# from interrupt handlers. If the worker thread is disabled,
-# then that clean will be performed by the IDLE thread instead
-# (which runs at the lowest of priority and may not be appropriate
-# if memory reclamation is of high priority). If CONFIG_SCHED_WORKQUEUE
-# is enabled, then the following options can also be used:
-# CONFIG_SCHED_WORKPRIORITY - The execution priority of the worker
-# thread. Default: 50
-# CONFIG_SCHED_WORKPERIOD - How often the worker thread checks for
-# work in units of microseconds. Default: 50*1000 (50 MS).
-# CONFIG_SCHED_WORKSTACKSIZE - The stack size allocated for the worker
-# thread. Default: CONFIG_IDLETHREAD_STACKSIZE.
-# CONFIG_SIG_SIGWORK - The signal number that will be used to wake-up
-# the worker thread. Default: 4
-#
-#CONFIG_APPS_DIR=
-CONFIG_DEBUG=n
-CONFIG_DEBUG_VERBOSE=n
-CONFIG_DEBUG_SYMBOLS=n
-CONFIG_DEBUG_NET=n
-CONFIG_DEBUG_USB=n
-CONFIG_MM_REGIONS=2
-CONFIG_ARCH_LOWPUTC=y
-CONFIG_RR_INTERVAL=200
-CONFIG_SCHED_INSTRUMENTATION=n
-CONFIG_TASK_NAME_SIZE=0
-CONFIG_START_YEAR=2011
-CONFIG_START_MONTH=3
-CONFIG_START_DAY=8
-CONFIG_GREGORIAN_TIME=n
-CONFIG_JULIAN_TIME=n
-CONFIG_DEV_CONSOLE=y
-CONFIG_DEV_LOWCONSOLE=n
-CONFIG_MUTEX_TYPES=n
-CONFIG_PRIORITY_INHERITANCE=n
-CONFIG_SEM_PREALLOCHOLDERS=0
-CONFIG_SEM_NNESTPRIO=0
-CONFIG_FDCLONE_DISABLE=n
-CONFIG_FDCLONE_STDIO=n
-CONFIG_SDCLONE_DISABLE=y
-CONFIG_NXFLAT=n
-CONFIG_SCHED_WORKQUEUE=y
-CONFIG_SCHED_WORKPRIORITY=50
-CONFIG_SCHED_WORKPERIOD=(50*1000)
-CONFIG_SCHED_WORKSTACKSIZE=1024
-CONFIG_SIG_SIGWORK=4
-
-#
-# The following can be used to disable categories of
-# APIs supported by the OS. If the compiler supports
-# weak functions, then it should not be necessary to
-# disable functions unless you want to restrict usage
-# of those APIs.
-#
-# There are certain dependency relationships in these
-# features.
-#
-# o mq_notify logic depends on signals to awaken tasks
-# waiting for queues to become full or empty.
-# o pthread_condtimedwait() depends on signals to wake
-# up waiting tasks.
-#
-CONFIG_DISABLE_CLOCK=n
-CONFIG_DISABLE_POSIX_TIMERS=n
-CONFIG_DISABLE_PTHREAD=n
-CONFIG_DISABLE_SIGNALS=n
-CONFIG_DISABLE_MQUEUE=n
-CONFIG_DISABLE_MOUNTPOINT=n
-CONFIG_DISABLE_ENVIRON=n
-CONFIG_DISABLE_POLL=n
-
-#
-# Misc libc settings
-#
-# CONFIG_NOPRINTF_FIELDWIDTH - sprintf-related logic is a
-# little smaller if we do not support fieldwidthes
-#
-CONFIG_NOPRINTF_FIELDWIDTH=n
-
-#
-# Allow for architecture optimized implementations
-#
-# The architecture can provide optimized versions of the
-# following to improve system performance
-#
-CONFIG_ARCH_MEMCPY=n
-CONFIG_ARCH_MEMCMP=n
-CONFIG_ARCH_MEMMOVE=n
-CONFIG_ARCH_MEMSET=n
-CONFIG_ARCH_STRCMP=n
-CONFIG_ARCH_STRCPY=n
-CONFIG_ARCH_STRNCPY=n
-CONFIG_ARCH_STRLEN=n
-CONFIG_ARCH_STRNLEN=n
-CONFIG_ARCH_BZERO=n
-
-#
-# Sizes of configurable things (0 disables)
-#
-# CONFIG_MAX_TASKS - The maximum number of simultaneously
-# active tasks. This value must be a power of two.
-# CONFIG_MAX_TASK_ARGS - This controls the maximum number of
-# of parameters that a task may receive (i.e., maxmum value
-# of 'argc')
-# CONFIG_NPTHREAD_KEYS - The number of items of thread-
-# specific data that can be retained
-# CONFIG_NFILE_DESCRIPTORS - The maximum number of file
-# descriptors (one for each open)
-# CONFIG_NFILE_STREAMS - The maximum number of streams that
-# can be fopen'ed
-# CONFIG_NAME_MAX - The maximum size of a file name.
-# CONFIG_STDIO_BUFFER_SIZE - Size of the buffer to allocate
-# on fopen. (Only if CONFIG_NFILE_STREAMS > 0)
-# CONFIG_NUNGET_CHARS - Number of characters that can be
-# buffered by ungetc() (Only if CONFIG_NFILE_STREAMS > 0)
-# CONFIG_PREALLOC_MQ_MSGS - The number of pre-allocated message
-# structures. The system manages a pool of preallocated
-# message structures to minimize dynamic allocations
-# CONFIG_MQ_MAXMSGSIZE - Message structures are allocated with
-# a fixed payload size given by this settin (does not include
-# other message structure overhead.
-# CONFIG_MAX_WDOGPARMS - Maximum number of parameters that
-# can be passed to a watchdog handler
-# CONFIG_PREALLOC_WDOGS - The number of pre-allocated watchdog
-# structures. The system manages a pool of preallocated
-# watchdog structures to minimize dynamic allocations
-# CONFIG_PREALLOC_TIMERS - The number of pre-allocated POSIX
-# timer structures. The system manages a pool of preallocated
-# timer structures to minimize dynamic allocations. Set to
-# zero for all dynamic allocations.
-#
-CONFIG_MAX_TASKS=16
-CONFIG_MAX_TASK_ARGS=4
-CONFIG_NPTHREAD_KEYS=4
-CONFIG_NFILE_DESCRIPTORS=8
-CONFIG_NFILE_STREAMS=8
-CONFIG_NAME_MAX=32
-CONFIG_STDIO_BUFFER_SIZE=256
-CONFIG_NUNGET_CHARS=2
-CONFIG_PREALLOC_MQ_MSGS=4
-CONFIG_MQ_MAXMSGSIZE=32
-CONFIG_MAX_WDOGPARMS=2
-CONFIG_PREALLOC_WDOGS=4
-CONFIG_PREALLOC_TIMERS=4
-
-#
-# Filesystem configuration
-#
-# CONFIG_FS_FAT - Enable FAT filesystem support
-# CONFIG_FAT_SECTORSIZE - Max supported sector size
-# CONFIG_FS_ROMFS - Enable ROMFS filesystem support
-#
-CONFIG_FS_FAT=n
-CONFIG_FS_ROMFS=n
-
-#
-# SPI-based MMC/SD driver
-#
-# CONFIG_MMCSD_NSLOTS
-# Number of MMC/SD slots supported by the driver
-# CONFIG_MMCSD_READONLY
-# Provide read-only access (default is read/write)
-# CONFIG_MMCSD_SPICLOCK - Maximum SPI clock to drive MMC/SD card.
-# Default is 20MHz.
-#
-CONFIG_MMCSD_NSLOTS=1
-CONFIG_MMCSD_READONLY=n
-CONFIG_MMCSD_SPICLOCK=12500000
-
-#
-# Block driver buffering
-#
-# CONFIG_FS_READAHEAD
-# Enable read-ahead buffering
-# CONFIG_FS_WRITEBUFFER
-# Enable write buffering
-#
-CONFIG_FS_READAHEAD=n
-CONFIG_FS_WRITEBUFFER=n
-
-#
-# SDIO-based MMC/SD driver
-#
-# CONFIG_SDIO_DMA
-# SDIO driver supports DMA
-# CONFIG_MMCSD_MMCSUPPORT
-# Enable support for MMC cards
-# CONFIG_MMCSD_HAVECARDDETECT
-# SDIO driver card detection is 100% accurate
-#
-CONFIG_SDIO_DMA=n
-CONFIG_MMCSD_MMCSUPPORT=n
-CONFIG_MMCSD_HAVECARDDETECT=n
-
-#
-# TCP/IP and UDP support via uIP
-# CONFIG_NET - Enable or disable all network features
-# CONFIG_NET_NOINTS - uIP not called from interrupt level.
-# CONFIG_NET_MULTIBUFFER - Use multiple input/output buffers (probably no)
-# CONFIG_NET_IPv6 - Build in support for IPv6
-# CONFIG_NSOCKET_DESCRIPTORS - Maximum number of socket descriptors per task/thread.
-# CONFIG_NET_SOCKOPTS - Enable or disable support for socket options
-# CONFIG_NET_BUFSIZE - uIP buffer size
-# CONFIG_NET_TCP - TCP support on or off
-# CONFIG_NET_TCP_CONNS - Maximum number of TCP connections (all tasks)
-# CONFIG_NET_TCP_READAHEAD_BUFSIZE - Size of TCP read-ahead buffers
-# CONFIG_NET_NTCP_READAHEAD_BUFFERS - Number of TCP read-ahead buffers (may be zero)
-# CONFIG_NET_TCPBACKLOG - Incoming connections pend in a backlog until
-# accept() is called. The size of the backlog is selected when listen() is called.
-# CONFIG_NET_MAX_LISTENPORTS - Maximum number of listening TCP ports (all tasks)
-# CONFIG_NET_UDP - UDP support on or off
-# CONFIG_NET_UDP_CHECKSUMS - UDP checksums on or off
-# CONFIG_NET_UDP_CONNS - The maximum amount of concurrent UDP connections
-# CONFIG_NET_ICMP - ICMP ping response support on or off
-# CONFIG_NET_ICMP_PING - ICMP ping request support on or off
-# CONFIG_NET_PINGADDRCONF - Use "ping" packet for setting IP address
-# CONFIG_NET_STATISTICS - uIP statistics on or off
-# CONFIG_NET_RECEIVE_WINDOW - The size of the advertised receiver's window
-# CONFIG_NET_ARPTAB_SIZE - The size of the ARP table
-# CONFIG_NET_BROADCAST - Broadcast support
-# CONFIG_NET_FWCACHE_SIZE - number of packets to remember when looking for duplicates
-# CONFIG_NET_WLAN - Enable or disable WLAN network interface
-#
-CONFIG_NET=y
-CONFIG_NET_NOINTS=y
-CONFIG_NET_MULTIBUFFER=y
-CONFIG_NET_IPv6=n
-CONFIG_NSOCKET_DESCRIPTORS=2
-CONFIG_NET_SOCKOPTS=y
-CONFIG_NET_BUFSIZE=420
-CONFIG_NET_TCP=y
-CONFIG_NET_TCP_CONNS=40
-CONFIG_NET_MAX_LISTENPORTS=40
-CONFIG_NET_UDP=y
-CONFIG_NET_UDP_CHECKSUMS=y
-#CONFIG_NET_UDP_CONNS=10
-CONFIG_NET_ICMP=n
-CONFIG_NET_ICMP_PING=n
-#CONFIG_NET_PINGADDRCONF=0
-CONFIG_NET_STATISTICS=y
-#CONFIG_NET_RECEIVE_WINDOW=
-#CONFIG_NET_ARPTAB_SIZE=8
-CONFIG_NET_BROADCAST=n
-#CONFIG_NET_FWCACHE_SIZE=2
-CONFIG_NET_WLAN=y
-
-#
-# UIP Network Utilities
-# CONFIG_NET_DHCP_LIGHT - Reduces size of DHCP
-# CONFIG_NET_RESOLV_ENTRIES - Number of resolver entries
-#
-CONFIG_NET_DHCP_LIGHT=n
-CONFIG_NET_RESOLV_ENTRIES=4
-
-#
-# USB Device Configuration
-#
-# CONFIG_USBDEV
-# Enables USB device support
-# CONFIG_USBDEV_ISOCHRONOUS
-# Build in extra support for isochronous endpoints
-# CONFIG_USBDEV_DUALSPEED
-# Hardware handles high and full speed operation (USB 2.0)
-# CONFIG_USBDEV_SELFPOWERED
-# Will cause USB features to indicate that the device is
-# self-powered
-# CONFIG_USBDEV_MAXPOWER
-# Maximum power consumption in mA
-# CONFIG_USBDEV_TRACE
-# Enables USB tracing for debug
-# CONFIG_USBDEV_TRACE_NRECORDS
-# Number of trace entries to remember
-#
-CONFIG_USBDEV=n
-CONFIG_USBDEV_ISOCHRONOUS=n
-CONFIG_USBDEV_DUALSPEED=n
-CONFIG_USBDEV_SELFPOWERED=y
-CONFIG_USBDEV_REMOTEWAKEUP=n
-CONFIG_USBDEV_MAXPOWER=100
-CONFIG_USBDEV_TRACE=n
-CONFIG_USBDEV_TRACE_NRECORDS=128
-
-#
-# USB Host Configuration
-#
-# CONFIG_USBHOST
-# Enables USB host support
-# CONFIG_USBHOST_NPREALLOC
-# Number of pre-allocated class instances
-# CONFIG_USBHOST_BULK_DISABLE
-# On some architectures, selecting this setting will reduce driver size
-# by disabling bulk endpoint support
-# CONFIG_USBHOST_INT_DISABLE
-# On some architectures, selecting this setting will reduce driver size
-# by disabling interrupt endpoint support
-# CONFIG_USBHOST_ISOC_DISABLE
-# On some architectures, selecting this setting will reduce driver size
-# by disabling isochronous endpoint support
-#
-CONFIG_USBHOST=y
-CONFIG_USBHOST_NPREALLOC=0
-CONFIG_USBHOST_BULK_DISABLE=n
-CONFIG_USBHOST_INT_DISABLE=y
-CONFIG_USBHOST_ISOC_DISABLE=y
-
-#
-# LPC17xx USB Device Configuration
-#
-# CONFIG_LPC17_USBDEV_FRAME_INTERRUPT
-# Handle USB Start-Of-Frame events.
-# Enable reading SOF from interrupt handler vs. simply reading on demand.
-# Probably a bad idea... Unless there is some issue with sampling the SOF
-# from hardware asynchronously.
-# CONFIG_LPC17_USBDEV_EPFAST_INTERRUPT
-# Enable high priority interrupts. I have no idea why you might want to
-# do that
-# CONFIG_LPC17_USBDEV_NDMADESCRIPTORS
-# Number of DMA descriptors to allocate in SRAM.
-# CONFIG_LPC17_USBDEV_DMA
-# Enable lpc17xx-specific DMA support
-#
-CONFIG_LPC17_USBDEV_FRAME_INTERRUPT=n
-CONFIG_LPC17_USBDEV_EPFAST_INTERRUPT=n
-CONFIG_LPC17_USBDEV_DMA=n
-CONFIG_LPC17_USBDEV_NDMADESCRIPTORS=0
-CONFIG_LPC17_USBDEV_DMAINTMASK=0
-
-#
-# LPC17xx USB Host Configuration
-#
-# OHCI RAM layout:
-# CONFIG_USBHOST_OHCIRAM_SIZE
-# Total size of OHCI RAM (in AHB SRAM Bank 1)
-# CONFIG_USBHOST_NEDS
-# Number of endpoint descriptors
-# CONFIG_USBHOST_NTDS
-# Number of transfer descriptors
-# CONFIG_USBHOST_TDBUFFERS
-# Number of transfer descriptor buffers
-# CONFIG_USBHOST_TDBUFSIZE
-# Size of one transfer descriptor buffer
-# CONFIG_USBHOST_IOBUFSIZE
-# Size of one end-user I/O buffer
-#
-CONFIG_USBHOST_OHCIRAM_SIZE=2048
-CONFIG_USBHOST_NEDS=3
-CONFIG_USBHOST_NTDS=2
-CONFIG_USBHOST_TDBUFFERS=4
-CONFIG_USBHOST_TDBUFSIZE=128
-CONFIG_USBHOST_IOBUFSIZE=448
-
-#
-# USB Serial Device Configuration
-#
-# CONFIG_USBSER
-# Enable compilation of the USB serial driver
-# CONFIG_USBSER_EPINTIN
-# The logical 7-bit address of a hardware endpoint that supports
-# interrupt IN operation
-# CONFIG_USBSER_EPBULKOUT
-# The logical 7-bit address of a hardware endpoint that supports
-# bulk OUT operation
-# CONFIG_USBSER_EPBULKIN
-# The logical 7-bit address of a hardware endpoint that supports
-# bulk IN operation
-# # CONFIG_USBSER_NWRREQS and CONFIG_USBSER_NRDREQS
-# The number of write/read requests that can be in flight
-# CONFIG_USBSER_VENDORID and CONFIG_USBSER_VENDORSTR
-# The vendor ID code/string
-# CONFIG_USBSER_PRODUCTID and CONFIG_USBSER_PRODUCTSTR
-# The product ID code/string
-# CONFIG_USBSER_RXBUFSIZE and CONFIG_USBSER_TXBUFSIZE
-# Size of the serial receive/transmit buffers
-#
-CONFIG_USBSER=n
-CONFIG_USBSER_EPINTIN=1
-CONFIG_USBSER_EPBULKOUT=2
-CONFIG_USBSER_EPBULKIN=5
-CONFIG_USBSER_NWRREQS=4
-CONFIG_USBSER_NRDREQS=4
-CONFIG_USBSER_VENDORID=0x067b
-CONFIG_USBSER_PRODUCTID=0x2303
-CONFIG_USBSER_VENDORSTR="Nuttx"
-CONFIG_USBSER_PRODUCTSTR="USBdev Serial"
-CONFIG_USBSER_RXBUFSIZE=512
-CONFIG_USBSER_TXBUFSIZE=512
-
-#
-# USB Storage Device Configuration
-#
-# CONFIG_USBSTRG
-# Enable compilation of the USB storage driver
-# CONFIG_USBSTRG_EP0MAXPACKET
-# Max packet size for endpoint 0
-# CONFIG_USBSTRG_EPBULKOUT and CONFIG_USBSTRG_EPBULKIN
-# The logical 7-bit address of a hardware endpoints that support
-# bulk OUT and IN operations
-# CONFIG_USBSTRG_NWRREQS and CONFIG_USBSTRG_NRDREQS
-# The number of write/read requests that can be in flight
-# CONFIG_USBSTRG_BULKINREQLEN and CONFIG_USBSTRG_BULKOUTREQLEN
-# The size of the buffer in each write/read request. This
-# value needs to be at least as large as the endpoint
-# maxpacket and ideally as large as a block device sector.
-# CONFIG_USBSTRG_VENDORID and CONFIG_USBSTRG_VENDORSTR
-# The vendor ID code/string
-# CONFIG_USBSTRG_PRODUCTID and CONFIG_USBSTRG_PRODUCTSTR
-# The product ID code/string
-# CONFIG_USBSTRG_REMOVABLE
-# Select if the media is removable
-#
-CONFIG_USBSTRG=n
-CONFIG_USBSTRG_EP0MAXPACKET=64
-CONFIG_USBSTRG_EPBULKOUT=2
-CONFIG_USBSTRG_EPBULKIN=5
-CONFIG_USBSTRG_NRDREQS=2
-CONFIG_USBSTRG_NWRREQS=2
-CONFIG_USBSTRG_BULKINREQLEN=256
-CONFIG_USBSTRG_BULKOUTREQLEN=256
-CONFIG_USBSTRG_VENDORID=0x584e
-CONFIG_USBSTRG_VENDORSTR="NuttX"
-CONFIG_USBSTRG_PRODUCTID=0x5342
-CONFIG_USBSTRG_PRODUCTSTR="USBdev Storage"
-CONFIG_USBSTRG_VERSIONNO=0x0399
-CONFIG_USBSTRG_REMOVABLE=y
-
-#
-# Settings for examples/uip
-#
-CONFIG_EXAMPLE_UIP_IPADDR=(10<<24|0<<16|0<<8|2)
-CONFIG_EXAMPLE_UIP_DRIPADDR=(10<<24|0<<16|0<<8|1)
-CONFIG_EXAMPLE_UIP_NETMASK=(255<<24|255<<16|255<<8|0)
-CONFIG_EXAMPLE_UIP_DHCPC=n
-
-#
-# Settings for examples/nettest
-# CONFIG_EXAMPLE_NETTEST_SERVER - The target board can act
-# as either the client side or server side of the test
-# CONFIG_EXAMPLE_NETTEST_PERFORMANCE - If set, then the
-# client side simply receives messages forever, allowing
-# measurement of throughput
-# CONFIG_EXAMPLE_NETTEST_NOMAC - Set if the hardware has
-# no MAC address; one will be assigned
-# CONFIG_EXAMPLE_NETTEST_IPADDR - Target board IP address
-# CONFIG_EXAMPLE_NETTEST_DRIPADDR - Default router address
-# CONFIG_EXAMPLE_NETTEST_NETMASK - Network mask
-# CONFIG_EXAMPLE_NETTEST_CLIENTIP - IP address of the
-# client side of the test (may be target or host)
-#
-CONFIG_EXAMPLE_NETTEST_SERVER=n
-CONFIG_EXAMPLE_NETTEST_PERFORMANCE=n
-CONFIG_EXAMPLE_NETTEST_NOMAC=n
-CONFIG_EXAMPLE_NETTEST_IPADDR=(10<<24|0<<16|0<<8|2)
-CONFIG_EXAMPLE_NETTEST_DRIPADDR=(10<<24|0<<16|0<<8|1)
-CONFIG_EXAMPLE_NETTEST_NETMASK=(255<<24|255<<16|255<<8|0)
-CONFIG_EXAMPLE_NETTEST_CLIENTIP=(10<<24|0<<16|0<<8|1)
-
-#
-# Settings for apps/examples/wlan
-#
-CONFIG_EXAMPLE_WLAN_DHCPC=n
-CONFIG_EXAMPLE_WLAN_NOMAC=n
-CONFIG_EXAMPLE_WLAN_IPADDR=(192<<24|168<<16|0<<8|201)
-CONFIG_EXAMPLE_WLAN_DRIPADDR=(192<<24|168<<16|0<<8|1)
-CONFIG_EXAMPLE_WLAN_NETMASK=(255<<24|255<<16|255<<8|0)
-
-#
-# Settings for examples/ostest
-#
-CONFIG_EXAMPLES_OSTEST_LOOPS=1
-CONFIG_EXAMPLES_OSTEST_STACKSIZE=2048
-CONFIG_EXAMPLES_OSTEST_NBARRIER_THREADS=3
-
-#
-# Settings for apps/nshlib
-#
-# CONFIG_NSH_FILEIOSIZE - Size of a static I/O buffer
-# CONFIG_NSH_STRERROR - Use strerror(errno)
-# CONFIG_NSH_LINELEN - Maximum length of one command line
-# CONFIG_NSH_STACKSIZE - Stack size to use for new threads.
-# CONFIG_NSH_NESTDEPTH - Max number of nested if-then[-else]-fi
-# CONFIG_NSH_DISABLESCRIPT - Disable scripting support
-# CONFIG_NSH_DISABLEBG - Disable background commands
-# CONFIG_NSH_ROMFSETC - Use startup script in /etc
-# CONFIG_NSH_CONSOLE - Use serial console front end
-# CONFIG_NSH_TELNET - Use telnetd console front end
-# CONFIG_NSH_ARCHINIT - Platform provides architecture
-# specific initialization (nsh_archinitialize()).
-#
-# If CONFIG_NSH_TELNET is selected:
-# CONFIG_NSH_IOBUFFER_SIZE -- Telnetd I/O buffer size
-# CONFIG_NSH_DHCPC - Obtain address using DHCP
-# CONFIG_NSH_IPADDR - Provides static IP address
-# CONFIG_NSH_DRIPADDR - Provides static router IP address
-# CONFIG_NSH_NETMASK - Provides static network mask
-# CONFIG_NSH_NOMAC - Use a bogus MAC address
-#
-# If CONFIG_NSH_ROMFSETC is selected:
-# CONFIG_NSH_ROMFSMOUNTPT - ROMFS mountpoint
-# CONFIG_NSH_INITSCRIPT - Relative path to init script
-# CONFIG_NSH_ROMFSDEVNO - ROMFS RAM device minor
-# CONFIG_NSH_ROMFSSECTSIZE - ROMF sector size
-# CONFIG_NSH_FATDEVNO - FAT FS RAM device minor
-# CONFIG_NSH_FATSECTSIZE - FAT FS sector size
-# CONFIG_NSH_FATNSECTORS - FAT FS number of sectors
-# CONFIG_NSH_FATMOUNTPT - FAT FS mountpoint
-#
-CONFIG_NSH_FILEIOSIZE=512
-CONFIG_NSH_STRERROR=n
-CONFIG_NSH_LINELEN=64
-CONFIG_NSH_STACKSIZE=2048
-CONFIG_NSH_NESTDEPTH=3
-CONFIG_NSH_DISABLESCRIPT=n
-CONFIG_NSH_DISABLEBG=n
-CONFIG_NSH_ROMFSETC=n
-CONFIG_NSH_CONSOLE=y
-CONFIG_NSH_TELNET=n
-CONFIG_NSH_ARCHINIT=y
-CONFIG_NSH_IOBUFFER_SIZE=512
-CONFIG_NSH_DHCPC=n
-CONFIG_NSH_NOMAC=n
-CONFIG_NSH_IPADDR=(10<<24|0<<16|0<<8|2)
-CONFIG_NSH_DRIPADDR=(10<<24|0<<16|0<<8|1)
-CONFIG_NSH_NETMASK=(255<<24|255<<16|255<<8|0)
-CONFIG_NSH_ROMFSMOUNTPT="/etc"
-CONFIG_NSH_INITSCRIPT="init.d/rcS"
-CONFIG_NSH_ROMFSDEVNO=0
-CONFIG_NSH_ROMFSSECTSIZE=64
-CONFIG_NSH_FATDEVNO=1
-CONFIG_NSH_FATSECTSIZE=512
-CONFIG_NSH_FATNSECTORS=1024
-CONFIG_NSH_FATMOUNTPT=/tmp
-
-#
-# Architecture-specific NSH options
-#
-CONFIG_NSH_MMCSDSPIPORTNO=0
-CONFIG_NSH_MMCSDSLOTNO=0
-CONFIG_NSH_MMCSDMINOR=0
-
-#
-# Settings for examples/usbserial
-#
-# CONFIG_EXAMPLES_USBSERIAL_INONLY
-# Only verify IN (device-to-host) data transfers. Default: both
-# CONFIG_EXAMPLES_USBSERIAL_OUTONLY
-# Only verify OUT (host-to-device) data transfers. Default: both
-# CONFIG_EXAMPLES_USBSERIAL_ONLYSMALL
-# Send only small, single packet messages. Default: Send large and small.
-# CONFIG_EXAMPLES_USBSERIAL_ONLYBIG
-# Send only large, multi-packet messages. Default: Send large and small.
-#
-CONFIG_EXAMPLES_USBSERIAL_INONLY=n
-CONFIG_EXAMPLES_USBSERIAL_OUTONLY=n
-CONFIG_EXAMPLES_USBSERIAL_ONLYSMALL=n
-CONFIG_EXAMPLES_USBSERIAL_ONLYBIG=n
-
-CONFIG_EXAMPLES_USBSERIAL_TRACEINIT=n
-CONFIG_EXAMPLES_USBSERIAL_TRACECLASS=n
-CONFIG_EXAMPLES_USBSERIAL_TRACETRANSFERS=n
-CONFIG_EXAMPLES_USBSERIAL_TRACECONTROLLER=n
-CONFIG_EXAMPLES_USBSERIAL_TRACEINTERRUPTS=n
-
-#
-# Settings for internet_radio by Decio
-#
-CONFIG_INTERNETRADIO_ARCHINIT=n
-
-#
-# Stack and heap information
-#
-# CONFIG_BOOT_RUNFROMFLASH - Some configurations support XIP
-# operation from FLASH but must copy initialized .data sections to RAM.
-# (should also be =n for the LPC17xx which always runs from flash)
-# CONFIG_BOOT_COPYTORAM - Some configurations boot in FLASH
-# but copy themselves entirely into RAM for better performance.
-# CONFIG_CUSTOM_STACK - The up_ implementation will handle
-# all stack operations outside of the nuttx model.
-# CONFIG_STACK_POINTER - The initial stack pointer (arm7tdmi only)
-# CONFIG_IDLETHREAD_STACKSIZE - The size of the initial stack.
-# This is the thread that (1) performs the inital boot of the system up
-# to the point where user_start() is spawned, and (2) there after is the
-# IDLE thread that executes only when there is no other thread ready to
-# run.
-# CONFIG_USERMAIN_STACKSIZE - The size of the stack to allocate
-# for the main user thread that begins at the user_start() entry point.
-# CONFIG_PTHREAD_STACK_MIN - Minimum pthread stack size
-# CONFIG_PTHREAD_STACK_DEFAULT - Default pthread stack size
-# CONFIG_HEAP_BASE - The beginning of the heap
-# CONFIG_HEAP_SIZE - The size of the heap
-#
-CONFIG_BOOT_RUNFROMFLASH=n
-CONFIG_BOOT_COPYTORAM=n
-CONFIG_CUSTOM_STACK=n
-CONFIG_STACK_POINTER=
-CONFIG_IDLETHREAD_STACKSIZE=1024
-CONFIG_USERMAIN_STACKSIZE=2048
-CONFIG_PTHREAD_STACK_MIN=256
-CONFIG_PTHREAD_STACK_DEFAULT=2048
-CONFIG_HEAP_BASE=
-CONFIG_HEAP_SIZE=
-
-#
-# USB WLAN device identification
-#
-CONFIG_USB_WLAN_VID=0x0bda
-CONFIG_USB_WLAN_PID=0x8189
diff --git a/nuttx/configs/detron/wlan/ld.script b/nuttx/configs/detron/wlan/ld.script
deleted file mode 100755
index ba374449d..000000000
--- a/nuttx/configs/detron/wlan/ld.script
+++ /dev/null
@@ -1,110 +0,0 @@
-/****************************************************************************
- * configs/detron/wlan/ld.script
- *
- * Copyright (C) 2011 Gregory Nutt. All rights reserved.
- * Authors: Gregory Nutt <spudmonkey@racsa.co.cr>
- * Rafael Noronha <rafael@pdsolucoes.com.br>
- *
- * 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.
- *
- ****************************************************************************/
-
-/* The LPC1768 has 512Kb of FLASH beginning at address 0x0000:0000 and
- * 64Kb of total SRAM: 32Kb of SRAM in the CPU block beginning at address
- * 0x10000000 and 32Kb of AHB SRAM in two banks of 16Kb beginning at addresses
- * 0x20070000 and 0x20080000. Here we assume that .data and .bss will all fit
- * into the 32Kb CPU SRAM address range.
- */
-
-MEMORY
-{
- flash (rx) : ORIGIN = 0x00000000, LENGTH = 512K
- sram (rwx) : ORIGIN = 0x10000000, LENGTH = 32K
-}
-
-OUTPUT_ARCH(arm)
-ENTRY(_stext)
-SECTIONS
-{
- .text : {
- _stext = ABSOLUTE(.);
- *(.vectors)
- *(.text .text.*)
- *(.fixup)
- *(.gnu.warning)
- *(.rodata .rodata.*)
- *(.gnu.linkonce.t.*)
- *(.glue_7)
- *(.glue_7t)
- *(.got)
- *(.gcc_except_table)
- *(.gnu.linkonce.r.*)
- _etext = ABSOLUTE(.);
- } > flash
-
- _eronly = ABSOLUTE(.); /* See below */
-
- .data : {
- _sdata = ABSOLUTE(.);
- *(.data .data.*)
- *(.gnu.linkonce.d.*)
- CONSTRUCTORS
- _edata = ABSOLUTE(.);
- } > sram AT > flash
-
- .ARM.extab : {
- *(.ARM.extab*)
- } >sram
-
- .ARM.exidx : {
- __exidx_start = ABSOLUTE(.);
- *(.ARM.exidx*)
- __exidx_end = ABSOLUTE(.);
- } >sram
-
- .bss : { /* BSS */
- _sbss = ABSOLUTE(.);
- *(.bss .bss.*)
- *(.gnu.linkonce.b.*)
- *(COMMON)
- _ebss = ABSOLUTE(.);
- } > sram
- /* Stabs debugging sections. */
- .stab 0 : { *(.stab) }
- .stabstr 0 : { *(.stabstr) }
- .stab.excl 0 : { *(.stab.excl) }
- .stab.exclstr 0 : { *(.stab.exclstr) }
- .stab.index 0 : { *(.stab.index) }
- .stab.indexstr 0 : { *(.stab.indexstr) }
- .comment 0 : { *(.comment) }
- .debug_abbrev 0 : { *(.debug_abbrev) }
- .debug_info 0 : { *(.debug_info) }
- .debug_line 0 : { *(.debug_line) }
- .debug_pubnames 0 : { *(.debug_pubnames) }
- .debug_aranges 0 : { *(.debug_aranges) }
-}
diff --git a/nuttx/configs/detron/wlan/setenv.sh b/nuttx/configs/detron/wlan/setenv.sh
deleted file mode 100755
index 7dfa40542..000000000
--- a/nuttx/configs/detron/wlan/setenv.sh
+++ /dev/null
@@ -1,47 +0,0 @@
-#!/bin/bash
-# configs/detron/wlan/setenv.sh
-#
-# Copyright (C) 2011 Gregory Nutt. All rights reserved.
-# Authors: Gregory Nutt <spudmonkey@racsa.co.cr>
-# Rafael Noronha <rafael@pdsolucoes.com.br>
-#
-# 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.
-#
-
-if [ "$(basename $0)" = "setenv.sh" ] ; then
- echo "You must source this script, not run it!" 1>&2
- exit 1
-fi
-
-if [ -z "${PATH_ORIG}" ]; then export PATH_ORIG="${PATH}"; fi
-
-WD=`pwd`
-export BUILDROOT_BIN="${WD}/../buildroot/build_arm_nofpu/staging_dir/bin"
-export PATH="${BUILDROOT_BIN}:/sbin:/usr/sbin:${PATH_ORIG}"
-
-echo "PATH : ${PATH}"