aboutsummaryrefslogtreecommitdiffstats
path: root/arduino/libraries/Bluefruit52Lib/examples/Hardware
diff options
context:
space:
mode:
Diffstat (limited to 'arduino/libraries/Bluefruit52Lib/examples/Hardware')
-rwxr-xr-xarduino/libraries/Bluefruit52Lib/examples/Hardware/Fading/Fading.ino45
-rwxr-xr-xarduino/libraries/Bluefruit52Lib/examples/Hardware/Serial1_test/Serial1_test.ino46
-rwxr-xr-xarduino/libraries/Bluefruit52Lib/examples/Hardware/SerialEcho/SerialEcho.ino45
-rwxr-xr-xarduino/libraries/Bluefruit52Lib/examples/Hardware/adc/adc.ino21
-rwxr-xr-xarduino/libraries/Bluefruit52Lib/examples/Hardware/adc_vbat/adc_vbat.ino93
-rwxr-xr-xarduino/libraries/Bluefruit52Lib/examples/Hardware/blinky/blinky.ino30
-rwxr-xr-xarduino/libraries/Bluefruit52Lib/examples/Hardware/dfu_ota/dfu_ota.ino28
-rwxr-xr-xarduino/libraries/Bluefruit52Lib/examples/Hardware/dfu_serial/dfu_serial.ino29
-rwxr-xr-xarduino/libraries/Bluefruit52Lib/examples/Hardware/digital_interrupt_deferred/digital_interrupt_deferred.ino46
-rwxr-xr-xarduino/libraries/Bluefruit52Lib/examples/Hardware/fwinfo/fwinfo.ino33
-rwxr-xr-xarduino/libraries/Bluefruit52Lib/examples/Hardware/gpstest_swuart/gpstest_swuart.ino57
-rwxr-xr-xarduino/libraries/Bluefruit52Lib/examples/Hardware/hw_systick/hw_systick.ino57
-rwxr-xr-xarduino/libraries/Bluefruit52Lib/examples/Hardware/hwinfo/hwinfo.ino42
-rwxr-xr-xarduino/libraries/Bluefruit52Lib/examples/Hardware/hwpwm/hwpwm.ino81
-rwxr-xr-xarduino/libraries/Bluefruit52Lib/examples/Hardware/meminfo/meminfo.ino33
-rwxr-xr-xarduino/libraries/Bluefruit52Lib/examples/Hardware/nfc_to_gpio/nfc_to_gpio.ino40
-rwxr-xr-xarduino/libraries/Bluefruit52Lib/examples/Hardware/rtos_scheduler/rtos_scheduler.ino49
-rwxr-xr-xarduino/libraries/Bluefruit52Lib/examples/Hardware/software_timer/software_timer.ino58
18 files changed, 833 insertions, 0 deletions
diff --git a/arduino/libraries/Bluefruit52Lib/examples/Hardware/Fading/Fading.ino b/arduino/libraries/Bluefruit52Lib/examples/Hardware/Fading/Fading.ino
new file mode 100755
index 0000000..d5df3a8
--- /dev/null
+++ b/arduino/libraries/Bluefruit52Lib/examples/Hardware/Fading/Fading.ino
@@ -0,0 +1,45 @@
+/*
+ Fading
+
+ This example shows how to fade an LED using the analogWrite() function.
+
+ The circuit:
+ * LED attached from digital pin 9 to ground.
+
+ Created 1 Nov 2008
+ By David A. Mellis
+ modified 30 Aug 2011
+ By Tom Igoe
+
+ http://www.arduino.cc/en/Tutorial/Fading
+
+ This example code is in the public domain.
+
+ */
+
+
+int ledPin = LED_RED; // LED connected to digital pin 9
+
+void setup() {
+ // nothing happens in setup
+}
+
+void loop() {
+ // fade in from min to max in increments of 5 points:
+ for (int fadeValue = 0 ; fadeValue <= 255; fadeValue += 5) {
+ // sets the value (range from 0 to 255):
+ analogWrite(ledPin, fadeValue);
+ // wait for 30 milliseconds to see the dimming effect
+ delay(30);
+ }
+
+ // fade out from max to min in increments of 5 points:
+ for (int fadeValue = 255 ; fadeValue >= 0; fadeValue -= 5) {
+ // sets the value (range from 0 to 255):
+ analogWrite(ledPin, fadeValue);
+ // wait for 30 milliseconds to see the dimming effect
+ delay(30);
+ }
+}
+
+
diff --git a/arduino/libraries/Bluefruit52Lib/examples/Hardware/Serial1_test/Serial1_test.ino b/arduino/libraries/Bluefruit52Lib/examples/Hardware/Serial1_test/Serial1_test.ino
new file mode 100755
index 0000000..ff5875d
--- /dev/null
+++ b/arduino/libraries/Bluefruit52Lib/examples/Hardware/Serial1_test/Serial1_test.ino
@@ -0,0 +1,46 @@
+/*********************************************************************
+ This is an example for our Feather Bluefruit modules
+
+ Pick one up today in the adafruit shop!
+
+ Adafruit invests time and resources providing this open source code,
+ please support Adafruit and open-source hardware by purchasing
+ products from Adafruit!
+
+ MIT license, check LICENSE for more information
+ All text above, and the splash screen below must be included in
+ any redistribution
+*********************************************************************/
+
+/*
+ * This sketch demonstrate how to use Hardware Serial1 along with
+ * native USB Serial on Bluefruit nRF52840.
+ * Note: Bluefruit nRF52832 does not support Serial1
+ */
+
+#include "Arduino.h"
+
+void setup()
+{
+ // Open serial communications and wait for port to open:
+ Serial.begin(115200);
+ while ( !Serial ) delay(10); // for nrf52840 with native usb
+
+ Serial.println("Goodnight moon!");
+
+ // set the data rate for the SoftwareSerial port
+ //mySerial.begin(9600);
+ //mySerial.println("Hello, world?");
+
+ Serial1.begin(115200);
+ Serial1.println("Hello, world?");
+}
+
+void loop() // run over and over//
+{
+ if (Serial1.available())
+ Serial.write(Serial1.read());
+
+ if (Serial.available())
+ Serial1.write(Serial.read());
+}
diff --git a/arduino/libraries/Bluefruit52Lib/examples/Hardware/SerialEcho/SerialEcho.ino b/arduino/libraries/Bluefruit52Lib/examples/Hardware/SerialEcho/SerialEcho.ino
new file mode 100755
index 0000000..0daf716
--- /dev/null
+++ b/arduino/libraries/Bluefruit52Lib/examples/Hardware/SerialEcho/SerialEcho.ino
@@ -0,0 +1,45 @@
+/*********************************************************************
+ This is an example for our Feather Bluefruit modules
+
+ Pick one up today in the adafruit shop!
+
+ Adafruit invests time and resources providing this open source code,
+ please support Adafruit and open-source hardware by purchasing
+ products from Adafruit!
+
+ MIT license, check LICENSE for more information
+ All text above, and the splash screen below must be included in
+ any redistribution
+*********************************************************************/
+
+#include <Arduino.h>
+
+const int baudrate = 115200;
+
+/**************************************************************************/
+/*!
+ @brief The setup function runs once when reset the board
+*/
+/**************************************************************************/
+void setup()
+{
+ Serial.begin (baudrate);
+
+ Serial.println("Serial Echo demo");
+ Serial.print("Badurate : ");
+ Serial.println(baudrate);
+}
+
+/**************************************************************************/
+/*!
+ @brief The loop function runs over and over again forever
+*/
+/**************************************************************************/
+void loop()
+{
+ // From Serial monitor to All
+ if ( Serial.available() )
+ {
+ Serial.write( Serial.read() );
+ }
+}
diff --git a/arduino/libraries/Bluefruit52Lib/examples/Hardware/adc/adc.ino b/arduino/libraries/Bluefruit52Lib/examples/Hardware/adc/adc.ino
new file mode 100755
index 0000000..1133826
--- /dev/null
+++ b/arduino/libraries/Bluefruit52Lib/examples/Hardware/adc/adc.ino
@@ -0,0 +1,21 @@
+int adcin = A5;
+int adcvalue = 0;
+float mv_per_lsb = 3600.0F/1024.0F; // 10-bit ADC with 3.6V input range
+
+void setup() {
+ Serial.begin(115200);
+ while ( !Serial ) delay(10); // for nrf52840 with native usb
+}
+
+void loop() {
+ // Get a fresh ADC value
+ adcvalue = analogRead(adcin);
+
+ // Display the results
+ Serial.print(adcvalue);
+ Serial.print(" [");
+ Serial.print((float)adcvalue * mv_per_lsb);
+ Serial.println(" mV]");
+
+ delay(100);
+}
diff --git a/arduino/libraries/Bluefruit52Lib/examples/Hardware/adc_vbat/adc_vbat.ino b/arduino/libraries/Bluefruit52Lib/examples/Hardware/adc_vbat/adc_vbat.ino
new file mode 100755
index 0000000..ceaa0a1
--- /dev/null
+++ b/arduino/libraries/Bluefruit52Lib/examples/Hardware/adc_vbat/adc_vbat.ino
@@ -0,0 +1,93 @@
+#define VBAT_PIN (A7)
+#define VBAT_MV_PER_LSB (0.73242188F) // 3.0V ADC range and 12-bit ADC resolution = 3000mV/4096
+#define VBAT_DIVIDER (0.71275837F) // 2M + 0.806M voltage divider on VBAT = (2M / (0.806M + 2M))
+#define VBAT_DIVIDER_COMP (1.403F) // Compensation factor for the VBAT divider
+
+int readVBAT(void) {
+ int raw;
+
+ // Set the analog reference to 3.0V (default = 3.6V)
+ analogReference(AR_INTERNAL_3_0);
+
+ // Set the resolution to 12-bit (0..4095)
+ analogReadResolution(12); // Can be 8, 10, 12 or 14
+
+ // Let the ADC settle
+ delay(1);
+
+ // Get the raw 12-bit, 0..3000mV ADC value
+ raw = analogRead(VBAT_PIN);
+
+ // Set the ADC back to the default settings
+ analogReference(AR_DEFAULT);
+ analogReadResolution(10);
+
+ return raw;
+}
+
+uint8_t mvToPercent(float mvolts) {
+ uint8_t battery_level;
+
+ if (mvolts >= 3000)
+ {
+ battery_level = 100;
+ }
+ else if (mvolts > 2900)
+ {
+ battery_level = 100 - ((3000 - mvolts) * 58) / 100;
+ }
+ else if (mvolts > 2740)
+ {
+ battery_level = 42 - ((2900 - mvolts) * 24) / 160;
+ }
+ else if (mvolts > 2440)
+ {
+ battery_level = 18 - ((2740 - mvolts) * 12) / 300;
+ }
+ else if (mvolts > 2100)
+ {
+ battery_level = 6 - ((2440 - mvolts) * 6) / 340;
+ }
+ else
+ {
+ battery_level = 0;
+ }
+
+ return battery_level;
+}
+
+void setup() {
+ Serial.begin(115200);
+ while ( !Serial ) delay(10); // for nrf52840 with native usb
+
+ // Get a single ADC sample and throw it away
+ readVBAT();
+}
+
+void loop() {
+ // Get a raw ADC reading
+ int vbat_raw = readVBAT();
+
+ // Convert from raw mv to percentage (based on LIPO chemistry)
+ uint8_t vbat_per = mvToPercent(vbat_raw * VBAT_MV_PER_LSB);
+
+ // Convert the raw value to compensated mv, taking the resistor-
+ // divider into account (providing the actual LIPO voltage)
+ // ADC range is 0..3000mV and resolution is 12-bit (0..4095),
+ // VBAT voltage divider is 2M + 0.806M, which needs to be added back
+ float vbat_mv = (float)vbat_raw * VBAT_MV_PER_LSB * VBAT_DIVIDER_COMP;
+
+ // Display the results
+ Serial.print("ADC = ");
+ Serial.print(vbat_raw * VBAT_MV_PER_LSB);
+ Serial.print(" mV (");
+ Serial.print(vbat_raw);
+ Serial.print(") ");
+ Serial.print("LIPO = ");
+ Serial.print(vbat_mv);
+ Serial.print(" mV (");
+ Serial.print(vbat_per);
+ Serial.println("%)");
+
+ delay(1000);
+}
diff --git a/arduino/libraries/Bluefruit52Lib/examples/Hardware/blinky/blinky.ino b/arduino/libraries/Bluefruit52Lib/examples/Hardware/blinky/blinky.ino
new file mode 100755
index 0000000..c2f4906
--- /dev/null
+++ b/arduino/libraries/Bluefruit52Lib/examples/Hardware/blinky/blinky.ino
@@ -0,0 +1,30 @@
+/*
+ Blink
+ Turns on an LED on for one second, then off for one second, repeatedly.
+
+ Most Arduinos have an on-board LED you can control. On the UNO, MEGA and ZERO
+ it is attached to digital pin 13, on MKR1000 on pin 6. LED_BUILTIN takes care
+ of use the correct LED pin whatever is the board used.
+ If you want to know what pin the on-board LED is connected to on your Arduino model, check
+ the Technical Specs of your board at https://www.arduino.cc/en/Main/Products
+
+ This example code is in the public domain.
+
+ modified 8 May 2014
+ by Scott Fitzgerald
+
+ modified 2 Sep 2016
+ by Arturo Guadalupi
+*/
+
+// the setup function runs once when you press reset or power the board
+void setup() {
+ // initialize digital pin LED_BUILTIN as an output.
+ pinMode(LED_RED, OUTPUT);
+}
+
+// the loop function runs over and over again forever
+void loop() {
+ digitalToggle(LED_RED); // turn the LED on (HIGH is the voltage level)
+ delay(1000); // wait for a second
+}
diff --git a/arduino/libraries/Bluefruit52Lib/examples/Hardware/dfu_ota/dfu_ota.ino b/arduino/libraries/Bluefruit52Lib/examples/Hardware/dfu_ota/dfu_ota.ino
new file mode 100755
index 0000000..4dca371
--- /dev/null
+++ b/arduino/libraries/Bluefruit52Lib/examples/Hardware/dfu_ota/dfu_ota.ino
@@ -0,0 +1,28 @@
+/*********************************************************************
+ This is an example for our nRF52 based Bluefruit LE modules
+
+ Pick one up today in the adafruit shop!
+
+ Adafruit invests time and resources providing this open source code,
+ please support Adafruit and open-source hardware by purchasing
+ products from Adafruit!
+
+ MIT license, check LICENSE for more information
+ All text above, and the splash screen below must be included in
+ any redistribution
+*********************************************************************/
+
+/* This sketch invoke API to enter OTA dfu mode */
+
+#include <Arduino.h>
+
+
+void setup()
+{
+ enterOTADfu();
+}
+
+
+void loop()
+{
+}
diff --git a/arduino/libraries/Bluefruit52Lib/examples/Hardware/dfu_serial/dfu_serial.ino b/arduino/libraries/Bluefruit52Lib/examples/Hardware/dfu_serial/dfu_serial.ino
new file mode 100755
index 0000000..65476b8
--- /dev/null
+++ b/arduino/libraries/Bluefruit52Lib/examples/Hardware/dfu_serial/dfu_serial.ino
@@ -0,0 +1,29 @@
+/*********************************************************************
+ This is an example for our nRF52 based Bluefruit LE modules
+
+ Pick one up today in the adafruit shop!
+
+ Adafruit invests time and resources providing this open source code,
+ please support Adafruit and open-source hardware by purchasing
+ products from Adafruit!
+
+ MIT license, check LICENSE for more information
+ All text above, and the splash screen below must be included in
+ any redistribution
+*********************************************************************/
+
+#include <Arduino.h>
+
+/*
+ * This sketch will reset the board into Serial DFU mode
+ */
+
+void setup()
+{
+ enterSerialDfu();
+}
+
+
+void loop()
+{
+}
diff --git a/arduino/libraries/Bluefruit52Lib/examples/Hardware/digital_interrupt_deferred/digital_interrupt_deferred.ino b/arduino/libraries/Bluefruit52Lib/examples/Hardware/digital_interrupt_deferred/digital_interrupt_deferred.ino
new file mode 100755
index 0000000..464e31b
--- /dev/null
+++ b/arduino/libraries/Bluefruit52Lib/examples/Hardware/digital_interrupt_deferred/digital_interrupt_deferred.ino
@@ -0,0 +1,46 @@
+/*********************************************************************
+ This is an example for our Feather Bluefruit modules
+
+ Pick one up today in the adafruit shop!
+
+ Adafruit invests time and resources providing this open source code,
+ please support Adafruit and open-source hardware by purchasing
+ products from Adafruit!
+
+ MIT license, check LICENSE for more information
+ All text above, and the splash screen below must be included in
+ any redistribution
+*********************************************************************/
+
+/*
+ * This sketch demonstrate how to pass ISR_DEFFERED as additional parameter
+ * to defer callback from ISR context with attachInterrupt
+ */
+#include <Arduino.h>
+
+int interruptPin = A0;
+
+void setup()
+{
+ Serial.begin(115200);
+
+ pinMode(interruptPin, INPUT_PULLUP);
+
+ // ISR_DEFERRED flag cause the callback to be deferred from ISR context
+ // and invoked within a callback thread.
+ // It is required to use ISR_DEFERRED if callback function take long time
+ // to run e.g Serial.print() or using any of Bluefruit API() which will
+ // potentially call rtos API
+ attachInterrupt(interruptPin, digital_callback, ISR_DEFERRED | CHANGE);
+}
+
+void loop()
+{
+ // nothing to do
+}
+
+void digital_callback(void)
+{
+ Serial.print("Pin value: ");
+ Serial.println(digitalRead(interruptPin));
+}
diff --git a/arduino/libraries/Bluefruit52Lib/examples/Hardware/fwinfo/fwinfo.ino b/arduino/libraries/Bluefruit52Lib/examples/Hardware/fwinfo/fwinfo.ino
new file mode 100755
index 0000000..538ac31
--- /dev/null
+++ b/arduino/libraries/Bluefruit52Lib/examples/Hardware/fwinfo/fwinfo.ino
@@ -0,0 +1,33 @@
+/*********************************************************************
+ This is an example for our nRF52 based Bluefruit LE modules
+
+ Pick one up today in the adafruit shop!
+
+ Adafruit invests time and resources providing this open source code,
+ please support Adafruit and open-source hardware by purchasing
+ products from Adafruit!
+
+ MIT license, check LICENSE for more information
+ All text above, and the splash screen below must be included in
+ any redistribution
+*********************************************************************/
+
+#include <Arduino.h>
+
+
+void setup()
+{
+ Serial.begin(115200);
+ while ( !Serial ) delay(10); // for nrf52840 with native usb
+
+ Serial.println("Bluefruit52 Firmware Info Example");
+ Serial.println("---------------------------------\n");
+}
+
+
+void loop()
+{
+ dbgPrintVersion();
+ digitalToggle(LED_RED);
+ delay(5000); // wait for a second
+}
diff --git a/arduino/libraries/Bluefruit52Lib/examples/Hardware/gpstest_swuart/gpstest_swuart.ino b/arduino/libraries/Bluefruit52Lib/examples/Hardware/gpstest_swuart/gpstest_swuart.ino
new file mode 100755
index 0000000..262f079
--- /dev/null
+++ b/arduino/libraries/Bluefruit52Lib/examples/Hardware/gpstest_swuart/gpstest_swuart.ino
@@ -0,0 +1,57 @@
+/*********************************************************************
+ This is an example for our nRF52 based Bluefruit LE modules
+
+ Pick one up today in the adafruit shop!
+
+ Adafruit invests time and resources providing this open source code,
+ please support Adafruit and open-source hardware by purchasing
+ products from Adafruit!
+
+ MIT license, check LICENSE for more information
+ All text above, and the splash screen below must be included in
+ any redistribution
+*********************************************************************/
+
+/* This example show how to use Software Serial on Bluefruit nRF52
+ * to interact with GPS FeatherWing https://www.adafruit.com/product/3133
+ *
+ * Hardware Set up
+ * - Connect 3V and GND to GPS wing
+ * -
+ */
+
+#include <SoftwareSerial.h>
+
+#define SW_RXD A0
+#define SW_TXD A1
+
+// Declare an Software Serial instance
+SoftwareSerial mySerial(SW_RXD, SW_TXD);
+
+void setup() {
+
+ // Init hardware UART <-> Serial Monitor
+ Serial.begin(115200);
+ while ( !Serial ) delay(10); // for nrf52840 with native usb
+
+ Serial.println("GPS echo test");
+
+ // Init Software Uart <-> GPS FeatherWing
+ mySerial.begin(9600); // default NMEA GPS baud
+}
+
+
+void loop() {
+
+ // Pass data from Serial (HW uart) to GPS Wing (SW Uart)
+ if (Serial.available()) {
+ char c = Serial.read();
+ mySerial.write(c);
+ }
+
+ // Pass data from GPS Wing (SW Uart) to Serial (HW uart)
+ if (mySerial.available()) {
+ char c = mySerial.read();
+ Serial.write(c);
+ }
+}
diff --git a/arduino/libraries/Bluefruit52Lib/examples/Hardware/hw_systick/hw_systick.ino b/arduino/libraries/Bluefruit52Lib/examples/Hardware/hw_systick/hw_systick.ino
new file mode 100755
index 0000000..72ae8f8
--- /dev/null
+++ b/arduino/libraries/Bluefruit52Lib/examples/Hardware/hw_systick/hw_systick.ino
@@ -0,0 +1,57 @@
+/*********************************************************************
+ This is an example for our nRF52 based Bluefruit LE modules
+
+ Pick one up today in the adafruit shop!
+
+ Adafruit invests time and resources providing this open source code,
+ please support Adafruit and open-source hardware by purchasing
+ products from Adafruit!
+
+ MIT license, check LICENSE for more information
+ All text above, and the splash screen below must be included in
+ any redistribution
+*********************************************************************/
+#include <Arduino.h>
+
+// Interval between systick event
+#define TICK_INTERVAL_MS 50
+
+// Note: Extern "C" is required since all the IRQ hardware handler is
+// declared as "C function" within the startup (assembly) file.
+// Without it, our SysTick_Handler will be declared as "C++ function"
+// which is not the same as the "C function" in startup even it has
+// the same name.
+extern "C"
+{
+
+/* This is hardware interupt service function exectuing in non-RTOS thread
+ * Function implementation should be quick and short if possible.
+ *
+ * WARNING: This function MUST NOT call any blocking FreeRTOS API
+ * such as delay(), xSemaphoreTake() etc ... for more information
+ * http://www.freertos.org/a00016.html
+ */
+void SysTick_Handler(void)
+{
+ digitalToggle(LED_RED);
+}
+
+} // extern C
+
+void setup()
+{
+ /* Input parameter is number of ticks between interrupts handler i.e SysTick_Handler
+ * 1000 ms --> F_CPU ticks
+ * T ms --> (F_CPU/1000)*T ticks
+ *
+ * Note: Since systick is 24-bit timer, the max tick value is 0xFFFFFF, F_CPU = 64 Mhz
+ * --> our Tmax = 0xFFFFFF/64000 ~ 262 ms
+ */
+
+ SysTick_Config( (F_CPU/1000)*TICK_INTERVAL_MS );
+}
+
+void loop()
+{
+ // do nothing here
+}
diff --git a/arduino/libraries/Bluefruit52Lib/examples/Hardware/hwinfo/hwinfo.ino b/arduino/libraries/Bluefruit52Lib/examples/Hardware/hwinfo/hwinfo.ino
new file mode 100755
index 0000000..23518b5
--- /dev/null
+++ b/arduino/libraries/Bluefruit52Lib/examples/Hardware/hwinfo/hwinfo.ino
@@ -0,0 +1,42 @@
+#include <Arduino.h>
+
+typedef volatile uint32_t REG32;
+#define pREG32 (REG32 *)
+
+#define DEVICE_ID_HIGH (*(pREG32 (0x10000060)))
+#define DEVICE_ID_LOW (*(pREG32 (0x10000064)))
+#define MAC_ADDRESS_HIGH (*(pREG32 (0x100000a8)))
+#define MAC_ADDRESS_LOW (*(pREG32 (0x100000a4)))
+
+void setup() {
+ Serial.begin(115200);
+ while ( !Serial ) delay(10); // for nrf52840 with native usb
+
+ Serial.println("Bluefruit 52 HW Info");
+ Serial.println("");
+
+ // MAC Address
+ uint32_t addr_high = ((MAC_ADDRESS_HIGH) & 0x0000ffff) | 0x0000c000;
+ uint32_t addr_low = MAC_ADDRESS_LOW;
+ Serial.print("MAC Address: ");
+ Serial.print((addr_high >> 8) & 0xFF, HEX); Serial.print(":");
+ Serial.print((addr_high) & 0xFF, HEX); Serial.print(":");
+ Serial.print((addr_low >> 24) & 0xFF, HEX); Serial.print(":");
+ Serial.print((addr_low >> 16) & 0xFF, HEX); Serial.print(":");
+ Serial.print((addr_low >> 8) & 0xFF, HEX); Serial.print(":");
+ Serial.print((addr_low) & 0xFF, HEX); Serial.println("");
+
+ // Unique Device ID
+ Serial.print("Device ID : ");
+ Serial.print(DEVICE_ID_HIGH, HEX);
+ Serial.println(DEVICE_ID_LOW, HEX);
+
+ // MCU Variant;
+ Serial.printf("MCU Variant: nRF%X 0x%08X\n",NRF_FICR->INFO.PART, NRF_FICR->INFO.VARIANT);
+ Serial.printf("Memory : Flash = %d KB, RAM = %d KB\n", NRF_FICR->INFO.FLASH, NRF_FICR->INFO.RAM);
+}
+
+void loop() {
+ // put your main code here, to run repeatedly:
+
+}
diff --git a/arduino/libraries/Bluefruit52Lib/examples/Hardware/hwpwm/hwpwm.ino b/arduino/libraries/Bluefruit52Lib/examples/Hardware/hwpwm/hwpwm.ino
new file mode 100755
index 0000000..93bf6cc
--- /dev/null
+++ b/arduino/libraries/Bluefruit52Lib/examples/Hardware/hwpwm/hwpwm.ino
@@ -0,0 +1,81 @@
+/*********************************************************************
+ This is an example for our Feather Bluefruit modules
+
+ Pick one up today in the adafruit shop!
+
+ Adafruit invests time and resources providing this open source code,
+ please support Adafruit and open-source hardware by purchasing
+ products from Adafruit!
+
+ MIT license, check LICENSE for more information
+ All text above, and the splash screen below must be included in
+ any redistribution
+*********************************************************************/
+
+/*
+ * This sketch use different Hardware PWMs for LED Blue and Red
+ * running with different frequency
+ * - PWM0 : clock/1 ~ 16Mhz
+ * - PWM1 : clock/16 ~ 1Mhz
+ *
+ * While LED RED looks solid, LED BLUE will blink while fading
+ * (due to its lower freq). Furthermore LED RED is inverted
+ * compared to LED BLUE (PWM2) --> They fade in opposite direction.
+ */
+
+#include <Arduino.h>
+
+/**************************************************************************/
+/*!
+ @brief The setup function runs once when reset the board
+*/
+/**************************************************************************/
+void setup()
+{
+ // Add LED RED to PWM0
+ HwPWM0.addPin( LED_RED );
+
+ // Add LED BLUE to PWM1
+ HwPWM1.addPin( LED_BLUE );
+
+ // Enable PWM modules with 15-bit resolutions(max) but different clock div
+ HwPWM0.begin();
+ HwPWM0.setResolution(15);
+ HwPWM0.setClockDiv(PWM_PRESCALER_PRESCALER_DIV_1); // freq = 16Mhz
+
+ HwPWM1.begin();
+ HwPWM1.setResolution(15);
+ HwPWM1.setClockDiv(PWM_PRESCALER_PRESCALER_DIV_16); // freq = 1Mhz
+}
+
+/**************************************************************************/
+/*!
+ @brief The loop function runs over and over again forever
+*/
+/**************************************************************************/
+void loop()
+{
+ const int maxValue = bit(15) - 1;
+
+ // fade in from min to max
+ for (int fadeValue = 0 ; fadeValue <= maxValue; fadeValue += 1024)
+ {
+ // Write same value but inverted for Led Blue
+ HwPWM0.writePin(LED_RED, fadeValue, false);
+ HwPWM1.writePin(LED_BLUE, fadeValue, true);
+
+ // wait for 30 milliseconds to see the dimming effect
+ delay(30);
+ }
+
+ // fade out from max to min
+ for (int fadeValue = maxValue ; fadeValue >= 0; fadeValue -= 1024)
+ {
+ // Write same value but inverted for Led Blue
+ HwPWM0.writePin(LED_RED, fadeValue, false);
+ HwPWM1.writePin(LED_BLUE, fadeValue, true);
+
+ // wait for 30 milliseconds to see the dimming effect
+ delay(30);
+ }
+}
diff --git a/arduino/libraries/Bluefruit52Lib/examples/Hardware/meminfo/meminfo.ino b/arduino/libraries/Bluefruit52Lib/examples/Hardware/meminfo/meminfo.ino
new file mode 100755
index 0000000..9df909c
--- /dev/null
+++ b/arduino/libraries/Bluefruit52Lib/examples/Hardware/meminfo/meminfo.ino
@@ -0,0 +1,33 @@
+/*********************************************************************
+ This is an example for our nRF52 based Bluefruit LE modules
+
+ Pick one up today in the adafruit shop!
+
+ Adafruit invests time and resources providing this open source code,
+ please support Adafruit and open-source hardware by purchasing
+ products from Adafruit!
+
+ MIT license, check LICENSE for more information
+ All text above, and the splash screen below must be included in
+ any redistribution
+*********************************************************************/
+
+#include <Arduino.h>
+
+
+void setup()
+{
+ Serial.begin(115200);
+ while ( !Serial ) delay(10); // for nrf52840 with native usb
+
+ Serial.println("Bluefruit52 Memory Info Example");
+ Serial.println("-------------------------------\n");
+}
+
+
+void loop()
+{
+ dbgMemInfo();
+ digitalToggle(LED_RED);
+ delay(5000); // wait for a second
+}
diff --git a/arduino/libraries/Bluefruit52Lib/examples/Hardware/nfc_to_gpio/nfc_to_gpio.ino b/arduino/libraries/Bluefruit52Lib/examples/Hardware/nfc_to_gpio/nfc_to_gpio.ino
new file mode 100755
index 0000000..89fa7cb
--- /dev/null
+++ b/arduino/libraries/Bluefruit52Lib/examples/Hardware/nfc_to_gpio/nfc_to_gpio.ino
@@ -0,0 +1,40 @@
+// This sketch will check if the NFC pins are configured for NFC mode,
+// and if so it will switch them to operate in GPIO mode. A system
+// reset is required before this change takes effect since the CONFIG
+// memory is only read on power up.
+
+// !!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!
+// !!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!
+// !!!!! IMPORTANT NOTE ... READ BEFORE RUNNING THIS SKETCH !!!!!
+// !!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!
+// !!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!!
+
+// UICR customer registers are meant to be stored with values
+// that are supposed to stay there during the life time of the softdevice.
+// You cannot erase them without erasing everything on chip, so setting the
+// NFC pins to GPIO mode is a ONE WAY OPERATION and you will need a debugger
+// like a Segger J-Link to set them back to NFC mode!
+
+void setup() {
+ Serial.begin(115200);
+ while ( !Serial ) delay(10); // for nrf52840 with native usb
+
+ Serial.println("Bluefruit52 NFC to GPIO Pin Config");
+ Serial.println("----------------------------------\n");
+ if ((NRF_UICR->NFCPINS & UICR_NFCPINS_PROTECT_Msk) == (UICR_NFCPINS_PROTECT_NFC << UICR_NFCPINS_PROTECT_Pos)){
+ Serial.println("Fix NFC pins");
+ NRF_NVMC->CONFIG = NVMC_CONFIG_WEN_Wen << NVMC_CONFIG_WEN_Pos;
+ while (NRF_NVMC->READY == NVMC_READY_READY_Busy);
+ NRF_UICR->NFCPINS &= ~UICR_NFCPINS_PROTECT_Msk;
+ while (NRF_NVMC->READY == NVMC_READY_READY_Busy);
+ NRF_NVMC->CONFIG = NVMC_CONFIG_WEN_Ren << NVMC_CONFIG_WEN_Pos;
+ while (NRF_NVMC->READY == NVMC_READY_READY_Busy);
+ Serial.println("Done");
+ delay(500);
+ NVIC_SystemReset();
+ }
+
+}
+void loop() {
+ // put your main code here, to run repeatedly:
+}
diff --git a/arduino/libraries/Bluefruit52Lib/examples/Hardware/rtos_scheduler/rtos_scheduler.ino b/arduino/libraries/Bluefruit52Lib/examples/Hardware/rtos_scheduler/rtos_scheduler.ino
new file mode 100755
index 0000000..032b070
--- /dev/null
+++ b/arduino/libraries/Bluefruit52Lib/examples/Hardware/rtos_scheduler/rtos_scheduler.ino
@@ -0,0 +1,49 @@
+/*********************************************************************
+ This is an example for our nRF52 based Bluefruit LE modules
+
+ Pick one up today in the adafruit shop!
+
+ Adafruit invests time and resources providing this open source code,
+ please support Adafruit and open-source hardware by purchasing
+ products from Adafruit!
+
+ MIT license, check LICENSE for more information
+ All text above, and the splash screen below must be included in
+ any redistribution
+*********************************************************************/
+
+#include <Arduino.h>
+
+/*
+ * Sketch demonstate mutli-task using Scheduler. Demo create loop2() that
+ * run in 'parallel' with loop().
+ * - loop() toggle LED_RED every 1 second
+ * - loop2() toggle LED_BLUE every half of second
+ */
+
+void setup()
+{
+ // LED_RED & LED_BLUE pin already initialized as an output.
+
+ // Create loop2() using Scheduler to run in 'parallel' with loop()
+ Scheduler.startLoop(loop2);
+}
+
+/**
+ * Toggle led1 every 1 second
+ */
+void loop()
+{
+ digitalToggle(LED_RED); // Toggle LED
+ delay(1000); // wait for a second
+}
+
+/**
+ * Toggle led1 every 0.5 second
+ */
+void loop2()
+{
+ digitalToggle(LED_BLUE); // Toggle LED
+ delay(500); // wait for a half second
+}
+
diff --git a/arduino/libraries/Bluefruit52Lib/examples/Hardware/software_timer/software_timer.ino b/arduino/libraries/Bluefruit52Lib/examples/Hardware/software_timer/software_timer.ino
new file mode 100755
index 0000000..8a63990
--- /dev/null
+++ b/arduino/libraries/Bluefruit52Lib/examples/Hardware/software_timer/software_timer.ino
@@ -0,0 +1,58 @@
+/*********************************************************************
+ This is an example for our nRF52 based Bluefruit LE modules
+
+ Pick one up today in the adafruit shop!
+
+ Adafruit invests time and resources providing this open source code,
+ please support Adafruit and open-source hardware by purchasing
+ products from Adafruit!
+
+ MIT license, check LICENSE for more information
+ All text above, and the splash screen below must be included in
+ any redistribution
+*********************************************************************/
+#include <Arduino.h>
+
+/* SoftwareTimer is a helper class that uses FreeRTOS software timer
+ * to invoke callback. Its periodic timing is flexible as opposed to
+ * hardware timer and cannot be faster than rtos's tick which is configured
+ * at ~1 ms interval.
+ *
+ * If you need an strict interval timing, or faster frequency, check out
+ * the hw_systick sketch example that use hardware systick timer.
+ *
+ * http://www.freertos.org/RTOS-software-timer.html
+ */
+SoftwareTimer blinkTimer;
+
+
+void setup()
+{
+ // Configure the timer with 1000 ms interval, with our callback
+ blinkTimer.begin(1000, blink_timer_callback);
+
+ // Start the timer
+ blinkTimer.start();
+}
+
+void loop()
+{
+ // do nothing here
+}
+
+
+/**
+ * Software Timer callback is invoked via a built-in FreeRTOS thread with
+ * minimal stack size. Therefore it should be as simple as possible. If
+ * a periodically heavy task is needed, please use Scheduler.startLoop() to
+ * create a dedicated task for it.
+ *
+ * More information http://www.freertos.org/RTOS-software-timer.html
+ */
+void blink_timer_callback(TimerHandle_t xTimerID)
+{
+ // freeRTOS timer ID, ignored if not used
+ (void) xTimerID;
+
+ digitalToggle(LED_RED);
+}