This is the final version of Mini Gateway for Automation and Security desgined for Renesas GR Peach Design Contest

Dependencies:   GR-PEACH_video GraphicsFramework HTTPServer R_BSP mbed-rpc mbed-rtos Socket lwip-eth lwip-sys lwip FATFileSystem

Fork of mbed-os-example-mbed5-blinky by mbed-os-examples

Auto generated API documentation and code listings for MGAS_GR_Peach

Classes

_ARM_DRIVER_STORAGE This is the set of operations constituting the Storage driver
_ARM_DRIVER_VERSION Driver Version
_ARM_STORAGE_BLOCK A storage block is a range of memory with uniform attributes
_ARM_STORAGE_BLOCK_ATTRIBUTES Attributes of the storage range within a storage block
_ARM_STORAGE_CAPABILITIES Storage Driver API Capabilities
_ARM_STORAGE_INFO Storage information
_ARM_STORAGE_SECURITY_FEATURES Device Data Security Protection Features
_ARM_STORAGE_STATUS Operating status of the storage controller
AnalogIn An analog input, used for reading the voltage on a pin
AnalogOut An analog output, used for setting the voltage on a pin
APSR_Type Union type to access the Application Program Status Register (APSR)
arm_bilinear_interp_instance_f32 Instance structure for the floating-point bilinear interpolation function
arm_bilinear_interp_instance_q15 Instance structure for the Q15 bilinear interpolation function
arm_bilinear_interp_instance_q31 Instance structure for the Q31 bilinear interpolation function
arm_bilinear_interp_instance_q7 Instance structure for the Q15 bilinear interpolation function
arm_biquad_cas_df1_32x64_ins_q31 Instance structure for the high precision Q31 Biquad cascade filter
arm_biquad_cascade_df2T_instance_f32 Instance structure for the floating-point transposed direct form II Biquad cascade filter
arm_biquad_cascade_df2T_instance_f64 Instance structure for the floating-point transposed direct form II Biquad cascade filter
arm_biquad_cascade_stereo_df2T_instance_f32 Instance structure for the floating-point transposed direct form II Biquad cascade filter
arm_biquad_casd_df1_inst_f32 Instance structure for the floating-point Biquad cascade filter
arm_biquad_casd_df1_inst_q15 Instance structure for the Q15 Biquad cascade filter
arm_biquad_casd_df1_inst_q31 Instance structure for the Q31 Biquad cascade filter
arm_cfft_instance_f32 Instance structure for the floating-point CFFT/CIFFT function
arm_cfft_instance_q15 Instance structure for the fixed-point CFFT/CIFFT function
arm_cfft_instance_q31 Instance structure for the fixed-point CFFT/CIFFT function
arm_cfft_radix2_instance_f32 Instance structure for the floating-point CFFT/CIFFT function
arm_cfft_radix2_instance_q15 Instance structure for the Q15 CFFT/CIFFT function
arm_cfft_radix2_instance_q31 Instance structure for the Radix-2 Q31 CFFT/CIFFT function
arm_cfft_radix4_instance_f32 Instance structure for the floating-point CFFT/CIFFT function
arm_cfft_radix4_instance_q15 Instance structure for the Q15 CFFT/CIFFT function
arm_cfft_radix4_instance_q31 Instance structure for the Q31 CFFT/CIFFT function
arm_dct4_instance_f32 Instance structure for the floating-point DCT4/IDCT4 function
arm_dct4_instance_q15 Instance structure for the Q15 DCT4/IDCT4 function
arm_dct4_instance_q31 Instance structure for the Q31 DCT4/IDCT4 function
arm_fir_decimate_instance_f32 Instance structure for the floating-point FIR decimator
arm_fir_decimate_instance_q15 Instance structure for the Q15 FIR decimator
arm_fir_decimate_instance_q31 Instance structure for the Q31 FIR decimator
arm_fir_instance_f32 Instance structure for the floating-point FIR filter
arm_fir_instance_q15 Instance structure for the Q15 FIR filter
arm_fir_instance_q31 Instance structure for the Q31 FIR filter
arm_fir_instance_q7 Instance structure for the Q7 FIR filter
arm_fir_interpolate_instance_f32 Instance structure for the floating-point FIR interpolator
arm_fir_interpolate_instance_q15 Instance structure for the Q15 FIR interpolator
arm_fir_interpolate_instance_q31 Instance structure for the Q31 FIR interpolator
arm_fir_lattice_instance_f32 Instance structure for the floating-point FIR lattice filter
arm_fir_lattice_instance_q15 Instance structure for the Q15 FIR lattice filter
arm_fir_lattice_instance_q31 Instance structure for the Q31 FIR lattice filter
arm_fir_sparse_instance_f32 Instance structure for the floating-point sparse FIR filter
arm_fir_sparse_instance_q15 Instance structure for the Q15 sparse FIR filter
arm_fir_sparse_instance_q31 Instance structure for the Q31 sparse FIR filter
arm_fir_sparse_instance_q7 Instance structure for the Q7 sparse FIR filter
arm_iir_lattice_instance_f32 Instance structure for the floating-point IIR lattice filter
arm_iir_lattice_instance_q15 Instance structure for the Q15 IIR lattice filter
arm_iir_lattice_instance_q31 Instance structure for the Q31 IIR lattice filter
arm_linear_interp_instance_f32 Instance structure for the floating-point Linear Interpolate function
arm_lms_instance_f32 Instance structure for the floating-point LMS filter
arm_lms_instance_q15 Instance structure for the Q15 LMS filter
arm_lms_instance_q31 Instance structure for the Q31 LMS filter
arm_lms_norm_instance_f32 Instance structure for the floating-point normalized LMS filter
arm_lms_norm_instance_q15 Instance structure for the Q15 normalized LMS filter
arm_lms_norm_instance_q31 Instance structure for the Q31 normalized LMS filter
arm_matrix_instance_f32 Instance structure for the floating-point matrix structure
arm_matrix_instance_f64 Instance structure for the floating-point matrix structure
arm_matrix_instance_q15 Instance structure for the Q15 matrix structure
arm_matrix_instance_q31 Instance structure for the Q31 matrix structure
arm_pid_instance_f32 Instance structure for the floating-point PID Control
arm_pid_instance_q15 Instance structure for the Q15 PID Control
arm_pid_instance_q31 Instance structure for the Q31 PID Control
arm_rfft_fast_instance_f32 Instance structure for the floating-point RFFT/RIFFT function
arm_rfft_instance_f32 Instance structure for the floating-point RFFT/RIFFT function
arm_rfft_instance_q15 Instance structure for the Q15 RFFT/RIFFT function
arm_rfft_instance_q31 Instance structure for the Q31 RFFT/RIFFT function
Bitmap_s Bitmap
buffer_s Generic buffer structure
BUS16 Parallel 16bit interface
BUS8 Parallel 8bit interface
BusIn A digital input bus, used for reading the state of a collection of pins
BusInOut A digital input output bus, used for setting the state of a collection of pins
BusOut A digital output bus, used for setting the state of a collection of pins
Callback< R()> Callback class based on template specialization
Callback< R(A0)> Callback class based on template specialization
Callback< R(A0, A1)> Callback class based on template specialization
Callback< R(A0, A1, A2)> Callback class based on template specialization
Callback< R(A0, A1, A2, A3)> Callback class based on template specialization
Callback< R(A0, A1, A2, A3, A4)> Callback class based on template specialization
CAN A can bus client, used for communicating with can devices
CANMessage CANMessage class
CircularBuffer< T, BufferSize, CounterType > Templated Circular buffer class
CThunk< T > Class for created a pointer with data bound to it
DigitalIn A digital input, used for reading the state of a pin
DigitalInOut A digital input/output, used for setting or reading a bi-directional pin
DigitalOut A digital output, used for setting the state of a pin
DirHandle Represents a directory stream
Ethernet An ethernet interface, to use with the ethernet pins
EthernetInterface Interface using Ethernet to connect to an IP-based network
FileHandle An OO equivalent of the internal FILEHANDLE variable and associated _sys_* functions
FileSystemLike A filesystem-like object is one that can be used to open files though it by fopen("/name/filename", mode)
GraphicsDisplay A common base class for Graphics displays
I2C An I2C Master, used for communicating with I2C slave devices
i2c_t Asynch I2C HAL structure
I2CSlave An I2C Slave, used for communicating with an I2C Master device
ILI9327 Class for ILI9327
ILI932x Class for ILI932x tft display controller to be copypasted and adapted for other controllers
ILI9341 Class for ILI9341 tft display controller to be copypasted and adapted for other controllers
ILI9486 Class for ILI9486 tft display controller to be copypasted and adapted for other controllers
InterruptIn A digital interrupt input, used to call a function on a rising or falling edge
InterruptManager Use this singleton if you need to chain interrupt handlers
IST3020 Class for IST3020 display controller to be copypasted and adapted for other controllers
LCD A common base class for monochrome Display
LocalFileSystem A filesystem for accessing the local mbed Microcontroller USB disk drive
LowPowerTicker Low Power Ticker
LowPowerTimeout Low Power Timout
LowPowerTimer Low power timer
PAR16 Parallel 16bit interface
PAR8 Parallel 8bit interface
PlatformMutex A stub mutex for when an RTOS is not present
PortIn A multiple pin digital input
PortInOut A multiple pin digital in/out used to set/read multiple bi-directional pins
PortOut A multiple pin digital out
Protocols Abstract interface class for spi and parallel protocols
PwmOut A pulse-width modulation digital output
RawSerial A serial port (UART) for communication with other serial devices This is a variation of the Serial class that doesn't use streams, thus making it safe to use in interrupt handlers with the RTOS
RF24 Driver for nRF24L01(+) 2.4GHz Wireless Transceiver
S6D04D1 Class for S6D04D1 TFT display controller for BM8K5113 TFT1P3520-E TFT8K5113FPC-A1-E and TFT1P3520 to be copypasted and adapted for other controllers
SEPS225 Class for SEPS225 Syncoam Co.,Ltd 128 x 128 Dots, 262K Colors PM-OLED Display Driver and Controller
Serial A serial port (UART) for communication with other serial devices
serial_t Asynch serial HAL structure
SerialBase A base class for serial port implementations Can't be instantiated directly (use Serial or RawSerial )
SingletonPtr< T > Utility class for creating an using a singleton
SPI A SPI Master, used for communicating with SPI slave devices
SPI16 SPI 16bit interface
SPI8 SPI 8bit interface
spi_t Asynch SPI HAL structure
SPISlave A SPI slave, used for communicating with a SPI Master device
SSD1306 Class for SSD1306 display controller to be copypasted and adapted for other controllers
ST7565 Class for ST7565 and similar display controllers to be copypasted and adapted for other controllers
Stream File stream
TextDisplay A common base class for Text displays
TFT A common base class for color TFT Display
TFT932x A custom base class for ILI932x color TFT Display (except ILI9327 which is MIPI standard)
TFT_MIPI Class for (quite)standard MIPI-DBI TypeB (parallel) and TypeC (spi) TFT display controller for Ilitek ILI9481, Renesas R61581, Raydium RM68042 to be copypasted and adapted for other controllers
Ticker A Ticker is used to call a function at a recurring interval
ticker_data_t Ticker's data structure
ticker_event_queue_t Ticker's event queue structure
ticker_event_s Ticker's event structure
ticker_interface_t Ticker's interface structure - required API for a ticker
Timeout A Timeout is used to call a function at a point in the future
Timer A general purpose timer
TimerEvent Base abstraction for timer interrupts
Transaction< Class > Transaction class defines a transaction
transaction_t Transaction structure
UC1608 Class for UC1608 display controller to be copypasted and adapted for other controllers

Code

AnalogIn.cpp [code]
AnalogIn.h [code]
analogin_api.h [code]
AnalogOut.h [code]
analogout_api.h [code]
Arial12x12.h [code]
Arial24x23.h [code]
Arial28x28.h [code]
Arial43x48_numb.h [code]
arm_common_tables.h [code]
arm_const_structs.h [code]
arm_math.h [code]
buffer.h [code]
BUS16.cpp [code]
BUS16.h [code]
BUS8.cpp [code]
BUS8.h [code]
BusIn.cpp [code]
BusIn.h [code]
BusInOut.cpp [code]
BusInOut.h [code]
BusOut.cpp [code]
BusOut.h [code]
Callback.h [code]
CallChain.cpp [code]
CallChain.h [code]
camera.h [code]
CAN.cpp [code]
CAN.h [code]
can_api.h [code]
can_helper.h [code]
CircularBuffer.h [code]
core_ca9.h [code] CMSIS Cortex-A9 Core Peripheral Access Layer Header File
core_ca_mmu.h [code] ; * ; *
core_caFunc.h [code] CMSIS Cortex-A Core Function Access Header File
core_caInstr.h [code] CMSIS Cortex-A9 Core Peripheral Access Layer Header File
core_cm0.h [code] CMSIS Cortex-M0 Core Peripheral Access Layer Header File
core_cm0plus.h [code] CMSIS Cortex-M0+ Core Peripheral Access Layer Header File
core_cm3.h [code] CMSIS Cortex-M3 Core Peripheral Access Layer Header File
core_cm4.h [code] CMSIS Cortex-M4 Core Peripheral Access Layer Header File
core_cm4_simd.h [code] CMSIS Cortex-M4 SIMD Header File
core_cm7.h [code] CMSIS Cortex-M7 Core Peripheral Access Layer Header File
core_cmFunc.h [code] CMSIS Cortex-M Core Function Access Header File
core_cmInstr.h [code] CMSIS Cortex-M Core Instruction Access Header File
core_cmSecureAccess.h [code] CMSIS Cortex-M Core Secure Access Header File
core_cmSimd.h [code] CMSIS Cortex-M SIMD Header File
core_sc000.h [code] CMSIS SC000 Core Peripheral Access Layer Header File
core_sc300.h [code] CMSIS SC300 Core Peripheral Access Layer Header File
critical.h [code]
CThunk.h [code]
DigitalIn.h [code]
DigitalInOut.h [code]
DigitalOut.h [code]
DirHandle.h [code]
dma_api.h [code]
Driver_Common.h [code]
Driver_Storage.h [code]
emac_api.h [code]
eth_arch.h [code]
Ethernet.cpp [code]
Ethernet.h [code]
ethernet_api.h [code]
EthernetInterface.cpp [code]
EthernetInterface.h [code]
FileBase.cpp [code]
FileBase.h [code]
FileHandle.h [code]
FileLike.cpp [code]
FileLike.h [code]
FilePath.cpp [code]
FilePath.h [code]
FileSystemLike.cpp [code]
FileSystemLike.h [code]
FunctionPointer.h [code]
gpio_api.h [code]
gpio_irq_api.h [code]
GraphicsDisplay.cpp [code]
GraphicsDisplay.h [code]
I2C.cpp [code]
I2C.h [code]
i2c_api.h [code]
I2CSlave.cpp [code]
I2CSlave.h [code]
ILI9327.cpp [code]
ILI9327.h [code]
ILI932x.cpp [code]
ILI932x.h [code]
ILI9341.cpp [code]
ILI9341.h [code]
ILI9486.cpp [code]
ILI9486.h [code]
InterruptIn.cpp [code]
InterruptIn.h [code]
InterruptManager.cpp [code]
InterruptManager.h [code]
IST3020.cpp [code]
IST3020.h [code]
LCD.cpp [code]
LCD.h [code]
LocalFileSystem.cpp [code]
LocalFileSystem.h [code]
LowPowerTicker.h [code]
LowPowerTimeout.h [code]
LowPowerTimer.h [code]
lp_ticker_api.h [code]
main.cpp [code]
mbed.h [code]
mbed_alloc_wrappers.cpp [code]
mbed_assert.c [code]
mbed_assert.h [code]
mbed_board.c [code]
mbed_critical.c [code]
mbed_debug.h [code]
mbed_error.c [code]
mbed_error.h [code]
mbed_gpio.c [code]
mbed_interface.c [code]
mbed_interface.h [code]
mbed_lp_ticker_api.c [code]
mbed_mem_trace.c [code]
mbed_mem_trace.h [code]
mbed_pinmap_common.c [code]
mbed_preprocessor.h [code]
mbed_rtc_time.cpp [code]
mbed_semihost_api.c [code]
mbed_stats.c [code]
mbed_stats.h [code]
mbed_ticker_api.c [code]
mbed_us_ticker_api.c [code]
mbed_wait_api_no_rtos.c [code]
mbed_wait_api_rtos.cpp [code]
nRF24L01.h [code]
PAR16.cpp [code]
PAR16.h [code]
PAR8.cpp [code]
PAR8.h [code]
pavement_48x34.h [code]
pict.h [code]
pinmap.h [code]
platform.h [code]
PlatformMutex.h [code]
port_api.h [code]
PortIn.h [code]
PortInOut.h [code]
PortOut.h [code]
Protocols.h [code]
PwmOut.h [code]
pwmout_api.h [code]
RawSerial.cpp [code]
RawSerial.h [code]
retarget.cpp [code]
RF24.cpp [code]
RF24.h [code] Class declaration for RF24 and helper enums
RF24_config.h [code]
rtc_api.h [code]
rtc_time.h [code]
S6D04D1.cpp [code]
S6D04D1.h [code]
SDFileSystem.cpp [code]
SDFileSystem.h [code]
semihost_api.h [code]
SEPS225.cpp [code]
SEPS225.h [code]
Serial.cpp [code]
Serial.h [code]
serial_api.h [code]
SerialBase.cpp [code]
SerialBase.h [code]
SingletonPtr.h [code]
sleep_api.h [code]
SPI.cpp [code]
SPI.h [code]
SPI16.cpp [code]
SPI16.h [code]
SPI8.cpp [code]
SPI8.h [code]
spi_api.h [code]
SPISlave.cpp [code]
SPISlave.h [code]
SSD1306.cpp [code]
SSD1306.h [code]
ST7565.cpp [code]
ST7565.h [code]
Stream.cpp [code]
Stream.h [code]
Terminal6x8.h [code]
TextDisplay.cpp [code]
TextDisplay.h [code]
TFT.cpp [code]
TFT.h [code]
TFT932x.cpp [code]
TFT932x.h [code]
TFT_MIPI.cpp [code]
TFT_MIPI.h [code]
Ticker.cpp [code]
Ticker.h [code]
ticker_api.h [code]
Timeout.cpp [code]
Timeout.h [code]
Timer.cpp [code]
Timer.h [code]
TimerEvent.cpp [code]
TimerEvent.h [code]
toolchain.h [code]
Touch.cpp [code]
Touch.h [code]
Transaction.h [code]
trng_api.h [code]
UC1608.cpp [code]
UC1608.h [code]
us_ticker_api.h [code]
wait_api.h [code]