Functions | Variables
mavlink_parameters.c File Reference
#include "mavlink_missionlib_data.h"
#include "mavlink_parameters.h"
#include "math.h"
Include dependency graph for mavlink_parameters.c:

Go to the source code of this file.

Functions

void mavlink_missionlib_send_gcs_string (const char *string)
void mavlink_missionlib_send_message (mavlink_message_t *msg)
void mavlink_pm_message_handler (const mavlink_channel_t chan, const mavlink_message_t *msg)
void mavlink_pm_queued_send (void)
 Send low-priority messages at a maximum rate of xx Hertz.

Variables

mavlink_system_t mavlink_system
mavlink_pm_storage pm

Function Documentation

void mavlink_missionlib_send_gcs_string ( const char *  string)

Definition at line 144 of file main.c.

Definition at line 135 of file main.c.

void mavlink_pm_message_handler ( const mavlink_channel_t  chan,
const mavlink_message_t msg 
)

Definition at line 30 of file mavlink_parameters.c.

void mavlink_pm_queued_send ( void  )

Send low-priority messages at a maximum rate of xx Hertz.

This function sends messages at a lower rate to not exceed the wireless bandwidth. It sends one message each time it is called until the buffer is empty. Call this function with xx Hertz to increase/decrease the bandwidth.

Definition at line 122 of file mavlink_parameters.c.


Variable Documentation

Definition at line 65 of file main.c.

Definition at line 86 of file main.c.



mavlink
Author(s): Lorenz Meier
autogenerated on Thu Jun 6 2019 19:01:57