mirror of
https://github.com/ArduPilot/ardupilot
synced 2025-01-05 07:28:29 -04:00
847c7980c7
Signed-off-by: Ryan Friedman <ryanfriedman5410+github@gmail.com> Co-authored-by: Andrew Tridgell <tridge60@gmail.com>
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
|