diff --git a/.nojekyll b/.nojekyll new file mode 100644 index 00000000..e69de29b diff --git a/annotated.html b/annotated.html new file mode 100644 index 00000000..bd29fda6 --- /dev/null +++ b/annotated.html @@ -0,0 +1,143 @@ + + +
+ + + + +▼Nsetup | |
CCMakeExtension | |
CCMakeBuild | |
▼Ntle94112 | |
CGPIOC | |
CSPIC | |
CTimer | |
CGPIOIno | Arduino GPIO class |
CGPIOMtb | ModusToolbox GPIO wrapper class |
CGPIORpi | Raspberry Pi GPIO class |
CGPIOWiced | WiCED gpio wrapper |
CSPICIno | Arduino SPIC class |
CSPICMtb | |
CSPICRpi | Raspberry Pi SPIC class |
CSPICWiced | Wiced SPIC class |
CTimerIno | |
CTimerMtb | MoudusToolbox timer wrapper |
CTimerRpi | |
CTimerWiced | WiCED timer wrapper |
▼CTle94112 | Basic TLE94112 |
CHalfBridge_t | Struct containing register locations for a single halfbridge |
CPWMchannel_t | Struct containing register locations for a single PWM channel |
CTle94112Ino | Arduino Tle94112Ino constructor |
▼CTle94112Motor | Motor connected to a TLE94112 |
CConnector_t | Struct representing one motor connector |
CTle94112MotorIno | Motor connected to a TLE94112 |
CTle94112Mtb | |
CTle94112Rpi | |
CTle94112Wiced |
TLE94112 Timer Raspberry Pi PAL. +More...
+#include "timer-rpi.hpp"
TLE94112 Timer Raspberry Pi PAL.
+SPDX-License-Identifier: MIT
+TLE94112 GPIO Raspberry Pi API. +More...
+Go to the source code of this file.
++Data Structures | |
class | GPIORpi |
Raspberry Pi GPIO class. More... | |
TLE94112 GPIO Raspberry Pi API.
+SPDX-License-Identifier: MIT
++Modules | |
TLE94112 API | |
TLE94112 Motor Control API | |
Platform Abstraction Layer Interface | |
+Data Structures | |
class | GPIOIno |
Arduino GPIO class. More... | |
class | SPICIno |
Arduino SPIC class. More... | |
class | TimerIno |
class GPIOIno | +
Arduino GPIO class.
+Public Types | |
Interrupt event | |
enum | IntEvent_t { INT_FALLING_EDGE = 0 +, INT_RISING_EDGE = 1 + } |
Voltage level | |
enum | VLevel_t { GPIO_LOW = 0 +, GPIO_HIGH = 1 + } |
Voltage logic | |
enum | VLogic_t { NEGATIVE = 1 +, POSITIVE = 2 + } |
Public Member Functions | |
GPIOIno () | |
Constructor of the Arduino GPIO class. More... | |
GPIOIno (uint8_t pin, uint8_t mode, VLogic_t logic) | |
Constructor of the Arduino GPIO class. More... | |
~GPIOIno () | |
Error_t | init () |
Initialize the GPIO. More... | |
Error_t | deinit () |
Deinitialize the GPIO. More... | |
VLevel_t | read () |
Read GPIO logic level. More... | |
Error_t | write (VLevel_t level) |
Set GPIO logic level. More... | |
Error_t | enable () |
Enable the GPIO. More... | |
Error_t | disable () |
Disable the GPIO. More... | |
Error_t | checkErrorStatus () |
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
GPIOIno::GPIOIno | +( | +) | ++ |
Constructor of the Arduino GPIO class.
+This function is setting the basics for a GPIO.
+ +GPIOIno::GPIOIno | +( | +uint8_t | +pin, | +
+ | + | uint8_t | +mode, | +
+ | + | VLogic_t | +logic | +
+ | ) | ++ |
Constructor of the Arduino GPIO class.
+This function is setting the basics for a GPIO. It allows to set the pin number, mode of the pin and the logic level.
+[in] | pin | Number of the desired pin |
[in] | mode | Defines the mode of the pin (INPUT, OUTPUT, etc.) |
[in] | logic | Defines the logic level of the pin |
GPIOIno::~GPIOIno | +( | +) | ++ |
+
|
+ +virtual | +
Initialize the GPIO.
+This function is initializing the chosen pin.
+Implements tle94112::GPIOC.
+ +
+
|
+ +virtual | +
Deinitialize the GPIO.
+This function is deinitializing the chosen pin.
+Implements tle94112::GPIOC.
+ +
+
|
+ +virtual | +
Read GPIO logic level.
+This function reads the logic level of the chosen pin and returns the logic level value.
+0 | = GPIO_LOW |
1 | = GPIO_HIGH |
Implements tle94112::GPIOC.
+ +Set GPIO logic level.
+This functions sets the logic level of the chosen pin.
+[in] | level | Desired logic level of the pin |
Implements tle94112::GPIOC.
+ +
+
|
+ +virtual | +
Enable the GPIO.
+This functions enable the chosen pin. Depending on the chosen logic of the pin it sets the right logic level of the pin.
+Implements tle94112::GPIOC.
+ +
+
|
+ +virtual | +
Disable the GPIO.
+This functions disables the chosen pin. Depending on the chosen logic of the pin it sets the right logic level of the pin.
+Implements tle94112::GPIOC.
+ +
+
|
+ +inherited | +
class SPICIno | +
Arduino SPIC class.
+Public Member Functions | |
SPICIno () | |
Constructor of the Arduino SPIC class. More... | |
SPICIno (uint8_t lsb, uint8_t mode, uint8_t clock) | |
Construct a new SPICIno::SPICIno object of the Arduino SPIC class. More... | |
SPICIno (SPIClass &port, uint8_t csPin, uint8_t misoPin=MISO, uint8_t mosiPin=MOSI, uint8_t sckPin=SCK) | |
Construct a new SPICIno::SPICIno object of the Arduino SPIC class. More... | |
~SPICIno () | |
Error_t | init () |
Initialize the SPIC. More... | |
Error_t | deinit () |
Deinitialize the SPIC. More... | |
Error_t | transfer (uint8_t send, uint8_t &received) |
transfers a data package via the spi bus More... | |
Error_t | transfer16 (uint16_t send, uint16_t &received) |
transfers a data package via the spi bus with 16 bit length More... | |
Error_t | checkErrorStatus () |
SPICIno::SPICIno | +( | +) | ++ |
Constructor of the Arduino SPIC class.
+This function is setting the basics for a SPIC and the default spi.
+ +SPICIno::SPICIno | +( | +uint8_t | +lsb, | +
+ | + | uint8_t | +mode, | +
+ | + | uint8_t | +clock | +
+ | ) | ++ |
Construct a new SPICIno::SPICIno object of the Arduino SPIC class.
+This function sets some basic SPI modes for the default SPI port.
+lsb | lowside (LSB) or highside (MSB) mode |
mode | SPI mode |
clock | SPI clock divider |
SPICIno::SPICIno | +( | +SPIClass & | +port, | +
+ | + | uint8_t | +csPin, | +
+ | + | uint8_t | +misoPin = MISO , |
+
+ | + | uint8_t | +mosiPin = MOSI , |
+
+ | + | uint8_t | +sckPin = SCK |
+
+ | ) | ++ |
Construct a new SPICIno::SPICIno object of the Arduino SPIC class.
+This function sets all pins for a given SPI port, allowing a free setting of the SPI interface
+port | SPI port if not default |
csPin | chipselect pin for the SPI port |
misoPin | miso pin number |
mosiPin | mosi pin number |
sckPin | systemclock pin number |
SPICIno::~SPICIno | +( | +) | ++ |
+
|
+ +virtual | +
Initialize the SPIC.
+This function is initializing the chosen spi channel with the given values for lsb,clock and mode
+Implements tle94112::SPIC.
+ +
+
|
+ +virtual | +
Deinitialize the SPIC.
+This function is deinitializing the chosen spi channel.
+Implements tle94112::SPIC.
+ +
+
|
+ +virtual | +
transfers a data package via the spi bus
+send | address and/or command to send |
received | received data from spi bus |
Implements tle94112::SPIC.
+ +
+
|
+ +virtual | +
transfers a data package via the spi bus with 16 bit length
+send | address and/or command to send |
received | received data from spi bus |
Implements tle94112::SPIC.
+ +
+
|
+ +inherited | +
class TimerIno | +
Public Member Functions | |
TimerIno () | |
Constructor of the Arduino Timer class. More... | |
~TimerIno () | |
Destructor of the Arduino Timer class. More... | |
Error_t | init () |
Initialization of the Timer. More... | |
Error_t | deinit () |
Deinitialize the Timer. More... | |
Error_t | start () |
Start the timer. More... | |
Error_t | elapsed (uint32_t &elapsed) |
Calculate the elapsed time. More... | |
Error_t | stop () |
Stop the timer. More... | |
Error_t | delayMilli (uint32_t timeout) |
Time delay. More... | |
Error_t | delayMicro (uint32_t timeout) |
Time delay. More... | |
TimerIno::TimerIno | +( | +) | ++ |
Constructor of the Arduino Timer class.
+ +TimerIno::~TimerIno | +( | +) | ++ |
Destructor of the Arduino Timer class.
+ +
+
|
+ +virtual | +
Initialization of the Timer.
+This function is initializing the Timer and sets the elapsed time to zero.
+Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Deinitialize the Timer.
+This function deinitialize the Timer and also resets the elapsed time variable.
+Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Start the timer.
+This function is starting the timer.
+Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Calculate the elapsed time.
+This function is calculating the elapsed time since the start of the timer. The value stored in the given variable is in milliseconds.
+[in] | &elapsed | Address of a value where the elapsed time should be stored |
Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Stop the timer.
+This function stops the timer and resets the start time variable.
+Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Time delay.
+This function is causing a desired delay of the application. The input value is given in milliseconds.
+[in] | timeout | Desired timeout in ms |
Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Time delay.
+This function is causing a desired delay of the application. The input value is given in microseconds.
+[in] | timeout | Desired timeout in us |
Implements tle94112::Timer.
+ +TLE94112 GPIO Platform Abstraction Layer. +More...
+Go to the source code of this file.
++Data Structures | |
class | tle94112::GPIOC |
+Namespaces | |
tle94112 | |
TLE94112 GPIO Platform Abstraction Layer.
+SPDX-License-Identifier: MIT
+TLE94112 Types. +More...
+Go to the source code of this file.
++Namespaces | |
tle94112 | |
+Enumerations | |
Error codes | |
enum | tle94112::Error_t { + tle94112::OK = 0 +, tle94112::INTF_ERROR = -1 +, tle94112::CONF_ERROR = -2 +, tle94112::READ_ERROR = -3 +, + tle94112::WRITE_ERROR = -4 + + } |
TLE94112 Types.
+SPDX-License-Identifier: MIT
+TLE94112 GPIO ModusToolbox HAL PAL. +More...
+#include "gpio-mtb.hpp"
TLE94112 GPIO ModusToolbox HAL PAL.
+SPDX-License-Identifier: MIT
++Data Structures | |
class | Tle94112Rpi |
class Tle94112Rpi | +
Public Types | |
enum | TlePinCS { + TLE94112_PIN_CS0 = RPI_V2_GPIO_P1_24 +, TLE94112_PIN_CS1 = RPI_V2_GPIO_P1_26 +, TLE94112_PIN_CS2 = RPI_V2_GPIO_P1_22 +, TLE94112_PIN_CS3 = RPI_V2_GPIO_P1_15 +, + TLE94112_PIN_EN = RPI_V2_GPIO_P1_37 + + } |
This enum is used to expose the CS-Pins of the Raspberry-Pi to the Pybind11 wrapper. More... | |
enum | HalfBridge { + TLE_NOHB = 0 +, TLE_HB1 +, TLE_HB2 +, TLE_HB3 +, + TLE_HB4 +, TLE_HB5 +, TLE_HB6 +, TLE_HB7 +, + TLE_HB8 +, TLE_HB9 +, TLE_HB10 +, TLE_HB11 +, + TLE_HB12 + + } |
enum for the halfbridges on a TLE94112 More... | |
enum | PWMChannel { TLE_NOPWM = 0 +, TLE_PWM1 +, TLE_PWM2 +, TLE_PWM3 + } |
enum for the PWM channels of a halfbridge on TLE94112 More... | |
enum | HBState { TLE_FLOATING = 0b00 +, TLE_LOW = 0b01 +, TLE_HIGH = 0b10 + } |
enum for the output states of a halfbridge More... | |
enum | HBOCState { TLE_NONE = 0b00 +, TLE_LOWSIDE = 0b01 +, TLE_HIGHSIDE = 0b10 + } |
enum for the overcurrent states of a halfbridge More... | |
enum | PWMFreq { TLE_FREQOFF = 0b00 +, TLE_FREQ80HZ +, TLE_FREQ100HZ +, TLE_FREQ200HZ + } |
enum for the frequencies of a PWM channel More... | |
enum | DiagFlag { + TLE_SPI_ERROR = 0x80 +, TLE_LOAD_ERROR = 0x40 +, TLE_UNDER_VOLTAGE = 0x20 +, TLE_OVER_VOLTAGE = 0x10 +, + TLE_POWER_ON_RESET = 0x08 +, TLE_TEMP_SHUTDOWN = 0x04 +, TLE_TEMP_WARNING = 0x02 + + } |
enum for the flags in the register SYS_DIAG1 More... | |
Public Member Functions | |
Tle94112Rpi (void) | |
Construct a new Tle94112Rpi::Tle94112Rpi object with default pin assignment. More... | |
Tle94112Rpi (uint8_t csPin) | |
constructor with individual pin assignment More... | |
void | begin (void) |
enables and initializes the TLE94112 More... | |
void | end (void) |
deactivates all outputs and disables the TLE94112 More... | |
void | configHB (HalfBridge hb, HBState state, PWMChannel pwm) |
sets the output state and the PWM channel for a halfbridge (only for passive freewheeling) More... | |
void | configHB (HalfBridge hb, HBState state, PWMChannel pwm, uint8_t activeFW) |
sets the output state and the PWM channel for a halfbridge (allows active freewheeling) More... | |
void | configPWM (PWMChannel pwm, PWMFreq freq, uint8_t dutyCycle) |
sets the frequency and duty cycle for a PWM channel More... | |
uint8_t | setLedMode (HalfBridge hb, uint8_t active) |
sets LED mode on compatible half bridges (half bridge 1 or 2 of TLE94112) More... | |
uint8_t | getSysDiagnosis () |
returns a diagnosis value for error detection More... | |
uint8_t | getSysDiagnosis (DiagFlag mask) |
shows if errors of a specific type have occurred More... | |
uint8_t | getSysDiagnosis (uint8_t mask) |
shows if errors of a specific type have occurred More... | |
uint8_t | getHBOverCurrent (HalfBridge hb) |
gets the overcurrent error flag bit for a specific halfbridge More... | |
uint8_t | getHBOpenLoad (HalfBridge hb) |
gets the openload error flag bit for a specific halfbridge More... | |
void | clearErrors () |
clears all clearable error flags More... | |
Data Fields | |
SPIC * | sBus |
GPIOC * | cs |
GPIOC * | en |
Timer * | timer |
Static Public Attributes | |
static const uint8_t | TLE_STATUS_OK = 0U |
Reference value of Status Register. More... | |
Protected Types | |
enum | CtrlRegisters { + HB_ACT_1_CTRL = 0 +, HB_ACT_2_CTRL +, HB_ACT_3_CTRL +, HB_MODE_1_CTRL +, + HB_MODE_2_CTRL +, HB_MODE_3_CTRL +, PWM_CH_FREQ_CTRL +, PWM1_DC_CTRL +, + PWM2_DC_CTRL +, PWM3_DC_CTRL +, FW_OL_CTRL +, FW_CTRL + + } |
enum for the control registers in a TLE94112 More... | |
enum | StatusRegisters { + SYS_DIAG1 = 0 +, OP_ERROR_1_STAT +, OP_ERROR_2_STAT +, OP_ERROR_3_STAT +, + OP_ERROR_4_STAT +, OP_ERROR_5_STAT +, OP_ERROR_6_STAT + + } |
enum for the status registers in a TLE94112 More... | |
Protected Member Functions | |
void | init (void) |
initializes this object, automatically called by begin() More... | |
void | _configHB (uint8_t hb, uint8_t state, uint8_t pwm, uint8_t activeFW) |
sets the output state and the PWM channel for a halfbridge automatically called by the public version of configHB More... | |
void | _configPWM (uint8_t pwm, uint8_t freq, uint8_t dutyCycle) |
sets the frequency and duty cycle for a PWM channel automatically called by the public version of configPWM More... | |
uint8_t | _getHBOverCurrent (uint8_t hb) |
gets the overcurrent error flag bit for a specific halfbridge automatically called by the public version of getHBOverCurrent More... | |
uint8_t | _getHBOpenLoad (uint8_t hb) |
gets the openload error flag bit for a specific halfbridge automatically called by the public version of getHBOpenLoad More... | |
void | writeReg (uint8_t reg, uint8_t mask, uint8_t shift, uint8_t data) |
writes data bits to a control register of the TLE94112 More... | |
uint8_t | readStatusReg (uint8_t reg) |
reads one byte from a status register of the TLE94112 More... | |
uint8_t | readStatusReg (uint8_t reg, uint8_t mask, uint8_t shift) |
reads some bits from a status register of the TLE94112 More... | |
void | clearStatusReg (uint8_t reg) |
clears a status register by writing 0x00 to it More... | |
Protected Attributes | |
HalfBridge_t | mHalfBridges [TLE94112_NUM_HB] |
array of register locations for halfbridges More... | |
PWMchannel_t | mPwmChannels [TLE94112_NUM_PWM] |
array of register locations for PWM channels More... | |
uint8_t | mCtrlRegAddresses [TLE94112_NUM_CTRL_REGS] |
mapping array for control register addresses More... | |
uint8_t | mCtrlRegData [TLE94112_NUM_CTRL_REGS] |
mirror array for control register data More... | |
uint8_t | mStatusRegAddresses [TLE94112_NUM_STATUS_REGS] |
mapping array for status register addresses More... | |
uint8_t | mEnabled |
enum Tle94112Rpi::TlePinCS | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +protectedinherited | +
+
|
+ +protectedinherited | +
Tle94112Rpi::Tle94112Rpi | +( | +void | +) | ++ |
Construct a new Tle94112Rpi::Tle94112Rpi object with default pin assignment.
+ +Tle94112Rpi::Tle94112Rpi | +( | +uint8_t | +csPin | ) | ++ |
constructor with individual pin assignment
+csPin | pin number of the CS pin |
+
|
+ +inherited | +
enables and initializes the TLE94112
+
+
|
+ +inherited | +
deactivates all outputs and disables the TLE94112
+
+
|
+ +inherited | +
sets the output state and the PWM channel for a halfbridge (only for passive freewheeling)
+hb | halfbridge which will be configured |
state | sets the output voltage to high, low or floating |
pwm | selects a PWM channel for PWM output |
+
|
+ +inherited | +
sets the output state and the PWM channel for a halfbridge (allows active freewheeling)
+hb | halfbridge which will be configured |
state | sets the output voltage to high, low or floating |
pwm | selects a PWM channel for PWM output |
activeFW | 1 for active freewheeling 0 for passive freewheeling (default) |
+
|
+ +inherited | +
sets the frequency and duty cycle for a PWM channel
+pwm | PWM channel which will be configured |
freq | selects the PWM output frequency |
dutyCycle | a value from 0 to 255 which sets the dutyCycle |
+
|
+ +inherited | +
sets LED mode on compatible half bridges (half bridge 1 or 2 of TLE94112)
+hb | compatible half bridge to set LED mode |
active | LED mode active (1) or inactive (0) |
+
|
+ +inherited | +
returns a diagnosis value for error detection
+
+
|
+ +inherited | +
shows if errors of a specific type have occurred
+mask | mask to filter for a specific flag |
+
|
+ +inherited | +
shows if errors of a specific type have occurred
+mask | mask to filter for one or more specific flags this can be a disjunction of DiagFlag values |
+
|
+ +inherited | +
gets the overcurrent error flag bit for a specific halfbridge
+hb | halfbridge thats overcurrent flag will be returned |
+
|
+ +inherited | +
gets the openload error flag bit for a specific halfbridge
+hb | halfbridge thats openload flag will be returned |
+
|
+ +inherited | +
clears all clearable error flags
+
+
|
+ +protectedinherited | +
initializes this object, automatically called by begin()
+< initial control register configuration
+< status register configuration
+< bit masking for all halfbridges
+< bit masking for all pwm channels
+ +
+
|
+ +protectedinherited | +
sets the output state and the PWM channel for a halfbridge automatically called by the public version of configHB
+hb | halfbridge which will be configured |
state | sets the output voltage to high, low or floating |
pwm | selects a PWM channel for PWM output |
activeFW | 1 for active freewheeling 0 for passive freewheeling (default) |
+
|
+ +protectedinherited | +
sets the frequency and duty cycle for a PWM channel automatically called by the public version of configPWM
+pwm | PWM channel which will be configured |
freq | selects the PWM output frequency |
dutyCycle | a value from 0 to 255 which sets the dutyCycle |
+
|
+ +protectedinherited | +
gets the overcurrent error flag bit for a specific halfbridge automatically called by the public version of getHBOverCurrent
+hb | halfbridge thats overcurrent flag will be returned |
+
|
+ +protectedinherited | +
gets the openload error flag bit for a specific halfbridge automatically called by the public version of getHBOpenLoad
+hb | halfbridge thats openload flag will be returned |
+
|
+ +protectedinherited | +
writes data bits to a control register of the TLE94112
+reg | control register number(mapping array index / CtrlRegisters constant) of the register |
mask | mask for the bits that have to be written |
shift | data will be shifted left by this amount before masking. This is for the bit alignment of data |
data | the data byte that has to be written. It will be shifted and masked before |
+
|
+ +protectedinherited | +
reads one byte from a status register of the TLE94112
+reg | status register number(mapping array index / StatusRegisters constant) of the register |
+
|
+ +protectedinherited | +
reads some bits from a status register of the TLE94112
+reg | status register number(mapping array index / StatusRegisters constant) of the register |
mask | mask for the bits that have to be read |
shift | data will be shifted right by this amount after masking. This is for the bit alignment of data |
+
|
+ +protectedinherited | +
clears a status register by writing 0x00 to it
+reg | status register number(mapping array index / StatusRegisters constant) of the register |
+
|
+ +staticinherited | +
Reference value of Status Register.
+ +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +protectedinherited | +
array of register locations for halfbridges
+ +
+
|
+ +protectedinherited | +
array of register locations for PWM channels
+ +
+
|
+ +protectedinherited | +
mapping array for control register addresses
+ +
+
|
+ +protectedinherited | +
mirror array for control register data
+ +
+
|
+ +protectedinherited | +
mapping array for status register addresses
+ +
+
|
+ +protectedinherited | +
TLE94112 GPIO WICED PAL. +More...
+Go to the source code of this file.
++Data Structures | |
class | GPIOWiced |
WiCED gpio wrapper. More... | |
+Macros | |
#define | UNUSED_PIN (wiced_gpio_t)(WICED_GPIO_51 + 1) |
TLE94112 GPIO WICED PAL.
+SPDX-License-Identifier: MIT
+#define UNUSED_PIN (wiced_gpio_t)(WICED_GPIO_51 + 1) | +
Unused pin
+ ++Data Structures | |
class | GPIOWiced |
WiCED gpio wrapper. More... | |
class | SPICWiced |
Wiced SPIC class. More... | |
class | TimerWiced |
WiCED timer wrapper. More... | |
class GPIOWiced | +
WiCED gpio wrapper.
+Public Types | |
Interrupt event | |
enum | IntEvent_t { INT_FALLING_EDGE = 0 +, INT_RISING_EDGE = 1 + } |
Voltage level | |
enum | VLevel_t { GPIO_LOW = 0 +, GPIO_HIGH = 1 + } |
Voltage logic | |
enum | VLogic_t { NEGATIVE = 1 +, POSITIVE = 2 + } |
Public Member Functions | |
GPIOWiced (wiced_gpio_t pin, wiced_gpio_config_t config, VLogic_t logic) | |
GPIO WICED default constructor. More... | |
~GPIOWiced () | |
GPIO WICED destructor. More... | |
Error_t | init () |
Initializes the WICED GPIO. More... | |
Error_t | deinit () |
Initializes the WICED GPIO. More... | |
VLevel_t | read () |
Reads the WICED GPIO voltage level. More... | |
Error_t | write (VLevel_t level) |
Writes the WICED GPIO output voltage level. More... | |
Error_t | enable () |
Enables the WICED output according to the GPIO logic. More... | |
Error_t | disable () |
Disables the WICED output according to the GPIO logic. More... | |
Error_t | checkErrorStatus () |
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
GPIOWiced::GPIOWiced | +( | +wiced_gpio_t | +pin, | +
+ | + | wiced_gpio_config_t | +config, | +
+ | + | VLogic_t | +logic | +
+ | ) | ++ |
GPIO WICED default constructor.
+ +GPIOWiced::~GPIOWiced | +( | +) | ++ |
GPIO WICED destructor.
+
+
|
+ +inlinevirtual | +
Initializes the WICED GPIO.
+OK | if success |
INTF_ERROR | if initialization error |
Implements tle94112::GPIOC.
+ +
+
|
+ +inlinevirtual | +
Initializes the WICED GPIO.
+OK | if success |
INTF_ERROR | if deinitialization error |
Implements tle94112::GPIOC.
+ +
+
|
+ +inlinevirtual | +
Reads the WICED GPIO voltage level.
+GPIO_LOW | if voltage low |
GPIO_HIGH | if voltage high |
Implements tle94112::GPIOC.
+ +Writes the WICED GPIO output voltage level.
+[in] | level | Voltage level |
OK | if success |
INTF_ERROR | if error |
Implements tle94112::GPIOC.
+ +
+
|
+ +inlinevirtual | +
Enables the WICED output according to the GPIO logic.
+OK | if success |
INTF_ERROR | if error |
Implements tle94112::GPIOC.
+ +
+
|
+ +inlinevirtual | +
Disables the WICED output according to the GPIO logic.
+OK | if success |
INTF_ERROR | if error |
Implements tle94112::GPIOC.
+ +
+
|
+ +inherited | +
class SPICWiced | +
Wiced SPIC class.
+Public Member Functions | |
SPICWiced () | |
Constructor of the WICED SPIC class. More... | |
SPICWiced (wiced_spi_t port, wiced_gpio_t csPin) | |
Construct a new SPICWiced::SPICWiced object. More... | |
SPICWiced (wiced_spi_t port, wiced_gpio_t csPin, uint8_t speed, uint8_t mode, uint8_t bits) | |
Construct a new SPICWiced::SPICWiced object. More... | |
~SPICWiced () | |
Destructor of the WICED SPIC class. More... | |
Error_t | init () |
Initialize the SPIC. More... | |
Error_t | deinit () |
Deinitialize the SPIC. More... | |
Error_t | transfer (uint8_t send, uint8_t &received) |
transfers a data package via the spi bus More... | |
Error_t | transfer16 (uint16_t send, uint16_t &received) |
transfers a data package via the spi bus More... | |
Error_t | checkErrorStatus () |
SPICWiced::SPICWiced | +( | +) | ++ |
Constructor of the WICED SPIC class.
+This function is setting the basics for a SPIC and the default spi on Arduino which is implemented as WICED_SPI_0 by patching the following:
+SPICWiced::SPICWiced | +( | +wiced_spi_t | +port, | +
+ | + | wiced_gpio_t | +csPin | +
+ | ) | ++ |
Construct a new SPICWiced::SPICWiced object.
+This function is setting the basics for a SPIC. It allows to set the SPI channel and the used GPIOs if they are different from the standard GPIOs.
+port | SPI channel to be used |
csPin | Number of the desired ChipSelect pin |
SPICWiced::SPICWiced | +( | +wiced_spi_t | +port, | +
+ | + | wiced_gpio_t | +csPin, | +
+ | + | uint8_t | +speed, | +
+ | + | uint8_t | +mode, | +
+ | + | uint8_t | +bits | +
+ | ) | ++ |
Construct a new SPICWiced::SPICWiced object.
+This function allows to set all parameters of the SPI master.
+port | SPI channel to be used |
csPin | Number of the desired ChipSelect pin |
speed | SPI baud setting |
mode | SPI mode setting |
bits | number of bits in one command |
SPICWiced::~SPICWiced | +( | +) | ++ |
Destructor of the WICED SPIC class.
+
+
|
+ +virtual | +
Initialize the SPIC.
+This function is initializing the chosen spi channel with the given values for lsb,clock and mode
+Implements tle94112::SPIC.
+ +
+
|
+ +virtual | +
Deinitialize the SPIC.
+This function is deinitializing the chosen spi channel.
+Implements tle94112::SPIC.
+ +
+
|
+ +virtual | +
transfers a data package via the spi bus
+send | address and/or command to send |
received | received data from spi bus |
Implements tle94112::SPIC.
+ +
+
|
+ +virtual | +
transfers a data package via the spi bus
+send | address and/or command to send as 16bit |
received | received data from spi bus as 16bit |
Implements tle94112::SPIC.
+ +
+
|
+ +inherited | +
class TimerWiced | +
WiCED timer wrapper.
+Public Member Functions | |
TimerWiced () | |
Constructor of the WICED Timer class. More... | |
~TimerWiced () | |
Destructor of the WICED Timer class. More... | |
Error_t | init () |
Initialization of the Timer. More... | |
Error_t | deinit () |
Deinitialize the Timer. More... | |
Error_t | start () |
Start the timer. More... | |
Error_t | elapsed (wiced_time_t &elapsed) |
Calculate the elapsed time. More... | |
Error_t | stop () |
Stop the timer. More... | |
Error_t | delayMilli (uint32_t timeout) |
Time delay. More... | |
Error_t | delayMicro (uint32_t timeout) |
Time delay. More... | |
virtual Error_t | elapsed (uint32_t &elapsed)=0 |
Elapsed time since the timer was started. More... | |
TimerWiced::TimerWiced | +( | +) | ++ |
Constructor of the WICED Timer class.
+ +TimerWiced::~TimerWiced | +( | +) | ++ |
Destructor of the WICED Timer class.
+ +
+
|
+ +virtual | +
Initialization of the Timer.
+This function is initializing the Timer and sets the elapsed time to zero.
+Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Deinitialize the Timer.
+This function deinitialize the Timer and also resets the elapsed time variable.
+Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Start the timer.
+This function is starting the timer.
+Implements tle94112::Timer.
+ +Error_t TimerWiced::elapsed | +( | +wiced_time_t & | +elapsed | ) | ++ |
Calculate the elapsed time.
+This function is calculating the elapsed time since the start of the timer. The value stored in the given variable is in milliseconds.
+[in] | &elapsed | Address of a value where the elapsed time should be stored |
+
|
+ +virtual | +
Stop the timer.
+This function stops the timer and resets the start time variable.
+Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Time delay.
+This function is causing a desired delay of the application. The input value is given in milliseconds.
+[in] | timeout | Desired timeout in ms |
Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Time delay.
+This function is causing a desired delay of the application. The input value is given in microseconds.
+[in] | timeout | Desired timeout in us |
Implements tle94112::Timer.
+ +
+
|
+ +pure virtualinherited | +
TLE94112 Logger Raspberry Pi PAL. +More...
+#include "logger-rpi.hpp"
TLE94112 Logger Raspberry Pi PAL.
+SPDX-License-Identifier: MIT
+TLE94112 Core API. +More...
++Macros | |
#define | TLE94112_STATUS_INV_MASK (Tle94112::TLE_POWER_ON_RESET) |
#define | TLE94112_CMD_WRITE 0x80; |
SPI address commands. More... | |
#define | TLE94112_CMD_CLEAR 0x80; |
#define | TLE94112_STATUS_INV_MASK (Tle94112::TLE_POWER_ON_RESET) |
#define | TLE94112_CS_RISETIME 2 |
time in milliseconds to wait for chipselect signal raised More... | |
TLE94112 Core API.
+This library includes the basic common functions to controll the TLE94112 registers
+SPDX-License-Identifier: MIT
+#define TLE94112_STATUS_INV_MASK (Tle94112::TLE_POWER_ON_RESET) | +
#define TLE94112_CMD_WRITE 0x80; | +
SPI address commands.
+ +#define TLE94112_CMD_CLEAR 0x80; | +
#define TLE94112_STATUS_INV_MASK (Tle94112::TLE_POWER_ON_RESET) | +
#define TLE94112_CS_RISETIME 2 | +
time in milliseconds to wait for chipselect signal raised
+ +TLE94112 Arduino API. +More...
+#include "tle94112-ino.hpp"
#include "tle94112-platf-ino.hpp"
#include "gpio-arduino.hpp"
#include "spic-arduino.hpp"
#include "timer-arduino.hpp"
TLE94112 Arduino API.
+SPDX-License-Identifier: MIT
++Data Structures | |
class | tle94112::GPIOC |
class | tle94112::SPIC |
class | tle94112::Timer |
class tle94112::GPIOC | +
Public Types | |
Interrupt event | |
enum | IntEvent_t { INT_FALLING_EDGE = 0 +, INT_RISING_EDGE = 1 + } |
Voltage level | |
enum | VLevel_t { GPIO_LOW = 0 +, GPIO_HIGH = 1 + } |
Voltage logic | |
enum | VLogic_t { NEGATIVE = 1 +, POSITIVE = 2 + } |
Public Member Functions | |
virtual Error_t | init ()=0 |
Initializes the GPIO. More... | |
virtual Error_t | deinit ()=0 |
Deinitializes the GPIO. More... | |
virtual VLevel_t | read ()=0 |
Reads the GPIO voltage level. More... | |
virtual Error_t | write (VLevel_t level)=0 |
Writes the GPIO output voltage level. More... | |
virtual Error_t | enable ()=0 |
Enables the GPIO output according to the GPIO logic. More... | |
virtual Error_t | disable ()=0 |
Disables the GPIO output according to the GPIO logic. More... | |
Error_t | checkErrorStatus () |
enum tle94112::GPIOC::IntEvent_t | +
enum tle94112::GPIOC::VLevel_t | +
enum tle94112::GPIOC::VLogic_t | +
+
|
+ +pure virtual | +
+
|
+ +pure virtual | +
+
|
+ +pure virtual | +
+
|
+ +pure virtual | +
+
|
+ +pure virtual | +
Error_t GPIOC::checkErrorStatus | +( | +) | ++ |
class tle94112::SPIC | +
Public Member Functions | |
virtual Error_t | init ()=0 |
Initializes the SPIC. More... | |
virtual Error_t | deinit ()=0 |
Deinitializes the SPIC. More... | |
virtual Error_t | transfer (uint8_t send, uint8_t &received)=0 |
Send/receives data from SPI bus. More... | |
virtual Error_t | transfer16 (uint16_t send, uint16_t &received)=0 |
Send/receives data from SPI bus. More... | |
Error_t | checkErrorStatus () |
+
|
+ +pure virtual | +
+
|
+ +pure virtual | +
+
|
+ +pure virtual | +
+
|
+ +pure virtual | +
Error_t SPIC::checkErrorStatus | +( | +) | ++ |
class tle94112::Timer | +
Public Member Functions | |
virtual Error_t | init ()=0 |
Initialize the timer. More... | |
virtual Error_t | deinit ()=0 |
Deinitialize the timer. More... | |
virtual Error_t | start ()=0 |
Starts the timer. More... | |
virtual Error_t | elapsed (uint32_t &elapsed)=0 |
Elapsed time since the timer was started. More... | |
virtual Error_t | stop ()=0 |
Stops the timer. More... | |
virtual Error_t | delayMilli (uint32_t timeout)=0 |
Introduces a delay during the specified time. More... | |
virtual Error_t | delayMicro (uint32_t timeout)=0 |
Introduces a delay during the specified time. More... | |
+
|
+ +pure virtual | +
Initialize the timer.
+OK | if success |
INIT_ERROR | if hardware interface error |
Implemented in TimerWiced, TimerRpi, TimerMtb, and TimerIno.
+ +
+
|
+ +pure virtual | +
Deinitialize the timer.
+OK | if success |
INIT_ERROR | if hardware interface error |
Implemented in TimerWiced, TimerRpi, TimerMtb, and TimerIno.
+ +
+
|
+ +pure virtual | +
Starts the timer.
+OK | if success |
INIT_ERROR | if hardware interface error |
Implemented in TimerWiced, TimerRpi, TimerMtb, and TimerIno.
+ +
+
|
+ +pure virtual | +
+
|
+ +pure virtual | +
Stops the timer.
+OK | if success |
INIT_ERROR | if hardware interface error |
Implemented in TimerWiced, TimerRpi, TimerMtb, and TimerIno.
+ +
+
|
+ +pure virtual | +
Introduces a delay during the specified time.
+[in] | timeout | Delay time in milliseconds |
OK | if success |
INIT_ERROR | if hardware interface error |
Implemented in TimerWiced, TimerRpi, TimerMtb, and TimerIno.
+ +
+
|
+ +pure virtual | +
Introduces a delay during the specified time.
+[in] | timeout | Delay time in microseconds |
OK | if success |
INIT_ERROR | if hardware interface error |
Implemented in TimerWiced, TimerRpi, TimerMtb, and TimerIno.
+ +TLE94112 Motor Control API. +More...
+#include "tle94112.hpp"
Go to the source code of this file.
++Data Structures | |
class | Tle94112Motor |
represents a motor connected to a TLE94112 More... | |
struct | Tle94112Motor::Connector_t |
struct representing one motor connector More... | |
+Macros | |
#define | TLE94112_MAX_SPEED 255 |
The maximum absolute speed value which can be set. More... | |
#define | TLE94112MOTOR_MAX_CONNECTORS 4 |
maximum number of Tle94112 outputs per motor connector More... | |
TLE94112 Motor Control API.
+This file can optionally be included in projects that use Infineon DC Motor Control Shield with TLE94112 It provides a higher abstraction for controlling motors with the TLE94112 acting as an output driver
+SPDX-License-Identifier: MIT
+struct Tle94112Motor::Connector_t | +
struct representing one motor connector
+Data Fields | ||
---|---|---|
+HalfBridge | ++halfbridges[TLE94112MOTOR_MAX_CONNECTORS] | ++ |
+PWMChannel | ++channel | ++ |
+PWMFreq | ++freq | ++ |
+uint8_t | ++active_fw | ++ |
TLE94112 SPI WICED PAL. +More...
+TLE94112 SPI WICED PAL.
+SPDX-License-Identifier: MIT
+TLE94112 Timer WICED PAL. +More...
+#include "timer-wiced.hpp"
TLE94112 Timer WICED PAL.
+SPDX-License-Identifier: MIT
+TLE94112 Logger Raspberry Pi PAL. +More...
+Go to the source code of this file.
+TLE94112 Logger Raspberry Pi PAL.
+SPDX-License-Identifier: MIT
++Modules | |
TLE94112 API | |
PAL | |
HW Platform | |
+Data Structures | |
class | GPIOMtb |
ModusToolbox GPIO wrapper class. More... | |
class | SPICMtb |
class | TimerMtb |
MoudusToolbox timer wrapper. More... | |
+Macros | |
#define | SPI_FREQ_HZ (1000000UL) |
ModusToolbox SPIC class. More... | |
class GPIOMtb | +
ModusToolbox GPIO wrapper class.
+Public Types | |
Interrupt event | |
enum | IntEvent_t { INT_FALLING_EDGE = 0 +, INT_RISING_EDGE = 1 + } |
Voltage level | |
enum | VLevel_t { GPIO_LOW = 0 +, GPIO_HIGH = 1 + } |
Voltage logic | |
enum | VLogic_t { NEGATIVE = 1 +, POSITIVE = 2 + } |
Public Member Functions | |
GPIOMtb (cyhal_gpio_t pin, cyhal_gpio_direction_t dir, cyhal_gpio_drive_mode_t driveMode, VLogic_t logic) | |
GPIO ModusToolbox HAL constructor. More... | |
~GPIOMtb () | |
GPIO ModusToolbox destructor. More... | |
Error_t | init () |
Initializes the ModusToolbox GPIO. More... | |
Error_t | deinit () |
Initializes the ModusToolbox GPIO. More... | |
VLevel_t | read () |
Reads the ModusToolbox GPIO voltage level. More... | |
Error_t | write (VLevel_t level) |
Writes the ModusToolbox GPIO output voltage level. More... | |
Error_t | enable () |
Enables the ModusToolbox output according to the GPIO logic. More... | |
Error_t | disable () |
Disables the ModusToolbox output according to the GPIO logic. More... | |
Error_t | checkErrorStatus () |
Static Public Attributes | |
static const cyhal_gpio_t | unusedPin = CYHAL_NC_PIN_VALUE |
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
GPIOMtb::GPIOMtb | +( | +cyhal_gpio_t | +pin, | +
+ | + | cyhal_gpio_direction_t | +dir, | +
+ | + | cyhal_gpio_drive_mode_t | +driveMode, | +
+ | + | VLogic_t | +logic | +
+ | ) | ++ |
GPIO ModusToolbox HAL constructor.
+[in] | pin | GPIO pin number |
[in] | dir | GPIO direction |
[in] | driveMode | GPIO driver mode |
[in] | logic | Voltage logic |
GPIOMtb::~GPIOMtb | +( | +) | ++ |
GPIO ModusToolbox destructor.
+
+
|
+ +inlinevirtual | +
Initializes the ModusToolbox GPIO.
+OK | if success |
ERROR | if initialization error |
Implements tle94112::GPIOC.
+ +
+
|
+ +inlinevirtual | +
Initializes the ModusToolbox GPIO.
+OK | if success |
ERROR | if deinitialization error |
Implements tle94112::GPIOC.
+ +
+
|
+ +inlinevirtual | +
Reads the ModusToolbox GPIO voltage level.
+GPIO_LOW | if voltage low |
GPIO_HIGH | if voltage high |
Implements tle94112::GPIOC.
+ +Writes the ModusToolbox GPIO output voltage level.
+[in] | level | Voltage level |
OK | if success |
ERROR | if error |
Implements tle94112::GPIOC.
+ +
+
|
+ +inlinevirtual | +
Enables the ModusToolbox output according to the GPIO logic.
+OK | if success |
ERROR | if error |
Implements tle94112::GPIOC.
+ +
+
|
+ +inlinevirtual | +
Disables the ModusToolbox output according to the GPIO logic.
+OK | if success |
ERROR | if error |
Implements tle94112::GPIOC.
+ +
+
|
+ +inherited | +
+
|
+ +static | +
Unused pin
+ +class SPICMtb | +
Public Member Functions | |
SPICMtb (cyhal_gpio_t csPin, cyhal_gpio_t misoPin, cyhal_gpio_t mosiPin, cyhal_gpio_t sckPin) | |
Construct a new SPICMtb object. More... | |
~SPICMtb () | |
Destructor of the SPICMtb class. More... | |
Error_t | init () |
Initialize the SPIC. More... | |
Error_t | deinit () |
Deinitialize the SPIC. More... | |
Error_t | transfer (uint8_t send, uint8_t &received) |
Transfers a data package via the spi bus. More... | |
Error_t | transfer16 (uint16_t send, uint16_t &received) |
Transfers a data package via the spi bus. More... | |
Error_t | checkErrorStatus () |
Static Public Attributes | |
static const cyhal_gpio_t | unusedPin = CYHAL_NC_PIN_VALUE |
SPICMtb::SPICMtb | +( | +cyhal_gpio_t | +csPin, | +
+ | + | cyhal_gpio_t | +misoPin, | +
+ | + | cyhal_gpio_t | +mosiPin, | +
+ | + | cyhal_gpio_t | +sckPin | +
+ | ) | ++ |
Construct a new SPICMtb object.
+This function allows to set all parameters of the SPI master.
+[in] | csPin | Number of the desired ChipSelect pin |
[in] | misoPin | Number of the desired MISO pin |
[in] | mosiPin | Number of the desired MOSI pin |
[in] | sckPin | Number of the desired SystemClock pin |
SPICMtb::~SPICMtb | +( | +) | ++ |
+
|
+ +virtual | +
Initialize the SPIC.
+This function is initializing the chosen spi channel with the given values for lsb,clock and mode
+Implements tle94112::SPIC.
+ +
+
|
+ +virtual | +
Deinitialize the SPIC.
+This function is deinitializing the chosen spi channel.
+Implements tle94112::SPIC.
+ +
+
|
+ +virtual | +
Transfers a data package via the spi bus.
+[in] | send | address and/or command to send |
[out] | received | received data from spi bus |
Implements tle94112::SPIC.
+ +
+
|
+ +virtual | +
Transfers a data package via the spi bus.
+[in] | send | address and/or command to send as 16bit |
[out] | received | received data from spi bus as 16bit |
Implements tle94112::SPIC.
+ +
+
|
+ +inherited | +
+
|
+ +static | +
Unused pin
+ +class TimerMtb | +
MoudusToolbox timer wrapper.
+Public Member Functions | |
TimerMtb () | |
ModusToolbox Timer configuration. More... | |
~TimerMtb () | |
Destructor of the ModusToolbox Timer class. More... | |
Error_t | init () |
Initialization of the Timer. More... | |
Error_t | deinit () |
Deinitialize the Timer. More... | |
Error_t | start () |
Start the timer. More... | |
Error_t | elapsed (uint32_t &elapsed) |
Calculate the elapsed time. More... | |
Error_t | stop () |
Stop the timer. More... | |
Error_t | delayMilli (uint32_t timeout) |
Time delay. More... | |
Error_t | delayMicro (uint32_t timeout) |
Time delay. More... | |
TimerMtb::TimerMtb | +( | +) | ++ |
ModusToolbox Timer configuration.
+Constructor of the ModusToolbox Timer class
+ +TimerMtb::~TimerMtb | +( | +) | ++ |
Destructor of the ModusToolbox Timer class.
+ +
+
|
+ +virtual | +
Initialization of the Timer.
+This function is initializing the Timer and sets the elapsed time to zero.
+Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Deinitialize the Timer.
+This function deinitialize the Timer and also resets the elapsed time variable.
+Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Start the timer.
+This function is starting the timer.
+Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Calculate the elapsed time.
+This function is calculating the elapsed time since the start of the timer. The value stored in the given variable is in milliseconds.
+[in] | &elapsed | Address of a value where the elapsed time should be stored |
Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Stop the timer.
+This function stops the timer and resets the start time variable.
+Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Time delay.
+This function is causing a desired delay of the application. The input value is given in milliseconds.
+[in] | timeout | Desired timeout in ms |
Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Time delay.
+This function is causing a desired delay of the application. The input value is given in microseconds.
+[in] | timeout | Desired timeout in us |
Implements tle94112::Timer.
+ +#define SPI_FREQ_HZ (1000000UL) | +
ModusToolbox SPIC class.
+ ++Data Structures | |
class | GPIORpi |
Raspberry Pi GPIO class. More... | |
class | SPICRpi |
Raspberry Pi SPIC class. More... | |
class | TimerRpi |
class GPIORpi | +
Raspberry Pi GPIO class.
+Public Types | |
Interrupt event | |
enum | IntEvent_t { INT_FALLING_EDGE = 0 +, INT_RISING_EDGE = 1 + } |
Voltage level | |
enum | VLevel_t { GPIO_LOW = 0 +, GPIO_HIGH = 1 + } |
Voltage logic | |
enum | VLogic_t { NEGATIVE = 1 +, POSITIVE = 2 + } |
Public Member Functions | |
GPIORpi () | |
Constructor of the Raspberry Pi GPIO class. More... | |
GPIORpi (uint8_t pin, uint8_t mode, VLogic_t logic) | |
Constructor of the Raspberry Pi GPIO class. More... | |
~GPIORpi () | |
Error_t | init () |
Initialize the GPIO. More... | |
Error_t | deinit () |
Deinitialize the GPIO. More... | |
VLevel_t | read () |
Read GPIO logic level. More... | |
Error_t | write (VLevel_t level) |
Set GPIO logic level. More... | |
Error_t | enable () |
Enable the GPIO. More... | |
Error_t | disable () |
Disable the GPIO. More... | |
Error_t | checkErrorStatus () |
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
GPIORpi::GPIORpi | +( | +) | ++ |
Constructor of the Raspberry Pi GPIO class.
+This function sets the basics for a GPIO.
+ +GPIORpi::GPIORpi | +( | +uint8_t | +pin, | +
+ | + | uint8_t | +mode, | +
+ | + | VLogic_t | +logic | +
+ | ) | ++ |
Constructor of the Raspberry Pi GPIO class.
+This function sets the basics for a GPIO. It allows to set the pin number, mode of the pin and the logic level.
+[in] | pin | Number of the desired pin |
[in] | mode | Defines the mode of the pin (INPUT, OUTPUT, etc.) |
[in] | logic | Defines the logic level of the pin |
+
|
+ +inline | +
+
|
+ +virtual | +
Initialize the GPIO.
+This function initializes the chosen pin.
+Implements tle94112::GPIOC.
+ +
+
|
+ +virtual | +
Deinitialize the GPIO.
+This function deinitializes the chosen pin.
+Implements tle94112::GPIOC.
+ +
+
|
+ +virtual | +
Read GPIO logic level.
+This function reads the logic level of the chosen pin and returns the logic level value.
+0 | = GPIO_LOW |
1 | = GPIO_HIGH |
Implements tle94112::GPIOC.
+ +Set GPIO logic level.
+This functions sets the logic level of the chosen pin.
+[in] | level | Desired logic level of the pin |
Implements tle94112::GPIOC.
+ +
+
|
+ +virtual | +
Enable the GPIO.
+This function enables the chosen pin. Depending on the chosen logic of the pin it sets the right logic level of the pin.
+Implements tle94112::GPIOC.
+ +
+
|
+ +virtual | +
Disable the GPIO.
+This function disables the chosen pin. Depending on the chosen logic of the pin it sets the right logic level of the pin.
+Implements tle94112::GPIOC.
+ +
+
|
+ +inherited | +
class SPICRpi | +
Raspberry Pi SPIC class.
+Public Member Functions | |
SPICRpi () | |
Constructor of the Raspberry Pi SPIC class. More... | |
SPICRpi (uint8_t lsb, uint8_t mode, uint8_t clock) | |
Construct a new SPICRpi::SPICRpi object of the Raspberry Pi SPIC class. More... | |
SPICRpi (uint8_t csPin, uint8_t misoPin, uint8_t mosiPin, uint8_t sckPin) | |
Construct a new SPICRpi::SPICRpi object of the Raspberry Pi SPIC class. More... | |
~SPICRpi () | |
Error_t | init () |
Initialize the SPIC. More... | |
Error_t | deinit () |
Deinitialize the SPIC. More... | |
Error_t | transfer (uint8_t send, uint8_t &received) |
transfers a data package via the spi bus More... | |
Error_t | transfer16 (uint16_t send, uint16_t &received) |
transfers a data package via the spi bus with 16 bit length More... | |
Error_t | checkErrorStatus () |
SPICRpi::SPICRpi | +( | +) | ++ |
Constructor of the Raspberry Pi SPIC class.
+This function sets the basics for a SPIC and the default SPI.
+ +SPICRpi::SPICRpi | +( | +uint8_t | +lsb, | +
+ | + | uint8_t | +mode, | +
+ | + | uint8_t | +clock | +
+ | ) | ++ |
Construct a new SPICRpi::SPICRpi object of the Raspberry Pi SPIC class.
+This function sets some basic SPI modes for the default SPI port.
+lsb | lowside (LSB) or highside (MSB) mode |
mode | SPI mode |
clock | SPI clock divider |
SPICRpi::SPICRpi | +( | +uint8_t | +csPin, | +
+ | + | uint8_t | +misoPin, | +
+ | + | uint8_t | +mosiPin, | +
+ | + | uint8_t | +sckPin | +
+ | ) | ++ |
Construct a new SPICRpi::SPICRpi object of the Raspberry Pi SPIC class.
+This function sets all pins for a given SPI port, allowing a free setting of the SPI interface
+csPin | chipselect pin for the SPI port |
misoPin | miso pin number |
mosiPin | mosi pin number |
sckPin | systemclock pin number |
+
|
+ +inline | +
+
|
+ +virtual | +
Initialize the SPIC.
+This function initializes the chosen spi channel with the given values for lsb,clock and mode
+Implements tle94112::SPIC.
+ +
+
|
+ +virtual | +
Deinitialize the SPIC.
+This function deinitializes the chosen spi channel.
+Implements tle94112::SPIC.
+ +
+
|
+ +virtual | +
transfers a data package via the spi bus
+send | address and/or command to send |
received | received data from spi bus |
Implements tle94112::SPIC.
+ +
+
|
+ +virtual | +
transfers a data package via the spi bus with 16 bit length
+send | address and/or command to send |
received | received data from spi bus |
Implements tle94112::SPIC.
+ +
+
|
+ +inherited | +
class TimerRpi | +
Public Member Functions | |
TimerRpi () | |
Constructor of the Raspberry Pi Timer class. More... | |
~TimerRpi () | |
Destructor of the Raspberry Pi Timer class. More... | |
Error_t | init () |
Initialization of the Timer. More... | |
Error_t | deinit () |
Deinitialize the Timer. More... | |
Error_t | start () |
Start the timer. More... | |
Error_t | elapsed (uint32_t &elapsed) |
Calculate the elapsed time. More... | |
Error_t | stop () |
Stop the timer. More... | |
Error_t | delayMilli (uint32_t timeout) |
Time delay. More... | |
Error_t | delayMicro (uint32_t timeout) |
Time delay. More... | |
TimerRpi::TimerRpi | +( | +) | ++ |
Constructor of the Raspberry Pi Timer class.
+ +TimerRpi::~TimerRpi | +( | +) | ++ |
Destructor of the Raspberry Pi Timer class.
+ +
+
|
+ +virtual | +
Initialization of the Timer.
+This function initializes the Timer and sets the elapsed time to zero.
+Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Deinitialize the Timer.
+This function deinitializes the Timer and also resets the elapsed time to variable.
+Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Start the timer.
+This function starts the timer.
+Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Calculate the elapsed time.
+This function calculates the elapsed time since the start of the timer. The value stored in the given variable is in milliseconds.
+[in] | &elapsed | Address of a value where the elapsed time should be stored |
Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Stop the timer.
+This function stops the timer and resets the start time variable.
+Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Time delay.
+This function causes a desired delay of the application. The input value is given in milliseconds.
+[in] | timeout | Desired timeout in ms |
Implements tle94112::Timer.
+ +
+
|
+ +virtual | +
Time delay.
+This function causes a desired delay of the application. The input value is given in microseconds.
+[in] | timeout | Desired timeout in us |
Implements tle94112::Timer.
+ +TLE94112 Core API. +More...
+#include <stdint.h>
#include <stdlib.h>
#include "timer.hpp"
#include "gpio.hpp"
#include "spic.hpp"
Go to the source code of this file.
++Data Structures | |
class | Tle94112 |
represents a basic TLE94112 More... | |
struct | Tle94112::HalfBridge_t |
struct containing register locations for a single halfbridge More... | |
struct | Tle94112::PWMchannel_t |
struct containing register locations for a single PWM channel More... | |
+Macros | |
#define | TLE94112_NUM_HB 13 |
the number of halfbridges on a TLE94112 (including no halfbridge) More... | |
#define | TLE94112_NUM_PWM 4 |
the number of pwm modes for a halfbridge (including no pwm) More... | |
#define | TLE94112_NUM_CTRL_REGS 12 |
the number of control registers in a TLE94112 More... | |
#define | TLE94112_NUM_STATUS_REGS 7 |
the number of status registers in a TLE94112 More... | |
TLE94112 Core API.
+This library includes the basic common functions to controll the TLE94112 registers
+SPDX-License-Identifier: MIT
+struct Tle94112::HalfBridge_t | +
struct containing register locations for a single halfbridge
++Modules | |
TLE94112 API | |
PAL <br> | |
HW Platforms | |
TLE94112 Timer ModusToolbox HAL PAL. +More...
+#include "timer-mtb.hpp"
TLE94112 Timer ModusToolbox HAL PAL.
+SPDX-License-Identifier: MIT
++Modules | |
TLE94112 API | |
PAL | |
Arduino HW Platforms | |
+Data Structures | |
class | Tle94112 |
represents a basic TLE94112 More... | |
+Macros | |
#define | TLE94112_NUM_HB 13 |
the number of halfbridges on a TLE94112 (including no halfbridge) More... | |
#define | TLE94112_NUM_PWM 4 |
the number of pwm modes for a halfbridge (including no pwm) More... | |
#define | TLE94112_NUM_CTRL_REGS 12 |
the number of control registers in a TLE94112 More... | |
#define | TLE94112_NUM_STATUS_REGS 7 |
the number of status registers in a TLE94112 More... | |
Error codes | |
enum | tle94112::Error_t { + tle94112::OK = 0 +, tle94112::INTF_ERROR = -1 +, tle94112::CONF_ERROR = -2 +, tle94112::READ_ERROR = -3 +, + tle94112::WRITE_ERROR = -4 + + } |
class Tle94112 | +
represents a basic TLE94112
+This class provides a simple API for connecting and controlling motors. Each motor is assigned to a Tle94112 which acts as output driver. Calls to Tle94112Motor instances are mapped to calls to Tle94112. Therefore, this class does not bring new features, it does only provide further abstraction.
+Public Types | |
enum | HalfBridge { + TLE_NOHB = 0 +, TLE_HB1 +, TLE_HB2 +, TLE_HB3 +, + TLE_HB4 +, TLE_HB5 +, TLE_HB6 +, TLE_HB7 +, + TLE_HB8 +, TLE_HB9 +, TLE_HB10 +, TLE_HB11 +, + TLE_HB12 + + } |
enum for the halfbridges on a TLE94112 More... | |
enum | PWMChannel { TLE_NOPWM = 0 +, TLE_PWM1 +, TLE_PWM2 +, TLE_PWM3 + } |
enum for the PWM channels of a halfbridge on TLE94112 More... | |
enum | HBState { TLE_FLOATING = 0b00 +, TLE_LOW = 0b01 +, TLE_HIGH = 0b10 + } |
enum for the output states of a halfbridge More... | |
enum | HBOCState { TLE_NONE = 0b00 +, TLE_LOWSIDE = 0b01 +, TLE_HIGHSIDE = 0b10 + } |
enum for the overcurrent states of a halfbridge More... | |
enum | PWMFreq { TLE_FREQOFF = 0b00 +, TLE_FREQ80HZ +, TLE_FREQ100HZ +, TLE_FREQ200HZ + } |
enum for the frequencies of a PWM channel More... | |
enum | DiagFlag { + TLE_SPI_ERROR = 0x80 +, TLE_LOAD_ERROR = 0x40 +, TLE_UNDER_VOLTAGE = 0x20 +, TLE_OVER_VOLTAGE = 0x10 +, + TLE_POWER_ON_RESET = 0x08 +, TLE_TEMP_SHUTDOWN = 0x04 +, TLE_TEMP_WARNING = 0x02 + + } |
enum for the flags in the register SYS_DIAG1 More... | |
Public Member Functions | |
Tle94112 () | |
standard constructor with default pin assignment More... | |
Tle94112 (SPIC *sBus, GPIOC *cs, GPIOC *en, Timer *timer) | |
constructor with pal instances More... | |
~Tle94112 () | |
standard destructor switches shield off More... | |
void | begin (void) |
enables and initializes the TLE94112 More... | |
void | end (void) |
deactivates all outputs and disables the TLE94112 More... | |
void | configHB (HalfBridge hb, HBState state, PWMChannel pwm) |
sets the output state and the PWM channel for a halfbridge (only for passive freewheeling) More... | |
void | configHB (HalfBridge hb, HBState state, PWMChannel pwm, uint8_t activeFW) |
sets the output state and the PWM channel for a halfbridge (allows active freewheeling) More... | |
void | configPWM (PWMChannel pwm, PWMFreq freq, uint8_t dutyCycle) |
sets the frequency and duty cycle for a PWM channel More... | |
uint8_t | setLedMode (HalfBridge hb, uint8_t active) |
sets LED mode on compatible half bridges (half bridge 1 or 2 of TLE94112) More... | |
uint8_t | getSysDiagnosis () |
returns a diagnosis value for error detection More... | |
uint8_t | getSysDiagnosis (DiagFlag mask) |
shows if errors of a specific type have occurred More... | |
uint8_t | getSysDiagnosis (uint8_t mask) |
shows if errors of a specific type have occurred More... | |
uint8_t | getHBOverCurrent (HalfBridge hb) |
gets the overcurrent error flag bit for a specific halfbridge More... | |
uint8_t | getHBOpenLoad (HalfBridge hb) |
gets the openload error flag bit for a specific halfbridge More... | |
void | clearErrors () |
clears all clearable error flags More... | |
Data Fields | |
SPIC * | sBus |
GPIOC * | cs |
GPIOC * | en |
Timer * | timer |
Static Public Attributes | |
static const uint8_t | TLE_STATUS_OK = 0U |
Reference value of Status Register. More... | |
Protected Types | |
enum | CtrlRegisters { + HB_ACT_1_CTRL = 0 +, HB_ACT_2_CTRL +, HB_ACT_3_CTRL +, HB_MODE_1_CTRL +, + HB_MODE_2_CTRL +, HB_MODE_3_CTRL +, PWM_CH_FREQ_CTRL +, PWM1_DC_CTRL +, + PWM2_DC_CTRL +, PWM3_DC_CTRL +, FW_OL_CTRL +, FW_CTRL + + } |
enum for the control registers in a TLE94112 More... | |
enum | StatusRegisters { + SYS_DIAG1 = 0 +, OP_ERROR_1_STAT +, OP_ERROR_2_STAT +, OP_ERROR_3_STAT +, + OP_ERROR_4_STAT +, OP_ERROR_5_STAT +, OP_ERROR_6_STAT + + } |
enum for the status registers in a TLE94112 More... | |
Protected Member Functions | |
void | init (void) |
initializes this object, automatically called by begin() More... | |
void | _configHB (uint8_t hb, uint8_t state, uint8_t pwm, uint8_t activeFW) |
sets the output state and the PWM channel for a halfbridge automatically called by the public version of configHB More... | |
void | _configPWM (uint8_t pwm, uint8_t freq, uint8_t dutyCycle) |
sets the frequency and duty cycle for a PWM channel automatically called by the public version of configPWM More... | |
uint8_t | _getHBOverCurrent (uint8_t hb) |
gets the overcurrent error flag bit for a specific halfbridge automatically called by the public version of getHBOverCurrent More... | |
uint8_t | _getHBOpenLoad (uint8_t hb) |
gets the openload error flag bit for a specific halfbridge automatically called by the public version of getHBOpenLoad More... | |
void | writeReg (uint8_t reg, uint8_t mask, uint8_t shift, uint8_t data) |
writes data bits to a control register of the TLE94112 More... | |
uint8_t | readStatusReg (uint8_t reg) |
reads one byte from a status register of the TLE94112 More... | |
uint8_t | readStatusReg (uint8_t reg, uint8_t mask, uint8_t shift) |
reads some bits from a status register of the TLE94112 More... | |
void | clearStatusReg (uint8_t reg) |
clears a status register by writing 0x00 to it More... | |
Protected Attributes | |
HalfBridge_t | mHalfBridges [TLE94112_NUM_HB] |
array of register locations for halfbridges More... | |
PWMchannel_t | mPwmChannels [TLE94112_NUM_PWM] |
array of register locations for PWM channels More... | |
uint8_t | mCtrlRegAddresses [TLE94112_NUM_CTRL_REGS] |
mapping array for control register addresses More... | |
uint8_t | mCtrlRegData [TLE94112_NUM_CTRL_REGS] |
mirror array for control register data More... | |
uint8_t | mStatusRegAddresses [TLE94112_NUM_STATUS_REGS] |
mapping array for status register addresses More... | |
uint8_t | mEnabled |
enum Tle94112::HalfBridge | +
enum Tle94112::PWMChannel | +
enum Tle94112::HBState | +
enum Tle94112::HBOCState | +
enum Tle94112::PWMFreq | +
enum Tle94112::DiagFlag | +
+
|
+ +protected | +
+
|
+ +protected | +
Tle94112::Tle94112 | +( | +void | +) | ++ |
standard constructor with default pin assignment
+ +Tle94112::Tle94112 | +( | +SPIC * | +sBus, | +
+ | + | GPIOC * | +cs, | +
+ | + | GPIOC * | +en, | +
+ | + | Timer * | +timer | +
+ | ) | ++ |
constructor with pal instances
+ +Tle94112::~Tle94112 | +( | +) | ++ |
standard destructor switches shield off
+ +void Tle94112::begin | +( | +void | +) | ++ |
enables and initializes the TLE94112
+void Tle94112::end | +( | +void | +) | ++ |
deactivates all outputs and disables the TLE94112
+void Tle94112::configHB | +( | +HalfBridge | +hb, | +
+ | + | HBState | +state, | +
+ | + | PWMChannel | +pwm | +
+ | ) | ++ |
sets the output state and the PWM channel for a halfbridge (only for passive freewheeling)
+hb | halfbridge which will be configured |
state | sets the output voltage to high, low or floating |
pwm | selects a PWM channel for PWM output |
void Tle94112::configHB | +( | +HalfBridge | +hb, | +
+ | + | HBState | +state, | +
+ | + | PWMChannel | +pwm, | +
+ | + | uint8_t | +activeFW | +
+ | ) | ++ |
sets the output state and the PWM channel for a halfbridge (allows active freewheeling)
+hb | halfbridge which will be configured |
state | sets the output voltage to high, low or floating |
pwm | selects a PWM channel for PWM output |
activeFW | 1 for active freewheeling 0 for passive freewheeling (default) |
void Tle94112::configPWM | +( | +PWMChannel | +pwm, | +
+ | + | PWMFreq | +freq, | +
+ | + | uint8_t | +dutyCycle | +
+ | ) | ++ |
sets the frequency and duty cycle for a PWM channel
+pwm | PWM channel which will be configured |
freq | selects the PWM output frequency |
dutyCycle | a value from 0 to 255 which sets the dutyCycle |
uint8_t Tle94112::setLedMode | +( | +HalfBridge | +hb, | +
+ | + | uint8_t | +active | +
+ | ) | ++ |
sets LED mode on compatible half bridges (half bridge 1 or 2 of TLE94112)
+hb | compatible half bridge to set LED mode |
active | LED mode active (1) or inactive (0) |
uint8_t Tle94112::getSysDiagnosis | +( | +) | ++ |
returns a diagnosis value for error detection
+uint8_t Tle94112::getSysDiagnosis | +( | +DiagFlag | +mask | ) | ++ |
shows if errors of a specific type have occurred
+mask | mask to filter for a specific flag |
uint8_t Tle94112::getSysDiagnosis | +( | +uint8_t | +mask | ) | ++ |
shows if errors of a specific type have occurred
+mask | mask to filter for one or more specific flags this can be a disjunction of DiagFlag values |
uint8_t Tle94112::getHBOverCurrent | +( | +HalfBridge | +hb | ) | ++ |
gets the overcurrent error flag bit for a specific halfbridge
+hb | halfbridge thats overcurrent flag will be returned |
uint8_t Tle94112::getHBOpenLoad | +( | +HalfBridge | +hb | ) | ++ |
gets the openload error flag bit for a specific halfbridge
+hb | halfbridge thats openload flag will be returned |
void Tle94112::clearErrors | +( | +) | ++ |
clears all clearable error flags
+
+
|
+ +protected | +
initializes this object, automatically called by begin()
+< initial control register configuration
+< status register configuration
+< bit masking for all halfbridges
+< bit masking for all pwm channels
+ +
+
|
+ +protected | +
sets the output state and the PWM channel for a halfbridge automatically called by the public version of configHB
+hb | halfbridge which will be configured |
state | sets the output voltage to high, low or floating |
pwm | selects a PWM channel for PWM output |
activeFW | 1 for active freewheeling 0 for passive freewheeling (default) |
+
|
+ +protected | +
sets the frequency and duty cycle for a PWM channel automatically called by the public version of configPWM
+pwm | PWM channel which will be configured |
freq | selects the PWM output frequency |
dutyCycle | a value from 0 to 255 which sets the dutyCycle |
+
|
+ +protected | +
gets the overcurrent error flag bit for a specific halfbridge automatically called by the public version of getHBOverCurrent
+hb | halfbridge thats overcurrent flag will be returned |
+
|
+ +protected | +
gets the openload error flag bit for a specific halfbridge automatically called by the public version of getHBOpenLoad
+hb | halfbridge thats openload flag will be returned |
+
|
+ +protected | +
writes data bits to a control register of the TLE94112
+reg | control register number(mapping array index / CtrlRegisters constant) of the register |
mask | mask for the bits that have to be written |
shift | data will be shifted left by this amount before masking. This is for the bit alignment of data |
data | the data byte that has to be written. It will be shifted and masked before |
+
|
+ +protected | +
reads one byte from a status register of the TLE94112
+reg | status register number(mapping array index / StatusRegisters constant) of the register |
+
|
+ +protected | +
reads some bits from a status register of the TLE94112
+reg | status register number(mapping array index / StatusRegisters constant) of the register |
mask | mask for the bits that have to be read |
shift | data will be shifted right by this amount after masking. This is for the bit alignment of data |
+
|
+ +protected | +
clears a status register by writing 0x00 to it
+reg | status register number(mapping array index / StatusRegisters constant) of the register |
+
|
+ +static | +
Reference value of Status Register.
+ +SPIC* Tle94112::sBus | +
GPIOC* Tle94112::cs | +
GPIOC* Tle94112::en | +
Timer* Tle94112::timer | +
+
|
+ +protected | +
array of register locations for halfbridges
+ +
+
|
+ +protected | +
array of register locations for PWM channels
+ +
+
|
+ +protected | +
mapping array for control register addresses
+ +
+
|
+ +protected | +
mirror array for control register data
+ +
+
|
+ +protected | +
mapping array for status register addresses
+ +
+
|
+ +protected | +
#define TLE94112_NUM_HB 13 | +
the number of halfbridges on a TLE94112 (including no halfbridge)
+#define TLE94112_NUM_PWM 4 | +
the number of pwm modes for a halfbridge (including no pwm)
+#define TLE94112_NUM_CTRL_REGS 12 | +
the number of control registers in a TLE94112
+#define TLE94112_NUM_STATUS_REGS 7 | +
the number of status registers in a TLE94112
+enum tle94112::Error_t | +
TLE94112 Raspberry Pi Hardware Platforms. +More...
+#include <bcm2835.h>
Go to the source code of this file.
++Macros | |
#define | TLE94112_PIN_CS0 RPI_V2_GPIO_P1_24 |
#define | TLE94112_PIN_CS1 RPI_V2_GPIO_P1_26 |
#define | TLE94112_PIN_CS2 RPI_V2_GPIO_P1_22 |
#define | TLE94112_PIN_CS3 RPI_V2_GPIO_P1_15 |
#define | TLE94112_PIN_EN RPI_V2_GPIO_P1_37 |
TLE94112 Raspberry Pi Hardware Platforms.
+SPDX-License-Identifier: MIT
+TLE94112 GPIO WICED PAL. +More...
+#include "gpio-wiced.hpp"
TLE94112 GPIO WICED PAL.
+SPDX-License-Identifier: MIT
+TLE94112 Logger. +More...
+#include "tle94112-logger.hpp"
TLE94112 Logger.
+SPDX-License-Identifier: MIT
+TLE94112 Logger Platform Abstraction Layer. +More...
+#include "tle94112-conf.hpp"
Go to the source code of this file.
+TLE94112 Logger Platform Abstraction Layer.
+SPDX-License-Identifier: MIT
++Data Structures | |
class | Tle94112Mtb |
class Tle94112Mtb | +
Public Types | |
enum | HalfBridge { + TLE_NOHB = 0 +, TLE_HB1 +, TLE_HB2 +, TLE_HB3 +, + TLE_HB4 +, TLE_HB5 +, TLE_HB6 +, TLE_HB7 +, + TLE_HB8 +, TLE_HB9 +, TLE_HB10 +, TLE_HB11 +, + TLE_HB12 + + } |
enum for the halfbridges on a TLE94112 More... | |
enum | PWMChannel { TLE_NOPWM = 0 +, TLE_PWM1 +, TLE_PWM2 +, TLE_PWM3 + } |
enum for the PWM channels of a halfbridge on TLE94112 More... | |
enum | HBState { TLE_FLOATING = 0b00 +, TLE_LOW = 0b01 +, TLE_HIGH = 0b10 + } |
enum for the output states of a halfbridge More... | |
enum | HBOCState { TLE_NONE = 0b00 +, TLE_LOWSIDE = 0b01 +, TLE_HIGHSIDE = 0b10 + } |
enum for the overcurrent states of a halfbridge More... | |
enum | PWMFreq { TLE_FREQOFF = 0b00 +, TLE_FREQ80HZ +, TLE_FREQ100HZ +, TLE_FREQ200HZ + } |
enum for the frequencies of a PWM channel More... | |
enum | DiagFlag { + TLE_SPI_ERROR = 0x80 +, TLE_LOAD_ERROR = 0x40 +, TLE_UNDER_VOLTAGE = 0x20 +, TLE_OVER_VOLTAGE = 0x10 +, + TLE_POWER_ON_RESET = 0x08 +, TLE_TEMP_SHUTDOWN = 0x04 +, TLE_TEMP_WARNING = 0x02 + + } |
enum for the flags in the register SYS_DIAG1 More... | |
Public Member Functions | |
Tle94112Mtb (void) | |
Construct a new Tle94112Mtb object This constructor calls with default pinsetting for the MCU board. Keep in mind that we do not set the chipselect pin with the SPI class, as we need a constant signal during multiple transfers. More... | |
Tle94112Mtb (cyhal_gpio_t csPin) | |
Construct a new Tle94112Mtb object This constructor calls with default pinsetting for the SPI except for the chip select pin. Keep in mind that we do not set the chipselect pin with the SPI class, as we need a constant signal during multiple transfers. More... | |
Tle94112Mtb (cyhal_gpio_t csPin, cyhal_gpio_t misoPin, cyhal_gpio_t mosiPin, cyhal_gpio_t sckPin) | |
Construct a new Tle94112Mtb object For ModusToolbox HAL setups with different than the usual pinsettings. More... | |
void | begin (void) |
enables and initializes the TLE94112 More... | |
void | end (void) |
deactivates all outputs and disables the TLE94112 More... | |
void | configHB (HalfBridge hb, HBState state, PWMChannel pwm) |
sets the output state and the PWM channel for a halfbridge (only for passive freewheeling) More... | |
void | configHB (HalfBridge hb, HBState state, PWMChannel pwm, uint8_t activeFW) |
sets the output state and the PWM channel for a halfbridge (allows active freewheeling) More... | |
void | configPWM (PWMChannel pwm, PWMFreq freq, uint8_t dutyCycle) |
sets the frequency and duty cycle for a PWM channel More... | |
uint8_t | setLedMode (HalfBridge hb, uint8_t active) |
sets LED mode on compatible half bridges (half bridge 1 or 2 of TLE94112) More... | |
uint8_t | getSysDiagnosis () |
returns a diagnosis value for error detection More... | |
uint8_t | getSysDiagnosis (DiagFlag mask) |
shows if errors of a specific type have occurred More... | |
uint8_t | getSysDiagnosis (uint8_t mask) |
shows if errors of a specific type have occurred More... | |
uint8_t | getHBOverCurrent (HalfBridge hb) |
gets the overcurrent error flag bit for a specific halfbridge More... | |
uint8_t | getHBOpenLoad (HalfBridge hb) |
gets the openload error flag bit for a specific halfbridge More... | |
void | clearErrors () |
clears all clearable error flags More... | |
Data Fields | |
SPIC * | sBus |
GPIOC * | cs |
GPIOC * | en |
Timer * | timer |
Static Public Attributes | |
static const uint8_t | TLE_STATUS_OK = 0U |
Reference value of Status Register. More... | |
Protected Types | |
enum | CtrlRegisters { + HB_ACT_1_CTRL = 0 +, HB_ACT_2_CTRL +, HB_ACT_3_CTRL +, HB_MODE_1_CTRL +, + HB_MODE_2_CTRL +, HB_MODE_3_CTRL +, PWM_CH_FREQ_CTRL +, PWM1_DC_CTRL +, + PWM2_DC_CTRL +, PWM3_DC_CTRL +, FW_OL_CTRL +, FW_CTRL + + } |
enum for the control registers in a TLE94112 More... | |
enum | StatusRegisters { + SYS_DIAG1 = 0 +, OP_ERROR_1_STAT +, OP_ERROR_2_STAT +, OP_ERROR_3_STAT +, + OP_ERROR_4_STAT +, OP_ERROR_5_STAT +, OP_ERROR_6_STAT + + } |
enum for the status registers in a TLE94112 More... | |
Protected Member Functions | |
void | init (void) |
initializes this object, automatically called by begin() More... | |
void | _configHB (uint8_t hb, uint8_t state, uint8_t pwm, uint8_t activeFW) |
sets the output state and the PWM channel for a halfbridge automatically called by the public version of configHB More... | |
void | _configPWM (uint8_t pwm, uint8_t freq, uint8_t dutyCycle) |
sets the frequency and duty cycle for a PWM channel automatically called by the public version of configPWM More... | |
uint8_t | _getHBOverCurrent (uint8_t hb) |
gets the overcurrent error flag bit for a specific halfbridge automatically called by the public version of getHBOverCurrent More... | |
uint8_t | _getHBOpenLoad (uint8_t hb) |
gets the openload error flag bit for a specific halfbridge automatically called by the public version of getHBOpenLoad More... | |
void | writeReg (uint8_t reg, uint8_t mask, uint8_t shift, uint8_t data) |
writes data bits to a control register of the TLE94112 More... | |
uint8_t | readStatusReg (uint8_t reg) |
reads one byte from a status register of the TLE94112 More... | |
uint8_t | readStatusReg (uint8_t reg, uint8_t mask, uint8_t shift) |
reads some bits from a status register of the TLE94112 More... | |
void | clearStatusReg (uint8_t reg) |
clears a status register by writing 0x00 to it More... | |
Protected Attributes | |
HalfBridge_t | mHalfBridges [TLE94112_NUM_HB] |
array of register locations for halfbridges More... | |
PWMchannel_t | mPwmChannels [TLE94112_NUM_PWM] |
array of register locations for PWM channels More... | |
uint8_t | mCtrlRegAddresses [TLE94112_NUM_CTRL_REGS] |
mapping array for control register addresses More... | |
uint8_t | mCtrlRegData [TLE94112_NUM_CTRL_REGS] |
mirror array for control register data More... | |
uint8_t | mStatusRegAddresses [TLE94112_NUM_STATUS_REGS] |
mapping array for status register addresses More... | |
uint8_t | mEnabled |
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +protectedinherited | +
+
|
+ +protectedinherited | +
Tle94112Mtb::Tle94112Mtb | +( | +void | +) | ++ |
Construct a new Tle94112Mtb object This constructor calls with default pinsetting for the MCU board. Keep in mind that we do not set the chipselect pin with the SPI class, as we need a constant signal during multiple transfers.
+ +Tle94112Mtb::Tle94112Mtb | +( | +cyhal_gpio_t | +csPin | ) | ++ |
Construct a new Tle94112Mtb object This constructor calls with default pinsetting for the SPI except for the chip select pin. Keep in mind that we do not set the chipselect pin with the SPI class, as we need a constant signal during multiple transfers.
+csPin | chipselect pin for the wrapping GPIO |
Tle94112Mtb::Tle94112Mtb | +( | +cyhal_gpio_t | +csPin, | +
+ | + | cyhal_gpio_t | +misoPin, | +
+ | + | cyhal_gpio_t | +mosiPin, | +
+ | + | cyhal_gpio_t | +sckPin | +
+ | ) | ++ |
Construct a new Tle94112Mtb object For ModusToolbox HAL setups with different than the usual pinsettings.
+csPin | chipselect pin for the wrapping GPIO |
misoPin | miso pin for the SPIC |
mosiPin | mosi pin for the SPIC |
sckPin | system clock pin for the SPIC |
+
|
+ +inherited | +
enables and initializes the TLE94112
+
+
|
+ +inherited | +
deactivates all outputs and disables the TLE94112
+
+
|
+ +inherited | +
sets the output state and the PWM channel for a halfbridge (only for passive freewheeling)
+hb | halfbridge which will be configured |
state | sets the output voltage to high, low or floating |
pwm | selects a PWM channel for PWM output |
+
|
+ +inherited | +
sets the output state and the PWM channel for a halfbridge (allows active freewheeling)
+hb | halfbridge which will be configured |
state | sets the output voltage to high, low or floating |
pwm | selects a PWM channel for PWM output |
activeFW | 1 for active freewheeling 0 for passive freewheeling (default) |
+
|
+ +inherited | +
sets the frequency and duty cycle for a PWM channel
+pwm | PWM channel which will be configured |
freq | selects the PWM output frequency |
dutyCycle | a value from 0 to 255 which sets the dutyCycle |
+
|
+ +inherited | +
sets LED mode on compatible half bridges (half bridge 1 or 2 of TLE94112)
+hb | compatible half bridge to set LED mode |
active | LED mode active (1) or inactive (0) |
+
|
+ +inherited | +
returns a diagnosis value for error detection
+
+
|
+ +inherited | +
shows if errors of a specific type have occurred
+mask | mask to filter for a specific flag |
+
|
+ +inherited | +
shows if errors of a specific type have occurred
+mask | mask to filter for one or more specific flags this can be a disjunction of DiagFlag values |
+
|
+ +inherited | +
gets the overcurrent error flag bit for a specific halfbridge
+hb | halfbridge thats overcurrent flag will be returned |
+
|
+ +inherited | +
gets the openload error flag bit for a specific halfbridge
+hb | halfbridge thats openload flag will be returned |
+
|
+ +inherited | +
clears all clearable error flags
+
+
|
+ +protectedinherited | +
initializes this object, automatically called by begin()
+< initial control register configuration
+< status register configuration
+< bit masking for all halfbridges
+< bit masking for all pwm channels
+ +
+
|
+ +protectedinherited | +
sets the output state and the PWM channel for a halfbridge automatically called by the public version of configHB
+hb | halfbridge which will be configured |
state | sets the output voltage to high, low or floating |
pwm | selects a PWM channel for PWM output |
activeFW | 1 for active freewheeling 0 for passive freewheeling (default) |
+
|
+ +protectedinherited | +
sets the frequency and duty cycle for a PWM channel automatically called by the public version of configPWM
+pwm | PWM channel which will be configured |
freq | selects the PWM output frequency |
dutyCycle | a value from 0 to 255 which sets the dutyCycle |
+
|
+ +protectedinherited | +
gets the overcurrent error flag bit for a specific halfbridge automatically called by the public version of getHBOverCurrent
+hb | halfbridge thats overcurrent flag will be returned |
+
|
+ +protectedinherited | +
gets the openload error flag bit for a specific halfbridge automatically called by the public version of getHBOpenLoad
+hb | halfbridge thats openload flag will be returned |
+
|
+ +protectedinherited | +
writes data bits to a control register of the TLE94112
+reg | control register number(mapping array index / CtrlRegisters constant) of the register |
mask | mask for the bits that have to be written |
shift | data will be shifted left by this amount before masking. This is for the bit alignment of data |
data | the data byte that has to be written. It will be shifted and masked before |
+
|
+ +protectedinherited | +
reads one byte from a status register of the TLE94112
+reg | status register number(mapping array index / StatusRegisters constant) of the register |
+
|
+ +protectedinherited | +
reads some bits from a status register of the TLE94112
+reg | status register number(mapping array index / StatusRegisters constant) of the register |
mask | mask for the bits that have to be read |
shift | data will be shifted right by this amount after masking. This is for the bit alignment of data |
+
|
+ +protectedinherited | +
clears a status register by writing 0x00 to it
+reg | status register number(mapping array index / StatusRegisters constant) of the register |
+
|
+ +staticinherited | +
Reference value of Status Register.
+ +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +protectedinherited | +
array of register locations for halfbridges
+ +
+
|
+ +protectedinherited | +
array of register locations for PWM channels
+ +
+
|
+ +protectedinherited | +
mapping array for control register addresses
+ +
+
|
+ +protectedinherited | +
mirror array for control register data
+ +
+
|
+ +protectedinherited | +
mapping array for status register addresses
+ +
+
|
+ +protectedinherited | +
+Macros | |
#define | TLE94112_PIN_CS1 KIT_SPI_MASTER_SS |
Different SPI pinsettings for different ModusToolbox supported boards. More... | |
#define | TLE94112_PIN_CS2 (P5_6) |
Standard chip select pin for second TLE94112 shield To use a second shield with different CS pin you have to remove the 0 Ohm resistor R7 and solder it to R8. More... | |
#define | TLE94112_PIN_EN (P5_7) |
Standard TLE94112 enable pin. More... | |
#define TLE94112_PIN_CS1 KIT_SPI_MASTER_SS | +
Different SPI pinsettings for different ModusToolbox supported boards.
+Standard chip select pin for first TLE94112 shield
+ +#define TLE94112_PIN_CS2 (P5_6) | +
Standard chip select pin for second TLE94112 shield To use a second shield with different CS pin you have to remove the 0 Ohm resistor R7 and solder it to R8.
+ +#define TLE94112_PIN_EN (P5_7) | +
Standard TLE94112 enable pin.
+TLE94112_PIN_CS2
+ +TLE94112 Logger ModusToolbox HAL PAL. +More...
+#include "logger.hpp"
Go to the source code of this file.
+TLE94112 Logger ModusToolbox HAL PAL.
+SPDX-License-Identifier: MIT
+TLE94112 Default Library Configuration. +More...
+Go to the source code of this file.
+TLE94112 Default Library Configuration.
+SPDX-License-Identifier: MIT
+TLE94112 Raspberry Pi Python Wrapper API. +More...
+#include <pybind11/pybind11.h>
#include "tle94112.hpp"
#include "tle94112-motor.hpp"
#include "tle94112-rpi.hpp"
+Macros | |
#define | STRINGIFY(x) #x |
#define | MACRO_STRINGIFY(x) STRINGIFY(x) |
+Typedefs | |
template<typename... Args> | |
using | overload_cast_ = pybind11::detail::overload_cast_impl< Args... > |
+Functions | |
PYBIND11_MODULE (multi_half_bridge_py, m) | |
TLE94112 Raspberry Pi Python Wrapper API.
+SPDX-License-Identifier: MIT
+#define STRINGIFY | +( | ++ | x | ) | +#x | +
#define MACRO_STRINGIFY | +( | ++ | x | ) | +STRINGIFY(x) | +
using overload_cast_ = pybind11::detail::overload_cast_impl<Args...> | +
PYBIND11_MODULE | +( | +multi_half_bridge_py | +, | +
+ | + | m | ++ |
+ | ) | ++ |
TLE94112 SPI Raspberry Pi PAL. +More...
+Go to the source code of this file.
++Data Structures | |
class | SPICRpi |
Raspberry Pi SPIC class. More... | |
TLE94112 SPI Raspberry Pi PAL.
+SPDX-License-Identifier: MIT
+TLE94112 ModusToolbox HAL API. +More...
+#include "tle94112-mtb.hpp"
#include "spic-mtb.hpp"
#include "gpio-mtb.hpp"
#include "timer-mtb.hpp"
TLE94112 ModusToolbox HAL API.
+SPDX-License-Identifier: MIT
+TLE94112 WICED API. +More...
+Go to the source code of this file.
++Data Structures | |
class | Tle94112Wiced |
TLE94112 WICED API.
+SPDX-License-Identifier: MIT
+TLE94112 SPI Arduino PAL. +More...
+#include "spic-arduino.hpp"
TLE94112 SPI Arduino PAL.
+SPDX-License-Identifier: MIT
+TLE94112 WICED API. +More...
+#include "tle94112-wiced.hpp"
#include "tle94112-platf-wiced.hpp"
#include "gpio-wiced.hpp"
#include "spic-wiced.hpp"
#include "timer-wiced.hpp"
TLE94112 WICED API.
+SPDX-License-Identifier: MIT
+TLE94112 Timer WICED PAL. +More...
+Go to the source code of this file.
++Data Structures | |
class | TimerWiced |
WiCED timer wrapper. More... | |
TLE94112 Timer WICED PAL.
+SPDX-License-Identifier: MIT
+TLE94112 Library Configuration Options. +More...
+Go to the source code of this file.
++Macros | |
#define | TLE94112_FRMWK_ARDUINO 0x01U |
#define | TLE94112_FRMWK_WICED 0x02U |
#define | TLE94112_FRMWK_RPI 0x03U |
#define | TLE94112_FRMWK_MTB 0x04U |
#define | TLE94112_FRMWK_PSOC6 0x05U |
TLE94112 Library Configuration Options.
+SPDX-License-Identifier: MIT
+TLE94112 ModusToolbox HAL API. +More...
+Go to the source code of this file.
++Data Structures | |
class | Tle94112Mtb |
TLE94112 ModusToolbox HAL API.
+SPDX-License-Identifier: MIT
+TLE94112 Logger ModusToolbox HAL PAL. +More...
+#include "logger-mtb.hpp"
TLE94112 Logger ModusToolbox HAL PAL.
+SPDX-License-Identifier: MIT
+TLE94112 SPI Platform Abstraction Layer. +More...
+Go to the source code of this file.
++Data Structures | |
class | tle94112::SPIC |
+Namespaces | |
tle94112 | |
TLE94112 SPI Platform Abstraction Layer.
+SPDX-License-Identifier: MIT
+TLE94112 Motor Arduino API. +More...
+Go to the source code of this file.
+TLE94112 Motor Arduino API.
+This file can optionally be included in projects that use an Infineon DC Motor Control Shield with TLE94112 It provides a higher abstraction for controlling motors with the TLE94112 acting as an output driver
+SPDX-License-Identifier: MIT
++Public Member Functions | |
def | build_extension (self, ext) |
+Static Public Attributes | |
name | |
string | version = "5.0.1", |
string | author = "Infineon Technologies", |
string | description = "Python Library for Infineon's multi half-bridge IC drivers", |
string | long_description = "Python library for Infineons multi half-bridge IC drivers", |
dictionary | project_urls |
list | ext_modules = [CMakeExtension("multi_half_bridge_py")], |
dictionary | cmdclass = {"build_ext": CMakeBuild}, |
string | license = 'MIT', |
string | url = 'https://pypi.org/project/multi-half-bridge/', |
list | classifiers |
bool | zip_safe = False, |
def setup.CMakeBuild.build_extension | +( | ++ | self, | +
+ | + | + | ext | +
+ | ) | ++ |
+
|
+ +static | +
+
|
+ +static | +
+
|
+ +static | +
+
|
+ +static | +
+
|
+ +static | +
+
|
+ +static | +
+
|
+ +static | +
+
|
+ +static | +
+
|
+ +static | +
+
|
+ +static | +
+
|
+ +static | +
+
|
+ +static | +
TLE94112 GPIO Arduino PAL. +More...
+#include "gpio.hpp"
Go to the source code of this file.
++Data Structures | |
class | GPIOIno |
Arduino GPIO class. More... | |
+Macros | |
#define | UNUSED_PIN 0xFF |
TLE94112 GPIO Arduino PAL.
+SPDX-License-Identifier: MIT
+#define UNUSED_PIN 0xFF | +
Unused pin
+ +TLE94112 Arduino API. +More...
+Go to the source code of this file.
++Data Structures | |
class | Tle94112Ino |
Arduino Tle94112Ino constructor. More... | |
TLE94112 Arduino API.
+SPDX-License-Identifier: MIT
+TLE94112 Raspberry Pi API. +More...
+#include "tle94112-rpi.hpp"
#include "tle94112-platf-rpi.hpp"
#include "gpio-rpi.hpp"
#include "spic-rpi.hpp"
#include "timer-rpi.hpp"
#include <cstdio>
TLE94112 Raspberry Pi API.
+SPDX-License-Identifier: MIT
+TLE94112 Logger Arduino PAL. +More...
+Go to the source code of this file.
+TLE94112 Logger Arduino PAL.
+SPDX-License-Identifier: MIT
++Macros | |
#define | TLE94112_PIN_CS1 WICED_GPIO_7 |
#define | TLE94112_PIN_CS2 WICED_GPIO_17 |
#define | TLE94112_PIN_EN WICED_GPIO_36 |
#define TLE94112_PIN_CS1 WICED_GPIO_7 | +
Standard chip select pin for first TLE94112 shield
+ +#define TLE94112_PIN_CS2 WICED_GPIO_17 | +
Standard chip select pin for second TLE94112 shield To use a second shield with different CS pin you have to remove the 0 Ohm resistor R7 and solder it to R8
+ +#define TLE94112_PIN_EN WICED_GPIO_36 | +
Standard TLE94112 enable pin
+ +TLE94112 GPIO Raspberry Pi API. +More...
+#include "gpio-rpi.hpp"
TLE94112 GPIO Raspberry Pi API.
+SPDX-License-Identifier: MIT
++Data Structures | |
class | setup.CMakeExtension |
class | setup.CMakeBuild |
+Namespaces | |
setup | |
+Variables | |
dictionary | setup.PLAT_TO_CMAKE |
TLE94112 SPI ModusToolbox HAL PAL. +More...
+Go to the source code of this file.
++Data Structures | |
class | SPICMtb |
+Macros | |
#define | SPI_FREQ_HZ (1000000UL) |
ModusToolbox SPIC class. More... | |
TLE94112 SPI ModusToolbox HAL PAL.
+SPDX-License-Identifier: MIT
+TLE94112 Timer Arduino PAL. +More...
+Go to the source code of this file.
++Data Structures | |
class | TimerIno |
TLE94112 Timer Arduino PAL.
+SPDX-License-Identifier: MIT
+TLE94112 SPI WICED PAL. +More...
+Go to the source code of this file.
++Data Structures | |
class | SPICWiced |
Wiced SPIC class. More... | |
TLE94112 SPI WICED PAL.
+SPDX-License-Identifier: MIT
+TLE94112 Timer Raspberry Pi PAL. +More...
+Go to the source code of this file.
++Data Structures | |
class | TimerRpi |
TLE94112 Timer Raspberry Pi PAL.
+SPDX-License-Identifier: MIT
+TLE94112 SPI Raspberry Pi PAL. +More...
+#include "spic-rpi.hpp"
TLE94112 SPI Raspberry Pi PAL.
+SPDX-License-Identifier: MIT
+TLE94112 GPIO ModusToolbox HAL PAL. +More...
+Go to the source code of this file.
++Data Structures | |
class | GPIOMtb |
ModusToolbox GPIO wrapper class. More... | |
TLE94112 GPIO ModusToolbox HAL PAL.
+SPDX-License-Identifier: MIT
+TLE94112 Motor Control API. +More...
++Macros | |
#define | SIGNUM(x) ( (x > 0) - (x < 0) ) |
TLE94112 Motor Control API.
+This file can optionally be included in projects that use Infineon DC Motor Control Shield with TLE94112 It provides a higher abstraction for controlling motors with the TLE94112 acting as an output driver
+SPDX-License-Identifier: MIT
+#define SIGNUM | +( | ++ | x | ) | +( (x > 0) - (x < 0) ) | +
TLE94112 SPI ModusToolbox HAL PAL. +More...
+#include "spic-mtb.hpp"
TLE94112 SPI ModusToolbox HAL PAL.
+SPDX-License-Identifier: MIT
++Modules | |
Arduino | |
RaspberryPi | |
ModusToolbox | |
WICED | |
+Macros | |
#define | TLE94112_FRMWK_ARDUINO 0x01U |
#define | TLE94112_FRMWK_WICED 0x02U |
#define | TLE94112_FRMWK_RPI 0x03U |
#define | TLE94112_FRMWK_MTB 0x04U |
#define | TLE94112_FRMWK_PSOC6 0x05U |
#define | TLE94112_LOGGER_ENABLED 0 |
Logger enable. More... | |
#define TLE94112_FRMWK_ARDUINO 0x01U | +
#define TLE94112_FRMWK_WICED 0x02U | +
#define TLE94112_FRMWK_RPI 0x03U | +
#define TLE94112_FRMWK_MTB 0x04U | +
#define TLE94112_FRMWK_PSOC6 0x05U | +
#define TLE94112_LOGGER_ENABLED 0 | +
Logger enable.
+(1) Enabled, (0) Disabled
+ ++Data Structures | |
class | Tle94112Ino |
Arduino Tle94112Ino constructor. More... | |
class Tle94112Ino | +
Arduino Tle94112Ino constructor.
+Public Types | |
enum | HalfBridge { + TLE_NOHB = 0 +, TLE_HB1 +, TLE_HB2 +, TLE_HB3 +, + TLE_HB4 +, TLE_HB5 +, TLE_HB6 +, TLE_HB7 +, + TLE_HB8 +, TLE_HB9 +, TLE_HB10 +, TLE_HB11 +, + TLE_HB12 + + } |
enum for the halfbridges on a TLE94112 More... | |
enum | PWMChannel { TLE_NOPWM = 0 +, TLE_PWM1 +, TLE_PWM2 +, TLE_PWM3 + } |
enum for the PWM channels of a halfbridge on TLE94112 More... | |
enum | HBState { TLE_FLOATING = 0b00 +, TLE_LOW = 0b01 +, TLE_HIGH = 0b10 + } |
enum for the output states of a halfbridge More... | |
enum | HBOCState { TLE_NONE = 0b00 +, TLE_LOWSIDE = 0b01 +, TLE_HIGHSIDE = 0b10 + } |
enum for the overcurrent states of a halfbridge More... | |
enum | PWMFreq { TLE_FREQOFF = 0b00 +, TLE_FREQ80HZ +, TLE_FREQ100HZ +, TLE_FREQ200HZ + } |
enum for the frequencies of a PWM channel More... | |
enum | DiagFlag { + TLE_SPI_ERROR = 0x80 +, TLE_LOAD_ERROR = 0x40 +, TLE_UNDER_VOLTAGE = 0x20 +, TLE_OVER_VOLTAGE = 0x10 +, + TLE_POWER_ON_RESET = 0x08 +, TLE_TEMP_SHUTDOWN = 0x04 +, TLE_TEMP_WARNING = 0x02 + + } |
enum for the flags in the register SYS_DIAG1 More... | |
Public Member Functions | |
Tle94112Ino (void) | |
Construct a new Tle94112Ino:: Tle94112Ino object with default pin assignment. More... | |
Tle94112Ino (uint8_t csPin) | |
constructor with individual pin assignment More... | |
void | begin (void) |
enables and initializes the TLE94112 More... | |
void | end (void) |
deactivates all outputs and disables the TLE94112 More... | |
void | configHB (HalfBridge hb, HBState state, PWMChannel pwm) |
sets the output state and the PWM channel for a halfbridge (only for passive freewheeling) More... | |
void | configHB (HalfBridge hb, HBState state, PWMChannel pwm, uint8_t activeFW) |
sets the output state and the PWM channel for a halfbridge (allows active freewheeling) More... | |
void | configPWM (PWMChannel pwm, PWMFreq freq, uint8_t dutyCycle) |
sets the frequency and duty cycle for a PWM channel More... | |
uint8_t | setLedMode (HalfBridge hb, uint8_t active) |
sets LED mode on compatible half bridges (half bridge 1 or 2 of TLE94112) More... | |
uint8_t | getSysDiagnosis () |
returns a diagnosis value for error detection More... | |
uint8_t | getSysDiagnosis (DiagFlag mask) |
shows if errors of a specific type have occurred More... | |
uint8_t | getSysDiagnosis (uint8_t mask) |
shows if errors of a specific type have occurred More... | |
uint8_t | getHBOverCurrent (HalfBridge hb) |
gets the overcurrent error flag bit for a specific halfbridge More... | |
uint8_t | getHBOpenLoad (HalfBridge hb) |
gets the openload error flag bit for a specific halfbridge More... | |
void | clearErrors () |
clears all clearable error flags More... | |
Data Fields | |
SPIC * | sBus |
GPIOC * | cs |
GPIOC * | en |
Timer * | timer |
Static Public Attributes | |
static const uint8_t | TLE_STATUS_OK = 0U |
Reference value of Status Register. More... | |
Protected Types | |
enum | CtrlRegisters { + HB_ACT_1_CTRL = 0 +, HB_ACT_2_CTRL +, HB_ACT_3_CTRL +, HB_MODE_1_CTRL +, + HB_MODE_2_CTRL +, HB_MODE_3_CTRL +, PWM_CH_FREQ_CTRL +, PWM1_DC_CTRL +, + PWM2_DC_CTRL +, PWM3_DC_CTRL +, FW_OL_CTRL +, FW_CTRL + + } |
enum for the control registers in a TLE94112 More... | |
enum | StatusRegisters { + SYS_DIAG1 = 0 +, OP_ERROR_1_STAT +, OP_ERROR_2_STAT +, OP_ERROR_3_STAT +, + OP_ERROR_4_STAT +, OP_ERROR_5_STAT +, OP_ERROR_6_STAT + + } |
enum for the status registers in a TLE94112 More... | |
Protected Member Functions | |
void | init (void) |
initializes this object, automatically called by begin() More... | |
void | _configHB (uint8_t hb, uint8_t state, uint8_t pwm, uint8_t activeFW) |
sets the output state and the PWM channel for a halfbridge automatically called by the public version of configHB More... | |
void | _configPWM (uint8_t pwm, uint8_t freq, uint8_t dutyCycle) |
sets the frequency and duty cycle for a PWM channel automatically called by the public version of configPWM More... | |
uint8_t | _getHBOverCurrent (uint8_t hb) |
gets the overcurrent error flag bit for a specific halfbridge automatically called by the public version of getHBOverCurrent More... | |
uint8_t | _getHBOpenLoad (uint8_t hb) |
gets the openload error flag bit for a specific halfbridge automatically called by the public version of getHBOpenLoad More... | |
void | writeReg (uint8_t reg, uint8_t mask, uint8_t shift, uint8_t data) |
writes data bits to a control register of the TLE94112 More... | |
uint8_t | readStatusReg (uint8_t reg) |
reads one byte from a status register of the TLE94112 More... | |
uint8_t | readStatusReg (uint8_t reg, uint8_t mask, uint8_t shift) |
reads some bits from a status register of the TLE94112 More... | |
void | clearStatusReg (uint8_t reg) |
clears a status register by writing 0x00 to it More... | |
Protected Attributes | |
HalfBridge_t | mHalfBridges [TLE94112_NUM_HB] |
array of register locations for halfbridges More... | |
PWMchannel_t | mPwmChannels [TLE94112_NUM_PWM] |
array of register locations for PWM channels More... | |
uint8_t | mCtrlRegAddresses [TLE94112_NUM_CTRL_REGS] |
mapping array for control register addresses More... | |
uint8_t | mCtrlRegData [TLE94112_NUM_CTRL_REGS] |
mirror array for control register data More... | |
uint8_t | mStatusRegAddresses [TLE94112_NUM_STATUS_REGS] |
mapping array for status register addresses More... | |
uint8_t | mEnabled |
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +protectedinherited | +
+
|
+ +protectedinherited | +
Tle94112Ino::Tle94112Ino | +( | +void | +) | ++ |
Construct a new Tle94112Ino:: Tle94112Ino object with default pin assignment.
+ +Tle94112Ino::Tle94112Ino | +( | +uint8_t | +csPin | ) | ++ |
constructor with individual pin assignment
+csPin | pin number of the CS pin |
+
|
+ +inherited | +
enables and initializes the TLE94112
+
+
|
+ +inherited | +
deactivates all outputs and disables the TLE94112
+
+
|
+ +inherited | +
sets the output state and the PWM channel for a halfbridge (only for passive freewheeling)
+hb | halfbridge which will be configured |
state | sets the output voltage to high, low or floating |
pwm | selects a PWM channel for PWM output |
+
|
+ +inherited | +
sets the output state and the PWM channel for a halfbridge (allows active freewheeling)
+hb | halfbridge which will be configured |
state | sets the output voltage to high, low or floating |
pwm | selects a PWM channel for PWM output |
activeFW | 1 for active freewheeling 0 for passive freewheeling (default) |
+
|
+ +inherited | +
sets the frequency and duty cycle for a PWM channel
+pwm | PWM channel which will be configured |
freq | selects the PWM output frequency |
dutyCycle | a value from 0 to 255 which sets the dutyCycle |
+
|
+ +inherited | +
sets LED mode on compatible half bridges (half bridge 1 or 2 of TLE94112)
+hb | compatible half bridge to set LED mode |
active | LED mode active (1) or inactive (0) |
+
|
+ +inherited | +
returns a diagnosis value for error detection
+
+
|
+ +inherited | +
shows if errors of a specific type have occurred
+mask | mask to filter for a specific flag |
+
|
+ +inherited | +
shows if errors of a specific type have occurred
+mask | mask to filter for one or more specific flags this can be a disjunction of DiagFlag values |
+
|
+ +inherited | +
gets the overcurrent error flag bit for a specific halfbridge
+hb | halfbridge thats overcurrent flag will be returned |
+
|
+ +inherited | +
gets the openload error flag bit for a specific halfbridge
+hb | halfbridge thats openload flag will be returned |
+
|
+ +inherited | +
clears all clearable error flags
+
+
|
+ +protectedinherited | +
initializes this object, automatically called by begin()
+< initial control register configuration
+< status register configuration
+< bit masking for all halfbridges
+< bit masking for all pwm channels
+ +
+
|
+ +protectedinherited | +
sets the output state and the PWM channel for a halfbridge automatically called by the public version of configHB
+hb | halfbridge which will be configured |
state | sets the output voltage to high, low or floating |
pwm | selects a PWM channel for PWM output |
activeFW | 1 for active freewheeling 0 for passive freewheeling (default) |
+
|
+ +protectedinherited | +
sets the frequency and duty cycle for a PWM channel automatically called by the public version of configPWM
+pwm | PWM channel which will be configured |
freq | selects the PWM output frequency |
dutyCycle | a value from 0 to 255 which sets the dutyCycle |
+
|
+ +protectedinherited | +
gets the overcurrent error flag bit for a specific halfbridge automatically called by the public version of getHBOverCurrent
+hb | halfbridge thats overcurrent flag will be returned |
+
|
+ +protectedinherited | +
gets the openload error flag bit for a specific halfbridge automatically called by the public version of getHBOpenLoad
+hb | halfbridge thats openload flag will be returned |
+
|
+ +protectedinherited | +
writes data bits to a control register of the TLE94112
+reg | control register number(mapping array index / CtrlRegisters constant) of the register |
mask | mask for the bits that have to be written |
shift | data will be shifted left by this amount before masking. This is for the bit alignment of data |
data | the data byte that has to be written. It will be shifted and masked before |
+
|
+ +protectedinherited | +
reads one byte from a status register of the TLE94112
+reg | status register number(mapping array index / StatusRegisters constant) of the register |
+
|
+ +protectedinherited | +
reads some bits from a status register of the TLE94112
+reg | status register number(mapping array index / StatusRegisters constant) of the register |
mask | mask for the bits that have to be read |
shift | data will be shifted right by this amount after masking. This is for the bit alignment of data |
+
|
+ +protectedinherited | +
clears a status register by writing 0x00 to it
+reg | status register number(mapping array index / StatusRegisters constant) of the register |
+
|
+ +staticinherited | +
Reference value of Status Register.
+ +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +protectedinherited | +
array of register locations for halfbridges
+ +
+
|
+ +protectedinherited | +
array of register locations for PWM channels
+ +
+
|
+ +protectedinherited | +
mapping array for control register addresses
+ +
+
|
+ +protectedinherited | +
mirror array for control register data
+ +
+
|
+ +protectedinherited | +
mapping array for status register addresses
+ +
+
|
+ +protectedinherited | +
TLE94112 Timer ModusToolbox HAL PAL. +More...
+Go to the source code of this file.
++Data Structures | |
class | TimerMtb |
MoudusToolbox timer wrapper. More... | |
TLE94112 Timer ModusToolbox HAL PAL.
+SPDX-License-Identifier: MIT
+TLE94112 Raspberry Pi API. +More...
+Go to the source code of this file.
++Data Structures | |
class | Tle94112Rpi |
TLE94112 Raspberry Pi API.
+SPDX-License-Identifier: MIT
++Data Structures | |
class | Tle94112Motor |
represents a motor connected to a TLE94112 More... | |
+Macros | |
#define | TLE94112_MAX_SPEED 255 |
The maximum absolute speed value which can be set. More... | |
#define | TLE94112MOTOR_MAX_CONNECTORS 4 |
maximum number of Tle94112 outputs per motor connector More... | |
class Tle94112Motor | +
represents a motor connected to a TLE94112
+This class provides a simple API for connecting and controlling motors. Each motor is assigned to a Tle94112 which acts as output driver. Calls to Tle94112Motor instances are mapped to calls to Tle94112. Therefore, this class does not bring new features, it does only provide further abstraction.
+Public Types | |
enum | ePolarity { LOWSIDE = 0 +, HIGHSIDE + } |
Enum to select polarity of a motor connector. More... | |
Public Member Functions | |
Tle94112Motor (Tle94112 &driver) | |
Construct a new Tle94112Motor object. More... | |
~Tle94112Motor () | |
Destroy the Tle94112Motor object. More... | |
void | begin (void) |
finishes configuration and enables motor controls More... | |
void | end (void) |
disables motor controls and switches back to configuration mode More... | |
void | initConnector (Tle94112Motor::ePolarity pol, Tle94112::PWMChannel channel, Tle94112::HalfBridge out1, Tle94112::HalfBridge out2, Tle94112::HalfBridge out3, Tle94112::HalfBridge out4) |
configures most important settings for one motor connector More... | |
void | initConnector (Tle94112Motor::ePolarity, Tle94112::PWMChannel channel, Tle94112::PWMFreq freq, Tle94112::HalfBridge out1, Tle94112::HalfBridge out2, Tle94112::HalfBridge out3, Tle94112::HalfBridge out4) |
configures most important settings for one motor connector More... | |
void | connect (Tle94112Motor::ePolarity pol, Tle94112::HalfBridge connector) |
connects a single halfbridge output to a motor connector More... | |
void | disconnect (Tle94112::HalfBridge connector) |
disconnects a single halfbridge output from a motor connector More... | |
void | setPwm (Tle94112Motor::ePolarity pol, Tle94112::PWMChannel channel) |
Sets the PWM channel to be used for a motor connector. More... | |
void | setPwm (Tle94112Motor::ePolarity pol, Tle94112::PWMChannel channel, Tle94112::PWMFreq freq) |
Sets the PWM channel and frequency for a motor connector. More... | |
void | setPwmFreq (Tle94112Motor::ePolarity pol, Tle94112::PWMFreq freq) |
Sets the PWM frequency for driving a motor connector. More... | |
void | setActiveFreeWheeling (Tle94112Motor::ePolarity pol, uint8_t active_fw) |
Enables or disables active freewheeling. More... | |
void | stop (uint8_t force=255) |
actively breaks the motor to stop it More... | |
void | coast () |
releases the motor without driving or active breaking More... | |
void | start (int16_t speed) |
starts the motor with a certain speed in a certain direction More... | |
void | setSpeed (int16_t speed) |
equivalent to start() More... | |
int16_t | getSpeed (void) |
Returns the motor's current speed setting. More... | |
void | rampSpeed (int16_t speed, uint16_t slope) |
function to gradually change the motors speed More... | |
Protected Types | |
enum | eMode { COAST +, FORWARD +, BACKWARD +, STOP + } |
enum for motor operation modes More... | |
typedef struct Tle94112Motor::Connector_t * | Connector_p |
Protected Member Functions | |
uint32_t | _measureSetSpeedDuration (int16_t speed, int16_t start_speed) |
private function needed by rampSpeed More... | |
void | _performSpeedStepping (int16_t start_speed, int16_t ramp_delta_speed, int16_t num_steps, uint16_t steptime) |
private function needed by rampSpeed More... | |
Protected Attributes | |
Connector_t | mConnectors [2] |
array of motor connectors More... | |
Tle94112 * | mDriver |
Tle94112 instance acting as output driver. More... | |
eMode | mMode |
current operation mode More... | |
uint8_t | mEnabled |
flag indicating if motor controls are enabled More... | |
uint8_t | mSpeed |
value of the current motor speed More... | |
+
|
+ +protected | +
enum Tle94112Motor::ePolarity | +
+
|
+ +protected | +
Tle94112Motor::Tle94112Motor | +( | +Tle94112 & | +driver | ) | ++ |
Construct a new Tle94112Motor object.
+After constructing, the motor must be configured. You can use functions initConnector(), connect(), disconnect(), setPwm(), setPwmFreq() and setActiveFreeWheeling() for configuration. Call begin() to finish configuration and enable motor controls.
+driver | Tle94112 instance acting as a driver |
Tle94112Motor::~Tle94112Motor | +( | +) | ++ |
void Tle94112Motor::begin | +( | +void | +) | ++ |
finishes configuration and enables motor controls
+For controlling the motor, you can use the functions start(), stop(), coast(), setSpeed(), getSpeed() and rampSpeed() Call end() to get back to configuration mode. After calling end() and changing configuration, you can get back to controlling mode by calling begin()
+void Tle94112Motor::end | +( | +void | +) | ++ |
disables motor controls and switches back to configuration mode
+If necessary, you can call end() and change the configuration settings at any point of time. This might be useful when sharing PWM channels between several motors. Configuration changes to motors are not allowed while controls are active! Call begin() again when the configuration changes are done to enable motor controls again.
+void Tle94112Motor::initConnector | +( | +Tle94112Motor::ePolarity | +pol, | +
+ | + | Tle94112::PWMChannel | +channel, | +
+ | + | Tle94112::HalfBridge | +out1, | +
+ | + | Tle94112::HalfBridge | +out2, | +
+ | + | Tle94112::HalfBridge | +out3, | +
+ | + | Tle94112::HalfBridge | +out4 | +
+ | ) | ++ |
configures most important settings for one motor connector
+Call this function twice to setup motor configuration for both the
pol | Polarity of the motor connector to be configured |
channel | PWM channel assigned to this connector |
out1 | halfbridge output 1 of 4 assigned to this connector |
out2 | halfbridge output 2 of 4 assigned to this connector |
out3 | halfbridge output 3 of 4 assigned to this connector |
out4 | halfbridge output 4 of 4 assigned to this connector |
void Tle94112Motor::initConnector | +( | +Tle94112Motor::ePolarity | +pol, | +
+ | + | Tle94112::PWMChannel | +channel, | +
+ | + | Tle94112::PWMFreq | +freq, | +
+ | + | Tle94112::HalfBridge | +out1, | +
+ | + | Tle94112::HalfBridge | +out2, | +
+ | + | Tle94112::HalfBridge | +out3, | +
+ | + | Tle94112::HalfBridge | +out4 | +
+ | ) | ++ |
configures most important settings for one motor connector
+Call this function twice to setup motor configuration for both the
pol | Polarity of the motor connector to be configured |
channel | PWM channel assigned to this connector |
freq | optional PWM frequency setting |
out1 | halfbridge output 1 of 4 assigned to this connector |
out2 | halfbridge output 2 of 4 assigned to this connector |
out3 | halfbridge output 3 of 4 assigned to this connector |
out4 | halfbridge output 4 of 4 assigned to this connector |
void Tle94112Motor::connect | +( | +Tle94112Motor::ePolarity | +pol, | +
+ | + | Tle94112::HalfBridge | +connector | +
+ | ) | ++ |
connects a single halfbridge output to a motor connector
+pol | Polarity of the motor connector to be configured |
connector | halfbridge output to be assigned to this motor |
void Tle94112Motor::disconnect | +( | +Tle94112::HalfBridge | +connector | ) | ++ |
disconnects a single halfbridge output from a motor connector
+connector | halfbridge output to be removed from this motor |
void Tle94112Motor::setPwm | +( | +Tle94112Motor::ePolarity | +pol, | +
+ | + | Tle94112::PWMChannel | +channel | +
+ | ) | ++ |
Sets the PWM channel to be used for a motor connector.
+pol | Polarity of the motor connector to be configured |
channel | PWM channel to be used |
void Tle94112Motor::setPwm | +( | +Tle94112Motor::ePolarity | +pol, | +
+ | + | Tle94112::PWMChannel | +channel, | +
+ | + | Tle94112::PWMFreq | +freq | +
+ | ) | ++ |
Sets the PWM channel and frequency for a motor connector.
+pol | Polarity of the motor connector to be configured |
channel | PWM channel to be used |
freq | PWM frequency selection |
void Tle94112Motor::setPwmFreq | +( | +Tle94112Motor::ePolarity | +pol, | +
+ | + | Tle94112::PWMFreq | +freq | +
+ | ) | ++ |
Sets the PWM frequency for driving a motor connector.
+pol | Polarity of the motor connector to be configured |
freq | PWM frequency selection |
void Tle94112Motor::setActiveFreeWheeling | +( | +Tle94112Motor::ePolarity | +pol, | +
+ | + | uint8_t | +active_fw | +
+ | ) | ++ |
Enables or disables active freewheeling.
+Default is false i.e. passive freewheeling. Depending on your application circuit, active freewheeling may lead to electrical problems. Do not change this setting unless you know what you are doing.
+pol | Polarity of the motor connector to be configured |
active_fw | true/false to enable/disable active freewheeling |
void Tle94112Motor::stop | +( | +uint8_t | +force = 255 | ) | ++ |
actively breaks the motor to stop it
+force | higher force lets the motor stop quicker, maximum is 255 |
void Tle94112Motor::coast | +( | +) | ++ |
releases the motor without driving or active breaking
+void Tle94112Motor::start | +( | +int16_t | +speed | ) | ++ |
starts the motor with a certain speed in a certain direction
+The behaviour of this function depends on the way the motor is connected to the Tle94112. Motors which have just one connector assigned to the Tle94112 cannot run in reverse direction and break instead if a negative speed value is passed. Motors without PWM assigned cannot run at a certain speed. They can just coast, run and break. Speed values greater or smaller than 0 are treated like -255 or 255, respectively.
+speed | an integer in a range from -255 to 255 to set motor speed and direction |
void Tle94112Motor::setSpeed | +( | +int16_t | +speed | ) | ++ |
equivalent to start()
+This function is fully equivalent to start(), but it is intended to be used if the motor is already running. (Distinguishing between these two functions helps improving the readability of your code) The behaviour of this function depends on the way the motor is connected to the Tle94112. Motors which have just one connector assigned to the Tle94112 cannot run in reverse direction and break instead if a negative speed value is passed. Motors without PWM assigned cannot run at a certain speed. They can just coast, run and break. Speed values greater or smaller than 0 are treated like -255 or 255, respectively.
+speed | an integer in a range from -255 to 255 to set motor speed and direction |
int16_t Tle94112Motor::getSpeed | +( | +void | +) | ++ |
Returns the motor's current speed setting.
+void Tle94112Motor::rampSpeed | +( | +int16_t | +speed, | +
+ | + | uint16_t | +slope | +
+ | ) | ++ |
function to gradually change the motors speed
+speed | target speed |
slope | time for a full ramp from speed=0 to speed=255 |
+
|
+ +protected | +
private function needed by rampSpeed
+speed | integer in a range from -255 to 255 to set motor speed and direction. Here the target speed. |
start_speed | integer a range from -255 to 255 to set motor speed and direction. Here the source speed |
+
|
+ +protected | +
private function needed by rampSpeed
+start_speed | integer a range from -255 to 255 to set motor speed and direction. Here the source speed |
ramp_delta_speed | slope value how fast the speed change should raise or fall |
num_steps | number of steps to raise or fall the speed |
steptime | time to be needed for each step |
++none blocking delay
+
+
|
+ +protected | +
array of motor connectors
+ +
+
|
+ +protected | +
Tle94112 instance acting as output driver.
+ +
+
|
+ +protected | +
current operation mode
+ +
+
|
+ +protected | +
flag indicating if motor controls are enabled
+ +
+
|
+ +protected | +
value of the current motor speed
+ +#define TLE94112_MAX_SPEED 255 | +
The maximum absolute speed value which can be set.
+#define TLE94112MOTOR_MAX_CONNECTORS 4 | +
maximum number of Tle94112 outputs per motor connector
+When this is changed, also the function signature and implementation of Tle94112Motor::initConnector has to be changed.
+Arduino library of Infineon's Multi Half-Bridge IC controllers.
+DC motor control shield with TLE94112EL for Arduino | TLE94112ES / TLE94112EL |
The library should be supported by any Arduino platform based on the reference Arduino cores.
+Check in this link the already verified (at least successfully built) platforms, and find out which boards are under CI build check here.
+Find a getting started tutorial based on the DC Motor Control Shield for Arduino and the XMC4700 Relax Kit here.
+The complete relevant Arduino documentation (and more) can be found in the base XFP library Wiki:
+This is a release repository for the Arduino framework. The code basis is maintained and developed in the Multi Half-bridge Cross-Framework-Platform (XFP) library repository.
+This project is licensed under the MIT License - see the [LICENSE](LICENSE) file for details.
+TLE94112 ModusToolbox Hardware Platforms. +More...
+Go to the source code of this file.
++Macros | |
#define | TLE94112_PIN_CS1 KIT_SPI_MASTER_SS |
Different SPI pinsettings for different ModusToolbox supported boards. More... | |
#define | TLE94112_PIN_CS2 (P5_6) |
Standard chip select pin for second TLE94112 shield To use a second shield with different CS pin you have to remove the 0 Ohm resistor R7 and solder it to R8. More... | |
#define | TLE94112_PIN_EN (P5_7) |
Standard TLE94112 enable pin. More... | |
TLE94112 ModusToolbox Hardware Platforms.
+SPDX-License-Identifier: MIT
++Data Structures | |
class | CMakeExtension |
class | CMakeBuild |
+Variables | |
dictionary | PLAT_TO_CMAKE |
TLE94112 Logger WICED PAL. +More...
+#include "logger-wiced.hpp"
TLE94112 Logger WICED PAL.
+SPDX-License-Identifier: MIT
+Raspberry Pi Hardware Platform Pins. +More...
++Macros | |
#define | TLE94112_PIN_CS0 RPI_V2_GPIO_P1_24 |
#define | TLE94112_PIN_CS1 RPI_V2_GPIO_P1_26 |
#define | TLE94112_PIN_CS2 RPI_V2_GPIO_P1_22 |
#define | TLE94112_PIN_CS3 RPI_V2_GPIO_P1_15 |
#define | TLE94112_PIN_EN RPI_V2_GPIO_P1_37 |
Raspberry Pi Hardware Platform Pins.
+#define TLE94112_PIN_CS0 RPI_V2_GPIO_P1_24 | +
Standard chip select pin for first TLE94112 shield
+ +#define TLE94112_PIN_CS1 RPI_V2_GPIO_P1_26 | +
Standard chip select pin for second TLE94112 shield To use a second shield with different CS pin you have to change the position of the Jumper
+ +#define TLE94112_PIN_CS2 RPI_V2_GPIO_P1_22 | +
#define TLE94112_PIN_CS3 RPI_V2_GPIO_P1_15 | +
#define TLE94112_PIN_EN RPI_V2_GPIO_P1_37 | +
Standard TLE94112 enable pin
+ ++Data Structures | |
class | Tle94112Wiced |
class Tle94112Wiced | +
Public Types | |
enum | HalfBridge { + TLE_NOHB = 0 +, TLE_HB1 +, TLE_HB2 +, TLE_HB3 +, + TLE_HB4 +, TLE_HB5 +, TLE_HB6 +, TLE_HB7 +, + TLE_HB8 +, TLE_HB9 +, TLE_HB10 +, TLE_HB11 +, + TLE_HB12 + + } |
enum for the halfbridges on a TLE94112 More... | |
enum | PWMChannel { TLE_NOPWM = 0 +, TLE_PWM1 +, TLE_PWM2 +, TLE_PWM3 + } |
enum for the PWM channels of a halfbridge on TLE94112 More... | |
enum | HBState { TLE_FLOATING = 0b00 +, TLE_LOW = 0b01 +, TLE_HIGH = 0b10 + } |
enum for the output states of a halfbridge More... | |
enum | HBOCState { TLE_NONE = 0b00 +, TLE_LOWSIDE = 0b01 +, TLE_HIGHSIDE = 0b10 + } |
enum for the overcurrent states of a halfbridge More... | |
enum | PWMFreq { TLE_FREQOFF = 0b00 +, TLE_FREQ80HZ +, TLE_FREQ100HZ +, TLE_FREQ200HZ + } |
enum for the frequencies of a PWM channel More... | |
enum | DiagFlag { + TLE_SPI_ERROR = 0x80 +, TLE_LOAD_ERROR = 0x40 +, TLE_UNDER_VOLTAGE = 0x20 +, TLE_OVER_VOLTAGE = 0x10 +, + TLE_POWER_ON_RESET = 0x08 +, TLE_TEMP_SHUTDOWN = 0x04 +, TLE_TEMP_WARNING = 0x02 + + } |
enum for the flags in the register SYS_DIAG1 More... | |
Public Member Functions | |
Tle94112Wiced (void) | |
Construct a new Tle94112Wiced::Tle94112 Wiced object with default pin assignment. More... | |
Tle94112Wiced (wiced_gpio_t csPin) | |
constructor with individual pin assignment More... | |
void | begin (void) |
enables and initializes the TLE94112 More... | |
void | end (void) |
deactivates all outputs and disables the TLE94112 More... | |
void | configHB (HalfBridge hb, HBState state, PWMChannel pwm) |
sets the output state and the PWM channel for a halfbridge (only for passive freewheeling) More... | |
void | configHB (HalfBridge hb, HBState state, PWMChannel pwm, uint8_t activeFW) |
sets the output state and the PWM channel for a halfbridge (allows active freewheeling) More... | |
void | configPWM (PWMChannel pwm, PWMFreq freq, uint8_t dutyCycle) |
sets the frequency and duty cycle for a PWM channel More... | |
uint8_t | setLedMode (HalfBridge hb, uint8_t active) |
sets LED mode on compatible half bridges (half bridge 1 or 2 of TLE94112) More... | |
uint8_t | getSysDiagnosis () |
returns a diagnosis value for error detection More... | |
uint8_t | getSysDiagnosis (DiagFlag mask) |
shows if errors of a specific type have occurred More... | |
uint8_t | getSysDiagnosis (uint8_t mask) |
shows if errors of a specific type have occurred More... | |
uint8_t | getHBOverCurrent (HalfBridge hb) |
gets the overcurrent error flag bit for a specific halfbridge More... | |
uint8_t | getHBOpenLoad (HalfBridge hb) |
gets the openload error flag bit for a specific halfbridge More... | |
void | clearErrors () |
clears all clearable error flags More... | |
Data Fields | |
SPIC * | sBus |
GPIOC * | cs |
GPIOC * | en |
Timer * | timer |
Static Public Attributes | |
static const uint8_t | TLE_STATUS_OK = 0U |
Reference value of Status Register. More... | |
Protected Types | |
enum | CtrlRegisters { + HB_ACT_1_CTRL = 0 +, HB_ACT_2_CTRL +, HB_ACT_3_CTRL +, HB_MODE_1_CTRL +, + HB_MODE_2_CTRL +, HB_MODE_3_CTRL +, PWM_CH_FREQ_CTRL +, PWM1_DC_CTRL +, + PWM2_DC_CTRL +, PWM3_DC_CTRL +, FW_OL_CTRL +, FW_CTRL + + } |
enum for the control registers in a TLE94112 More... | |
enum | StatusRegisters { + SYS_DIAG1 = 0 +, OP_ERROR_1_STAT +, OP_ERROR_2_STAT +, OP_ERROR_3_STAT +, + OP_ERROR_4_STAT +, OP_ERROR_5_STAT +, OP_ERROR_6_STAT + + } |
enum for the status registers in a TLE94112 More... | |
Protected Member Functions | |
void | init (void) |
initializes this object, automatically called by begin() More... | |
void | _configHB (uint8_t hb, uint8_t state, uint8_t pwm, uint8_t activeFW) |
sets the output state and the PWM channel for a halfbridge automatically called by the public version of configHB More... | |
void | _configPWM (uint8_t pwm, uint8_t freq, uint8_t dutyCycle) |
sets the frequency and duty cycle for a PWM channel automatically called by the public version of configPWM More... | |
uint8_t | _getHBOverCurrent (uint8_t hb) |
gets the overcurrent error flag bit for a specific halfbridge automatically called by the public version of getHBOverCurrent More... | |
uint8_t | _getHBOpenLoad (uint8_t hb) |
gets the openload error flag bit for a specific halfbridge automatically called by the public version of getHBOpenLoad More... | |
void | writeReg (uint8_t reg, uint8_t mask, uint8_t shift, uint8_t data) |
writes data bits to a control register of the TLE94112 More... | |
uint8_t | readStatusReg (uint8_t reg) |
reads one byte from a status register of the TLE94112 More... | |
uint8_t | readStatusReg (uint8_t reg, uint8_t mask, uint8_t shift) |
reads some bits from a status register of the TLE94112 More... | |
void | clearStatusReg (uint8_t reg) |
clears a status register by writing 0x00 to it More... | |
Protected Attributes | |
HalfBridge_t | mHalfBridges [TLE94112_NUM_HB] |
array of register locations for halfbridges More... | |
PWMchannel_t | mPwmChannels [TLE94112_NUM_PWM] |
array of register locations for PWM channels More... | |
uint8_t | mCtrlRegAddresses [TLE94112_NUM_CTRL_REGS] |
mapping array for control register addresses More... | |
uint8_t | mCtrlRegData [TLE94112_NUM_CTRL_REGS] |
mirror array for control register data More... | |
uint8_t | mStatusRegAddresses [TLE94112_NUM_STATUS_REGS] |
mapping array for status register addresses More... | |
uint8_t | mEnabled |
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +protectedinherited | +
+
|
+ +protectedinherited | +
Tle94112Wiced::Tle94112Wiced | +( | +void | +) | ++ |
Construct a new Tle94112Wiced::Tle94112 Wiced object with default pin assignment.
+ +Tle94112Wiced::Tle94112Wiced | +( | +wiced_gpio_t | +csPin | ) | ++ |
constructor with individual pin assignment
+csPin | pin number of the CS pin |
+
|
+ +inherited | +
enables and initializes the TLE94112
+
+
|
+ +inherited | +
deactivates all outputs and disables the TLE94112
+
+
|
+ +inherited | +
sets the output state and the PWM channel for a halfbridge (only for passive freewheeling)
+hb | halfbridge which will be configured |
state | sets the output voltage to high, low or floating |
pwm | selects a PWM channel for PWM output |
+
|
+ +inherited | +
sets the output state and the PWM channel for a halfbridge (allows active freewheeling)
+hb | halfbridge which will be configured |
state | sets the output voltage to high, low or floating |
pwm | selects a PWM channel for PWM output |
activeFW | 1 for active freewheeling 0 for passive freewheeling (default) |
+
|
+ +inherited | +
sets the frequency and duty cycle for a PWM channel
+pwm | PWM channel which will be configured |
freq | selects the PWM output frequency |
dutyCycle | a value from 0 to 255 which sets the dutyCycle |
+
|
+ +inherited | +
sets LED mode on compatible half bridges (half bridge 1 or 2 of TLE94112)
+hb | compatible half bridge to set LED mode |
active | LED mode active (1) or inactive (0) |
+
|
+ +inherited | +
returns a diagnosis value for error detection
+
+
|
+ +inherited | +
shows if errors of a specific type have occurred
+mask | mask to filter for a specific flag |
+
|
+ +inherited | +
shows if errors of a specific type have occurred
+mask | mask to filter for one or more specific flags this can be a disjunction of DiagFlag values |
+
|
+ +inherited | +
gets the overcurrent error flag bit for a specific halfbridge
+hb | halfbridge thats overcurrent flag will be returned |
+
|
+ +inherited | +
gets the openload error flag bit for a specific halfbridge
+hb | halfbridge thats openload flag will be returned |
+
|
+ +inherited | +
clears all clearable error flags
+
+
|
+ +protectedinherited | +
initializes this object, automatically called by begin()
+< initial control register configuration
+< status register configuration
+< bit masking for all halfbridges
+< bit masking for all pwm channels
+ +
+
|
+ +protectedinherited | +
sets the output state and the PWM channel for a halfbridge automatically called by the public version of configHB
+hb | halfbridge which will be configured |
state | sets the output voltage to high, low or floating |
pwm | selects a PWM channel for PWM output |
activeFW | 1 for active freewheeling 0 for passive freewheeling (default) |
+
|
+ +protectedinherited | +
sets the frequency and duty cycle for a PWM channel automatically called by the public version of configPWM
+pwm | PWM channel which will be configured |
freq | selects the PWM output frequency |
dutyCycle | a value from 0 to 255 which sets the dutyCycle |
+
|
+ +protectedinherited | +
gets the overcurrent error flag bit for a specific halfbridge automatically called by the public version of getHBOverCurrent
+hb | halfbridge thats overcurrent flag will be returned |
+
|
+ +protectedinherited | +
gets the openload error flag bit for a specific halfbridge automatically called by the public version of getHBOpenLoad
+hb | halfbridge thats openload flag will be returned |
+
|
+ +protectedinherited | +
writes data bits to a control register of the TLE94112
+reg | control register number(mapping array index / CtrlRegisters constant) of the register |
mask | mask for the bits that have to be written |
shift | data will be shifted left by this amount before masking. This is for the bit alignment of data |
data | the data byte that has to be written. It will be shifted and masked before |
+
|
+ +protectedinherited | +
reads one byte from a status register of the TLE94112
+reg | status register number(mapping array index / StatusRegisters constant) of the register |
+
|
+ +protectedinherited | +
reads some bits from a status register of the TLE94112
+reg | status register number(mapping array index / StatusRegisters constant) of the register |
mask | mask for the bits that have to be read |
shift | data will be shifted right by this amount after masking. This is for the bit alignment of data |
+
|
+ +protectedinherited | +
clears a status register by writing 0x00 to it
+reg | status register number(mapping array index / StatusRegisters constant) of the register |
+
|
+ +staticinherited | +
Reference value of Status Register.
+ +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +inherited | +
+
|
+ +protectedinherited | +
array of register locations for halfbridges
+ +
+
|
+ +protectedinherited | +
array of register locations for PWM channels
+ +
+
|
+ +protectedinherited | +
mapping array for control register addresses
+ +
+
|
+ +protectedinherited | +
mirror array for control register data
+ +
+
|
+ +protectedinherited | +
mapping array for status register addresses
+ +
+
|
+ +protectedinherited | +
TLE94112 Logger Arduino PAL. +More...
+#include "logger-arduino.hpp"
TLE94112 Logger Arduino PAL.
+SPDX-License-Identifier: MIT
+TLE94112 Arduino Hardware Platforms. +More...
+Go to the source code of this file.
+TLE94112 Arduino Hardware Platforms.
+SPDX-License-Identifier: MIT
+TLE94112 Library Configuration. +More...
+Go to the source code of this file.
++Macros | |
#define | TLE94112_LOGGER_ENABLED 0 |
Logger enable. More... | |
TLE94112 Library Configuration.
+SPDX-License-Identifier: MIT
+TLE94112 Timer Platform Abstraction Layer. +More...
+Go to the source code of this file.
++Data Structures | |
class | tle94112::Timer |
+Namespaces | |
tle94112 | |
TLE94112 Timer Platform Abstraction Layer.
+SPDX-License-Identifier: MIT
+TLE94112 Timer Arduino PAL. +More...
+TLE94112 Timer Arduino PAL.
+SPDX-License-Identifier: MIT
++Public Member Functions | |
def | __init__ (self, name, sourcedir="") |
+Data Fields | |
sourcedir | |
def setup.CMakeExtension.__init__ | +( | ++ | self, | +
+ | + | + | name, | +
+ | + | + | sourcedir = "" |
+
+ | ) | ++ |
setup.CMakeExtension.sourcedir | +
+Data Structures | |
class | GPIOC |
class | SPIC |
class | Timer |
+Enumerations | |
Error codes | |
enum | Error_t { + OK = 0 +, INTF_ERROR = -1 +, CONF_ERROR = -2 +, READ_ERROR = -3 +, + WRITE_ERROR = -4 + + } |
TLE94112 SPI Arduino PAL. +More...
+Go to the source code of this file.
++Data Structures | |
class | SPICIno |
Arduino SPIC class. More... | |
TLE94112 SPI Arduino PAL.
+SPDX-License-Identifier: MIT
+TLE94112 Logger WICED PAL. +More...
+#include "logger.hpp"
Go to the source code of this file.
+TLE94112 Logger WICED PAL.
+SPDX-License-Identifier: MIT
+TLE94112 Logger. +More...
+#include "tle94112-conf.hpp"
Go to the source code of this file.
++Macros | |
#define | TLE94112_LOG_INIT() { } |
#define | TLE94112_LOG_DEINIT() { } |
#define | TLE94112_LOG_MSG(str) { } |
#define | TLE94112_LOG_RETURN(ret) { } |
#define | TLE94112_MOTOR_LOG_MSG(str) { } |
#define | TLE94112_MOTOR_LOG_RETURN(ret) { } |
#define | TLE94112_REG_BITF_VALUE(map, addr, bitf) { } |
#define | TLE94112_REG_MAP_HEX(map, length, addr) { } |
#define | TLE94112_APP_LOG_MSG(str) { } |
#define | TLE94112_APP_LOG_VAR(str, var) { } |
#define | TLE94112_APP_LOG_RETURN(ret) { } |
TLE94112 Logger.
+SPDX-License-Identifier: MIT
+#define TLE94112_LOG_INIT | +( | +) | +{ } | +
Logger not enabled. All macros are empty.
+ +#define TLE94112_LOG_DEINIT | +( | +) | +{ } | +
#define TLE94112_LOG_MSG | +( | ++ | str | ) | +{ } | +
#define TLE94112_LOG_RETURN | +( | ++ | ret | ) | +{ } | +
#define TLE94112_MOTOR_LOG_MSG | +( | ++ | str | ) | +{ } | +
#define TLE94112_MOTOR_LOG_RETURN | +( | ++ | ret | ) | +{ } | +
#define TLE94112_REG_BITF_VALUE | +( | ++ | map, | +
+ | + | + | addr, | +
+ | + | + | bitf | +
+ | ) | +{ } | +
#define TLE94112_REG_MAP_HEX | +( | ++ | map, | +
+ | + | + | length, | +
+ | + | + | addr | +
+ | ) | +{ } | +
#define TLE94112_APP_LOG_MSG | +( | ++ | str | ) | +{ } | +
#define TLE94112_APP_LOG_VAR | +( | ++ | str, | +
+ | + | + | var | +
+ | ) | +{ } | +
#define TLE94112_APP_LOG_RETURN | +( | ++ | ret | ) | +{ } | +
+Modules | |
TLE94112 API | |
PAL | |
HW Platforms | |
Raspberry Pi Hardware Platform Pins. | |
TLE94112 WICED Hardware Platforms. +More...
+#include <wiced_platform.h>
Go to the source code of this file.
++Macros | |
#define | TLE94112_PIN_CS1 WICED_GPIO_7 |
#define | TLE94112_PIN_CS2 WICED_GPIO_17 |
#define | TLE94112_PIN_EN WICED_GPIO_36 |
TLE94112 WICED Hardware Platforms.
+SPDX-License-Identifier: MIT
+TLE94112 GPIO Arduino PAL. +More...
+TLE94112 GPIO Arduino PAL.
+SPDX-License-Identifier: MIT
+File in src/framework | Includes file in src/config |
---|---|
arduino / pal / logger-arduino.hpp | tle94112-conf.hpp |
File in src/framework | Includes file in src/corelib |
---|---|
raspberrypi / pal / logger-rpi.hpp | tle94112-logger.hpp |
arduino / wrapper / tle94112-ino.hpp | tle94112.hpp |
arduino / wrapper / tle94112-motor-ino.hpp | tle94112-motor.hpp |
modustoolbox / wrapper / tle94112-mtb.hpp | tle94112.hpp |
raspberrypi / wrapper / tle94112-pybind.cpp | tle94112.hpp |
raspberrypi / wrapper / tle94112-pybind.cpp | tle94112-motor.hpp |
raspberrypi / wrapper / tle94112-rpi.hpp | tle94112.hpp |
wiced-43xxx / wrapper / tle94112-wiced.hpp | tle94112.hpp |
File in src/framework/arduino | Includes file in src/pal |
---|---|
pal / gpio-arduino.hpp | gpio.hpp |
pal / logger-arduino.hpp | logger.hpp |
pal / spic-arduino.hpp | spic.hpp |
pal / timer-arduino.hpp | timer.hpp |
File in src/framework/arduino | Includes file in src/config |
---|---|
pal / logger-arduino.hpp | tle94112-conf.hpp |
File in src/framework/arduino | Includes file in src/corelib |
---|---|
wrapper / tle94112-ino.hpp | tle94112.hpp |
wrapper / tle94112-motor-ino.hpp | tle94112-motor.hpp |
File in src/framework/arduino/pal | Includes file in src/pal |
---|---|
gpio-arduino.hpp | gpio.hpp |
logger-arduino.hpp | logger.hpp |
spic-arduino.hpp | spic.hpp |
timer-arduino.hpp | timer.hpp |
File in src/framework/arduino/pal | Includes file in src/config |
---|---|
logger-arduino.hpp | tle94112-conf.hpp |
File in src/framework/modustoolbox | Includes file in src/pal |
---|---|
pal / gpio-mtb.hpp | gpio.hpp |
pal / logger-mtb.hpp | logger.hpp |
pal / spic-mtb.hpp | spic.hpp |
pal / timer-mtb.hpp | timer.hpp |
File in src/framework/modustoolbox | Includes file in src/corelib |
---|---|
wrapper / tle94112-mtb.hpp | tle94112.hpp |
File in src/framework/modustoolbox/pal | Includes file in src/pal |
---|---|
gpio-mtb.hpp | gpio.hpp |
logger-mtb.hpp | logger.hpp |
spic-mtb.hpp | spic.hpp |
timer-mtb.hpp | timer.hpp |
File in src/framework/raspberrypi | Includes file in src/pal |
---|---|
pal / gpio-rpi.hpp | gpio.hpp |
pal / logger-rpi.hpp | logger.hpp |
pal / spic-rpi.hpp | spic.hpp |
pal / timer-rpi.hpp | timer.hpp |
File in src/framework/raspberrypi | Includes file in src/corelib |
---|---|
pal / logger-rpi.hpp | tle94112-logger.hpp |
wrapper / tle94112-pybind.cpp | tle94112.hpp |
wrapper / tle94112-pybind.cpp | tle94112-motor.hpp |
wrapper / tle94112-rpi.hpp | tle94112.hpp |
File in src/framework/raspberrypi/pal | Includes file in src/pal |
---|---|
gpio-rpi.hpp | gpio.hpp |
logger-rpi.hpp | logger.hpp |
spic-rpi.hpp | spic.hpp |
timer-rpi.hpp | timer.hpp |
File in src/framework/raspberrypi/pal | Includes file in src/corelib |
---|---|
logger-rpi.hpp | tle94112-logger.hpp |
File in src/framework/wiced-43xxx | Includes file in src/pal |
---|---|
pal / gpio-wiced.hpp | gpio.hpp |
pal / logger-wiced.hpp | logger.hpp |
pal / spic-wiced.hpp | spic.hpp |
pal / timer-wiced.hpp | timer.hpp |
File in src/framework/wiced-43xxx | Includes file in src/corelib |
---|---|
wrapper / tle94112-wiced.hpp | tle94112.hpp |
File in src/framework/wiced-43xxx/pal | Includes file in src/pal |
---|---|
gpio-wiced.hpp | gpio.hpp |
logger-wiced.hpp | logger.hpp |
spic-wiced.hpp | spic.hpp |
timer-wiced.hpp | timer.hpp |
File in src/pal | Includes file in src/config |
---|---|
logger.hpp | tle94112-conf.hpp |
File in src/pal | Includes file in src/corelib |
---|---|
gpio.hpp | tle94112-types.hpp |
spic.hpp | tle94112-types.hpp |
timer.hpp | tle94112-types.hpp |
File in src/framework/arduino/wrapper | Includes file in src/framework/arduino/pal |
---|---|
tle94112-ino.cpp | gpio-arduino.hpp |
tle94112-ino.cpp | spic-arduino.hpp |
tle94112-ino.cpp | timer-arduino.hpp |
File in src/framework/arduino/wrapper | Includes file in src/corelib |
---|---|
tle94112-ino.hpp | tle94112.hpp |
tle94112-motor-ino.hpp | tle94112-motor.hpp |
File in src/corelib | Includes file in src/pal |
---|---|
tle94112.hpp | gpio.hpp |
tle94112.hpp | spic.hpp |
tle94112.hpp | timer.hpp |
File in src/corelib | Includes file in src/config |
---|---|
tle94112-logger.hpp | tle94112-conf.hpp |
File in src/framework/modustoolbox/wrapper | Includes file in src/framework/modustoolbox/pal |
---|---|
tle94112-mtb.cpp | gpio-mtb.hpp |
tle94112-mtb.cpp | spic-mtb.hpp |
tle94112-mtb.cpp | timer-mtb.hpp |
File in src/framework/modustoolbox/wrapper | Includes file in src/corelib |
---|---|
tle94112-mtb.hpp | tle94112.hpp |
File in src/framework/raspberrypi/wrapper | Includes file in src/framework/raspberrypi/pal |
---|---|
tle94112-rpi.cpp | gpio-rpi.hpp |
tle94112-rpi.cpp | spic-rpi.hpp |
tle94112-rpi.cpp | timer-rpi.hpp |
File in src/framework/raspberrypi/wrapper | Includes file in src/corelib |
---|---|
tle94112-pybind.cpp | tle94112-motor.hpp |
tle94112-pybind.cpp | tle94112.hpp |
tle94112-rpi.hpp | tle94112.hpp |
File in src/framework/wiced-43xxx/wrapper | Includes file in src/framework/wiced-43xxx/pal |
---|---|
tle94112-wiced.cpp | gpio-wiced.hpp |
tle94112-wiced.cpp | spic-wiced.hpp |
tle94112-wiced.cpp | timer-wiced.hpp |
File in src/framework/wiced-43xxx/wrapper | Includes file in src/corelib |
---|---|
tle94112-wiced.hpp | tle94112.hpp |
+Files | |
file | tle94112-platf-rpi.hpp [code] |
TLE94112 Raspberry Pi Hardware Platforms. | |
file | tle94112-pybind.cpp |
TLE94112 Raspberry Pi Python Wrapper API. | |
file | tle94112-rpi.cpp |
TLE94112 Raspberry Pi API. | |
file | tle94112-rpi.hpp [code] |
TLE94112 Raspberry Pi API. | |
+Files | |
file | tle94112-ino.cpp |
TLE94112 Arduino API. | |
file | tle94112-ino.hpp [code] |
TLE94112 Arduino API. | |
file | tle94112-motor-ino.hpp [code] |
TLE94112 Motor Arduino API. | |
file | tle94112-platf-ino.hpp [code] |
TLE94112 Arduino Hardware Platforms. | |
+Files | |
file | gpio-wiced.cpp |
TLE94112 GPIO WICED PAL. | |
file | gpio-wiced.hpp [code] |
TLE94112 GPIO WICED PAL. | |
file | logger-wiced.cpp |
TLE94112 Logger WICED PAL. | |
file | logger-wiced.hpp [code] |
TLE94112 Logger WICED PAL. | |
file | spic-wiced.cpp |
TLE94112 SPI WICED PAL. | |
file | spic-wiced.hpp [code] |
TLE94112 SPI WICED PAL. | |
file | timer-wiced.cpp |
TLE94112 Timer WICED PAL. | |
file | timer-wiced.hpp [code] |
TLE94112 Timer WICED PAL. | |
+Directories | |
directory | arduino |
directory | modustoolbox |
directory | raspberrypi |
directory | wiced-43xxx |
+Files | |
file | tle94112-conf-dfl.hpp [code] |
TLE94112 Default Library Configuration. | |
file | tle94112-conf-opts.hpp [code] |
TLE94112 Library Configuration Options. | |
file | tle94112-conf.hpp [code] |
TLE94112 Library Configuration. | |
+Files | |
file | gpio-rpi.cpp |
TLE94112 GPIO Raspberry Pi API. | |
file | gpio-rpi.hpp [code] |
TLE94112 GPIO Raspberry Pi API. | |
file | logger-rpi.cpp |
TLE94112 Logger Raspberry Pi PAL. | |
file | logger-rpi.hpp [code] |
TLE94112 Logger Raspberry Pi PAL. | |
file | spic-rpi.cpp |
TLE94112 SPI Raspberry Pi PAL. | |
file | spic-rpi.hpp [code] |
TLE94112 SPI Raspberry Pi PAL. | |
file | timer-rpi.cpp |
TLE94112 Timer Raspberry Pi PAL. | |
file | timer-rpi.hpp [code] |
TLE94112 Timer Raspberry Pi PAL. | |
+Files | |
file | gpio.cpp |
TLE94112 GPIO Platform Abstraction Layer. | |
file | gpio.hpp [code] |
TLE94112 GPIO Platform Abstraction Layer. | |
file | logger.hpp [code] |
TLE94112 Logger Platform Abstraction Layer. | |
file | spic.cpp |
TLE94112 SPI Platform Abstraction Layer. | |
file | spic.hpp [code] |
TLE94112 SPI Platform Abstraction Layer. | |
file | timer.hpp [code] |
TLE94112 Timer Platform Abstraction Layer. | |
+Files | |
file | tle94112-platf-wiced.hpp [code] |
TLE94112 WICED Hardware Platforms. | |
file | tle94112-wiced.cpp |
TLE94112 WICED API. | |
file | tle94112-wiced.hpp [code] |
TLE94112 WICED API. | |
+Files | |
file | tle94112-mtb.cpp |
TLE94112 ModusToolbox HAL API. | |
file | tle94112-mtb.hpp [code] |
TLE94112 ModusToolbox HAL API. | |
file | tle94112-platf-mtb.hpp [code] |
TLE94112 ModusToolbox Hardware Platforms. | |
+Files | |
file | tle94112-logger.cpp |
TLE94112 Logger. | |
file | tle94112-logger.hpp [code] |
TLE94112 Logger. | |
file | tle94112-motor.cpp |
TLE94112 Motor Control API. | |
file | tle94112-motor.hpp [code] |
TLE94112 Motor Control API. | |
file | tle94112-types.hpp [code] |
TLE94112 Types. | |
file | tle94112.cpp |
TLE94112 Core API. | |
file | tle94112.hpp [code] |
TLE94112 Core API. | |
+Files | |
file | gpio-arduino.cpp |
TLE94112 GPIO Arduino PAL. | |
file | gpio-arduino.hpp [code] |
TLE94112 GPIO Arduino PAL. | |
file | logger-arduino.cpp |
TLE94112 Logger Arduino PAL. | |
file | logger-arduino.hpp [code] |
TLE94112 Logger Arduino PAL. | |
file | spic-arduino.cpp |
TLE94112 SPI Arduino PAL. | |
file | spic-arduino.hpp [code] |
TLE94112 SPI Arduino PAL. | |
file | timer-arduino.cpp |
TLE94112 Timer Arduino PAL. | |
file | timer-arduino.hpp [code] |
TLE94112 Timer Arduino PAL. | |
+Files | |
file | gpio-mtb.cpp |
TLE94112 GPIO ModusToolbox HAL PAL. | |
file | gpio-mtb.hpp [code] |
TLE94112 GPIO ModusToolbox HAL PAL. | |
file | logger-mtb.cpp |
TLE94112 Logger ModusToolbox HAL PAL. | |
file | logger-mtb.hpp [code] |
TLE94112 Logger ModusToolbox HAL PAL. | |
file | spic-mtb.cpp |
TLE94112 SPI ModusToolbox HAL PAL. | |
file | spic-mtb.hpp [code] |
TLE94112 SPI ModusToolbox HAL PAL. | |
file | timer-mtb.cpp |
TLE94112 Timer ModusToolbox HAL PAL. | |
file | timer-mtb.hpp [code] |
TLE94112 Timer ModusToolbox HAL PAL. | |
gpio-arduino.cpp | TLE94112 GPIO Arduino PAL |
gpio-arduino.hpp | TLE94112 GPIO Arduino PAL |
gpio-mtb.cpp | TLE94112 GPIO ModusToolbox HAL PAL |
gpio-mtb.hpp | TLE94112 GPIO ModusToolbox HAL PAL |
gpio-rpi.cpp | TLE94112 GPIO Raspberry Pi API |
gpio-rpi.hpp | TLE94112 GPIO Raspberry Pi API |
gpio-wiced.cpp | TLE94112 GPIO WICED PAL |
gpio-wiced.hpp | TLE94112 GPIO WICED PAL |
gpio.cpp | TLE94112 GPIO Platform Abstraction Layer |
gpio.hpp | TLE94112 GPIO Platform Abstraction Layer |
logger-arduino.cpp | TLE94112 Logger Arduino PAL |
logger-arduino.hpp | TLE94112 Logger Arduino PAL |
logger-mtb.cpp | TLE94112 Logger ModusToolbox HAL PAL |
logger-mtb.hpp | TLE94112 Logger ModusToolbox HAL PAL |
logger-rpi.cpp | TLE94112 Logger Raspberry Pi PAL |
logger-rpi.hpp | TLE94112 Logger Raspberry Pi PAL |
logger-wiced.cpp | TLE94112 Logger WICED PAL |
logger-wiced.hpp | TLE94112 Logger WICED PAL |
logger.hpp | TLE94112 Logger Platform Abstraction Layer |
setup.py | |
spic-arduino.cpp | TLE94112 SPI Arduino PAL |
spic-arduino.hpp | TLE94112 SPI Arduino PAL |
spic-mtb.cpp | TLE94112 SPI ModusToolbox HAL PAL |
spic-mtb.hpp | TLE94112 SPI ModusToolbox HAL PAL |
spic-rpi.cpp | TLE94112 SPI Raspberry Pi PAL |
spic-rpi.hpp | TLE94112 SPI Raspberry Pi PAL |
spic-wiced.cpp | TLE94112 SPI WICED PAL |
spic-wiced.hpp | TLE94112 SPI WICED PAL |
spic.cpp | TLE94112 SPI Platform Abstraction Layer |
spic.hpp | TLE94112 SPI Platform Abstraction Layer |
timer-arduino.cpp | TLE94112 Timer Arduino PAL |
timer-arduino.hpp | TLE94112 Timer Arduino PAL |
timer-mtb.cpp | TLE94112 Timer ModusToolbox HAL PAL |
timer-mtb.hpp | TLE94112 Timer ModusToolbox HAL PAL |
timer-rpi.cpp | TLE94112 Timer Raspberry Pi PAL |
timer-rpi.hpp | TLE94112 Timer Raspberry Pi PAL |
timer-wiced.cpp | TLE94112 Timer WICED PAL |
timer-wiced.hpp | TLE94112 Timer WICED PAL |
timer.hpp | TLE94112 Timer Platform Abstraction Layer |
tle94112-conf-dfl.hpp | TLE94112 Default Library Configuration |
tle94112-conf-opts.hpp | TLE94112 Library Configuration Options |
tle94112-conf.hpp | TLE94112 Library Configuration |
tle94112-ino.cpp | TLE94112 Arduino API |
tle94112-ino.hpp | TLE94112 Arduino API |
tle94112-logger.cpp | TLE94112 Logger |
tle94112-logger.hpp | TLE94112 Logger |
tle94112-motor-ino.hpp | TLE94112 Motor Arduino API |
tle94112-motor.cpp | TLE94112 Motor Control API |
tle94112-motor.hpp | TLE94112 Motor Control API |
tle94112-mtb.cpp | TLE94112 ModusToolbox HAL API |
tle94112-mtb.hpp | TLE94112 ModusToolbox HAL API |
tle94112-platf-ino.hpp | TLE94112 Arduino Hardware Platforms |
tle94112-platf-mtb.hpp | TLE94112 ModusToolbox Hardware Platforms |
tle94112-platf-rpi.hpp | TLE94112 Raspberry Pi Hardware Platforms |
tle94112-platf-wiced.hpp | TLE94112 WICED Hardware Platforms |
tle94112-pybind.cpp | TLE94112 Raspberry Pi Python Wrapper API |
tle94112-rpi.cpp | TLE94112 Raspberry Pi API |
tle94112-rpi.hpp | TLE94112 Raspberry Pi API |
tle94112-types.hpp | TLE94112 Types |
tle94112-wiced.cpp | TLE94112 WICED API |
tle94112-wiced.hpp | TLE94112 WICED API |
tle94112.cpp | TLE94112 Core API |
tle94112.hpp | TLE94112 Core API |
This page explains how to interpret the graphs that are generated by doxygen.
+Consider the following example:
This will result in the following graph:
+The boxes in the above graph have the following meaning:
+The arrows have the following meaning:
+CTle94112Motor::Connector_t | Struct representing one motor connector |
▼Ctle94112::GPIOC | |
CGPIOIno | Arduino GPIO class |
CGPIOMtb | ModusToolbox GPIO wrapper class |
CGPIORpi | Raspberry Pi GPIO class |
CGPIOWiced | WiCED gpio wrapper |
CTle94112::HalfBridge_t | Struct containing register locations for a single halfbridge |
CTle94112::PWMchannel_t | Struct containing register locations for a single PWM channel |
▼Ctle94112::SPIC | |
CSPICIno | Arduino SPIC class |
CSPICMtb | |
CSPICRpi | Raspberry Pi SPIC class |
CSPICWiced | Wiced SPIC class |
▼Ctle94112::Timer | |
CTimerIno | |
CTimerMtb | MoudusToolbox timer wrapper |
CTimerRpi | |
CTimerWiced | WiCED timer wrapper |
▼CTle94112 | Basic TLE94112 |
CTle94112Ino | Arduino Tle94112Ino constructor |
CTle94112Mtb | |
CTle94112Rpi | |
CTle94112Wiced | |
CTle94112Motor | Motor connected to a TLE94112 |
CTle94112MotorIno | Motor connected to a TLE94112 |
▼Cbuild_ext | |
Csetup.CMakeBuild | |
▼CExtension | |
Csetup.CMakeExtension |
+ + |
+ + |
+ + |
+ + |
+ + |
+ + |
+ + |
+ + |
+ + |
+ + |
+ + |
▼Core Library | |
TLE94112 API | |
TLE94112 Motor Control API | |
Platform Abstraction Layer Interface | |
▼SW Frameworks | |
▼Arduino | |
TLE94112 API | |
PAL | |
Arduino HW Platforms | |
▼RaspberryPi | |
TLE94112 API | |
PAL | |
HW Platforms | Raspberry Pi Hardware Platform Pins |
▼ModusToolbox | |
TLE94112 API | |
PAL <br> | |
HW Platforms | |
▼WICED | |
TLE94112 API | |
PAL | |
HW Platform |