Public Member Functions | Public Attributes | Private Attributes | List of all members
Sensors Struct Reference

#include <sensors.hpp>

Public Member Functions

int8_t init (const std::shared_ptr< UavDynamicsSimBase > &uavDynamicsSim)
 
void publishStateToCommunicator (uint8_t dynamicsNotation)
 
 Sensors (ros::NodeHandle *nh)
 

Public Attributes

AttitudeSensor attitudeSensor
 
BatteryInfoSensor batteryInfoSensor
 
DiffPressureSensor diffPressureSensor
 
EscStatusSensor escStatusSensor
 
FuelTankSensor fuelTankSensor
 
GpsSensor gpsSensor
 
IceStatusSensor iceStatusSensor
 
ImuSensor imuSensor
 
MagSensor magSensor
 
PressureSensor pressureSensor
 
TemperatureSensor temperatureSensor
 
VelocitySensor velocitySensor_
 

Private Attributes

std::shared_ptr< UavDynamicsSimBase_uavDynamicsSim
 
CoordinateConverter geodeticConverter
 

Detailed Description

Definition at line 37 of file sensors.hpp.

Constructor & Destructor Documentation

◆ Sensors()

Sensors::Sensors ( ros::NodeHandle nh)
explicit

Definition at line 26 of file sensors.cpp.

Member Function Documentation

◆ init()

int8_t Sensors::init ( const std::shared_ptr< UavDynamicsSimBase > &  uavDynamicsSim)

Definition at line 42 of file sensors.cpp.

◆ publishStateToCommunicator()

void Sensors::publishStateToCommunicator ( uint8_t  dynamicsNotation)
Note
Different simulators return data in different notation (PX4 or ROS) But we must publish only in PX4 notation

Definition at line 95 of file sensors.cpp.

Member Data Documentation

◆ _uavDynamicsSim

std::shared_ptr<UavDynamicsSimBase> Sensors::_uavDynamicsSim
private

Definition at line 58 of file sensors.hpp.

◆ attitudeSensor

AttitudeSensor Sensors::attitudeSensor

Definition at line 42 of file sensors.hpp.

◆ batteryInfoSensor

BatteryInfoSensor Sensors::batteryInfoSensor

Definition at line 54 of file sensors.hpp.

◆ diffPressureSensor

DiffPressureSensor Sensors::diffPressureSensor

Definition at line 45 of file sensors.hpp.

◆ escStatusSensor

EscStatusSensor Sensors::escStatusSensor

Definition at line 52 of file sensors.hpp.

◆ fuelTankSensor

FuelTankSensor Sensors::fuelTankSensor

Definition at line 53 of file sensors.hpp.

◆ geodeticConverter

CoordinateConverter Sensors::geodeticConverter
private

Definition at line 57 of file sensors.hpp.

◆ gpsSensor

GpsSensor Sensors::gpsSensor

Definition at line 49 of file sensors.hpp.

◆ iceStatusSensor

IceStatusSensor Sensors::iceStatusSensor

Definition at line 46 of file sensors.hpp.

◆ imuSensor

ImuSensor Sensors::imuSensor

Definition at line 47 of file sensors.hpp.

◆ magSensor

MagSensor Sensors::magSensor

Definition at line 50 of file sensors.hpp.

◆ pressureSensor

PressureSensor Sensors::pressureSensor

Definition at line 43 of file sensors.hpp.

◆ temperatureSensor

TemperatureSensor Sensors::temperatureSensor

Definition at line 44 of file sensors.hpp.

◆ velocitySensor_

VelocitySensor Sensors::velocitySensor_

Definition at line 48 of file sensors.hpp.


The documentation for this struct was generated from the following files:


inno_vtol_dynamics
Author(s): Roman Fedorenko, Dmitry Ponomarev, Ezra Tal, Winter Guerra
autogenerated on Mon Dec 9 2024 03:13:35