_action_start | MissionBlock | protected |
_actuator_pub | MissionBlock | protected |
_current_target_motion | FollowTarget | private |
_current_vel | FollowTarget | private |
_est_target_vel | FollowTarget | private |
_filtered_target_position_delta | FollowTarget | private |
_follow_offset | FollowTarget | private |
_follow_position_matricies | FollowTarget | privatestatic |
_follow_target_position | FollowTarget | private |
_follow_target_sub | FollowTarget | private |
_last_update_time | FollowTarget | private |
_mission_item | MissionBlock | protected |
_navigator | NavigatorMode | protected |
_previous_target_motion | FollowTarget | private |
_responsiveness | FollowTarget | private |
_rot_matrix | FollowTarget | private |
_step_time_in_ms | FollowTarget | private |
_step_vel | FollowTarget | private |
_target_distance | FollowTarget | private |
_target_position_delta | FollowTarget | private |
_target_position_offset | FollowTarget | private |
_target_updates | FollowTarget | private |
_time_first_inside_orbit | MissionBlock | protected |
_time_wp_reached | MissionBlock | protected |
_waypoint_position_reached | MissionBlock | protected |
_waypoint_position_reached_previously | MissionBlock | protected |
_waypoint_yaw_reached | MissionBlock | protected |
_yaw_angle | FollowTarget | private |
_yaw_rate | FollowTarget | private |
ACCEL enum value | FollowTarget | private |
ATT_RATES enum value | FollowTarget | private |
DEFINE_PARAMETERS((ParamFloat< px4::params::NAV_MIN_FT_HT >) _param_nav_min_ft_ht,(ParamFloat< px4::params::NAV_FT_DST >) _param_nav_ft_dst,(ParamInt< px4::params::NAV_FT_FS >) _param_nav_ft_fs,(ParamFloat< px4::params::NAV_FT_RS >) _param_nav_ft_rs) FollowTargetState _follow_target_state | FollowTarget | inlineprivate |
FF_K | FollowTarget | privatestatic |
FOLLOW_FROM_BEHIND enum value | FollowTarget | private |
FOLLOW_FROM_FRONT enum value | FollowTarget | private |
FOLLOW_FROM_LEFT enum value | FollowTarget | private |
FOLLOW_FROM_RIGHT enum value | FollowTarget | private |
FollowTarget(Navigator *navigator) | FollowTarget | |
FollowTargetState enum name | FollowTarget | private |
get_absolute_altitude_for_item(const mission_item_s &mission_item) const | MissionBlock | protected |
get_time_inside(const mission_item_s &item) const | MissionBlock | protected |
INTERPOLATION_PNTS | FollowTarget | privatestatic |
is_mission_item_reached() | MissionBlock | protected |
issue_command(const mission_item_s &item) | MissionBlock | protected |
item_contains_position(const mission_item_s &item) | MissionBlock | static |
mission_apply_limitation(mission_item_s &item) | MissionBlock | protected |
mission_item_to_position_setpoint(const mission_item_s &item, position_setpoint_s *sp) | MissionBlock | protected |
MissionBlock(Navigator *navigator) | MissionBlock | |
MissionBlock(const MissionBlock &)=delete | MissionBlock | |
NavigatorMode(Navigator *navigator) | NavigatorMode | |
NavigatorMode(const NavigatorMode &)=delete | NavigatorMode | |
OFFSET_M | FollowTarget | privatestatic |
on_activation() override | FollowTarget | virtual |
on_active() override | FollowTarget | virtual |
on_inactivation() | NavigatorMode | virtual |
on_inactive() override | FollowTarget | virtual |
operator=(const MissionBlock &)=delete | MissionBlock | |
NavigatorMode::operator=(const NavigatorMode &)=delete | NavigatorMode | |
POS enum value | FollowTarget | private |
reset_mission_item_reached() | MissionBlock | protected |
reset_target_validity() | FollowTarget | private |
run(bool active) | NavigatorMode | |
set_follow_target_item(struct mission_item_s *item, float min_clearance, follow_target_s &target, float yaw) | FollowTarget | private |
set_idle_item(struct mission_item_s *item) | MissionBlock | protected |
set_land_item(struct mission_item_s *item, bool at_current_location) | MissionBlock | protected |
set_loiter_item(struct mission_item_s *item, float min_clearance=-1.0f) | MissionBlock | protected |
set_takeoff_item(struct mission_item_s *item, float abs_altitude, float min_pitch=0.0f) | MissionBlock | protected |
set_vtol_transition_item(struct mission_item_s *item, const uint8_t new_mode) | MissionBlock | protected |
SET_WAIT_FOR_TARGET_POSITION enum value | FollowTarget | private |
TARGET_ACCEPTANCE_RADIUS_M | FollowTarget | privatestatic |
target_position_valid() | FollowTarget | private |
TARGET_TIMEOUT_MS | FollowTarget | privatestatic |
target_velocity_valid() | FollowTarget | private |
TRACK_POSITION enum value | FollowTarget | private |
track_target_position() | FollowTarget | private |
track_target_velocity() | FollowTarget | private |
TRACK_VELOCITY enum value | FollowTarget | private |
update_position_sp(bool velocity_valid, bool position_valid, float yaw_rate) | FollowTarget | private |
update_target_motion() | FollowTarget | private |
update_target_velocity() | FollowTarget | private |
VEL enum value | FollowTarget | private |
WAIT_FOR_TARGET_POSITION enum value | FollowTarget | private |
~FollowTarget()=default | FollowTarget | |
~MissionBlock()=default | MissionBlock | virtual |
~NavigatorMode()=default | NavigatorMode | virtual |