#include "mavlink.h"
#include <stdbool.h>
Go to the source code of this file.
Functions | |
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. |
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.