From ece31509cb21c1085f450be7127be44a6962922f Mon Sep 17 00:00:00 2001 From: vivek Date: Thu, 14 Jun 2018 13:56:23 -0400 Subject: [PATCH] added solo config --- launch/launch_config/solo.yaml | 22 ++++++++++++++++++++++ 1 file changed, 22 insertions(+) create mode 100644 launch/launch_config/solo.yaml diff --git a/launch/launch_config/solo.yaml b/launch/launch_config/solo.yaml new file mode 100644 index 0000000..b8a465d --- /dev/null +++ b/launch/launch_config/solo.yaml @@ -0,0 +1,22 @@ +topics: + gps : mavros/global_position/global + battery : mavros/battery + status : mavros/state + fcclient: mavros/cmd/command + setpoint: mavros/setpoint_position/local + armclient: mavros/cmd/arming + modeclient: mavros/set_mode + localpos: /mavros/local_position/pose + stream: mavros/set_stream_rate + altitude: mavros/global_position/rel_alt +type: + gps : sensor_msgs/NavSatFix + # for SITL Solo + # battery : mavros_msgs/BatteryState + # for solo + battery : mavros_msgs/BatteryStatus + status : mavros_msgs/State + altitude: std_msgs/Float64 +environment : + environment : solo-simulator +