mavlink / mavros

MAVLink to ROS gateway with proxy for Ground Control Station
Other
875 stars 989 forks source link

Unable to Issue Mavros mavcmd takeoff command (Pixhawk 4 mini, Ardupilot, Odroid companion computer, and Optitrack system) #1561

Closed FioreViola closed 5 months ago

FioreViola commented 3 years ago

Trying to fly autonomously using pixhawk 4 min FCU, ardupilot, companion computer (ODROID C4) and Optitrack mo cap system. Able to Arm but not able to issue take off command.

I am currently an d undergrad working on robotics research and have become stuck and am hoping someone in this community could help point me in the right direction. I currently have a pixhawk4 mini flashed with ardupilot (apm flight stack). That is hooked up to a companion computer currently by the debugging usb port to usb port (I do have an FTDI adapter wired that I will use eventually). The companion computer is running ros and receives optitrack pose data. The steps I take to arm the drone are as follows:

1) Plug in drone battery and ODROID

2) open up several terminals and source them ( source ~/catkin_ws/devel/setup.bash and source /opt/ros/melodic/setup.bash)

3) run mavproxy.py

4) start roscore

5) run roslaunch mavros apm.launch

6) run rosrun mavros mavsys rate --all 10

7) run roslaunch vrpn_client_ros sample.launch server:=IP ADDRESS OF OPTITRACK

8) rostopic echo /vrpn_client_node/trackerID/pose (this confirms that I do get pose information)

9) remap topics rosrun topic_tools relay /vrpn_client_node/trackerID/pose /mavros/mocap/pose

10) rosrun mavros mavsafety arm (this works and motors spin then stop)

11) rosrun mavros mavsys mode -c GUIDED

12) rosrun mavros mavsafety arm (This fails now, sometimes it works sometimes it fails)

I am still very new and have read a lot of information but could you help me figure out how to get the drone to take off to about .5 or 1 m off the ground using ros (or via the terminal mavcmd takeoff) attached are the logs, and explain if I am missing any steps or crucial stuff. Thank you so much in advance for any help!

MAVROS version and platform

Mavros: ?0.18.ardupilot optitrack guided mode takeoff4? ROS: ?Kinetic? Ubuntu: ?16.04?

Autopilot type and version

[ X] ArduPilot [ ] PX4

Version: ?3.7.1?

Node logs from roslaunch mavros apm.launch

... logging to /home/fioreviola/.ros/log/df2a9e5e-9715-11eb-80f4-dc1ba1f14c2b/roslaunch-fioreviola-25480.log
Checking log directory for disk usage. This may take a while.
Press Ctrl-C to interrupt
Done checking log file disk usage. Usage is <1GB.

started roslaunch server http://fioreviola:42225/

SUMMARY
========

CLEAR PARAMETERS
 * /mavros/

PARAMETERS
 * /mavros/cmd/use_comp_id_system_control: False
 * /mavros/conn/heartbeat_mav_type: ONBOARD_CONTROLLER
 * /mavros/conn/heartbeat_rate: 1.0
 * /mavros/conn/system_time_rate: 1.0
 * /mavros/conn/timeout: 10.0
 * /mavros/conn/timesync_rate: 10.0
 * /mavros/distance_sensor/rangefinder_pub/field_of_view: 0.0
 * /mavros/distance_sensor/rangefinder_pub/frame_id: lidar
 * /mavros/distance_sensor/rangefinder_pub/id: 0
 * /mavros/distance_sensor/rangefinder_pub/send_tf: False
 * /mavros/distance_sensor/rangefinder_pub/sensor_position/x: 0.0
 * /mavros/distance_sensor/rangefinder_pub/sensor_position/y: 0.0
 * /mavros/distance_sensor/rangefinder_pub/sensor_position/z: -0.1
 * /mavros/distance_sensor/rangefinder_sub/id: 1
 * /mavros/distance_sensor/rangefinder_sub/orientation: PITCH_270
 * /mavros/distance_sensor/rangefinder_sub/subscriber: True
 * /mavros/fake_gps/eph: 2.0
 * /mavros/fake_gps/epv: 2.0
 * /mavros/fake_gps/fix_type: 3
 * /mavros/fake_gps/geo_origin/alt: 408.0
 * /mavros/fake_gps/geo_origin/lcopy output of mavros_node. Usually console where you run roslaunchat: 47.3667
 * /mavros/fake_gps/geo_origin/lon: 8.55
 * /mavros/fake_gps/gps_id: 4
 * /mavros/fake_gps/gps_rate: 5.0
 * /mavros/fake_gps/horiz_accuracy: 0.5
 * /mavros/fake_gps/mocap_transform: False
 * /mavros/fake_gps/mocap_withcovariance: False
 * /mavros/fake_gps/satellites_visible: 6
 * /mavros/fake_gps/speed_accuracy: 0.0
 * /mavros/fake_gps/tf/child_frame_id: fix
 * /mavros/fake_gps/tf/frame_id: map
 * /mavros/fake_gps/tf/listen: False
 * /mavros/fake_gps/tf/rate_limit: 10.0
 * /mavros/fake_gps/tf/send: False
 * /mavros/fake_gps/use_hil_gps: True
 * /mavros/fake_gps/use_mocap: True
 * /mavros/fake_gps/use_vision: False
 * /mavros/fake_gps/vert_accuracy: 0.5
 * /mavros/fcu_protocol: v2.0
 * /mavros/fcu_url: /dev/ttyACM0:57600
 * /mavros/gcs_url: 
 * /mavros/global_position/child_frame_id: base_link
 * /mavros/global_position/frame_id: map
 * /mavros/global_position/gps_uere: 1.0
 * /mavros/global_position/rot_covariance: 99999.0
 * /mavros/global_position/tf/child_frame_id: base_link
 * /mavros/global_position/tf/frame_id: map
 * /mavros/global_position/tf/global_frame_id: earth
 * /mavros/global_position/tf/send: False
 * /mavros/global_position/use_relative_alt: True
 * /mavros/image/frame_id: px4flow
 * /mavros/imu/angular_velocity_stdev: 0.0003490659 // 0...
 * /mavros/imu/frame_id: base_link
 * /mavros/imu/linear_acceleration_stdev: 0.0003
 * /mavros/imu/magnetic_stdev: 0.0
 * /mavros/imu/orientation_stdev: 1.0
 * /mavros/landing_target/camera/fov_x: 2.0071286398
 * /mavros/landing_target/camera/fov_y: 2.0071286398
 * /mavros/landing_target/image/height: 480
 * /mavros/landing_target/image/width: 640
 * /mavros/landing_target/land_target_type: VISION_FIDUCIAL
 * /mavros/landing_target/listen_lt: False
 * /mavros/landing_target/mav_frame: LOCAL_NED
 * /mavros/landing_target/target_size/x: 0.3
 * /mavros/landing_target/target_size/y: 0.3
 * /mavros/landing_target/tf/child_frame_id: camera_center
 * /mavros/landing_target/tf/frame_id: landing_target
 * /mavros/landing_target/tf/listen: False
 * /mavros/landing_target/tf/rate_limit: 10.0
 * /mavros/landing_target/tf/send: True
 * /mavros/local_position/frame_id: map
 * /mavros/local_position/tf/child_frame_id: base_link
 * /mavros/local_position/tf/frame_id: map
 * /mavros/local_position/tf/send: False
 * /mavros/local_position/tf/send_fcu: False
 * /mavros/mission/pull_after_gcs: True
 * /mavros/mission/use_mission_item_int: True
 * /mavros/mocap/use_pose: True
 * /mavros/mocap/use_tf: False
 * /mavros/odometry/estimator_type: 3
 * /mavros/odometry/frame_tf/desired_frame: ned
 * /mavros/plugin_blacklist: ['actuator_contro...
 * /mavros/plugin_whitelist: []
 * /mavros/px4flow/frame_id: px4flow
 * /mavros/px4flow/ranger_fov: 0.118682
 * /mavros/px4flow/ranger_max_range: 5.0
 * /mavros/px4flow/ranger_min_range: 0.3
 * /mavros/safety_area/p1/x: 1.0
 * /mavros/safety_area/p1/y: 1.0
 * /mavros/safety_area/p1/z: 1.0
 * /mavros/safety_area/p2/x: -1.0
 * /mavros/safety_area/p2/y: -1.0
 * /mavros/safety_area/p2/z: -1.0
 * /mavros/setpoint_accel/send_force: False
 * /mavros/setpoint_attitude/reverse_thrust: False
 * /mavros/setpoint_attitude/tf/child_frame_id: target_attitude
 * /mavros/setpoint_attitude/tf/frame_id: map
 * /mavros/setpoint_attitude/tf/listen: False
 * /mavros/setpoint_attitude/tf/rate_limit: 50.0
 * /mavros/setpoint_attitude/use_quaternion: False
 * /mavros/setpoint_position/mav_frame: LOCAL_NED
 * /mavros/setpoint_position/tf/child_frame_id: target_position
 * /mavros/setpoint_position/tf/frame_id: map
 * /mavros/setpoint_position/tf/listen: False
 * /mavros/setpoint_position/tf/rate_limit: 50.0
 * /mavros/setpoint_raw/thrust_scaling: 1.0
 * /mavros/setpoint_velocity/mav_frame: LOCAL_NED
 * /mavros/startup_px4_usb_quirk: False
 * /mavros/sys/disable_diag: False
 * /mavros/sys/min_voltage: 10.0
 * /mavros/target_component_id: 1
 * /mavros/target_system_id: 1
 * /mavros/tdr_radio/low_rssi: 40
 * /mavros/time/time_ref_source: fcu
 * /mavros/time/timesync_avg_alpha: 0.6
 * /mavros/time/timesync_mode: MAVLINK
 * /mavros/vibration/frame_id: base_link
 * /mavros/vision_pose/tf/child_frame_id: vision_estimate
 * /mavros/vision_pose/tf/frame_id: map
 * /mavros/vision_pose/tf/listen: False
 * /mavros/vision_pose/tf/rate_limit: 10.0
 * /mavros/vision_speed/listen_twist: True
 * /mavros/vision_speed/twist_cov: True
 * /mavros/wheel_odometry/child_frame_id: base_link
 * /mavros/wheel_odometry/count: 2
 * /mavros/wheel_odometry/frame_id: map
 * /mavros/wheel_odometry/send_raw: True
 * /mavros/wheel_odometry/send_twist: False
 * /mavros/wheel_odometry/tf/child_frame_id: base_link
 * /mavros/wheel_odometry/tf/frame_id: map
 * /mavros/wheel_odometry/tf/send: True
 * /mavros/wheel_odometry/use_rpm: False
 * /mavros/wheel_odometry/vel_error: 0.1
 * /mavros/wheel_odometry/wheel0/radius: 0.05
 * /mavros/wheel_odometry/wheel0/x: 0.0
 * /mavros/wheel_odometry/wheel0/y: -0.15
 * /mavros/wheel_odometry/wheel1/radius: 0.05
 * /mavros/wheel_odometry/wheel1/x: 0.0
 * /mavros/wheel_odometry/wheel1/y: 0.15
 * /rosdistro: melodic
 * /rosversion: 1.14.10

NODES
  /
    mavros (mavros/mavros_node)

ROS_MASTER_URI=http://localhost:11311

process[mavros-1]: started with pid [25496]
[ INFO] [1617740947.971777065]: FCU URL: /dev/ttyACM0:57600
[ INFO] [1617740947.972747052]: serial0: device: /dev/ttyACM0 @ 57600 bps
[ INFO] [1617740947.972927994]: GCS bridge disabled
[ INFO] [1617740947.978832900]: Plugin 3dr_radio loaded
[ INFO] [1617740947.979345635]: Plugin 3dr_radio initialized
[ INFO] [1617740947.979356535]: Plugin actuator_control blacklisted
[ INFO] [1617740947.980955517]: Plugin adsb loaded
[ INFO] [1617740947.982323062]: Plugin adsb initialized
[ INFO] [1617740947.982333645]: Plugin altitude blacklisted
[ INFO] [1617740947.982362451]: Plugin cam_imu_sync loaded
[ INFO] [1617740947.982570313]: Plugin cam_imu_sync initialized
[ INFO] [1617740947.982601869]: Plugin command loaded
[ INFO] [1617740947.984657729]: Plugin command initialized
[ INFO] [1617740947.984748009]: Plugin companion_process_status loaded
[ INFO] [1617740947.985618193]: Plugin companion_process_status initialized
[ INFO] [1617740947.985627260]: Plugin debug_value blacklisted
[ INFO] [1617740947.985653632]: Plugin distance_sensor loaded
[ INFO] [1617740947.988455211]: Plugin distance_sensor initialized
[ INFO] [1617740947.988490369]: Plugin esc_status loaded
[ INFO] [1617740947.988927079]: Plugin esc_status initialized
[ INFO] [1617740947.989005894]: Plugin fake_gps loaded
[ INFO] [1617740947.994933864]: Plugin fake_gps initialized
[ INFO] [1617740947.994943826]: Plugin ftp blacklisted
[ INFO] [1617740947.994980678]: Plugin global_position loaded
[ INFO] [1617740948.000651580]: Plugin global_position initialized
[ INFO] [1617740948.000689199]: Plugin gps_rtk loaded
[ INFO] [1617740948.002033171]: Plugin gps_rtk initialized
[ INFO] [1617740948.002095389]: Plugin gps_status loaded
[ INFO] [1617740948.002935832]: Plugin gps_status initialized
[ INFO] [1617740948.002946337]: Plugin hil blacklisted
[ INFO] [1617740948.003006906]: Plugin home_position loaded
[ INFO] [1617740948.004332203]: Plugin home_position initialized
[ INFO] [1617740948.004405625]: Plugin imu loaded
[ INFO] [1617740948.007142668]: Plugin imu initialized
[ INFO] [1617740948.007177183]: Plugin landing_target loaded
[ INFO] [1617740948.012711508]: Plugin landing_target initialized
[ INFO] [1617740948.012792473]: Plugin local_position loaded
[ INFO] [1617740948.015350690]: Plugin local_position initialized
[ INFO] [1617740948.015425568]: Plugin log_transfer loaded
[ INFO] [1617740948.016431335]: Plugin log_transfer initialized
[ INFO] [1617740948.016505232]: Plugin manual_control loaded
[ INFO] [1617740948.018391009]: Plugin manual_control initialized
[ INFO] [1617740948.018473836]: Plugin mocap_pose_estimate loaded
[ INFO] [1617740948.020449545]: Plugin mocap_pose_estimate initialized
[ INFO] [1617740948.020510954]: Plugin mount_control loaded
[ INFO] [1617740948.021804443]: Plugin mount_control initialized
[ INFO] [1617740948.021865626]: Plugin obstacle_distance loaded
[ INFO] [1617740948.022839286]: Plugin obstacle_distance initialized
[ INFO] [1617740948.022898835]: Plugin odom loaded
[ INFO] [1617740948.024199374]: Plugin odom initialized
[ INFO] [1617740948.024258708]: Plugin onboard_computer_status loaded
[ INFO] [1617740948.025231756]: Plugin onboard_computer_status initialized
[ INFO] [1617740948.025297331]: Plugin param loaded
[ INFO] [1617740948.026322436]: Plugin param initialized
[ INFO] [1617740948.026398796]: Plugin play_tune loaded
[ INFO] [1617740948.027336369]: Plugin play_tune initialized
[ INFO] [1617740948.027349878]: Plugin px4flow blacklisted
[ INFO] [1617740948.027407149]: Plugin rangefinder loaded
[ INFO] [1617740948.027666041]: Plugin rangefinder initialized
[ INFO] [1617740948.027726596]: Plugin rc_io loaded
[ INFO] [1617740948.028938005]: Plugin rc_io initialized
[ INFO] [1617740948.028979016]: Plugin safety_area blacklisted
[ INFO] [1617740948.029053598]: Plugin setpoint_accel loaded
[ INFO] [1617740948.030175164]: Plugin setpoint_accel initialized
[ INFO] [1617740948.030237739]: Plugin setpoint_attitude loaded
[ INFO] [1617740948.033470973]: Plugin setpoint_attitude initialized
[ INFO] [1617740948.033544397]: Plugin setpoint_position loaded
[ INFO] [1617740948.039321060]: Plugin setpoint_position initialized
[ INFO] [1617740948.039392233]: Plugin setpoint_raw loaded
[ INFO] [1617740948.042438520]: Plugin setpoint_raw initialized
[ INFO] [1617740948.042507500]: Plugin setpoint_trajectory loaded
[ INFO] [1617740948.044168484]: Plugin setpoint_trajectory initialized
[ INFO] [1617740948.044251734]: Plugin setpoint_velocity loaded
[ INFO] [1617740948.046313989]: Plugin setpoint_velocity initialized
[ INFO] [1617740948.046409184]: Plugin sys_status loaded
[ INFO] [1617740948.049959573]: Plugin sys_status initialized
[ INFO] [1617740948.050048087]: Plugin sys_time loaded
[ INFO] [1617740948.051960598]: TM: Timesync mode: MAVLINK
[ INFO] [1617740948.052372387]: Plugin sys_time initialized
[ INFO] [1617740948.052413445]: Plugin trajectory loaded
[ INFO] [1617740948.054296941]: Plugin trajectory initialized
[ INFO] [1617740948.054342375]: Plugin vfr_hud loaded
[ INFO] [1617740948.054552516]: Plugin vfr_hud initialized
[ INFO] [1617740948.054566987]: Plugin vibration blacklisted
[ INFO] [1617740948.054609183]: Plugin vision_pose_estimate loaded
[ INFO] [1617740948.057338507]: Plugin vision_pose_estimate initialized
[ INFO] [1617740948.057355720]: Plugin vision_speed_estimate blacklisted
[ INFO] [1617740948.057397277]: Plugin waypoint loaded
[ INFO] [1617740948.059048458]: Plugin waypoint initialized
[ INFO] [1617740948.059064554]: Plugin wheel_odometry blacklisted
[ INFO] [1617740948.059107151]: Plugin wind_estimation loaded
[ INFO] [1617740948.059320932]: Plugin wind_estimation initialized
[ INFO] [1617740948.059340149]: Built-in SIMD instructions: SSE, SSE2
[ INFO] [1617740948.059352519]: Built-in MAVLink package version: 2021.3.3
[ INFO] [1617740948.059367146]: Known MAVLink dialects: common ardupilotmega ASLUAV all autoquad icarous matrixpilot paparazzi standard uAvionix ualberta
[ INFO] [1617740948.059380235]: MAVROS started. MY ID 1.240, TARGET ID 1.1
[ INFO] [1617740948.274471136]: RC_CHANNELS message detected!
[ INFO] [1617740948.274662043]: IMU: Raw IMU message used.
[ WARN] [1617740948.274759425]: IMU: linear acceleration on RAW_IMU known on APM only.
[ WARN] [1617740948.274878856]: IMU: ~imu/data_raw stores unscaled raw acceleration report.
[ WARN] [1617740948.276349601]: GP: No GPS fix
[ WARN] [1617740948.276601561]: TM: Wrong FCU time.
[ INFO] [1617740948.358270063]: CON: Got HEARTBEAT, connected. FCU: ArduPilot
[ INFO] [1617740948.524361664]: RC_CHANNELS message detected!
[ WARN] [1617740949.366212945]: CMD: Unexpected command 520, result 0
[ INFO] [1617740949.366398310]: WP: Using MISSION_ITEM_INT
[ INFO] [1617740949.366572415]: VER: 1.1: Capabilities         0x000000000000fbef
[ INFO] [1617740949.366690603]: VER: 1.1: Flight software:     040007ff ( 0bb18a1)
[ INFO] [1617740949.366799149]: VER: 1.1: Middleware software: 00000000 (        )
[ INFO] [1617740949.366935223]: VER: 1.1: OS software:         00000000 ( d4fce84)
[ INFO] [1617740949.367054673]: VER: 1.1: Board hardware:      00000000
[ INFO] [1617740949.367158330]: VER: 1.1: VID/PID:             0000:0000
[ INFO] [1617740949.367226452]: VER: 1.1: UID:                 0000000000000000
[ INFO] [1617740958.358707348]: HP: requesting home position
[ INFO] [1617740958.363646230]: FCU: ArduCopter V4.0.7 (0bb18a15)
[ INFO] [1617740958.363846582]: FCU: ChibiOS: d4fce84e
[ INFO] [1617740958.364094291]: FCU: PH4-mini 00320023 3039510A 30323632
[ INFO] [1617740958.364374094]: FCU: RCOut: PWM:1-8
[ INFO] [1617740958.364480606]: FCU: Frame: QUAD
[ INFO] [1617740963.362226251]: WP: mission received
[ WARN] [1617740965.857385592]: PR: request param #6 timeout, retries left 2, and 93 params still missing
[ INFO] [1617740968.358600150]: HP: requesting home position
[ INFO] [1617740975.156381035]: PR: parameters list received
[ INFO] [1617740978.358674596]: HP: requesting home position
[ WARN] [1617740978.523085689]: GP: No GPS fix
[ INFO] [1617740988.358669881]: HP: requesting home position
[ INFO] [1617740988.571854874]: FCU: EKF2 IMU0 is using external nav data
[ INFO] [1617740988.572061051]: FCU: EKF2 IMU0 initial pos NED = 0.1,-0.2,-0.1 (m)
[ INFO] [1617740988.572388909]: FCU: EKF2 IMU0 ext nav yaw alignment complete
[ INFO] [1617740988.572538145]: FCU: EKF2 IMU1 is using external nav data
[ INFO] [1617740988.572695308]: FCU: EKF2 IMU1 initial pos NED = 0.1,-0.2,-0.1 (m)
[ INFO] [1617740988.572882095]: FCU: EKF2 IMU1 ext nav yaw alignment complete
[ INFO] [1617740998.358680896]: HP: requesting home position
[ INFO] [1617741008.358673143]: HP: requesting home position
[ WARN] [1617741008.522245225]: TM: Wrong FCU time.
[ WARN] [1617741008.772242050]: GP: No GPS fix
[ INFO] [1617741018.358482583]: HP: requesting home position
[ INFO] [1617741028.358674587]: HP: requesting home position
[ INFO] [1617741038.358600894]: HP: requesting home position
[ WARN] [1617741039.017986910]: GP: No GPS fix
[ INFO] [1617741048.358689071]: HP: requesting home position
[ INFO] [1617741058.358645335]: HP: requesting home position
[ INFO] [1617741068.358489983]: HP: requesting home position
[ WARN] [1617741068.764546742]: TM: Wrong FCU time.
[ WARN] [1617741069.264362534]: GP: No GPS fix
[ INFO] [1617741078.358590195]: HP: requesting home position
[ INFO] [1617741088.358668898]: HP: requesting home position
[ INFO] [1617741098.358566379]: HP: requesting home position
[ WARN] [1617741099.506831494]: GP: No GPS fix
[ INFO] [1617741108.358602790]: HP: requesting home position
[ INFO] [1617741118.358482303]: HP: requesting home position
[ INFO] [1617741128.358678687]: HP: requesting home position
[ WARN] [1617741128.905300307]: TM: Wrong FCU time.
[ WARN] [1617741129.655210067]: GP: No GPS fix
[ INFO] [1617741138.358616780]: HP: requesting home position
[ INFO] [1617741148.358604977]: HP: requesting home position
[ INFO] [1617741158.358672219]: HP: requesting home position
[ WARN] [1617741159.903172285]: GP: No GPS fix
[ INFO] [1617741168.358670358]: HP: requesting home position
[ INFO] [1617741178.358670450]: HP: requesting home position
[ INFO] [1617741188.358519416]: HP: requesting home position
[ WARN] [1617741189.149229702]: TM: Wrong FCU time.
[ WARN] [1617741190.151034697]: GP: No GPS fix
[ INFO] [1617741198.358643384]: HP: requesting home position
[ INFO] [1617741208.358650446]: HP: requesting home position
[ INFO] [1617741218.358567107]: HP: requesting home position
[ WARN] [1617741220.393983242]: GP: No GPS fix
[ INFO] [1617741228.358667843]: HP: requesting home position
[ INFO] [1617741238.358565569]: HP: requesting home position
[ INFO] [1617741248.358631830]: HP: requesting home position
[ WARN] [1617741249.388870765]: TM: Wrong FCU time.
[ WARN] [1617741250.636643056]: GP: No GPS fix
[ INFO] [1617741258.358584219]: HP: requesting home position
[ INFO] [1617741268.358688021]: HP: requesting home position
[ WARN] [1617741277.283395607]: CMD: Unexpected command 11, result 0
[ INFO] [1617741278.358675761]: HP: requesting home position
[ WARN] [1617741280.643236211]: GP: No GPS fix
[ INFO] [1617741288.358653839]: HP: requesting home position
[ INFO] [1617741298.358738488]: HP: requesting home position
[ INFO] [1617741308.358676925]: HP: requesting home position
[ WARN] [1617741309.404140185]: TM: Wrong FCU time.
[ WARN] [1617741310.657291173]: GP: No GPS fix
[ INFO] [1617741318.358494668]: HP: requesting home position
[ INFO] [1617741328.358455521]: HP: requesting home position
[ INFO] [1617741338.358621508]: HP: requesting home position
[ WARN] [1617741340.664000025]: GP: No GPS fix
[ INFO] [1617741348.358668284]: HP: requesting home position
[ INFO] [1617741358.358643537]: HP: requesting home position
[ INFO] [1617741368.358675927]: HP: requesting home position
[ WARN] [1617741369.421671935]: TM: Wrong FCU time.
[ WARN] [1617741370.669964308]: GP: No GPS fix
[ INFO] [1617741378.358671740]: HP: requesting home position
[ INFO] [1617741388.358678913]: HP: requesting home position
[ INFO] [1617741398.358450158]: HP: requesting home position
[ WARN] [1617741400.67404780copy output of mavros_node. Usually console where you run roslaunch4]: GP: No GPS fix
[ INFO] [1617741408.358652923]: HP: requesting home position
[ INFO] [1617741418.358672703]: HP: requesting home position
[ INFO] [1617741428.358673242]: HP: requesting home position
[ WARN] [1617741429.427571902]: TM: Wrong FCU time.
[ WARN] [1617741430.677618562]: GP: No GPS fix
[ INFO] [1617741438.358681807]: HP: requesting home position
[ INFO] [1617741448.358571841]: HP: requesting home position
[ INFO] [1617741458.358679060]: HP: requesting home position
[ WARN] [1617741460.678979133]: GP: No GPS fix
[ INFO] [1617741468.358640002]: HP: requesting home position
[ INFO] [1617741478.358600712]: HP: requesting home position
[ INFO] [1617741488.358673876]: HP: requesting home position
[ WARN] [1617741489.429416224]: TM: Wrong FCU time.
[ WARN] [1617741490.679464706]: GP: No GPS fix
[ INFO] [1617741498.358456008]: HP: requesting home position
[ INFO] [1617741508.358524359]: HP: requesting home position
[ INFO] [1617741518.358669525]: HP: requesting home position
[ WARN] [1617741520.680253124]: GP: No GPS fix
[ INFO] [1617741528.358667769]: HP: requesting home position
[ INFO] [1617741538.358619576]: HP: requesting home position
[ INFO] [1617741548.358521168]: HP: requesting home position
[ WARN] [1617741549.681319080]: TM: Wrong FCU time.
[ WARN] [1617741550.931301612]: GP: No GPS fix
[ INFO] [1617741558.358641024]: HP: requesting home position
[ INFO] [1617741568.358637308]: HP: requesting home position
[ INFO] [1617741578.358636503]: HP: requesting home position
[ WARN] [1617741581.177966530]: GP: No GPS fix
[ INFO] [1617741588.358635857]: HP: requesting home position
[ INFO] [1617741598.358611767]: HP: requesting home position
[ INFO] [1617741608.358671968]: HP: requesting home position
[ WARN] [1617741609.927362350]: TM: Wrong FCU time.
[ WARN] [1617741611.427233735]: GP: No GPS fix
[ INFO] [1617741618.358672454]: HP: requesting home position
[ INFO] [1617741628.358673112]: HP: requesting home position
[ INFO] [1617741638.358652296]: HP: requesting home position
[ WARN] [1617741641.675147071]: GP: No GPS fix
[ INFO] [1617741648.358663498]: HP: requesting home position
[ INFO] [1617741658.358608780]: HP: requesting home position
[ INFO] [1617741668.358668867]: HP: requesting home position
[ WARN] [1617741670.174990063]: TM: Wrong FCU time.
[ WARN] [1617741671.922938648]: GP: No GPS fix
[ INFO] [1617741678.358636322]: HP: requesting home position
[ INFO] [1617741688.358672007]: HP: requesting home position
[ INFO] [1617741698.358673113]: HP: requesting home position
[ WARN] [1617741702.170516352]: GP: No GPS fix
[ INFO] [1617741708.358652733]: HP: requesting home position
[ INFO] [1617741718.358675420]: HP: requesting home position
[ INFO] [1617741728.358673390]: HP: requesting home position
[ WARN] [1617741730.419203865]: TM: Wrong FCU time.
[ WARN] [1617741732.419058454]: GP: No GPS fix
[ INFO] [1617741738.358632730]: HP: requesting home position
[ INFO] [1617741748.358663233]: HP: requesting home position
[ INFO] [1617741758.358604391]: HP: requesting home position
[ WARN] [1617741762.666240639]: GP: No GPS fix
[ INFO] [1617741768.358673862]: HP: requesting home position
[ INFO] [1617741778.358643008]: HP: requesting home position
[ INFO] [1617741788.358665337]: HP: requesting home position
[ WARN] [1617741790.666046539]: TM: Wrong FCU time.
[ WARN] [1617741792.666325683]: GP: No GPS fix
[ INFO] [1617741798.358669414]: HP: requesting home position
[ INFO] [1617741808.358670452]: HP: requesting home position
[ INFO] [1617741818.358672466]: HP: requesting home position
[ WARN] [1617741822.669135612]: GP: No GPS fix
[ INFO] [1617741828.358515718]: HP: requesting home position
[ INFO] [1617741838.358675298]: HP: requesting home position
[ INFO] [1617741848.358545189]: HP: requesting home position
[ WARN] [1617741850.670221489]: TM: Wrong FCU time.
[ WARN] [1617741852.670397273]: GP: No GPS fix
[ INFO] [1617741858.358674076]: HP: requesting home position
[ INFO] [1617741868.358673325]: HP: requesting home position
[ INFO] [1617741878.358629049]: HP: requesting home position
[ WARN] [1617741882.671188353]: GP: No GPS fix
[ INFO] [1617741888.358611191]: HP: requesting home position
[ INFO] [1617741898.358557187]: HP: requesting home position
[ INFO] [1617741908.358668396]: HP: requesting home position
[ WARN] [1617741910.674678340]: TM: Wrong FCU time.
[ WARN] [1617741912.672821612]: GP: No GPS fix
[ INFO] [1617741918.358608673]: HP: requesting home position
[ INFO] [1617741928.358671099]: HP: requesting home position
[ INFO] [1617741938.358613611]: HP: requesting home position
[ WARN] [1617741942.673080754]: GP: No GPS fix
[ INFO] [1617741948.358689671]: HP: requesting home position
[ INFO] [1617741958.358674847]: HP: requesting home position
[ INFO] [1617741968.358496526]: HP: requesting home position
[ WARN] [1617741970.923900924]: TM: Wrong FCU time.
[ WARN] [1617741972.673799101]: GP: No GPS fix
[ INFO] [1617741978.358676264]: HP: requesting home position
[ INFO] [1617741988.358558385]: HP: requesting home position
[ INFO] [1617741998.358611121]: HP: requesting home position
[ WARN] [1617742002.923545157]: GP: No GPS fix
[ INFO] [1617742008.358673839]: HP: requesting home position
[ INFO] [1617742018.358527563]: HP: requesting home position
[ INFO] [1617742028.358672556]: HP: requesting home position
[ WARN] [1617742030.925710211]: TM: Wrong FCU time.
[ WARN] [1617742033.172942979]: GP: No GPS fix
[ INFO] [1617742038.358538451]: HP: requesting home position
[ INFO] [1617742048.358634012]: HP: requesting home position
[ INFO] [1617742058.358624771]: HP: requesting home position
[ WARN] [1617742063.173106883]: GP: No GPS fix
[ INFO] [1617742068.358674023]: HP: requesting home position
[ INFO] [1617742078.358675329]: HP: requesting home position
[ INFO] [1617742088.358642567]: HP: requesting home position
[ WARN] [1617742091.172117728]: TM: Wrong FCU time.
[ WARN] [1617742093.421871380]: GP: No GPS fix
[ INFO] [1617742098.358676144]: HP: requesting home position
[ INFO] [1617742108.358675048]: HP: requesting home position
[ INFO] [1617742118.358741636]: HP: requesting home position
[ WARN] [1617742123.670897464]: GP: No GPS fix
[ INFO] [1617742128.358567812]: HP: requesting home position
[ INFO] [1617742138.358668634]: HP: requesting home position
[ INFO] [1617742148.358669453]: HP: requesting home position
[ WARN] [1617742151.172520082]: TM: Wrong FCU time.
[ WARN] [1617742153.920627709]: GP: No GPS fix
[ INFO] [1617742158.358636573]: HP: requesting home position
[ INFO] [1617742168.358669327]: HP: requesting home position
[ INFO] [1617742178.358673479]: HP: requesting home position
[ WARN] [1617742184.169135911]: GP: No GPS fix
[ INFO] [1617742188.358672275]: HP: requesting home position
[ INFO] [1617742198.358568938]: HP: requesting home position
[ WARN] [1617742203.361093880]: CMD: Command 410 -- wait ack timeout
[ INFO] [1617742208.358674135]: HP: requesting home position
[ WARN] [1617742211.420708396]: TM: Wrong FCU time.
[ WARN] [1617742214.420510605]: GP: No GPS fix
[ INFO] [1617742218.358674723]: HP: requesting home position
[ INFO] [1617742228.358526536]: HP: requesting home position
[ INFO] [1617742238.358676512]: HP: requesting home position
[ WARN] [1617742244.666974889]: GP: No GPS fix
[ INFO] [1617742248.358638129]: HP: requesting home position
[ INFO] [1617742258.358671191]: HP: requesting home position
[ INFO] [1617742268.358673738]: HP: requesting home position
[ WARN] [1617742271.667209390]: TM: Wrong FCU time.
[ WARN] [1617742274.915090392]: GP: No GPS fix
[ INFO] [1617742278.358680388]: HP: requesting home position
[ INFO] [1617742288.358670993]: HP: requesting home position
[ INFO] [1617742298.358671135]: HP: requesting home position
[ WARN] [1617742305.166293582]: GP: No GPS fix
[ INFO] [1617742308.358669215]: HP: requesting home position
[ INFO] [1617742318.358671976]: HP: requesting home position
[ INFO] [1617742328.358592294]: HP: requesting home position
[ WARN] [1617742331.912456111]: TM: Wrong FCU time.
[ WARN] [1617742335.411485951]: GP: No GPS fix
[ INFO] [1617742338.358670153]: HP: requesting home position
[ INFO] [1617742348.358639379]: HP: requesting home position
[ INFO] [1617742358.358586266]: HP: requesting home position
[ WARN] [1617742365.662381604]: GP: No GPS fix
[ INFO] [1617742368.358669702]: HP: requesting home position
[ INFO] [1617742378.358671724]: HP: requesting home position
[ INFO] [1617742388.358673577]: HP: requesting home position
[ WARN] [1617742392.161182715]: TM: Wrong FCU time.
[ WARN] [1617742395.908336688]: GP: No GPS fix
[ INFO] [1617742398.358673160]: HP: requesting home position
[ INFO] [1617742408.358673716]: HP: requesting home position
[ INFO] [1617742418.358678151]: HP: requesting home position
[ WARN] [1617742425.909253003]: GP: No GPS fix
[ INFO] [1617742428.358681983]: HP: requesting home position
[ INFO] [1617742438.358671180]: HP: requesting home position
[ INFO] [1617742448.358672717]: HP: requesting home position
[ WARN] [1617742452.405258065]: TM: Wrong FCU time.
[ WARN] [1617742456.158088635]: GP: No GPS fix
[ INFO] [1617742458.358669512]: HP: requesting home position
[ INFO] [1617742468.358470568]: HP: requesting home position
[ INFO] [1617742478.358670048]: HP: requesting home position
[ WARN] [1617742480.401240897]: FCU: EKF2 IMU0 has stopped aiding
[ WARN] [1617742480.401382158]: FCU: EKF2 IMU1 has stopped aiding
[ERROR] [1617742482.599119703]: FCU: PreArm: EKF2 still initialising
[ WARN] [1617742486.402948776]: GP: No GPS fix
[ INFO] [1617742488.358554021]: HP: requesting home position
[ INFO] [1617742498.358669592]: HP: requesting home position
[ INFO] [1617742508.358626716]: HP: requesting home position
[ERROR] [1617742512.596899483]: FCU: PreArm: EKF2 still initialising
[ WARN] [1617742512.651927594]: TM: Wrong FCU time.
[ WARN] [1617742516.651697178]: GP: No GPS fix
[ INFO] [1617742518.358658820]: HP: requesting home position
[ INFO] [1617742528.358629550]: HP: requesting home position
[ INFO] [1617742538.358666070]: HP: requesting home position
[ERROR] [1617742542.594575161]: FCU: PreArm: EKF2 still initialising
[ WARN] [1617742546.899544245]: GP: No GPS fix
[ INFO] [1617742548.358676066]: HP: requesting home position
[ERROR] [1617742550.134207727]: FCU: PreArm: EKF2 still initialising
[ERROR] [1617742554.869033414]: FCU: PreArm: EKF2 still initialising
[ INFO] [1617742558.358615562]: HP: requesting home position
[ERROR] [1617742564.760657281]: FCU: PreArm: EKF2 still initialising
[ INFO] [1617742568.358626476]: HP: requesting home position
[ WARN] [1617742572.565223436]: CMD: Unexpected command 11, result 0
[ WARN] [1617742572.900340594]: TM: Wrong FCU time.
[ WARN] [1617742576.949123966]: FCU: SmartRTL deactivated: bad position
[ WARN] [1617742577.147133634]: GP: No GPS fix
[ INFO] [1617742578.358624657]: HP: requesting home position
[ INFO] [1617742588.358681958]: HP: requesting home position
[ INFO] [1617742598.358586817]: HP: requesting home position
[ WARN] [1617742607.394899933]: GP: No GPS fix
[ INFO] [1617742608.358486255]: HP: requesting home position
[ WARN] [1617742613.359306829]: CMD: Command 410 -- wait ack timeout
[ INFO] [1617742618.358673372]: HP: requesting home position
[ INFO] [1617742628.358575872]: HP: requesting home position
[ WARN] [1617742633.145613112]: TM: Wrong FCU time.
[ WARN] [1617742637.643379058]: GP: No GPS fix
[ INFO] [1617742638.358669475]: HP: requesting home position
[ INFO] [1617742648.358508481]: HP: requesting home position
[ INFO] [1617742658.358672772]: HP: requesting home position
[ WARN] [1617742667.891160113]: GP: No GPS fix
[ INFO] [1617742668.358670330]: HP: requesting home position
[ INFO] [1617742678.358667119]: HP: requesting home position
[ INFO] [1617742688.358641512]: HP: requesting home position
[ WARN] [1617742693.389991044]: TM: Wrong FCU time.
[ WARN] [1617742698.140018432]: GP: No GPS fix
[ INFO] [1617742698.358635306]: HP: requesting home position
[ INFO] [1617742708.358647037]: HP: requesting home position
[ INFO] [1617742718.358656068]: HP: requesting home position
[ WARN] [1617742719.313981814]: FCU: EKF primary changed:1
[ WARN] [1617742722.113748964]: FCU: EKF primary changed:0
[ INFO] [1617742728.358675598]: HP: requesting home position
[ WARN] [1617742728.387602053]: GP: No GPS fix
[ INFO] [1617742738.358670684]: HP: requesting home position
[ INFO] [1617742748.358673294]: HP: requesting home position
[ WARN] [1617742753.635408203]: TM: Wrong FCU time.
[ INFO] [1617742758.358680493]: HP: requesting home position
[ WARN] [1617742758.635169768]: GP: No GPS fix
[ INFO] [1617742768.358671500]: HP: requesting home position
[ INFO] [1617742778.358604468]: HP: requesting home position
[ INFO] [1617742788.358667926]: HP: requesting home position
[ WARN] [1617742788.883813592]: GP: No GPS fix
[ INFO] [1617742798.358675989]: HP: requesting home position
[ INFO] [1617742808.358672260]: HP: requesting home position
[ WARN] [1617742814.135258227]: TM: Wrong FCU time.
[ INFO] [1617742818.358669560]: HP: requesting home position
[ WARN] [1617742818.886160046]: GP: No GPS fix
[ INFO] [1617742828.358675930]: HP: requesting home position
[ INFO] [1617742838.358684712]: HP: requesting home position
[ INFO] [1617742848.358675224]: HP: requesting home position
[ WARN] [1617742848.892848966]: GP: No GPS fix
[ INFO] [1617742858.358625232]: HP: requesting home position
[ INFO] [1617742868.358675536]: HP: requesting home position
[ WARN] [1617742874.145186277]: TM: Wrong FCU time.
[ INFO] [1617742878.358668124]: HP: requesting home position
[ WARN] [1617742878.894842502]: GP: No GPS fix
[ INFO] [1617742888.358676418]: HP: requesting home position
[ INFO] [1617742898.358700051]: HP: requesting home position
[ INFO] [1617742908.358674454]: HP: requesting home position
[ WARN] [1617742908.901241313]: GP: No GPS fix
[ INFO] [1617742918.358681894]: HP: requesting home position
[ INFO] [1617742928.358652897]: HP: requesting home position
[ WARN] [1617742934.151617754]: TM: Wrong FCU time.
[ INFO] [1617742938.358673145]: HP: requesting home position
[ WARN] [1617742938.901966459]: GP: No GPS fix
[ INFO] [1617742948.358716770]: HP: requesting home position
[ INFO] [1617742958.358668736]: HP: requesting home position
[ INFO] [1617742968.358679255]: HP: requesting home position
[ WARN] [1617742968.905328653]: GP: No GPS fix
[ INFO] [1617742978.358643801]: HP: requesting home position
[ INFO] [1617742988.358582807]: HP: requesting home position
[ WARN] [1617742994.156643358]: TM: Wrong FCU time.
[ INFO] [1617742998.358604735]: HP: requesting home position
[ WARN] [1617742998.907363727]: GP: No GPS fix
[ INFO] [1617743008.358458445]: HP: requesting home position
[ INFO] [1617743018.358616405]: HP: requesting home position
[ INFO] [1617743028.358675815]: HP: requesting home position
[ WARN] [1617743028.908844990]: GP: No GPS fix
[ INFO] [1617743038.358674626]: HP: requesting home position
[ INFO] [1617743048.358677398]: HP: requesting home position
[ WARN] [1617743054.160686866]: TM: Wrong FCU time.
[ INFO] [1617743058.358654502]: HP: requesting home position
[ WARN] [1617743058.911023311]: GP: No GPS fix
[ INFO] [1617743068.358673456]: HP: requesting home position
[ WARN] [1617743073.116794043]: FCU: EKF primary changed:1
[ WARN] [1617743074.916791101]: FCU: EKF primary changed:0
[ INFO] [1617743078.358677381]: HP: requesting home position
[ INFO] [1617743088.358669394]: HP: requesting home position
[ WARN] [1617743088.911951536]: GP: No GPS fix
[ INFO] [1617743098.358697769]: HP: requesting home position
[ INFO] [1617743108.358540998]: HP: requesting home position
[ WARN] [1617743114.164912509]: TM: Wrong FCU time.
[ INFO] [1617743118.358588511]: HP: requesting home position
[ WARN] [1617743118.912501064]: GP: No GPS fix
[ INFO] [1617743128.358481578]: HP: requesting home position
[ INFO] [1617743138.358674814]: HP: requesting home position
[ INFO] [1617743148.358676132]: HP: requesting home position
[ WARN] [1617743148.912652641]: GP: No GPS fix
[ INFO] [1617743158.358667032]: HP: requesting home position
[ INFO] [1617743168.358669955]: HP: requesting home position
[ WARN] [1617743174.165660943]: TM: Wrong FCU time.
[ INFO] [1617743178.358562392]: HP: requesting home position
[ WARN] [1617743178.913807750]: GP: No GPS fix
[ INFO] [1617743188.358607356]: HP: requesting home position
[ INFO] [1617743198.358669981]: HP: requesting home position
[ INFO] [1617743208.358629629]: HP: requesting home position
[ WARN] [1617743209.163687662]: GP: No GPS fix
[ INFO] [1617743218.358640183]: HP: requesting home position
[ INFO] [1617743228.358556724]: HP: requesting home position
[ WARN] [1617743234.414429906]: TM: Wrong FCU time.
[ INFO] [1617743238.358583632]: HP: requesting home position
[ WARN] [1617743239.164654985]: GP: No GPS fix
[ INFO] [1617743248.358536416]: HP: requesting home position
[ INFO] [1617743258.358639410]: HP: requesting home position
[ INFO] [1617743268.358640153]: HP: requesting home position
[ WARN] [1617743269.414249631]: GP: No GPS fix
[ INFO] [1617743278.358549024]: HP: requesting home position
[ INFO] [1617743288.358482778]: HP: requesting home position
[ WARN] [1617743294.416639898]: TM: Wrong FCU time.
[ INFO] [1617743298.358682124]: HP: requesting home position
[ WARN] [1617743299.663801865]: GP: No GPS fix
[ WARN] [1617743303.359486355]: CMD: Command 410 -- wait ack timeout
[ INFO] [1617743308.358628937]: HP: requesting home position
[ INFO] [1617743318.358517888]: HP: requesting home position
[ INFO] [1617743328.358671615]: HP: requesting home position
[ WARN] [1617743329.664055246]: GP: No GPS fix
[ INFO] [1617743338.358677234]: HP: requesting home position
[ INFO] [1617743348.358688056]: HP: requesting home position
[ WARN] [1617743354.663415236]: TM: Wrong FCU time.
[ INFO] [1617743358.358534249]: HP: requesting home position
[ WARN] [1617743359.913257151]: GP: No GPS fix
[ INFO] [1617743368.358644182]: HP: requesting home position
[ INFO] [1617743378.358641278]: HP: requesting home position
[ INFO] [1617743388.358627741]: HP: requesting home position
[ WARN] [1617743389.915513992]: GP: No GPS fix
[ INFO] [1617743398.358674244]: HP: requesting home position
[ INFO] [1617743408.358672499]: HP: requesting home position
[ WARN] [1617743414.664635911]: TM: Wrong FCU time.
[ INFO] [1617743418.358577813]: HP: requesting home position
[ WARN] [1617743420.162591586]: GP: No GPS fix
[ INFO] [1617743428.358633590]: HP: requesting home position
[ INFO] [1617743438.358624311]: HP: requesting home position
[ INFO] [1617743448.358578230]: HP: requesting home position
[ WARN] [1617743450.411715236]: GP: No GPS fix
[ INFO] [1617743458.358634397]: HP: requesting home position
[ INFO] [1617743468.358668199]: HP: requesting home position
[ WARN] [1617743474.910631176]: TM: Wrong FCU time.
[ INFO] [1617743478.358594128]: HP: requesting home position
[ WARN] [1617743480.660559750]: GP: No GPS fix
[ INFO] [1617743488.358674709]: HP: requesting home position
[ INFO] [1617743498.358526705]: HP: requesting home position
[ INFO] [1617743508.358673958]: HP: requesting home position
[ WARN] [1617743510.910463617]: GP: No GPS fix
[ INFO] [1617743518.358670031]: HP: requesting home position
[ INFO] [1617743528.358674230]: HP: requesting home position
[ WARN] [1617743535.162139989]: TM: Wrong FCU time.
[ INFO] [1617743538.358672145]: HP: requesting home position
[ WARN] [1617743541.411166256]: GP: No GPS fix
[ INFO] [1617743548.358676160]: HP: requesting home position
[ INFO] [1617743558.358622562]: HP: requesting home position
[ INFO] [1617743568.358675870]: HP: requesting home position
[ WARN] [1617743571.658051742]: GP: No GPS fix
[ INFO] [1617743578.358583735]: HP: requesting home position
[ INFO] [1617743588.358632726]: HP: requesting home position
[ WARN] [1617743595.407924995]: TM: Wrong FCU time.
[ INFO] [1617743598.358569297]: HP: requesting home position
[ WARN] [1617743601.659520967]: GP: No GPS fix
[ INFO] [1617743608.358677922]: HP: requesting home position
[ INFO] [1617743618.358612915]: HP: requesting home position
[ WARN] [1617743628.072330052]: FCU: EKF primary changed:1
[ INFO] [1617743628.358670661]: HP: requesting home position
[ WARN] [1617743631.906395897]: GP: No GPS fix
[ WARN] [1617743632.672562556]: FCU: EKF primary changed:0
[ INFO] [1617743638.358638399]: HP: requesting home position
[ INFO] [1617743648.358672568]: HP: requesting home position
[ WARN] [1617743655.408203830]: TM: Wrong FCU time.
[ INFO] [1617743658.358676654]: HP: requesting home position
[ WARN] [1617743662.158099280]: GP: No GPS fix
[ INFO] [1617743668.358676618]: HP: requesting home position
[ INFO] [1617743678.358672611]: HP: requesting home position
[ INFO] [1617743688.358657017]: HP: requesting home position
[ WARN] [1617743692.404672552]: GP: No GPS fix
[ INFO] [1617743698.358649919]: HP: requesting home position
[ INFO] [1617743708.358681148]: HP: requesting home position
[ WARN] [1617743715.653474306]: TM: Wrong FCU time.
[ INFO] [1617743718.358682556]: HP: requesting home position
[ WARN] [1617743722.655362466]: GP: No GPS fix
[ INFO] [1617743728.358638045]: HP: requesting home position
[ INFO] [1617743738.358679115]: HP: requesting home position
[ INFO] [1617743748.358646249]: HP: requesting home position
[ WARN] [1617743752.901873358]: GP: No GPS fix
[ INFO] [1617743758.358669937]: HP: requesting home position
[ INFO] [1617743768.358679770]: HP: requesting home position
[ WARN] [1617743775.653637497]: TM: Wrong FCU time.
[ INFO] [1617743778.358653189]: HP: requesting home position
[ WARN] [1617743783.150613331]: GP: No GPS fix
[ INFO] [1617743788.358674726]: HP: requesting home position
[ INFO] [1617743798.358675658]: HP: requesting home position
[ INFO] [1617743808.358680604]: HP: requesting home position
[ WARN] [1617743813.402098080]: GP: No GPS fix
[ INFO] [1617743818.358672381]: HP: requesting home position
[ INFO] [1617743828.358673182]: HP: requesting home position
[ WARN] [1617743835.655456738]: TM: Wrong FCU time.
[ INFO] [1617743838.358669270]: HP: requesting home position
[ WARN] [1617743843.649797860]: GP: No GPS fix
[ INFO] [1617743848.358677749]: HP: requesting home position
[ INFO] [1617743858.358499045]: HP: requesting home position
[ WARN] [1617743858.535387182]: FCU: Mode change failed: GUIDED requires position
[ WARN] [1617743858.535532651]: CMD: Unexpected command 11, result 3
[ WARN] [1617743863.359605284]: CMD: Command 410 -- wait ack timeout
[ INFO] [1617743868.358672395]: HP: requesting home position
[ERROR] [1617743871.362726363]: FCU: PreArm: EKF2 still initialising
[ WARN] [1617743873.650847268]: GP: No GPS fix
[ INFO] [1617743878.358679772]: HP: requesting home position
[ INFO] [1617743888.358672739]: HP: requesting home position
[ERROR] [1617743891.316672684]: FCU: PreArm: EKF2 still initialising
[ WARN] [1617743895.900917946]: TM: Wrong FCU time.
[ERROR] [1617743897.847807797]: FCU: PreArm: EKF2 still initialising
[ INFO] [1617743898.358673897]: HP: requesting home position
[ WARN] [1617743903.651155158]: GP: No GPS fix
[ INFO] [1617743908.358593306]: HP: requesting home position
[ INFO] [1617743918.358523408]: HP: requesting home position
[ERROR] [1617743921.316677105]: FCU: PreArm: EKF2 still initialising
[ INFO] [1617743928.358605535]: HP: requesting home position
[ WARN] [1617743933.651334932]: GP: No GPS fix
[ INFO] [1617743938.358662585]: HP: requesting home position
[ INFO] [1617743948.358640370]: HP: requesting home position
[ERROR] [1617743951.157783763]: FCU: PreArm: EKF2 still initialising
[ WARN] [1617743955.901907913]: TM: Wrong FCU time.
[ INFO] [1617743958.358678832]: HP: requesting home position
[ WARN] [1617743963.652249305]: GP: No GPS fix
[ INFO] [1617743968.358678277]: HP: requesting home position
[ INFO] [1617743978.358685134]: HP: requesting home position
[ERROR] [1617743981.157689490]: FCU: PreArm: EKF2 still initialising
[ INFO] [1617743988.358586565]: HP: requesting home position
[ WARN] [1617743993.902144106]: GP: No GPS fix
[ INFO] [1617743998.358607137]: HP: requesting home position
[ INFO] [1617744008.358516961]: HP: requesting home position
[ERROR] [1617744011.157570748]: FCU: PreArm: EKF2 still initialising
[ WARN] [1617744016.154754225]: TM: Wrong FCU time.
[ INFO] [1617744018.358623399]: HP: requesting home position
[ WARN] [1617744024.151960696]: GP: No GPS fix
[ INFO] [1617744028.358667244]: HP: requesting home position
[ INFO] [1617744038.358596610]: HP: requesting home position
[ERROR] [1617744041.158137216]: FCU: PreArm: EKF2 still initialising
[ INFO] [1617744048.358564910]: HP: requesting home position
[ WARN] [1617744054.152735536]: GP: No GPS fix
[ INFO] [1617744058.358498771]: HP: requesting home position
[ INFO] [1617744068.358618167]: HP: requesting home position
[ERROR] [1617744071.158181956]: FCU: PreArm: EKF2 still initialising
[ WARN] [1617744076.154925221]: TM: Wrong FCU time.
[ INFO] [1617744078.358638473]: HP: requesting home position
[ WARN] [1617744084.402438286]: GP: No GPS fix
[ INFO] [1617744088.358676761]: HP: requesting home position
[ INFO] [1617744098.358453535]: HP: requesting home position
[ERROR] [1617744100.997698784]: FCU: PreArm: EKF2 still initialising
[ INFO] [1617744108.358634882]: HP: requesting home position
[ WARN] [1617744114.651959006]: GP: No GPS fix
[ INFO] [1617744118.358658513]: HP: requesting home position
[ INFO] [1617744128.358590890]: HP: requesting home position
[ERROR] [1617744130.997302529]: FCU: PreArm: EKF2 still initialising
[ WARN] [1617744136.402552459]: TM: Wrong FCU time.
[ INFO] [1617744138.358672890]: HP: requesting home position

Diagnostics

header: 
  seq: 1537
  stamp: 
    secs: 1617743056
    nsecs:  59808312
  frame_id: ''
status: 
  - 
    level: 0
    name: "mavros: FCU connection"
    message: "connected"
    hardware_id: "/dev/ttyACM0:57600"
    values: 
      - 
        key: "Received packets:"
        value: "12728"
      - 
        key: "Dropped packets:"
        value: "0"
      - 
        key: "Buffer overruns:"
        value: "0"
      - 
        key: "Parse errors:"
        value: "0"
      - 
        key: "Rx sequence number:"
        value: "33"
      - 
        key: "Tx sequence number:"
        value: "0"
      - 
        key: "Rx total bytes:"
        value: "6184675"
      - 
        key: "Tx total bytes:"
        value: "7168220"
      - 
        key: "Rx speed:"
        value: "4373.000000"
      - 
        key: "Tx speed:"
        value: "500.000000"
  - 
    level: 2
    name: "mavros: GPS"
    message: "No satellites"
    hardware_id: "/dev/ttyACM0:57600"
    values: 
      - 
        key: "Satellites visible"
        value: "0"
      - 
        key: "Fix type"
        value: "0"
      - 
        key: "EPH (m)"
        value: "Unknown"
      - 
        key: "EPV (m)"
        value: "Unknown"
  - 
    level: 0
    name: "mavros: Heartbeat"
    message: "Normal"
    hardware_id: "/dev/ttyACM0:57600"
    values: 
      - 
        key: "Heartbeats since startup"
        value: "2064"
      - 
        key: "Frequency (Hz)"
        value: "1.000006"
      - 
        key: "Vehicle type"
        value: "Quadrotor"
      - 
        key: "Autopilot type"
        value: "ArduPilot"
      - 
        key: "Mode"
        value: "STABILIZE"
      - 
        key: "System status"
        value: "Standby"
  - 
    level: 0
    name: "mavros: System"
    message: "Normal"
    hardware_id: "/dev/ttyACM0:57600"
    values: 
      - 
        key: "Sensor present"
        value: "0x1360FC0B"
      - 
        key: "Sensor enabled"
        value: "0x02609C0B"
      - 
        key: "Sensor health"
        value: "0x03709C0B"
      - 
        key: "3D gyro"
        value: "Ok"
      - 
        key: "3D accelerometer"
        value: "Ok"
      - 
        key: "absolute pressure"
        value: "Ok"
      - 
        key: "3D angular rate control"
        value: "Ok"
      - 
        key: "attitude stabilization"
        value: "Ok"
      - 
        key: "yaw position"
        value: "Ok"
      - 
        key: "motor outputs / control"
        value: "Ok"
      - 
        key: "AHRS subsystem health"
        value: "Ok"
      - 
        key: "Terrain subsystem health"
        value: "Ok"
      - 
        key: "Battery"
        value: "Ok"
      - 
        key: "CPU Load (%)"
        value: "28.2"
      - 
        key: "Drop rate (%)"
        value: "0.0"
      - 
        key: "Errors comm"
        value: "0"
      - 
        key: "Errors count #1"
        value: "0"
      - 
        key: "Errors count #2"
        value: "0"
      - 
        key: "Errors count #3"
        value: "0"
      - 
        key: "Errors count #4"
        value: "0"
  - 
    level: 0
    name: "mavros: Battery"
    message: "Normal"
    hardware_id: "/dev/ttyACM0:57600"
    values: 
      - 
        key: "Voltage"
        value: "11.06"
      - 
        key: "Current"
        value: "-0.0"
      - 
        key: "Remaining"
        value: "-1.0"
  - 
    level: 0
    name: "mavros: Time Sync"
    message: "Normal"
    hardware_id: "/dev/ttyACM0:57600"
    values: 
      - 
        key: "Timesyncs since startup"
        value: "20814"
      - 
        key: "Frequency (Hz)"
        value: "9.857207"
      - 
        key: "Last RTT (ms)"
        value: "5.003013"
      - 
        key: "Mean RTT (ms)"
        value: "3.749398"
      - 
        key: "Last remote time (s)"
        value: "2909.255099000"
      - 
        key: "Estimated time offset (s)"
        value: "1617740146.800788164"
---

Check ID

rosrun mavros checkid OK. I got messages from 1:1.


Received 1487 messages, from 2 addresses sys:comp list of messages 253:1 3997696 1:1 0, 1, 2, 193, 152, 147, 150, 24, 27, 29, 30, 33, 163, 36, 165, 42, 178, 182, 62, 65, 74, 77, 111, 241, 116, 125

rosrun mavros checkid

data from Optitrack

roslaunch vrpn_client_ros sample.launch server:=192.168.1.43 ... logging to /home/fioreviola/.ros/log/df2a9e5e-9715-11eb-80f4-dc1ba1f14c2b/roslaunch-fioreviola-25405.log Checking log directory for disk usage. This may take a while. Press Ctrl-C to interrupt Done checking log file disk usage. Usage is <1GB.

started roslaunch server http://fioreviola:34405/

SUMMARY

PARAMETERS

NODES / vrpn_client_node (vrpn_client_ros/vrpn_client_node)

ROS_MASTER_URI=http://localhost:11311

process[vrpn_client_node-1]: started with pid [25420] [ INFO] [1617740900.826981358]: Connecting to VRPN server at IP ADDRESS OF OPTITRACK (removed) [ INFO] [1617740900.852034011]: Connection established check_vrpn_cookie(): VRPN Note: minor version number doesn't match: (prefer 'vrpn: ver. 07.34', got 'vrpn: ver. 07.20 0'). This is not normally a problem. [ INFO] [1617740901.856915299]: Found new sender: MiniDrone1 [ INFO] [1617740901.857219899]: Creating new tracker MiniDrone1

data from echoing rostopic echo /vrpn_client_node/MiniDrone1/pose


header: seq: 2054 stamp: secs: 1617740954 nsecs: 194667032 frame_id: "world" pose: position: x: -0.287670522928 y: 0.0826278924942 z: 0.103268995881 orientation: x: 0.551197648048 y: -0.0056214989163 z: 0.794052064419 w: -0.256185412407

the remap command line I am using to remap topics

rosrun topic_tools relay /vrpn_client_node/MiniDrone1/pose /mavros/mocap/pose [ INFO] [1617744393.977017240]: advertised as /mavros/mocap/pose

rob-clarke commented 3 years ago

Looks like you need to do some configuration of ArduPilot first. The ArduPilot docs have a section on this. You should be able to fly the vehicle in Loiter mode based off the OptiTrack data if the vehicle is configured properly. The docs also have some text on how to test the setup before you move on to software-based control.

It may be this section here that is of particular interest, especially when using GUIDED:

In order to take off in guided or auto mode, you need to use GPS_GLOBAL_ORIGIN to set the GPS location of motion capture system origin. It is not need to be accurate, any valid lat/lng is ok.

ZhongmouLi commented 5 months ago

I think you need to set the EKF origin before flights.