PX4 Firmware
PX4 Autopilot Software http://px4.io
sensors.cpp File Reference
#include <drivers/drv_adc.h>
#include <drivers/drv_airspeed.h>
#include <drivers/drv_hrt.h>
#include <lib/airspeed/airspeed.h>
#include <lib/conversion/rotation.h>
#include <lib/mathlib/mathlib.h>
#include <lib/parameters/param.h>
#include <lib/perf/perf_counter.h>
#include <px4_platform_common/getopt.h>
#include <px4_platform_common/module.h>
#include <px4_platform_common/module_params.h>
#include <px4_platform_common/posix.h>
#include <px4_platform_common/px4_config.h>
#include <px4_platform_common/tasks.h>
#include <px4_platform_common/time.h>
#include <uORB/Publication.hpp>
#include <uORB/PublicationMulti.hpp>
#include <uORB/Subscription.hpp>
#include <uORB/topics/actuator_controls.h>
#include <uORB/topics/airspeed.h>
#include <uORB/topics/differential_pressure.h>
#include <uORB/topics/parameter_update.h>
#include <uORB/topics/sensor_preflight.h>
#include <uORB/topics/vehicle_air_data.h>
#include <uORB/topics/vehicle_control_mode.h>
#include <uORB/topics/vehicle_magnetometer.h>
#include <DevMgr.hpp>
#include "parameters.h"
#include "voted_sensors_update.h"
#include "vehicle_acceleration/VehicleAcceleration.hpp"
#include "vehicle_angular_velocity/VehicleAngularVelocity.hpp"
Include dependency graph for sensors.cpp:

Go to the source code of this file.

Classes

class  Sensors
 

Macros

#define PCB_TEMP_ESTIMATE_DEG   5.0f
 HACK - true temperature is much less than indicated temperature in baro, subtract 5 degrees in an attempt to account for the electrical upheating of the PCB. More...
 

Functions

__EXPORT int sensors_main (int argc, char *argv[])
 

Detailed Description

Macro Definition Documentation

◆ PCB_TEMP_ESTIMATE_DEG

#define PCB_TEMP_ESTIMATE_DEG   5.0f

HACK - true temperature is much less than indicated temperature in baro, subtract 5 degrees in an attempt to account for the electrical upheating of the PCB.

Definition at line 87 of file sensors.cpp.

Referenced by Sensors::diff_pres_poll().

Function Documentation

◆ sensors_main()

__EXPORT int sensors_main ( int  argc,
char *  argv[] 
)

Definition at line 612 of file sensors.cpp.

References main().

Here is the call graph for this function: