diff options
Diffstat (limited to 'libraries/SPI')
| -rw-r--r-- | libraries/SPI/SPI.cpp | 132 | ||||
| -rw-r--r-- | libraries/SPI/SPI.h | 284 | ||||
| -rw-r--r-- | libraries/SPI/examples/BarometricPressureSensor/BarometricPressureSensor.ino | 143 | ||||
| -rw-r--r-- | libraries/SPI/examples/DigitalPotControl/DigitalPotControl.ino | 71 | ||||
| -rw-r--r-- | libraries/SPI/keywords.txt | 36 | ||||
| -rw-r--r-- | libraries/SPI/library.properties | 8 | 
6 files changed, 674 insertions, 0 deletions
| diff --git a/libraries/SPI/SPI.cpp b/libraries/SPI/SPI.cpp new file mode 100644 index 0000000..9a7a400 --- /dev/null +++ b/libraries/SPI/SPI.cpp @@ -0,0 +1,132 @@ +/* + * Copyright (c) 2010 by Cristian Maglie <c.maglie@bug.st> + * Copyright (c) 2014 by Paul Stoffregen <paul@pjrc.com> (Transaction API) + * SPI Master library for arduino. + * + * This file is free software; you can redistribute it and/or modify + * it under the terms of either the GNU General Public License version 2 + * or the GNU Lesser General Public License version 2.1, both as + * published by the Free Software Foundation. + */ + +#include "SPI.h" +#include "pins_arduino.h" + +SPIClass SPI; + +uint8_t SPIClass::interruptMode = 0; +uint8_t SPIClass::interruptMask = 0; +uint8_t SPIClass::interruptSave = 0; +#ifdef SPI_TRANSACTION_MISMATCH_LED +uint8_t SPIClass::inTransactionFlag = 0; +#endif + +void SPIClass::begin() +{ +  // Set SS to high so a connected chip will be "deselected" by default +  digitalWrite(SS, HIGH); + +  // When the SS pin is set as OUTPUT, it can be used as +  // a general purpose output port (it doesn't influence +  // SPI operations). +  pinMode(SS, OUTPUT); + +  // Warning: if the SS pin ever becomes a LOW INPUT then SPI +  // automatically switches to Slave, so the data direction of +  // the SS pin MUST be kept as OUTPUT. +  SPCR |= _BV(MSTR); +  SPCR |= _BV(SPE); + +  // Set direction register for SCK and MOSI pin. +  // MISO pin automatically overrides to INPUT. +  // By doing this AFTER enabling SPI, we avoid accidentally +  // clocking in a single bit since the lines go directly +  // from "input" to SPI control.   +  // http://code.google.com/p/arduino/issues/detail?id=888 +  pinMode(SCK, OUTPUT); +  pinMode(MOSI, OUTPUT); +} + +void SPIClass::end() { +  SPCR &= ~_BV(SPE); +} + +// mapping of interrupt numbers to bits within SPI_AVR_EIMSK +#if defined(__AVR_ATmega32U4__) +  #define SPI_INT0_MASK  (1<<INT0) +  #define SPI_INT1_MASK  (1<<INT1) +  #define SPI_INT2_MASK  (1<<INT2) +  #define SPI_INT3_MASK  (1<<INT3) +  #define SPI_INT4_MASK  (1<<INT6) +#elif defined(__AVR_AT90USB646__) || defined(__AVR_AT90USB1286__) +  #define SPI_INT0_MASK  (1<<INT0) +  #define SPI_INT1_MASK  (1<<INT1) +  #define SPI_INT2_MASK  (1<<INT2) +  #define SPI_INT3_MASK  (1<<INT3) +  #define SPI_INT4_MASK  (1<<INT4) +  #define SPI_INT5_MASK  (1<<INT5) +  #define SPI_INT6_MASK  (1<<INT6) +  #define SPI_INT7_MASK  (1<<INT7) +#elif defined(EICRA) && defined(EICRB) && defined(EIMSK) +  #define SPI_INT0_MASK  (1<<INT4) +  #define SPI_INT1_MASK  (1<<INT5) +  #define SPI_INT2_MASK  (1<<INT0) +  #define SPI_INT3_MASK  (1<<INT1) +  #define SPI_INT4_MASK  (1<<INT2) +  #define SPI_INT5_MASK  (1<<INT3) +  #define SPI_INT6_MASK  (1<<INT6) +  #define SPI_INT7_MASK  (1<<INT7) +#else +  #ifdef INT0 +  #define SPI_INT0_MASK  (1<<INT0) +  #endif +  #ifdef INT1 +  #define SPI_INT1_MASK  (1<<INT1) +  #endif +  #ifdef INT2 +  #define SPI_INT2_MASK  (1<<INT2) +  #endif +#endif + +void SPIClass::usingInterrupt(uint8_t interruptNumber) +{ +  uint8_t mask; + +  if (interruptMode > 1) return; + +  noInterrupts(); +  switch (interruptNumber) { +  #ifdef SPI_INT0_MASK +  case 0: mask = SPI_INT0_MASK; break; +  #endif +  #ifdef SPI_INT1_MASK +  case 1: mask = SPI_INT1_MASK; break; +  #endif +  #ifdef SPI_INT2_MASK +  case 2: mask = SPI_INT2_MASK; break; +  #endif +  #ifdef SPI_INT3_MASK +  case 3: mask = SPI_INT3_MASK; break; +  #endif +  #ifdef SPI_INT4_MASK +  case 4: mask = SPI_INT4_MASK; break; +  #endif +  #ifdef SPI_INT5_MASK +  case 5: mask = SPI_INT5_MASK; break; +  #endif +  #ifdef SPI_INT6_MASK +  case 6: mask = SPI_INT6_MASK; break; +  #endif +  #ifdef SPI_INT7_MASK +  case 7: mask = SPI_INT7_MASK; break; +  #endif +  default: +    interruptMode = 2; +    interrupts(); +    return; +  } +  interruptMode = 1; +  interruptMask |= mask; +  interrupts(); +} + diff --git a/libraries/SPI/SPI.h b/libraries/SPI/SPI.h new file mode 100644 index 0000000..962100b --- /dev/null +++ b/libraries/SPI/SPI.h @@ -0,0 +1,284 @@ +/* + * Copyright (c) 2010 by Cristian Maglie <c.maglie@bug.st> + * Copyright (c) 2014 by Paul Stoffregen <paul@pjrc.com> (Transaction API) + * Copyright (c) 2014 by Matthijs Kooijman <matthijs@stdin.nl> (SPISettings AVR) + * SPI Master library for arduino. + * + * This file is free software; you can redistribute it and/or modify + * it under the terms of either the GNU General Public License version 2 + * or the GNU Lesser General Public License version 2.1, both as + * published by the Free Software Foundation. + */ + +#ifndef _SPI_H_INCLUDED +#define _SPI_H_INCLUDED + +#include <Arduino.h> + +// SPI_HAS_TRANSACTION means SPI has beginTransaction(), endTransaction(), +// usingInterrupt(), and SPISetting(clock, bitOrder, dataMode) +#define SPI_HAS_TRANSACTION 1 + +// Uncomment this line to add detection of mismatched begin/end transactions. +// A mismatch occurs if other libraries fail to use SPI.endTransaction() for +// each SPI.beginTransaction().  Connect a LED to this pin.  The LED will turn +// on if any mismatch is ever detected. +//#define SPI_TRANSACTION_MISMATCH_LED 5 + +#ifndef LSBFIRST +#define LSBFIRST 0 +#endif +#ifndef MSBFIRST +#define MSBFIRST 1 +#endif + +#define SPI_CLOCK_DIV4 0x00 +#define SPI_CLOCK_DIV16 0x01 +#define SPI_CLOCK_DIV64 0x02 +#define SPI_CLOCK_DIV128 0x03 +#define SPI_CLOCK_DIV2 0x04 +#define SPI_CLOCK_DIV8 0x05 +#define SPI_CLOCK_DIV32 0x06 + +#define SPI_MODE0 0x00 +#define SPI_MODE1 0x04 +#define SPI_MODE2 0x08 +#define SPI_MODE3 0x0C + +#define SPI_MODE_MASK 0x0C  // CPOL = bit 3, CPHA = bit 2 on SPCR +#define SPI_CLOCK_MASK 0x03  // SPR1 = bit 1, SPR0 = bit 0 on SPCR +#define SPI_2XCLOCK_MASK 0x01  // SPI2X = bit 0 on SPSR + +// define SPI_AVR_EIMSK for AVR boards with external interrupt pins +#if defined(EIMSK) +  #define SPI_AVR_EIMSK  EIMSK +#elif defined(GICR) +  #define SPI_AVR_EIMSK  GICR +#elif defined(GIMSK) +  #define SPI_AVR_EIMSK  GIMSK +#endif + +class SPISettings { +public: +  SPISettings(uint32_t clock, uint8_t bitOrder, uint8_t dataMode) { +    if (__builtin_constant_p(clock)) { +      init_AlwaysInline(clock, bitOrder, dataMode); +    } else { +      init_MightInline(clock, bitOrder, dataMode); +    } +  } +  SPISettings() { +    init_AlwaysInline(4000000, MSBFIRST, SPI_MODE0); +  } +private: +  void init_MightInline(uint32_t clock, uint8_t bitOrder, uint8_t dataMode) { +    init_AlwaysInline(clock, bitOrder, dataMode); +  } +  void init_AlwaysInline(uint32_t clock, uint8_t bitOrder, uint8_t dataMode) +    __attribute__((__always_inline__)) { +    // Clock settings are defined as follows. Note that this shows SPI2X +    // inverted, so the bits form increasing numbers. Also note that +    // fosc/64 appears twice +    // SPR1 SPR0 ~SPI2X Freq +    //   0    0     0   fosc/2 +    //   0    0     1   fosc/4 +    //   0    1     0   fosc/8 +    //   0    1     1   fosc/16 +    //   1    0     0   fosc/32 +    //   1    0     1   fosc/64 +    //   1    1     0   fosc/64 +    //   1    1     1   fosc/128 + +    // We find the fastest clock that is less than or equal to the +    // given clock rate. The clock divider that results in clock_setting +    // is 2 ^^ (clock_div + 1). If nothing is slow enough, we'll use the +    // slowest (128 == 2 ^^ 7, so clock_div = 6). +    uint8_t clockDiv; + +    // When the clock is known at compiletime, use this if-then-else +    // cascade, which the compiler knows how to completely optimize +    // away. When clock is not known, use a loop instead, which generates +    // shorter code. +    if (__builtin_constant_p(clock)) { +      if (clock >= F_CPU / 2) { +        clockDiv = 0; +      } else if (clock >= F_CPU / 4) { +        clockDiv = 1; +      } else if (clock >= F_CPU / 8) { +        clockDiv = 2; +      } else if (clock >= F_CPU / 16) { +        clockDiv = 3; +      } else if (clock >= F_CPU / 32) { +        clockDiv = 4; +      } else if (clock >= F_CPU / 64) { +        clockDiv = 5; +      } else { +        clockDiv = 6; +      } +    } else { +      uint32_t clockSetting = F_CPU / 2; +      clockDiv = 0; +      while (clockDiv < 6 && clock < clockSetting) { +        clockSetting /= 2; +        clockDiv++; +      } +    } + +    // Compensate for the duplicate fosc/64 +    if (clockDiv == 6) +    clockDiv = 7; + +    // Invert the SPI2X bit +    clockDiv ^= 0x1; + +    // Pack into the SPISettings class +    spcr = _BV(SPE) | _BV(MSTR) | ((bitOrder == LSBFIRST) ? _BV(DORD) : 0) | +      (dataMode & SPI_MODE_MASK) | ((clockDiv >> 1) & SPI_CLOCK_MASK); +    spsr = clockDiv & SPI_2XCLOCK_MASK; +  } +  uint8_t spcr; +  uint8_t spsr; +  friend class SPIClass; +}; + + +class SPIClass { +public: +  // Initialize the SPI library +  static void begin(); + +  // If SPI is to used from within an interrupt, this function registers +  // that interrupt with the SPI library, so beginTransaction() can +  // prevent conflicts.  The input interruptNumber is the number used +  // with attachInterrupt.  If SPI is used from a different interrupt +  // (eg, a timer), interruptNumber should be 255. +  static void usingInterrupt(uint8_t interruptNumber); + +  // Before using SPI.transfer() or asserting chip select pins, +  // this function is used to gain exclusive access to the SPI bus +  // and configure the correct settings. +  inline static void beginTransaction(SPISettings settings) { +    if (interruptMode > 0) { +      #ifdef SPI_AVR_EIMSK +      if (interruptMode == 1) { +        interruptSave = SPI_AVR_EIMSK; +        SPI_AVR_EIMSK &= ~interruptMask; +      } else +      #endif +      { +        interruptSave = SREG; +        cli(); +      } +    } +    #ifdef SPI_TRANSACTION_MISMATCH_LED +    if (inTransactionFlag) { +      pinMode(SPI_TRANSACTION_MISMATCH_LED, OUTPUT); +      digitalWrite(SPI_TRANSACTION_MISMATCH_LED, HIGH); +    } +    inTransactionFlag = 1; +    #endif +    SPCR = settings.spcr; +    SPSR = settings.spsr; +  } + +  // Write to the SPI bus (MOSI pin) and also receive (MISO pin) +  inline static uint8_t transfer(uint8_t data) { +    SPDR = data; +    asm volatile("nop"); +    while (!(SPSR & _BV(SPIF))) ; // wait +    return SPDR; +  } +  inline static uint16_t transfer16(uint16_t data) { +    union { uint16_t val; struct { uint8_t lsb; uint8_t msb; }; } in, out; +    in.val = data; +    if (!(SPCR & _BV(DORD))) { +      SPDR = in.msb; +      while (!(SPSR & _BV(SPIF))) ; +      out.msb = SPDR; +      SPDR = in.lsb; +      while (!(SPSR & _BV(SPIF))) ; +      out.lsb = SPDR; +    } else { +      SPDR = in.lsb; +      while (!(SPSR & _BV(SPIF))) ; +      out.lsb = SPDR; +      SPDR = in.msb; +      while (!(SPSR & _BV(SPIF))) ; +      out.msb = SPDR; +    } +    return out.val; +  } +  inline static void transfer(void *buf, size_t count) { +    if (count == 0) return; +    uint8_t *p = (uint8_t *)buf; +    SPDR = *p; +    while (--count > 0) { +      uint8_t out = *(p + 1); +      while (!(SPSR & _BV(SPIF))) ; +      uint8_t in = SPDR; +      SPDR = out; +      *p++ = in; +    } +    while (!(SPSR & _BV(SPIF))) ; +    *p = SPDR; +  } +  // After performing a group of transfers and releasing the chip select +  // signal, this function allows others to access the SPI bus +  inline static void endTransaction(void) { +    #ifdef SPI_TRANSACTION_MISMATCH_LED +    if (!inTransactionFlag) { +      pinMode(SPI_TRANSACTION_MISMATCH_LED, OUTPUT); +      digitalWrite(SPI_TRANSACTION_MISMATCH_LED, HIGH); +    } +    inTransactionFlag = 0; +    #endif +    if (interruptMode > 0) { +      #ifdef SPI_AVR_EIMSK +      if (interruptMode == 1) { +        SPI_AVR_EIMSK = interruptSave; +      } else +      #endif +      { +        SREG = interruptSave; +      } +    } +  } + +  // Disable the SPI bus +  static void end(); + +  // This function is deprecated.  New applications should use +  // beginTransaction() to configure SPI settings. +  inline static void setBitOrder(uint8_t bitOrder) { +    if (bitOrder == LSBFIRST) SPCR |= _BV(DORD); +    else SPCR &= ~(_BV(DORD)); +  } +  // This function is deprecated.  New applications should use +  // beginTransaction() to configure SPI settings. +  inline static void setDataMode(uint8_t dataMode) { +    SPCR = (SPCR & ~SPI_MODE_MASK) | dataMode; +  } +  // This function is deprecated.  New applications should use +  // beginTransaction() to configure SPI settings. +  inline static void setClockDivider(uint8_t clockDiv) { +    SPCR = (SPCR & ~SPI_CLOCK_MASK) | (clockDiv & SPI_CLOCK_MASK); +    SPSR = (SPSR & ~SPI_2XCLOCK_MASK) | ((clockDiv >> 2) & SPI_2XCLOCK_MASK); +  } +  // These undocumented functions should not be used.  SPI.transfer() +  // polls the hardware flag which is automatically cleared as the +  // AVR responds to SPI's interrupt +  inline static void attachInterrupt() { SPCR |= _BV(SPIE); } +  inline static void detachInterrupt() { SPCR &= ~_BV(SPIE); } + +private: +  static uint8_t interruptMode; // 0=none, 1=mask, 2=global +  static uint8_t interruptMask; // which interrupts to mask +  static uint8_t interruptSave; // temp storage, to restore state +  #ifdef SPI_TRANSACTION_MISMATCH_LED +  static uint8_t inTransactionFlag; +  #endif +}; + +extern SPIClass SPI; + +#endif diff --git a/libraries/SPI/examples/BarometricPressureSensor/BarometricPressureSensor.ino b/libraries/SPI/examples/BarometricPressureSensor/BarometricPressureSensor.ino new file mode 100644 index 0000000..8104fcb --- /dev/null +++ b/libraries/SPI/examples/BarometricPressureSensor/BarometricPressureSensor.ino @@ -0,0 +1,143 @@ +/* + SCP1000 Barometric Pressure Sensor Display + + Shows the output of a Barometric Pressure Sensor on a + Uses the SPI library. For details on the sensor, see: + http://www.sparkfun.com/commerce/product_info.php?products_id=8161 + http://www.vti.fi/en/support/obsolete_products/pressure_sensors/ + + This sketch adapted from Nathan Seidle's SCP1000 example for PIC: + http://www.sparkfun.com/datasheets/Sensors/SCP1000-Testing.zip + + Circuit: + SCP1000 sensor attached to pins 6, 7, 10 - 13: + DRDY: pin 6 + CSB: pin 7 + MOSI: pin 11 + MISO: pin 12 + SCK: pin 13 + + created 31 July 2010 + modified 14 August 2010 + by Tom Igoe + */ + +// the sensor communicates using SPI, so include the library: +#include <SPI.h> + +//Sensor's memory register addresses: +const int PRESSURE = 0x1F;      //3 most significant bits of pressure +const int PRESSURE_LSB = 0x20;  //16 least significant bits of pressure +const int TEMPERATURE = 0x21;   //16 bit temperature reading +const byte READ = 0b11111100;     // SCP1000's read command +const byte WRITE = 0b00000010;   // SCP1000's write command + +// pins used for the connection with the sensor +// the other you need are controlled by the SPI library): +const int dataReadyPin = 6; +const int chipSelectPin = 7; + +void setup() { +  Serial.begin(9600); + +  // start the SPI library: +  SPI.begin(); + +  // initalize the  data ready and chip select pins: +  pinMode(dataReadyPin, INPUT); +  pinMode(chipSelectPin, OUTPUT); + +  //Configure SCP1000 for low noise configuration: +  writeRegister(0x02, 0x2D); +  writeRegister(0x01, 0x03); +  writeRegister(0x03, 0x02); +  // give the sensor time to set up: +  delay(100); +} + +void loop() { +  //Select High Resolution Mode +  writeRegister(0x03, 0x0A); + +  // don't do anything until the data ready pin is high: +  if (digitalRead(dataReadyPin) == HIGH) { +    //Read the temperature data +    int tempData = readRegister(0x21, 2); + +    // convert the temperature to celsius and display it: +    float realTemp = (float)tempData / 20.0; +    Serial.print("Temp[C]="); +    Serial.print(realTemp); + + +    //Read the pressure data highest 3 bits: +    byte  pressure_data_high = readRegister(0x1F, 1); +    pressure_data_high &= 0b00000111; //you only needs bits 2 to 0 + +    //Read the pressure data lower 16 bits: +    unsigned int pressure_data_low = readRegister(0x20, 2); +    //combine the two parts into one 19-bit number: +    long pressure = ((pressure_data_high << 16) | pressure_data_low) / 4; + +    // display the temperature: +    Serial.println("\tPressure [Pa]=" + String(pressure)); +  } +} + +//Read from or write to register from the SCP1000: +unsigned int readRegister(byte thisRegister, int bytesToRead ) { +  byte inByte = 0;           // incoming byte from the SPI +  unsigned int result = 0;   // result to return +  Serial.print(thisRegister, BIN); +  Serial.print("\t"); +  // SCP1000 expects the register name in the upper 6 bits +  // of the byte. So shift the bits left by two bits: +  thisRegister = thisRegister << 2; +  // now combine the address and the command into one byte +  byte dataToSend = thisRegister & READ; +  Serial.println(thisRegister, BIN); +  // take the chip select low to select the device: +  digitalWrite(chipSelectPin, LOW); +  // send the device the register you want to read: +  SPI.transfer(dataToSend); +  // send a value of 0 to read the first byte returned: +  result = SPI.transfer(0x00); +  // decrement the number of bytes left to read: +  bytesToRead--; +  // if you still have another byte to read: +  if (bytesToRead > 0) { +    // shift the first byte left, then get the second byte: +    result = result << 8; +    inByte = SPI.transfer(0x00); +    // combine the byte you just got with the previous one: +    result = result | inByte; +    // decrement the number of bytes left to read: +    bytesToRead--; +  } +  // take the chip select high to de-select: +  digitalWrite(chipSelectPin, HIGH); +  // return the result: +  return(result); +} + + +//Sends a write command to SCP1000 + +void writeRegister(byte thisRegister, byte thisValue) { + +  // SCP1000 expects the register address in the upper 6 bits +  // of the byte. So shift the bits left by two bits: +  thisRegister = thisRegister << 2; +  // now combine the register address and the command into one byte: +  byte dataToSend = thisRegister | WRITE; + +  // take the chip select low to select the device: +  digitalWrite(chipSelectPin, LOW); + +  SPI.transfer(dataToSend); //Send register location +  SPI.transfer(thisValue);  //Send value to record into register + +  // take the chip select high to de-select: +  digitalWrite(chipSelectPin, HIGH); +} + diff --git a/libraries/SPI/examples/DigitalPotControl/DigitalPotControl.ino b/libraries/SPI/examples/DigitalPotControl/DigitalPotControl.ino new file mode 100644 index 0000000..b135a74 --- /dev/null +++ b/libraries/SPI/examples/DigitalPotControl/DigitalPotControl.ino @@ -0,0 +1,71 @@ +/* +  Digital Pot Control + +  This example controls an Analog Devices AD5206 digital potentiometer. +  The AD5206 has 6 potentiometer channels. Each channel's pins are labeled +  A - connect this to voltage +  W - this is the pot's wiper, which changes when you set it +  B - connect this to ground. + + The AD5206 is SPI-compatible,and to command it, you send two bytes, + one with the channel number (0 - 5) and one with the resistance value for the + channel (0 - 255). + + The circuit: +  * All A pins  of AD5206 connected to +5V +  * All B pins of AD5206 connected to ground +  * An LED and a 220-ohm resisor in series connected from each W pin to ground +  * CS - to digital pin 10  (SS pin) +  * SDI - to digital pin 11 (MOSI pin) +  * CLK - to digital pin 13 (SCK pin) + + created 10 Aug 2010 + by Tom Igoe + + Thanks to Heather Dewey-Hagborg for the original tutorial, 2005 + +*/ + + +// inslude the SPI library: +#include <SPI.h> + + +// set pin 10 as the slave select for the digital pot: +const int slaveSelectPin = 10; + +void setup() { +  // set the slaveSelectPin as an output: +  pinMode (slaveSelectPin, OUTPUT); +  // initialize SPI: +  SPI.begin(); +} + +void loop() { +  // go through the six channels of the digital pot: +  for (int channel = 0; channel < 6; channel++) { +    // change the resistance on this channel from min to max: +    for (int level = 0; level < 255; level++) { +      digitalPotWrite(channel, level); +      delay(10); +    } +    // wait a second at the top: +    delay(100); +    // change the resistance on this channel from max to min: +    for (int level = 0; level < 255; level++) { +      digitalPotWrite(channel, 255 - level); +      delay(10); +    } +  } + +} + +void digitalPotWrite(int address, int value) { +  // take the SS pin low to select the chip: +  digitalWrite(slaveSelectPin, LOW); +  //  send in the address and value via SPI: +  SPI.transfer(address); +  SPI.transfer(value); +  // take the SS pin high to de-select the chip: +  digitalWrite(slaveSelectPin, HIGH); +} diff --git a/libraries/SPI/keywords.txt b/libraries/SPI/keywords.txt new file mode 100644 index 0000000..fa76165 --- /dev/null +++ b/libraries/SPI/keywords.txt @@ -0,0 +1,36 @@ +####################################### +# Syntax Coloring Map SPI +####################################### + +####################################### +# Datatypes (KEYWORD1) +####################################### + +SPI	KEYWORD1 + +####################################### +# Methods and Functions (KEYWORD2) +####################################### +begin	KEYWORD2 +end	KEYWORD2 +transfer	KEYWORD2 +setBitOrder	KEYWORD2 +setDataMode	KEYWORD2 +setClockDivider	KEYWORD2 + + +####################################### +# Constants (LITERAL1) +####################################### +SPI_CLOCK_DIV4	LITERAL1 +SPI_CLOCK_DIV16	LITERAL1 +SPI_CLOCK_DIV64	LITERAL1 +SPI_CLOCK_DIV128	LITERAL1 +SPI_CLOCK_DIV2	LITERAL1 +SPI_CLOCK_DIV8	LITERAL1 +SPI_CLOCK_DIV32	LITERAL1 +SPI_CLOCK_DIV64	LITERAL1 +SPI_MODE0	LITERAL1 +SPI_MODE1	LITERAL1 +SPI_MODE2	LITERAL1 +SPI_MODE3	LITERAL1
\ No newline at end of file diff --git a/libraries/SPI/library.properties b/libraries/SPI/library.properties new file mode 100644 index 0000000..6f1ae20 --- /dev/null +++ b/libraries/SPI/library.properties @@ -0,0 +1,8 @@ +name=SPI +version=1.0 +author=Arduino +maintainer=Arduino <info@arduino.cc> +sentence=Enables the communication with devices that use the Serial Peripheral Interface (SPI) Bus. For all Arduino boards, BUT Arduino DUE.  +paragraph= +url=http://arduino.cc/en/Reference/SPI +architectures=avr | 
