Skyward boardcore
Loading...
Searching...
No Matches
Class Hierarchy

Go to the graphical class hierarchy

This inheritance list is sorted roughly, but not completely, alphabetically:
[detail level 12345]
 CBoardcore::AbstractSensorBase abstract class for sensor drivers
 CBoardcore::AccelerometerDataStructure to handle accelerometer data
 CBoardcore::AccelerometerSimulatorData< N_DATA >
 CBoardcore::BMX160Defs::AccRawRaw struct, read directly from device
 CBoardcore::ActiveObject
 CBoardcore::AD5204
 CBoardcore::ADA
 CBoardcore::ADAState
 CBoardcore::ADCDataStructure to handle ADC data
 CBoardcore::ADS1118::ADS1118ConfigStructure of configuration word
 CBoardcore::ADS1118::ADS1118InputConfigDriver's input config
 CBoardcore::ADS131M04Data
 CBoardcore::ADS131M08Data
 CBoardcore::Aeroutils::AerodynamicCoeff
 CBoardcore::AirBrakesInterpConfig
 CBoardcore::AirBrakesPIConfig
 CBoardcore::Algorithm
 CBoardcore::AntennaAnglesA structure for storing angles relative to the NED frame
 CBoardcore::VN300Defs::AntennaPositionStructure to handle antenna A position units [m]
 CBoardcore::Xbee::APIFrame
 CBoardcore::Xbee::APIFrameLog
 CBoardcore::Xbee::APIFrameParserParses a byte sequence into an Xbee APIFrame
 CBoardcore::Xbee::ATCommandFrameLog
 CBoardcore::Xbee::ATCommandResponseFrameLog
 CBoardcore::Canbus::CanbusDriver::AutoBitTimingStruct defining high level bit timing requirements. Register values will then be calculated automatically
 CBoardcore::AxisOrientationThis struct represents in the most general way any kind of transformation of the reference frame (axis X, Y and Z)
 CBoardcore::BarometerSimulatorData< N_DATA >
 CBase
 CBoardcore::BasicTimerDriver for STM32 basic timers
 CBoardcore::BiasCalibrationThis is the dumbest type of calibration possible: an offset
 CBoardcore::BiasCorrectorBias correction removes a bias from a measurement
 CBoardcore::Canbus::CanbusDriver::BitTimingStruct specifying exact bit timing registers values
 CBoardcore::BME280::BME280Comp
 CBoardcore::BME280I2C::BME280Comp
 CBoardcore::BME280::BME280Config
 CBoardcore::BME280I2C::BME280Config
 CBoardcore::BMP280::BMP280Comp
 CBoardcore::BMP280I2C::BMP280Comp
 CBoardcore::BMP280::BMP280Config
 CBoardcore::BMP280I2C::BMP280Config
 CBoardcore::BMX160ConfigBMX160 Configuration
 CBoardcore::BMX160FifoStatsBMX160 fifo statistics
 CBoardcore::BMX160GyroscopeCalibrationBiases
 CBoardcore::Bounds
 CBoardcore::Canbus::BusLoadEstimation
 CBoardcore::Canbus::BusLoadEstimation::BusLoadInfo
 CBoardcore::BuzzerThis driver does not provide a square wave signal but instead is a simple utility that provides long PWM signals to make the buzzer beep on and off
 CBoardcore::Canbus::CanbusDriver::CanbusConfigConfiguration struct for basic CanBus operation
 CBoardcore::Canbus::CanbusDriverLow level CanBus driver, with support for both peripherals (CAN1 and CAN2) on stm32f4 microcontrollers
 CBoardcore::CanEvent
 CBoardcore::Canbus::CanMessageGeneric struct that contains a can protocol message
 CBoardcore::Canbus::CanPacket
 CBoardcore::Canbus::CanProtocolCanbus protocol implementation
 CBoardcore::Canbus::CanRXPacket
 CBoardcore::Canbus::CanRXStatus
 CBoardcore::Canbus::CanTXResult
 CBoardcore::ADS131M04::Config::ChannelConfig
 CBoardcore::ADS131M08::Config::ChannelConfig
 CBoardcore::CircularBuffer< T, Size >
 CBoardcore::CircularBuffer< Boardcore::Canbus::CanMessage, Size >
 CBoardcore::CircularBuffer< Boardcore::Canbus::CanRXPacket, Size >
 CBoardcore::CircularBuffer< Boardcore::Canbus::CanTXResult, Size >
 CBoardcore::CircularBuffer< Boardcore::LogRecord, ASYNC_LOG_BUFFER_SIZE >
 CBoardcore::CircularBuffer< Boardcore::Packet< pktLen >, pktNum >
 CBoardcore::CircularBuffer< Boardcore::Xbee::RXPacketFrame, RX_FRAMES_BUF_SIZE >
 CBoardcore::CircularBuffer< float, Size >
 CBoardcore::CircularBuffer< PacketInfo, BUFFER_LEN >
 CBoardcore::ADS131M04::Config
 CBoardcore::ADS131M08::Config
 CBoardcore::LIS2MDL::ConfigSensor configuration
 CBoardcore::LIS3MDL::ConfigSensor configuration
 CBoardcore::LPS22DF::ConfigStruct that sums up all the settings of the sensor
 CBoardcore::MEA::Config
 CBoardcore::SX1278Fsk::ConfigRequested SX1278 configuration
 CBoardcore::SX1278Lora::ConfigRequested SX1278 configuration
 CBoardcore::ContiguousQueue< T, N >
 CBoardcore::CoordinatesCoordinates struct with latitude [degree], longitude [degree]
 CBoardcore::CountedPWMThis class generates a PWM signal for a chosen number of pulses
 CBoardcore::CpuMeterData
 CBoardcore::CpuMeter::CpuMeterLauncher
 CBoardcore::CSVIterator< Data >Iterable CSV data
 CBoardcore::CSVParser< Data >Iterable parser of CSV files
 CBoardcore::CurrentDataStructure to handle current data
 CBoardcore::DataAsciiRequestStructure that contains all the parameters for the request to be sent
 CBoardcore::DataModTStructure of the output of the load cell in [continuous mode -> ModT]
 CBoardcore::DataModTdStructure of the output of the load cell in [continuous mode -> ModTd]
 CBoardcore::DependencyInjectorProxy class used to obtain dependencies
 CBoardcore::DependencyManagerMain DependencyManager class
 CBoardcore::DeserializerClass used to deserialize the binary logs created using fedetft's logger into csv files
 CBoardcore::DeviceStatus
 CBoardcore::DipSwitchDip switch driver to read the current status of the switch
 CBoardcore::DMADriverThis class is responsible for streams acquisition, streams release and interrupt handling
 CBoardcore::DMAStreamThis class represents the actual DMA stream. It can be used to setup, start and stop DMA transactions
 CBoardcore::DMAStreamGuardSimple RAII class to handle DMA streams
 CBoardcore::DMATransactionThis is the configuration struct for a DMA transaction
 CBoardcore::EntryStructsUnionUnion data struct to be stored in the map. It does contain the enumeration index and the value of such configuration entry
 CBoardcore::ErrataRegistersValues
 CBoardcore::EventDataLoggable struct for each event posted
 CBoardcore::EventHandlerBase
 CBoardcore::EventSniffer
 Cstd::false_type
 CBoardcore::LSM6DSRXDefs::FifoTimeslotDataTemporary struct used to store data extracted from fifo, before turning it into LSM6DSRXData
 CBoardcore::Canbus::FilterBankBase class for a Canbus filter bank
 CBoardcore::FollowerStateState of the Follower algorithm, with the angles and speeds
 CBoardcore::GammaMessage::gamma_msg_t
 CBoardcore::GammaConf
 CBoardcore::GammaMessage
 CBoardcore::GpioPinCompareComparison operator between GpioPins used for std::map
 CBoardcore::GPSDataStructure to handle GPS data
 CBoardcore::GPSSimulatorData< N_DATA >
 CBoardcore::GyroscopeDataStructure to handle gyroscope data
 CBoardcore::GyroscopeSimulatorData< N_DATA >
 CBoardcore::BMX160Defs::GyrRawRaw struct, read directly from device
 CBoardcore::HBridgeDriver to operate an H-bridge
 CBoardcore::HumidityDataStructure to handle humidity data
 CBoardcore::I2CHigh level driver for the I2C peripherals
 Cmiosix::I2C1Driver
 CBoardcore::I2CDriverLow level driver for I2C peripherals
 CBoardcore::I2CDriver::I2CSlaveConfigConfiguration struct for a slave device. This will be used for configuring the bus in order to communicate with the addressed device
 CBoardcore::InjectableInterface for an injectable dependency
 CBoardcore::InjectableBase< T >
 CBoardcore::VN300Defs::INSDataStructure to handle INS (inertial navigation system) data
 Cstd::integral_constant
 CBoardcore::InternalADCData
 CBoardcore::IRQCircularBuffer< T, Size >
 CBoardcore::IRQCircularBuffer< Boardcore::Canbus::CanRXPacket, RX_BUF_SIZE >
 CBoardcore::IRQCircularBuffer< Boardcore::Canbus::CanTXResult, TX_STATUS_BUF_SIZE >
 Cstd::is_base_of
 CBoardcore::SX1278::ISX1278FrontendShared interface between all SX1278 frontends
 CBoardcore::Kalman< T, N_size, P_size, M_size >Implementation of a generic Kalman filter using the Eigen library
 CBoardcore::Kalman< float, 3, 1 >
 CBoardcore::Kalman< T, N_size, P_size, M_size >::KalmanConfigConfiguration struct for the Kalman class
 CBoardcore::LoadCellData
 CBoardcore::SX1278::SX1278Common::LockRAII scoped bus lock guard
 CBoardcore::SX1278::SX1278Common::LockModeRAII scoped mode lock, requires a previous lock
 CBoardcore::LoggerStatsStatistics for the logger
 CBoardcore::LoggingString
 CBoardcore::LogRecord
 CBoardcore::LogSink
 CBoardcore::LSM6DSRXConfig
 CBoardcore::MagnetometerDataStructure to handle magnetometer data
 CBoardcore::MagnetometerSimulatorData< N_DATA >
 CBoardcore::BMX160Defs::MagRawRaw struct, read directly from device
 CBoardcore::SX1278::RegDioMapping::MappingRepresents an actual Dio mapping.
 CBoardcore::MavlinkDriver< PktLength, OutQueueSize, MavMsgLength >The MavlinkDriver object offers an interface to send and receive from a Transceiver object using an implementation of the Mavlink protocol
 CBoardcore::MavlinkStatus
 CBoardcore::MBLoadCellSettingsStructure of the output of the load cell in [continuous mode -> ModT]
 CBoardcore::MEA
 CBoardcore::MEAState
 CBoardcore::Xbee::ModemStatusFrameLog
 CBoardcore::Module
 CBoardcore::MovingAverage< T, Size >
 CBoardcore::MPU9250::MPU9250RawData
 CBoardcore::MS5803CalibrationDataMS5803 calibration data. See page 13 of datasheet for more details
 CBoardcore::NAS
 CBoardcore::NASConfig
 CBoardcore::NASState
 CBoardcore::NavControllerUI navigation controller: listens for button clicks and dispatches the interactions to the view tree
 CBoardcore::NEDCoords
 CBoardcore::Outcomes
 CBoardcore::Packet< len >The Packet class is used for packing together messages with variable lengths into a fixed size packet. Useful for telemetry
 CBoardcore::Packet< pktLen >
 CBoardcore::Wiz5500::PhyState
 CBoardcore::PIControllerProportional and integral controller with saturation
 CBoardcore::PinDataPin informations
 CBoardcore::PinObserver
 CBoardcore::PitotData
 CBoardcore::PitotSimulatorData< N_DATA >
 CBoardcore::Position
 CBoardcore::PressureData
 CBoardcore::PrintLogger
 CBoardcore::PropagatorStateState of the propagator, taking into account the prediction steps (0 if true NAS state) and the propagated NAS
 CBoardcore::PWMDriver for easy access to the PWM capabilities of the general purpose timers
 CBoardcore::QuaternionDataStructure to handle quaternion data
 CBoardcore::LSM6DSRXDefs::RawFifoDataStructure used to store data from fifo before being processed
 CBoardcore::ReferenceValuesReference values for the Apogee Detection Algorithm
 CBoardcore::RegistryBackendRegistry Backend class used to save and load data to the designated storage/memory
 CBoardcore::RegistryFooterRegistry Footer, with checksum of the configuration data (not whole data). Placed at the end of the actually serialized data
 CBoardcore::RegistryFrontendThis is the front-end for the registry to store and load the configuration. Its methods are type unsafe since the type is determined by the entry setted. It does check the data types but its job is mainly the one of get and set for the given ConfigurationId, the value of the entry. It also exposes methods for go into a "safe" state during armed state / flight. Finally there are methods to visit the entire configuration (forEach)
 CBoardcore::RegistryHeaderSerialization header, with useful information about the serialized data. Header to the actually serialized data
 CBoardcore::RegistrySerializerSerialization and de-serialization class for the registry. It does serialize and deserialize the configuration to the specified vector
 CBoardcore::RuncamClass for controlling the Runcam via uart
 CBoardcore::Xbee::RXPacketFrameLog
 CBoardcore::LPS28DFW::SensorConfigStruct that sums up all the settings of the sensor
 CBoardcore::SensorInfoSensors information struct needed by the SensorManager
 CBoardcore::SensorManagerThe SensorManager handles sensors initialization and sampling
 CBoardcore::SensorSamplerVirtual sensor sampler class
 CBoardcore::ServoDriver to operate a PWM controlled servo motor
 CBoardcore::ServoCommand
 CBoardcore::ServoData
 CBoardcore::ServoFeedback
 CBoardcore::Singleton< T >
 CBoardcore::Singleton< ButtonHandler >
 CBoardcore::Singleton< EventBroker >
 CBoardcore::Singleton< Logger >
 CBoardcore::Singleton< Logging >
 CBoardcore::Singleton< ModuleManager >
 CBoardcore::Singleton< StackLogger >
 CBoardcore::SixParameterCalibration
 CBoardcore::Size
 CBoardcore::SoftAndHardIronCalibrationSoft and hard iron calibration utility
 CBoardcore::SPIAcquireLockRAII Interface for SPI bus acquisition
 CBoardcore::SPIBusConfigSPI Bus configuration for a specific slave
 CBoardcore::SPIBusInterfaceInterface for low level access of a SPI bus as a master
 CBoardcore::SPISelectLockRAII Interface for SPI chip selection
 CBoardcore::SPISlaveContains information about a single SPI slave device
 CBoardcore::SPITransactionProvides high-level access to the SPI Bus for a single transaction
 CBoardcore::StackData
 CBoardcore::StateInitializerUtility used to initialize the extended kalman filter's state
 CBoardcore::StatsComputes on-line statistics of a dataset
 CBoardcore::StatsResultStatistics computed by the Stats class
 CBoardcore::MEA::Step
 CBoardcore::Stepper
 CBoardcore::StepperData
 CBoardcore::DependencyManagerDetails::Storage< Types >
 CBoardcore::DependencyManagerDetails::Storage< Types... >
 CBoardcore::SyncCircularBuffer< T, Size >
 CBoardcore::SyncCircularBuffer< Boardcore::Canbus::CanMessage, 10 >
 CBoardcore::SynchronizedQueue< T >
 CBoardcore::SynchronizedQueue< Event >
 CBoardcore::SyncPacketQueue< pktLen, pktNum >A SyncPacketQueue is a SyncCircularBuffer of Packets
 CBoardcore::SyncPacketQueue< PktLength, OutQueueSize >
 CT
 CBoardcore::TaskStatsResultStatistics over a single task
 CBoardcore::TemperatureData
 CBoardcore::TemperatureSimulatorData< N_DATA >
 CBoardcore::TimestampData
 CBoardcore::Trajectory
 CBoardcore::TrajectoryPoint
 CBoardcore::TrajectorySet
 CBoardcore::Transceiver
 CBoardcore::BMX160Defs::TrimDataStruct holding trim data used for magnetomer compensation
 CBoardcore::Xbee::TXRequestFrameLog
 CBoardcore::Xbee::TXStatusFrameLog
 CBoardcore::TypeUnionUnion type used for the underlying saving mechanism for the configuration values
 CBoardcore::UBXDateTimeStructure to handle UBX UTC time. Nanoseconds range from -5000000 (5 ms) to 994999999 (~995 ms) and when negative the other fields have been rounded to the nearest hundredth of a second. Because of leap seconds, minutes can be a second longer or shorter, so seconds range from 0 to 60
 CBoardcore::UBXFrameGeneric UBX frame
 CBoardcore::Units::Unit< Kind, Ratio >
 CBoardcore::USARTInterfaceAbstract class that implements the interface for the USART/UART serial communication
 CBoardcore::ViewBase class for anything that can be drawn on the screen and interacted with
 CBoardcore::VNCommonSerial
 CBoardcore::VoltageDataStructure to handle voltage data
 CBoardcore::Wiz5500Driver for the WizNet W5500 ethernet
 CBoardcore::WizIpClass representing an IPv4 ip
 CBoardcore::WizMacClass representing an ethernet MAC address
 CBoardcore::Xbee::XbeeStatus