PX4 Firmware
PX4 Autopilot Software http://px4.io
FixedwingPositionControl.hpp File Reference
#include "launchdetection/LaunchDetector.h"
#include "runway_takeoff/RunwayTakeoff.h"
#include <float.h>
#include <drivers/drv_hrt.h>
#include <lib/ecl/geo/geo.h>
#include <lib/ecl/l1/ecl_l1_pos_controller.h>
#include <lib/ecl/tecs/tecs.h>
#include <lib/landing_slope/Landingslope.hpp>
#include <lib/mathlib/mathlib.h>
#include <lib/perf/perf_counter.h>
#include <px4_platform_common/px4_config.h>
#include <px4_platform_common/defines.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_work_queue/WorkItem.hpp>
#include <uORB/Publication.hpp>
#include <uORB/Subscription.hpp>
#include <uORB/SubscriptionCallback.hpp>
#include <uORB/topics/airspeed_validated.h>
#include <uORB/topics/manual_control_setpoint.h>
#include <uORB/topics/parameter_update.h>
#include <uORB/topics/position_controller_landing_status.h>
#include <uORB/topics/position_controller_status.h>
#include <uORB/topics/position_setpoint_triplet.h>
#include <uORB/topics/sensor_baro.h>
#include <uORB/topics/tecs_status.h>
#include <uORB/topics/vehicle_acceleration.h>
#include <uORB/topics/vehicle_angular_velocity.h>
#include <uORB/topics/vehicle_attitude.h>
#include <uORB/topics/vehicle_attitude_setpoint.h>
#include <uORB/topics/vehicle_command.h>
#include <uORB/topics/vehicle_control_mode.h>
#include <uORB/topics/vehicle_global_position.h>
#include <uORB/topics/vehicle_land_detected.h>
#include <uORB/topics/vehicle_local_position.h>
#include <uORB/topics/vehicle_status.h>
#include <uORB/uORB.h>
#include <vtol_att_control/vtol_type.h>
Include dependency graph for FixedwingPositionControl.hpp:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Classes

class  FixedwingPositionControl
 

Variables

static constexpr float HDG_HOLD_DIST_NEXT
 
static constexpr float HDG_HOLD_REACHED_DIST
 
static constexpr float HDG_HOLD_SET_BACK_DIST = 100.0f
 
static constexpr float HDG_HOLD_YAWRATE_THRESH = 0.15f
 
static constexpr float HDG_HOLD_MAN_INPUT_THRESH
 
static constexpr hrt_abstime T_ALT_TIMEOUT = 1_s
 
static constexpr float THROTTLE_THRESH
 max throttle from user which will not lead to motors spinning up in altitude controlled modes More...
 
static constexpr float MANUAL_THROTTLE_CLIMBOUT_THRESH
 a throttle / pitch input above this value leads to the system switching to climbout mode More...
 
static constexpr float ALTHOLD_EPV_RESET_THRESH = 5.0f
 

Variable Documentation

◆ ALTHOLD_EPV_RESET_THRESH

constexpr float ALTHOLD_EPV_RESET_THRESH = 5.0f
static

◆ HDG_HOLD_DIST_NEXT

constexpr float HDG_HOLD_DIST_NEXT
static
Initial value:
=
3000.0f

Definition at line 111 of file FixedwingPositionControl.hpp.

Referenced by FixedwingPositionControl::get_waypoint_heading_distance().

◆ HDG_HOLD_MAN_INPUT_THRESH

constexpr float HDG_HOLD_MAN_INPUT_THRESH
static
Initial value:
=
0.01f

Definition at line 117 of file FixedwingPositionControl.hpp.

Referenced by FixedwingPositionControl::control_position().

◆ HDG_HOLD_REACHED_DIST

constexpr float HDG_HOLD_REACHED_DIST
static

◆ HDG_HOLD_SET_BACK_DIST

constexpr float HDG_HOLD_SET_BACK_DIST = 100.0f
static

◆ HDG_HOLD_YAWRATE_THRESH

constexpr float HDG_HOLD_YAWRATE_THRESH = 0.15f
static

◆ MANUAL_THROTTLE_CLIMBOUT_THRESH

constexpr float MANUAL_THROTTLE_CLIMBOUT_THRESH
static
Initial value:
=
0.85f

a throttle / pitch input above this value leads to the system switching to climbout mode

Definition at line 124 of file FixedwingPositionControl.hpp.

Referenced by FixedwingPositionControl::update_desired_altitude().

◆ T_ALT_TIMEOUT

constexpr hrt_abstime T_ALT_TIMEOUT = 1_s
static

◆ THROTTLE_THRESH

constexpr float THROTTLE_THRESH
static
Initial value:
=
0.05f

max throttle from user which will not lead to motors spinning up in altitude controlled modes

Definition at line 122 of file FixedwingPositionControl.hpp.

Referenced by FixedwingPositionControl::control_position().