mirror of
https://github.com/ArduPilot/ardupilot
synced 2025-01-03 14:38:30 -04:00
12 lines
228 B
C
12 lines
228 B
C
|
#pragma once
|
||
|
|
||
|
#if AP_DDS_ENABLED
|
||
|
#include "geometry_msgs/msg/TwistStamped.h"
|
||
|
|
||
|
class AP_DDS_External_Control
|
||
|
{
|
||
|
public:
|
||
|
static bool handle_velocity_control(geometry_msgs_msg_TwistStamped& cmd_vel);
|
||
|
};
|
||
|
#endif // AP_DDS_ENABLED
|