ardupilot/libraries/GCS_MAVLink/examples/routing/routing.cpp

123 lines
3.5 KiB
C++
Raw Normal View History

2014-12-16 19:28:56 -04:00
//
// Simple test for the GCS_MAVLink routing
//
#include <AP_HAL/AP_HAL.h>
#include <GCS_MAVLink/GCS.h>
#include <GCS_MAVLink/GCS_MAVLink.h>
2014-12-16 19:28:56 -04:00
void setup();
void loop();
const AP_HAL::HAL& hal = AP_HAL::get_HAL();
2014-12-16 19:28:56 -04:00
class GCS_MAVLINK_routing : public GCS_MAVLINK
{
public:
void data_stream_send(void) override { };
protected:
2016-07-01 02:35:49 -03:00
uint32_t telem_delay() const override { return 0; }
AP_Mission *get_mission() override { return nullptr; }
uint8_t sysid_my_gcs() const override { return 1; }
private:
void handleMessage(mavlink_message_t * msg) { }
bool handle_guided_request(AP_Mission::Mission_Command &cmd) override { return false ; }
void handle_change_alt_request(AP_Mission::Mission_Command &cmd) override { }
bool try_send_message(enum ap_message id) override { return false; }
};
2014-12-16 19:28:56 -04:00
static const uint8_t num_gcs = MAVLINK_COMM_NUM_BUFFERS;
2016-05-30 07:05:00 -03:00
static GCS_MAVLINK_routing gcs_link[MAVLINK_COMM_NUM_BUFFERS];
2014-12-16 19:28:56 -04:00
extern mavlink_system_t mavlink_system;
const AP_Param::GroupInfo GCS_MAVLINK::var_info[] = {
2014-12-16 19:28:56 -04:00
AP_GROUPEND
};
static MAVLink_routing routing;
void setup(void)
{
2016-05-30 07:05:00 -03:00
hal.console->printf("routing test startup...");
gcs_link[0].init(hal.uartA, MAVLINK_COMM_0);
2014-12-16 19:28:56 -04:00
}
void loop(void)
{
uint16_t err_count = 0;
// incoming heartbeat
mavlink_message_t msg;
mavlink_heartbeat_t heartbeat = {0};
mavlink_msg_heartbeat_encode(3, 1, &msg, &heartbeat);
if (!routing.check_and_forward(MAVLINK_COMM_0, &msg)) {
hal.console->printf("heartbeat should be processed locally\n");
err_count++;
}
// incoming non-targetted message
mavlink_attitude_t attitude = {0};
mavlink_msg_attitude_encode(3, 1, &msg, &attitude);
if (!routing.check_and_forward(MAVLINK_COMM_0, &msg)) {
hal.console->printf("attitude should be processed locally\n");
err_count++;
}
2016-05-12 13:51:11 -03:00
// incoming targeted message for someone else
2014-12-16 19:28:56 -04:00
mavlink_param_set_t param_set = {0};
param_set.target_system = mavlink_system.sysid+1;
param_set.target_component = mavlink_system.compid;
mavlink_msg_param_set_encode(3, 1, &msg, &param_set);
if (routing.check_and_forward(MAVLINK_COMM_0, &msg)) {
hal.console->printf("param set 1 should not be processed locally\n");
err_count++;
}
2016-05-12 13:51:11 -03:00
// incoming targeted message for us
2014-12-16 19:28:56 -04:00
param_set.target_system = mavlink_system.sysid;
param_set.target_component = mavlink_system.compid;
mavlink_msg_param_set_encode(3, 1, &msg, &param_set);
if (!routing.check_and_forward(MAVLINK_COMM_0, &msg)) {
hal.console->printf("param set 2 should be processed locally\n");
err_count++;
}
2016-05-12 13:51:11 -03:00
// incoming targeted message for our system, but other compid
2014-12-16 19:28:56 -04:00
// should be processed locally
param_set.target_system = mavlink_system.sysid;
param_set.target_component = mavlink_system.compid+1;
mavlink_msg_param_set_encode(3, 1, &msg, &param_set);
if (!routing.check_and_forward(MAVLINK_COMM_0, &msg)) {
hal.console->printf("param set 3 should be processed locally\n");
err_count++;
}
// incoming broadcast message should be processed locally
param_set.target_system = 0;
param_set.target_component = mavlink_system.compid+1;
mavlink_msg_param_set_encode(3, 1, &msg, &param_set);
if (!routing.check_and_forward(MAVLINK_COMM_0, &msg)) {
hal.console->printf("param set 4 should be processed locally\n");
err_count++;
}
if (err_count == 0) {
hal.console->printf("All OK\n");
}
hal.scheduler->delay(1000);
}
AP_HAL_MAIN();