#include "mavlink.h"
#include <stdbool.h>
Go to the source code of this file.
Classes | |
struct | mavlink_pm_storage |
Typedefs | |
typedef struct mavlink_pm_storage | mavlink_pm_storage |
Enumerations | |
enum | MAVLINK_PM_PARAMETERS { MAVLINK_PM_PARAM_SYSTEM_ID, MAVLINK_PM_PARAM_ATT_K_D, MAVLINK_PM_MAX_PARAM_COUNT, MAVLINK_PM_PARAM_SYSTEM_ID, MAVLINK_PM_PARAM_ATT_K_D, MAVLINK_PM_MAX_PARAM_COUNT } |
Functions | |
void | mavlink_pm_reset_params (mavlink_pm_storage *pm) |
reset all parameters to default |
typedef struct mavlink_pm_storage mavlink_pm_storage |
Definition at line 52 of file testing/mavlink_missionlib_data.h.
MAVLINK_PM_PARAM_SYSTEM_ID | |
MAVLINK_PM_PARAM_ATT_K_D | |
MAVLINK_PM_MAX_PARAM_COUNT | |
MAVLINK_PM_PARAM_SYSTEM_ID | |
MAVLINK_PM_PARAM_ATT_K_D | |
MAVLINK_PM_MAX_PARAM_COUNT |
Definition at line 33 of file testing/mavlink_missionlib_data.h.
void mavlink_pm_reset_params | ( | mavlink_pm_storage * | pm | ) |