ModalAI Forum
    • Categories
    • Recent
    • Tags
    • Popular
    • Users
    • Groups
    • Register
    • Login
    1. Home
    2. Captain 7th
    3. Posts
    • Profile
    • Following 0
    • Followers 0
    • Topics 4
    • Posts 21
    • Best 0
    • Controversial 0
    • Groups 0

    Posts made by Captain 7th

    • RE: Trouble in running the mavros_test Project (simple-example)

      @brahim

      Yes, while I am in manual mode, I can arm and disarm the drone with using ROS command using mavros services. But, when I switch back to offboard mode, I get a message that arming/disarming failed!

      The process for arming/disarming is like this:

      1. With the transmitter, I change the mode to the manual.
      2. launch the roscore
      3. launch px4 and mavros: roslaunch mavros px4.launch fcu_url:=udp://127.0.0.1:14551@127.0.0.1:14551
      4. run this script :
      #!/usr/bin/env python
      
      import rospy
      from geometry_msgs.msg import TwistStamped
      from mavros_msgs.srv import CommandBool, SetMode
      
      def move_drone():
          rospy.init_node('move_drone', anonymous=True)
      
          # Service proxies for arming and setting the mode
          rospy.wait_for_service('/mavros/cmd/arming')
          rospy.wait_for_service('/mavros/set_mode')
      
          try:
              arm_service = rospy.ServiceProxy('/mavros/cmd/arming', CommandBool)
              set_mode_service = rospy.ServiceProxy('/mavros/set_mode', SetMode)
          except rospy.ServiceException as e:
              rospy.logerr("Service proxy failed: %s" % e)
              return
      
          # Arm the drone
          arm_request = arm_service(True)
          if arm_request.success:
              rospy.loginfo("Drone armed successfully")
          else:
              rospy.logerr("Failed to arm the drone")
              return
      
          # Set to OFFBOARD mode
          set_mode_request = set_mode_service(custom_mode='OFFBOARD')
          if set_mode_request.mode_sent:
              rospy.loginfo("OFFBOARD mode set")
          else:
              rospy.logerr("Failed to set OFFBOARD mode")
              return
      
          # Publisher for velocity commands
          vel_pub = rospy.Publisher('/mavros/setpoint_velocity/cmd_vel', TwistStamped, queue_size=10)
          rate = rospy.Rate(10)  # 10 Hz
      
          # Prepare the velocity message
          vel_msg = TwistStamped()
          vel_msg.twist.linear.x = 0
          vel_msg.twist.linear.y = 0
      
          # Move up for 5 seconds
          rospy.loginfo("Moving up")
          vel_msg.twist.linear.z = 1.0  # Positive Z is upwards
          for i in range(100):
              vel_msg.header.stamp = rospy.Time.now()
              vel_pub.publish(vel_msg)
              rate.sleep()
      
          # Hover for 2 seconds
          rospy.loginfo("Hovering")
          vel_msg.twist.linear.z = 0.0
          for i in range(100):
              vel_msg.header.stamp = rospy.Time.now()
              vel_pub.publish(vel_msg)
              rate.sleep()
      
          # Move down for 5 seconds
          rospy.loginfo("Moving down")
          vel_msg.twist.linear.z = -1.0  # Negative Z is downwards
          for i in range(100):
              vel_msg.header.stamp = rospy.Time.now()
              vel_pub.publish(vel_msg)
              rate.sleep()
      
          # Land the drone
          rospy.loginfo("Landing")
          set_mode_service(custom_mode='AUTO.LAND')
      
      if __name__ == '__main__':
          try:
              move_drone()
          except rospy.ROSInterruptException:
              pass
      

      The drone start arming and motors are working, but the drone does not goes up! I am installed the propellers properly and have been already double checked!

      posted in ROS
      Captain 7thC
      Captain 7th
    • Unable to run "rosrun mavros mavsafety arm": Request failed. Check mavros logs

      Hi,

      I am trying to disarm my drone through rosrun mavros mavsafety arm but I got this error: Request failed. Check mavros logs

      Does anyone know why?

      Let me share more info:

      voxl2:~$ roslaunch mavros px4.launch fcu_url:=udp://127.0.0.1:14551@127.0.0.1:14551
      ... logging to /home/root/.ros/log/bf820300-75cc-11ef-ac5b-00c0cab5abe5/roslaunch-m0054-3885.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://m0054:40181/
      
      SUMMARY
      ========
      
      CLEAR PARAMETERS
       * /mavros/
      
      PARAMETERS
       * /mavros/camera/frame_id: base_link
       * /mavros/cmd/use_comp_id_system_control: False
       * /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/hrlv_ez4_pub/field_of_view: 0.0
       * /mavros/distance_sensor/hrlv_ez4_pub/frame_id: hrlv_ez4_sonar
       * /mavros/distance_sensor/hrlv_ez4_pub/id: 0
       * /mavros/distance_sensor/hrlv_ez4_pub/orientation: PITCH_270
       * /mavros/distance_sensor/hrlv_ez4_pub/send_tf: True
       * /mavros/distance_sensor/hrlv_ez4_pub/sensor_position/x: 0.0
       * /mavros/distance_sensor/hrlv_ez4_pub/sensor_position/y: 0.0
       * /mavros/distance_sensor/hrlv_ez4_pub/sensor_position/z: -0.1
       * /mavros/distance_sensor/laser_1_sub/id: 3
       * /mavros/distance_sensor/laser_1_sub/orientation: PITCH_270
       * /mavros/distance_sensor/laser_1_sub/subscriber: True
       * /mavros/distance_sensor/lidarlite_pub/field_of_view: 0.0
       * /mavros/distance_sensor/lidarlite_pub/frame_id: lidarlite_laser
       * /mavros/distance_sensor/lidarlite_pub/id: 1
       * /mavros/distance_sensor/lidarlite_pub/orientation: PITCH_270
       * /mavros/distance_sensor/lidarlite_pub/send_tf: True
       * /mavros/distance_sensor/lidarlite_pub/sensor_position/x: 0.0
       * /mavros/distance_sensor/lidarlite_pub/sensor_position/y: 0.0
       * /mavros/distance_sensor/lidarlite_pub/sensor_position/z: -0.1
       * /mavros/distance_sensor/sonar_1_sub/horizontal_fov_ratio: 1.0
       * /mavros/distance_sensor/sonar_1_sub/id: 2
       * /mavros/distance_sensor/sonar_1_sub/orientation: PITCH_270
       * /mavros/distance_sensor/sonar_1_sub/subscriber: True
       * /mavros/distance_sensor/sonar_1_sub/vertical_fov_ratio: 1.0
       * /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/lat: 47.3667
       * /mavros/fake_gps/geo_origin/lon: 8.55
       * /mavros/fake_gps/gps_rate: 5.0
       * /mavros/fake_gps/mocap_transform: True
       * /mavros/fake_gps/satellites_visible: 5
       * /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_mocap: True
       * /mavros/fake_gps/use_vision: False
       * /mavros/fcu_protocol: v2.0
       * /mavros/fcu_url: udp://127.0.0.1:1...
       * /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/mount/debounce_s: 4.0
       * /mavros/mount/err_threshold_deg: 10.0
       * /mavros/mount/negate_measured_pitch: False
       * /mavros/mount/negate_measured_roll: False
       * /mavros/mount/negate_measured_yaw: False
       * /mavros/odometry/fcu/odom_child_id_des: base_link
       * /mavros/odometry/fcu/odom_parent_id_des: map
       * /mavros/plugin_blacklist: ['safety_area', '...
       * /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: odom
       * /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: odom
       * /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: odom
       * /mavros/wheel_odometry/tf/send: False
       * /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.13
      
      NODES
        /
          mavros (mavros/mavros_node)
      
      ROS_MASTER_URI=http://localhost:11311
      
      process[mavros-1]: started with pid [3905]
      [ INFO] [1726671462.865298704]: FCU URL: udp://127.0.0.1:14551@127.0.0.1:14551
      [ INFO] [1726671462.869065077]: udp0: Bind address: 127.0.0.1:14551
      [ INFO] [1726671462.869132420]: udp0: Remote address: 127.0.0.1:14551
      [ INFO] [1726671462.871294744]: GCS bridge disabled
      [ INFO] [1726671462.879079883]: Plugin 3dr_radio loaded
      [ INFO] [1726671462.880078520]: Plugin 3dr_radio initialized
      [ INFO] [1726671462.880140811]: Plugin actuator_control loaded
      [ INFO] [1726671462.881787047]: Plugin actuator_control initialized
      [ INFO] [1726671462.885081236]: Plugin adsb loaded
      [ INFO] [1726671462.887321633]: Plugin adsb initialized
      [ INFO] [1726671462.887454236]: Plugin altitude loaded
      [ INFO] [1726671462.888070064]: Plugin altitude initialized
      [ INFO] [1726671462.888141782]: Plugin cam_imu_sync loaded
      [ INFO] [1726671462.888472769]: Plugin cam_imu_sync initialized
      [ INFO] [1726671462.888537195]: Plugin camera loaded
      [ INFO] [1726671462.888864223]: Plugin camera initialized
      [ INFO] [1726671462.888927244]: Plugin cellular_status loaded
      [ INFO] [1726671462.890160097]: Plugin cellular_status initialized
      [ INFO] [1726671462.890231347]: Plugin command loaded
      [ INFO] [1726671462.895107345]: Plugin command initialized
      [ INFO] [1726671462.895462550]: Plugin companion_process_status loaded
      [ INFO] [1726671462.897225972]: Plugin companion_process_status initialized
      [ INFO] [1726671462.897301700]: Plugin debug_value loaded
      [ INFO] [1726671462.902058064]: Plugin debug_value initialized
      [ INFO] [1726671462.902095616]: Plugin distance_sensor blacklisted
      [ INFO] [1726671462.902179990]: Plugin esc_status loaded
      [ INFO] [1726671462.902769673]: Plugin esc_status initialized
      [ INFO] [1726671462.902845037]: Plugin esc_telemetry loaded
      [ INFO] [1726671462.903176023]: Plugin esc_telemetry initialized
      [ INFO] [1726671462.903265502]: Plugin fake_gps loaded
      [ INFO] [1726671462.912476565]: Plugin fake_gps initialized
      [ INFO] [1726671462.912619012]: Plugin ftp loaded
      [ INFO] [1726671462.915981795]: Plugin ftp initialized
      [ INFO] [1726671462.916077836]: Plugin geofence loaded
      [ INFO] [1726671462.917684748]: Plugin geofence initialized
      [ INFO] [1726671462.917773550]: Plugin global_position loaded
      [ INFO] [1726671462.929318655]: Plugin global_position initialized
      [ INFO] [1726671462.929446571]: Plugin gps_input loaded
      [ INFO] [1726671462.930911037]: Plugin gps_input initialized
      [ INFO] [1726671462.930995567]: Plugin gps_rtk loaded
      [ INFO] [1726671462.932572793]: Plugin gps_rtk initialized
      [ INFO] [1726671462.932653834]: Plugin gps_status loaded
      [ INFO] [1726671462.933874761]: Plugin gps_status initialized
      [ INFO] [1726671462.933953302]: Plugin guided_target loaded
      [ INFO] [1726671462.936268854]: Plugin guided_target initialized
      [ INFO] [1726671462.936351874]: Plugin hil loaded
      [ INFO] [1726671462.946114912]: Plugin hil initialized
      [ INFO] [1726671462.946241265]: Plugin home_position loaded
      [ INFO] [1726671462.950601799]: Plugin home_position initialized
      [ INFO] [1726671462.950714038]: Plugin imu loaded
      [ INFO] [1726671462.954832178]: Plugin imu initialized
      [ INFO] [1726671462.954950042]: Plugin landing_target loaded
      [ INFO] [1726671462.964023242]: Plugin landing_target initialized
      [ INFO] [1726671462.964170064]: Plugin local_position loaded
      [ INFO] [1726671462.969867253]: Plugin local_position initialized
      [ INFO] [1726671462.969972044]: Plugin log_transfer loaded
      [ INFO] [1726671462.971817444]: Plugin log_transfer initialized
      [ INFO] [1726671462.971929110]: Plugin mag_calibration_status loaded
      [ INFO] [1726671462.981040591]: Plugin mag_calibration_status initialized
      [ INFO] [1726671462.981181319]: Plugin manual_control loaded
      [ INFO] [1726671462.985301907]: Plugin manual_control initialized
      [ INFO] [1726671462.985417740]: Plugin mocap_pose_estimate loaded
      [ INFO] [1726671462.989715410]: Plugin mocap_pose_estimate initialized
      [ INFO] [1726671462.989856711]: Plugin mount_control loaded
      [ WARN] [1726671463.000827967]: Could not retrive negate_measured_roll parameter value, using default (0)
      [ WARN] [1726671463.001137131]: Could not retrive negate_measured_pitch parameter value, using default (0)
      [ WARN] [1726671463.001397233]: Could not retrive negate_measured_yaw parameter value, using default (0)
      [ WARN] [1726671463.002250819]: Could not retrive debounce_s parameter value, using default (4.000000)
      [ WARN] [1726671463.002499359]: Could not retrive err_threshold_deg parameter value, using default (10.000000)
      [ INFO] [1726671463.002546806]: Plugin mount_control initialized
      [ INFO] [1726671463.003329768]: Plugin nav_controller_output loaded
      [ INFO] [1726671463.004275020]: Plugin nav_controller_output initialized
      [ INFO] [1726671463.004357363]: Plugin obstacle_distance loaded
      [ INFO] [1726671463.006672707]: Plugin obstacle_distance initialized
      [ INFO] [1726671463.006769633]: Plugin odom loaded
      [ INFO] [1726671463.010279810]: Plugin odom initialized
      [ INFO] [1726671463.010398351]: Plugin onboard_computer_status loaded
      [ INFO] [1726671463.012245105]: Plugin onboard_computer_status initialized
      [ INFO] [1726671463.012358438]: Plugin param loaded
      [ INFO] [1726671463.014463731]: Plugin param initialized
      [ INFO] [1726671463.014579407]: Plugin play_tune loaded
      [ INFO] [1726671463.016387256]: Plugin play_tune initialized
      [ INFO] [1726671463.016483453]: Plugin px4flow loaded
      [ INFO] [1726671463.021737052]: Plugin px4flow initialized
      [ INFO] [1726671463.021872832]: Plugin rallypoint loaded
      [ INFO] [1726671463.023855731]: Plugin rallypoint initialized
      [ INFO] [1726671463.023897554]: Plugin rangefinder blacklisted
      [ INFO] [1726671463.026300814]: Plugin rc_io loaded
      [ INFO] [1726671463.029646200]: Plugin rc_io initialized
      [ INFO] [1726671463.029698231]: Plugin safety_area blacklisted
      [ INFO] [1726671463.029798282]: Plugin setpoint_accel loaded
      [ INFO] [1726671463.031504986]: Plugin setpoint_accel initialized
      [ INFO] [1726671463.031618110]: Plugin setpoint_attitude loaded
      [ INFO] [1726671463.037076968]: Plugin setpoint_attitude initialized
      [ INFO] [1726671463.037183842]: Plugin setpoint_position loaded
      [ INFO] [1726671463.049201131]: Plugin setpoint_position initialized
      [ INFO] [1726671463.049335557]: Plugin setpoint_raw loaded
      [ INFO] [1726671463.054972121]: Plugin setpoint_raw initialized
      [ INFO] [1726671463.055100089]: Plugin setpoint_trajectory loaded
      [ INFO] [1726671463.057608452]: Plugin setpoint_trajectory initialized
      [ INFO] [1726671463.057704180]: Plugin setpoint_velocity loaded
      [ INFO] [1726671463.062054923]: Plugin setpoint_velocity initialized
      [ INFO] [1726671463.062260650]: Plugin sys_status loaded
      [ INFO] [1726671463.070084278]: Plugin sys_status initialized
      [ INFO] [1726671463.070212090]: Plugin sys_time loaded
      [ INFO] [1726671463.076160110]: TM: Timesync mode: MAVLINK
      [ INFO] [1726671463.076424014]: TM: Not publishing sim time
      [ INFO] [1726671463.077227704]: Plugin sys_time initialized
      [ INFO] [1726671463.077334787]: Plugin terrain loaded
      [ INFO] [1726671463.077742752]: Plugin terrain initialized
      [ INFO] [1726671463.077829939]: Plugin trajectory loaded
      [ INFO] [1726671463.080625903]: Plugin trajectory initialized
      [ INFO] [1726671463.080710486]: Plugin tunnel loaded
      [ INFO] [1726671463.083419889]: Plugin tunnel initialized
      [ INFO] [1726671463.083536242]: Plugin vfr_hud loaded
      [ INFO] [1726671463.085674660]: Plugin vfr_hud initialized
      [ INFO] [1726671463.085863721]: Plugin vibration blacklisted
      [ INFO] [1726671463.086246322]: Plugin vision_pose_estimate loaded
      [ INFO] [1726671463.091077165]: Plugin vision_pose_estimate initialized
      [ INFO] [1726671463.091167268]: Plugin vision_speed_estimate loaded
      [ INFO] [1726671463.093310999]: Plugin vision_speed_estimate initialized
      [ INFO] [1726671463.093423237]: Plugin waypoint loaded
      [ INFO] [1726671463.097554242]: Plugin waypoint initialized
      [ INFO] [1726671463.097620544]: Plugin wheel_odometry blacklisted
      [ INFO] [1726671463.097717366]: Plugin wind_estimation loaded
      [ INFO] [1726671463.098288819]: Plugin wind_estimation initialized
      [ INFO] [1726671463.098411839]: Built-in SIMD instructions: ARM NEON
      [ INFO] [1726671463.098450745]: Built-in MAVLink package version: 2022.12.30
      [ INFO] [1726671463.098471005]: Known MAVLink dialects: common ardupilotmega ASLUAV AVSSUAS all cubepilot development icarous matrixpilot paparazzi standard storm32 uAvionix ualberta
      [ INFO] [1726671463.098493921]: MAVROS started. MY ID 1.240, TARGET ID 1.1
      [ INFO] [1726671463.098563817]: udp0: Remote address: 127.0.0.1:54920
      [ WARN] [1726671463.100022814]: GP: No GPS fix
      [ INFO] [1726671463.100963952]: IMU: High resolution IMU detected!
      [ INFO] [1726671463.102041859]: IMU: Attitude quaternion IMU detected!
      [ INFO] [1726671463.171056245]: CON: Got HEARTBEAT, connected. FCU: PX4 Autopilot
      [ INFO] [1726671463.207674565]: IMU: High resolution IMU detected!
      [ INFO] [1726671463.260930602]: IMU: Attitude quaternion IMU detected!
      [ INFO] [1726671464.182184752]: GF: Using MISSION_ITEM_INT
      [ INFO] [1726671464.182427406]: RP: Using MISSION_ITEM_INT
      [ INFO] [1726671464.182707403]: WP: Using MISSION_ITEM_INT
      [ INFO] [1726671464.183667864]: VER: 1.1: Capabilities         0x000000000000ecff
      [ INFO] [1726671464.184980248]: VER: 1.1: Flight software:     010e0000 (636ffefcb102004d)
      [ INFO] [1726671464.185900552]: VER: 1.1: Middleware software: 010e0000 (636ffefcb1000000)
      [ INFO] [1726671464.186142217]: VER: 1.1: OS software:         04137dff (3f77354c0dc88793)
      [ INFO] [1726671464.186327215]: VER: 1.1: Board hardware:      00000001
      [ INFO] [1726671464.186974709]: VER: 1.1: VID/PID:             0000:0000
      [ INFO] [1726671464.187178041]: VER: 1.1: UID:                 5649414c324c584f
      [ WARN] [1726671464.188356520]: CMD: Unexpected command 520, result 0
      [ INFO] [1726671473.177403186]: HP: requesting home position
      [ INFO] [1726671478.176482057]: GF: mission received
      [ INFO] [1726671478.177594704]: RP: mission received
      [ INFO] [1726671478.178223448]: WP: mission received
      [ INFO] [1726671483.176735398]: HP: requesting home position
      [ INFO] [1726671493.176405941]: HP: requesting home position
      [ WARN] [1726671493.275066105]: GP: No GPS fix
      [ INFO] [1726671503.180478788]: HP: requesting home position
      [ INFO] [1726671513.176654363]: HP: requesting home position
      [ INFO] [1726671523.176815788]: HP: requesting home position
      

      And here is:

      voxl2:~/.ros/log/latest$ rostopic echo /mavros/state
      header: 
        seq: 860
        stamp: 
          secs: 1726672322
          nsecs: 120797373
        frame_id: ''
      connected: True
      armed: False
      guided: False
      manual_input: True
      mode: "MANUAL"
      system_status: 3
      ---
      header: 
        seq: 861
        stamp: 
          secs: 1726672323
          nsecs: 121633367
        frame_id: ''
      connected: True
      armed: False
      guided: False
      manual_input: True
      mode: "MANUAL"
      system_status: 3
      ---
      header: 
        seq: 862
        stamp: 
          secs: 1726672324
          nsecs: 120723284
        frame_id: ''
      connected: True
      armed: False
      guided: False
      manual_input: True
      mode: "MANUAL"
      system_status: 3
      ---
      

      And here is:

      voxl2:~/.ros/log/latest$ rostopic list
      /diagnostics
      /mavlink/from
      /mavlink/gcs_ip
      /mavlink/to
      /mavros/actuator_control
      /mavros/adsb/send
      /mavros/adsb/vehicle
      /mavros/altitude
      /mavros/battery
      /mavros/cam_imu_sync/cam_imu_stamp
      /mavros/camera/image_captured
      /mavros/cellular_status/status
      /mavros/companion_process/status
      /mavros/debug_value/debug
      /mavros/debug_value/debug_float_array
      /mavros/debug_value/debug_vector
      /mavros/debug_value/named_value_float
      /mavros/debug_value/named_value_int
      /mavros/debug_value/send
      /mavros/esc_info
      /mavros/esc_status
      /mavros/esc_telemetry
      /mavros/estimator_status
      /mavros/extended_state
      /mavros/fake_gps/mocap/tf
      /mavros/geofence/waypoints
      /mavros/global_position/compass_hdg
      /mavros/global_position/global
      /mavros/global_position/gp_lp_offset
      /mavros/global_position/gp_origin
      /mavros/global_position/home
      /mavros/global_position/local
      /mavros/global_position/raw/fix
      /mavros/global_position/raw/gps_vel
      /mavros/global_position/raw/satellites
      /mavros/global_position/rel_alt
      /mavros/global_position/set_gp_origin
      /mavros/gps_input/gps_input
      /mavros/gps_rtk/rtk_baseline
      /mavros/gps_rtk/send_rtcm
      /mavros/gpsstatus/gps1/raw
      /mavros/gpsstatus/gps1/rtk
      /mavros/gpsstatus/gps2/raw
      /mavros/gpsstatus/gps2/rtk
      /mavros/hil/actuator_controls
      /mavros/hil/controls
      /mavros/hil/gps
      /mavros/hil/imu_ned
      /mavros/hil/optical_flow
      /mavros/hil/rc_inputs
      /mavros/hil/state
      /mavros/home_position/home
      /mavros/home_position/set
      /mavros/imu/data
      /mavros/imu/data_raw
      /mavros/imu/diff_pressure
      /mavros/imu/mag
      /mavros/imu/static_pressure
      /mavros/imu/temperature_baro
      /mavros/imu/temperature_imu
      /mavros/landing_target/lt_marker
      /mavros/landing_target/pose
      /mavros/landing_target/pose_in
      /mavros/local_position/accel
      /mavros/local_position/odom
      /mavros/local_position/pose
      /mavros/local_position/pose_cov
      /mavros/local_position/velocity_body
      /mavros/local_position/velocity_body_cov
      /mavros/local_position/velocity_local
      /mavros/log_transfer/raw/log_data
      /mavros/log_transfer/raw/log_entry
      /mavros/mag_calibration/report
      /mavros/mag_calibration/status
      /mavros/manual_control/control
      /mavros/manual_control/send
      /mavros/mission/reached
      /mavros/mission/waypoints
      /mavros/mocap/pose
      /mavros/mount_control/command
      /mavros/mount_control/orientation
      /mavros/mount_control/status
      /mavros/nav_controller_output
      /mavros/obstacle/send
      /mavros/odometry/in
      /mavros/odometry/out
      /mavros/onboard_computer/status
      /mavros/param/param_value
      /mavros/play_tune
      /mavros/px4flow/ground_distance
      /mavros/px4flow/raw/optical_flow_rad
      /mavros/px4flow/raw/send
      /mavros/px4flow/temperature
      /mavros/radio_status
      /mavros/rallypoint/waypoints
      /mavros/rc/in
      /mavros/rc/out
      /mavros/rc/override
      /mavros/setpoint_accel/accel
      /mavros/setpoint_attitude/cmd_vel
      /mavros/setpoint_attitude/thrust
      /mavros/setpoint_position/global
      /mavros/setpoint_position/global_to_local
      /mavros/setpoint_position/local
      /mavros/setpoint_raw/attitude
      /mavros/setpoint_raw/global
      /mavros/setpoint_raw/local
      /mavros/setpoint_raw/target_attitude
      /mavros/setpoint_raw/target_global
      /mavros/setpoint_raw/target_local
      /mavros/setpoint_trajectory/desired
      /mavros/setpoint_trajectory/local
      /mavros/setpoint_velocity/cmd_vel
      /mavros/setpoint_velocity/cmd_vel_unstamped
      /mavros/state
      /mavros/statustext/recv
      /mavros/statustext/send
      /mavros/target_actuator_control
      /mavros/terrain/report
      /mavros/time_reference
      /mavros/timesync_status
      /mavros/trajectory/desired
      /mavros/trajectory/generated
      /mavros/trajectory/path
      /mavros/tunnel/in
      /mavros/tunnel/out
      /mavros/vfr_hud
      /mavros/vision_pose/pose
      /mavros/vision_pose/pose_cov
      /mavros/vision_speed/speed_twist_cov
      /mavros/wind_estimation
      /move_base_simple/goal
      /rosout
      /rosout_agg
      /tf
      /tf_static
      
      posted in Software Development
      Captain 7thC
      Captain 7th
    • RE: Trouble in running the mavros_test Project (simple-example)

      @brahim

      Thank you for your reply. Here is the info from ros topic:

      ---
      header: 
        seq: 72
        stamp: 
          secs: 1726594638
          nsecs: 117869663
        frame_id: ''
      connected: True
      armed: False
      guided: False
      manual_input: False
      mode: "OFFBOARD"
      system_status: 3
      ---
      header: 
        seq: 73
        stamp: 
          secs: 1726594639
          nsecs: 117602864
        frame_id: ''
      connected: True
      armed: False
      guided: False
      manual_input: True
      mode: "MANUAL"
      system_status: 3
      

      When I run the simple-example, and then I switch between the "offboard" and "manual", the drone is not able to get armed! Here is the message on the terminal:

      voxl2:/home/mavros_test(simple-example)$ ./run_mavros_test.sh 
      ... logging to /home/root/.ros/log/d9e22bd2-751b-11ef-bd2d-00c0cab5abe5/roslaunch-m0054-2796.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://192.168.1.45:46595/
      
      SUMMARY
      ========
      
      CLEAR PARAMETERS
       * /mavros/
      
      PARAMETERS
       * /mavros/camera/frame_id: base_link
       * /mavros/cmd/use_comp_id_system_control: False
       * /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/hrlv_ez4_pub/field_of_view: 0.0
       * /mavros/distance_sensor/hrlv_ez4_pub/frame_id: hrlv_ez4_sonar
       * /mavros/distance_sensor/hrlv_ez4_pub/id: 0
       * /mavros/distance_sensor/hrlv_ez4_pub/orientation: PITCH_270
       * /mavros/distance_sensor/hrlv_ez4_pub/send_tf: True
       * /mavros/distance_sensor/hrlv_ez4_pub/sensor_position/x: 0.0
       * /mavros/distance_sensor/hrlv_ez4_pub/sensor_position/y: 0.0
       * /mavros/distance_sensor/hrlv_ez4_pub/sensor_position/z: -0.1
       * /mavros/distance_sensor/laser_1_sub/id: 3
       * /mavros/distance_sensor/laser_1_sub/orientation: PITCH_270
       * /mavros/distance_sensor/laser_1_sub/subscriber: True
       * /mavros/distance_sensor/lidarlite_pub/field_of_view: 0.0
       * /mavros/distance_sensor/lidarlite_pub/frame_id: lidarlite_laser
       * /mavros/distance_sensor/lidarlite_pub/id: 1
       * /mavros/distance_sensor/lidarlite_pub/orientation: PITCH_270
       * /mavros/distance_sensor/lidarlite_pub/send_tf: True
       * /mavros/distance_sensor/lidarlite_pub/sensor_position/x: 0.0
       * /mavros/distance_sensor/lidarlite_pub/sensor_position/y: 0.0
       * /mavros/distance_sensor/lidarlite_pub/sensor_position/z: -0.1
       * /mavros/distance_sensor/sonar_1_sub/horizontal_fov_ratio: 1.0
       * /mavros/distance_sensor/sonar_1_sub/id: 2
       * /mavros/distance_sensor/sonar_1_sub/orientation: PITCH_270
       * /mavros/distance_sensor/sonar_1_sub/subscriber: True
       * /mavros/distance_sensor/sonar_1_sub/vertical_fov_ratio: 1.0
       * /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/lat: 47.3667
       * /mavros/fake_gps/geo_origin/lon: 8.55
       * /mavros/fake_gps/gps_rate: 5.0
       * /mavros/fake_gps/mocap_transform: True
       * /mavros/fake_gps/satellites_visible: 5
       * /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_mocap: True
       * /mavros/fake_gps/use_vision: False
       * /mavros/fcu_protocol: v2.0
       * /mavros/fcu_url: udp://127.0.0.1:1...
       * /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/mount/debounce_s: 4.0
       * /mavros/mount/err_threshold_deg: 10.0
       * /mavros/mount/negate_measured_pitch: False
       * /mavros/mount/negate_measured_roll: False
       * /mavros/mount/negate_measured_yaw: False
       * /mavros/odometry/fcu/odom_child_id_des: base_link
       * /mavros/odometry/fcu/odom_parent_id_des: map
       * /mavros/plugin_blacklist: ['safety_area', '...
       * /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: odom
       * /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: odom
       * /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: odom
       * /mavros/wheel_odometry/tf/send: False
       * /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.13
      
      NODES
        /
          mavros (mavros/mavros_node)
          mavros_test_node (mavros_test/mavros_test_node)
      
      auto-starting new master
      process[master]: started with pid [2810]
      ROS_MASTER_URI=http://127.0.0.1:11311/
      
      setting /run_id to d9e22bd2-751b-11ef-bd2d-00c0cab5abe5
      process[rosout-1]: started with pid [2821]
      started core service [/rosout]
      process[mavros-2]: started with pid [2829]
      process[mavros_test_node-3]: started with pid [2830]
      [ INFO] [1726594796.214120407]: simple_demo
      [ INFO] [1726594796.314832807]: FCU URL: udp://127.0.0.1:14551@:14551
      [ INFO] [1726594796.317305328]: udp0: Bind address: 127.0.0.1:14551
      [ INFO] [1726594796.319478270]: GCS bridge disabled
      [ INFO] [1726594796.330857244]: Plugin 3dr_radio loaded
      [ INFO] [1726594796.332309413]: Plugin 3dr_radio initialized
      [ INFO] [1726594796.332392694]: Plugin actuator_control loaded
      [ INFO] [1726594796.334354336]: Plugin actuator_control initialized
      [ INFO] [1726594796.338348870]: Plugin adsb loaded
      [ INFO] [1726594796.340326814]: Plugin adsb initialized
      [ INFO] [1726594796.340427021]: Plugin altitude loaded
      [ INFO] [1726594796.341168262]: Plugin altitude initialized
      [ INFO] [1726594796.341253834]: Plugin cam_imu_sync loaded
      [ INFO] [1726594796.342251790]: Plugin cam_imu_sync initialized
      [ INFO] [1726594796.342400851]: Plugin camera loaded
      [ INFO] [1726594796.342852200]: Plugin camera initialized
      [ INFO] [1726594796.342942459]: Plugin cellular_status loaded
      [ INFO] [1726594796.344562803]: Plugin cellular_status initialized
      [ INFO] [1726594796.344652281]: Plugin command loaded
      [ INFO] [1726594796.348940405]: Plugin command initialized
      [ INFO] [1726594796.349052644]: Plugin companion_process_status loaded
      [ INFO] [1726594796.350713196]: Plugin companion_process_status initialized
      [ INFO] [1726594796.350805330]: Plugin debug_value loaded
      [ INFO] [1726594796.354203569]: Plugin debug_value initialized
      [ INFO] [1726594796.354248621]: Plugin distance_sensor blacklisted
      [ INFO] [1726594796.354333360]: Plugin esc_status loaded
      [ INFO] [1726594796.355075121]: Plugin esc_status initialized
      [ INFO] [1726594796.355161578]: Plugin esc_telemetry loaded
      [ INFO] [1726594796.355564230]: Plugin esc_telemetry initialized
      [ INFO] [1726594796.355666156]: Plugin fake_gps loaded
      [ INFO] [1726594796.366434304]: Plugin fake_gps initialized
      [ INFO] [1726594796.366559198]: Plugin ftp loaded
      [ INFO] [1726594796.370116029]: Plugin ftp initialized
      [ INFO] [1726594796.370203996]: Plugin geofence loaded
      [ INFO] [1726594796.371933715]: Plugin geofence initialized
      [ INFO] [1726594796.372017203]: Plugin global_position loaded
      [ INFO] [1726594796.383542581]: Plugin global_position initialized
      [ INFO] [1726594796.383671538]: Plugin gps_input loaded
      [ INFO] [1726594796.385748387]: Plugin gps_input initialized
      [ INFO] [1726594796.385841147]: Plugin gps_rtk loaded
      [ INFO] [1726594796.387900705]: Plugin gps_rtk initialized
      [ INFO] [1726594796.387991224]: Plugin gps_status loaded
      [ INFO] [1726594796.389556830]: Plugin gps_status initialized
      [ INFO] [1726594796.389657506]: Plugin guided_target loaded
      [ INFO] [1726594796.393238243]: Plugin guided_target initialized
      [ INFO] [1726594796.393468448]: Plugin hil loaded
      [ INFO] [1726594796.400807732]: Plugin hil initialized
      [ INFO] [1726594796.401154134]: Plugin home_position loaded
      [ INFO] [1726594796.404127952]: Plugin home_position initialized
      [ INFO] [1726594796.404220503]: Plugin imu loaded
      [ INFO] [1726594796.408209828]: Plugin imu initialized
      [ INFO] [1726594796.408310504]: Plugin landing_target loaded
      [ INFO] [1726594796.419679895]: Plugin landing_target initialized
      [ INFO] [1726594796.419817497]: Plugin local_position loaded
      [ INFO] [1726594796.424506762]: Plugin local_position initialized
      [ INFO] [1726594796.424627073]: Plugin log_transfer loaded
      [ INFO] [1726594796.428045208]: Plugin log_transfer initialized
      [ INFO] [1726594796.428182810]: Plugin mag_calibration_status loaded
      [ INFO] [1726594796.429988205]: Plugin mag_calibration_status initialized
      [ INFO] [1726594796.430065079]: Plugin manual_control loaded
      [ INFO] [1726594796.431586987]: Plugin manual_control initialized
      [ INFO] [1726594796.431664694]: Plugin mocap_pose_estimate loaded
      [ INFO] [1726594796.435245379]: Plugin mocap_pose_estimate initialized
      [ INFO] [1726594796.435333190]: Plugin mount_control loaded
      [ WARN] [1726594796.438282841]: Could not retrive negate_measured_roll parameter value, using default (0)
      [ WARN] [1726594796.438520651]: Could not retrive negate_measured_pitch parameter value, using default (0)
      [ WARN] [1726594796.438761690]: Could not retrive negate_measured_yaw parameter value, using default (0)
      [ WARN] [1726594796.439565846]: Could not retrive debounce_s parameter value, using default (4.000000)
      [ WARN] [1726594796.439798239]: Could not retrive err_threshold_deg parameter value, using default (10.000000)
      [ INFO] [1726594796.439838343]: Plugin mount_control initialized
      [ INFO] [1726594796.439924592]: Plugin nav_controller_output loaded
      [ INFO] [1726594796.442058888]: Plugin nav_controller_output initialized
      [ INFO] [1726594796.442160293]: Plugin obstacle_distance loaded
      [ INFO] [1726594796.444083603]: Plugin obstacle_distance initialized
      [ INFO] [1726594796.444191518]: Plugin odom loaded
      [ INFO] [1726594796.446595187]: Plugin odom initialized
      [ INFO] [1726594796.446678050]: Plugin onboard_computer_status loaded
      [ INFO] [1726594796.450546440]: Plugin onboard_computer_status initialized
      [ INFO] [1726594796.450646543]: Plugin param loaded
      [ INFO] [1726594796.452225794]: Plugin param initialized
      [ INFO] [1726594796.452388136]: Plugin play_tune loaded
      [ INFO] [1726594796.454038167]: Plugin play_tune initialized
      [ INFO] [1726594796.454121812]: Plugin px4flow loaded
      [ INFO] [1726594796.457780725]: Plugin px4flow initialized
      [ INFO] [1726594796.457911140]: Plugin rallypoint loaded
      [ INFO] [1726594796.459707316]: Plugin rallypoint initialized
      [ INFO] [1726594796.459784294]: Plugin rangefinder blacklisted
      [ INFO] [1726594796.460000750]: Plugin rc_io loaded
      [ INFO] [1726594796.461943694]: Plugin rc_io initialized
      [ INFO] [1726594796.461972548]: Plugin safety_area blacklisted
      [ INFO] [1726594796.462042808]: Plugin setpoint_accel loaded
      [ INFO] [1726594796.463607736]: Plugin setpoint_accel initialized
      [ INFO] [1726594796.463691017]: Plugin setpoint_attitude loaded
      [ INFO] [1726594796.468460645]: Plugin setpoint_attitude initialized
      [ INFO] [1726594796.468569081]: Plugin setpoint_position loaded
      [ INFO] [1726594796.477376837]: Plugin setpoint_position initialized
      [ INFO] [1726594796.477515898]: Plugin setpoint_raw loaded
      [ INFO] [1726594796.482752291]: Plugin setpoint_raw initialized
      [ INFO] [1726594796.482866248]: Plugin setpoint_trajectory loaded
      [ INFO] [1726594796.492653679]: Plugin setpoint_trajectory initialized
      [ INFO] [1726594796.492846750]: Plugin setpoint_velocity loaded
      [ INFO] [1726594796.497461849]: Plugin setpoint_velocity initialized
      [ INFO] [1726594796.497638149]: Plugin sys_status loaded
      [ INFO] [1726594796.504055413]: Plugin sys_status initialized
      [ INFO] [1726594796.504612906]: Plugin sys_time loaded
      [ INFO] [1726594796.508017864]: TM: Timesync mode: MAVLINK
      [ INFO] [1726594796.508257809]: TM: Not publishing sim time
      [ INFO] [1726594796.511214751]: Plugin sys_time initialized
      [ INFO] [1726594796.511329490]: Plugin terrain loaded
      [ INFO] [1726594796.511699329]: Plugin terrain initialized
      [ INFO] [1726594796.511778703]: Plugin trajectory loaded
      [ INFO] [1726594796.515814330]: Plugin trajectory initialized
      [ INFO] [1726594796.516015682]: Plugin tunnel loaded
      [ INFO] [1726594796.518193207]: Plugin tunnel initialized
      [ INFO] [1726594796.518302685]: Plugin vfr_hud loaded
      [ INFO] [1726594796.518638514]: Plugin vfr_hud initialized
      [ INFO] [1726594796.518673565]: Plugin vibration blacklisted
      [ INFO] [1726594796.518738512]: Plugin vision_pose_estimate loaded
      [ INFO] [1726594796.522767890]: Plugin vision_pose_estimate initialized
      [ INFO] [1726594796.522845337]: Plugin vision_speed_estimate loaded
      [ INFO] [1726594796.527713297]: Plugin vision_speed_estimate initialized
      [ INFO] [1726594796.527866004]: Plugin waypoint loaded
      [ INFO] [1726594796.530877112]: Plugin waypoint initialized
      [ INFO] [1726594796.530930341]: Plugin wheel_odometry blacklisted
      [ INFO] [1726594796.531022006]: Plugin wind_estimation loaded
      [ INFO] [1726594796.533300989]: Plugin wind_estimation initialized
      [ INFO] [1726594796.533477028]: Built-in SIMD instructions: ARM NEON
      [ INFO] [1726594796.533580933]: Built-in MAVLink package version: 2022.12.30
      [ INFO] [1726594796.533718275]: Known MAVLink dialects: common ardupilotmega ASLUAV AVSSUAS all cubepilot development icarous matrixpilot paparazzi standard storm32 uAvionix ualberta
      [ INFO] [1726594796.533843221]: MAVROS started. MY ID 1.240, TARGET ID 1.1
      [ INFO] [1726594796.534121030]: udp0: Remote address: 127.0.0.1:48652
      [ INFO] [1726594796.537097921]: RC_CHANNELS message detected!
      [ INFO] [1726594796.537972285]: IMU: High resolution IMU detected!
      [ INFO] [1726594796.538613787]: IMU: Attitude quaternion IMU detected!
      [ WARN] [1726594796.539202009]: GP: No GPS fix
      [ INFO] [1726594797.117976826]: CON: Got HEARTBEAT, connected. FCU: PX4 Autopilot
      [ INFO] [1726594797.134853701]: RC_CHANNELS message detected!
      [ INFO] [1726594797.139449112]: IMU: High resolution IMU detected!
      [ INFO] [1726594797.177394945]: IMU: Attitude quaternion IMU detected!
      [ INFO] [1726594798.137137651]: GF: Using MISSION_ITEM_INT
      [ INFO] [1726594798.137605771]: RP: Using MISSION_ITEM_INT
      [ INFO] [1726594798.137778321]: WP: Using MISSION_ITEM_INT
      [ INFO] [1726594798.138168680]: VER: 1.1: Capabilities         0x000000000000ecff
      [ INFO] [1726594798.138370188]: VER: 1.1: Flight software:     010e0000 (636ffefcb102004d)
      [ INFO] [1726594798.138766017]: VER: 1.1: Middleware software: 010e0000 (636ffefcb1000000)
      [ INFO] [1726594798.138908619]: VER: 1.1: OS software:         04137dff (3f77354c0dc88793)
      [ INFO] [1726594798.139093200]: VER: 1.1: Board hardware:      00000001
      [ INFO] [1726594798.139228511]: VER: 1.1: VID/PID:             0000:0000
      [ INFO] [1726594798.139464446]: VER: 1.1: UID:                 5649414c324c584f
      [ WARN] [1726594798.139942200]: CMD: Unexpected command 520, result 0
      [ INFO] [1726594801.249404137]: waiting for offboard mode
      [ INFO] [1726594807.120839499]: HP: requesting home position
      [ INFO] [1726594809.199350808]: arming
      **[ INFO] [1726594809.213191783]: Vehicle failed to arm**
      [mavros_test_node-3] process has finished cleanly
      log file: /home/root/.ros/log/d9e22bd2-751b-11ef-bd2d-00c0cab5abe5/mavros_test_node-3*.log
      [ INFO] [1726594812.119727325]: GF: mission received
      [ INFO] [1726594812.123151814]: RP: mission received
      [ INFO] [1726594812.123413165]: WP: mission received
      
      

      The only way that I can arm the drone is when I am using RC (I put it on "manual" mode, and then use the QGC bar to arb the drone! Check the attached photo!Screenshot from 2024-09-17 19-44-43.jpg

      posted in ROS
      Captain 7thC
      Captain 7th
    • RE: The GPS is not working on auto-start

      @Eric-Katzfey Sure. Here is the link of the new post: https://forum.modalai.com/topic/3649/trouble-in-running-the-mavros_test-project-simple-example?_=1721124109041

      posted in Software Development
      Captain 7thC
      Captain 7th
    • RE: Trouble in running the mavros_test Project (simple-example)

      @Captain-7th . The problem is here: When I switch between manual and offboard, the drone does not arm/disarm as expected in the video tutorial and instructions!

      posted in ROS
      Captain 7thC
      Captain 7th
    • Trouble in running the mavros_test Project (simple-example)

      I have trouble running the mavros_test Project (simple-example) (https://docs.modalai.com/mavros/#mavros_test-project-simple-example).

      I followed all the instructions carefully, and when I ran:

      cd /home/mavros_test
      ./run_mavros_test.sh
      I got this on the terminal:
      
      voxl2:/home/mavros_test(simple-example)$ ./run_mavros_test.sh
      ... logging to /home/root/.ros/log/740b46ce-42c4-11ef-b08e-00c0cab5abe5/roslaunch-m0054-5058.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://192.168.1.45:39563/
      
      SUMMARY
      ========
      
      CLEAR PARAMETERS
       * /mavros/
      
      PARAMETERS
       * /mavros/camera/frame_id: base_link
       * /mavros/cmd/use_comp_id_system_control: False
       * /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/hrlv_ez4_pub/field_of_view: 0.0
       * /mavros/distance_sensor/hrlv_ez4_pub/frame_id: hrlv_ez4_sonar
       * /mavros/distance_sensor/hrlv_ez4_pub/id: 0
       * /mavros/distance_sensor/hrlv_ez4_pub/orientation: PITCH_270
       * /mavros/distance_sensor/hrlv_ez4_pub/send_tf: True
       * /mavros/distance_sensor/hrlv_ez4_pub/sensor_position/x: 0.0
       * /mavros/distance_sensor/hrlv_ez4_pub/sensor_position/y: 0.0
       * /mavros/distance_sensor/hrlv_ez4_pub/sensor_position/z: -0.1
       * /mavros/distance_sensor/laser_1_sub/id: 3
       * /mavros/distance_sensor/laser_1_sub/orientation: PITCH_270
       * /mavros/distance_sensor/laser_1_sub/subscriber: True
       * /mavros/distance_sensor/lidarlite_pub/field_of_view: 0.0
       * /mavros/distance_sensor/lidarlite_pub/frame_id: lidarlite_laser
       * /mavros/distance_sensor/lidarlite_pub/id: 1
       * /mavros/distance_sensor/lidarlite_pub/orientation: PITCH_270
       * /mavros/distance_sensor/lidarlite_pub/send_tf: True
       * /mavros/distance_sensor/lidarlite_pub/sensor_position/x: 0.0
       * /mavros/distance_sensor/lidarlite_pub/sensor_position/y: 0.0
       * /mavros/distance_sensor/lidarlite_pub/sensor_position/z: -0.1
       * /mavros/distance_sensor/sonar_1_sub/horizontal_fov_ratio: 1.0
       * /mavros/distance_sensor/sonar_1_sub/id: 2
       * /mavros/distance_sensor/sonar_1_sub/orientation: PITCH_270
       * /mavros/distance_sensor/sonar_1_sub/subscriber: True
       * /mavros/distance_sensor/sonar_1_sub/vertical_fov_ratio: 1.0
       * /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/lat: 47.3667
       * /mavros/fake_gps/geo_origin/lon: 8.55
       * /mavros/fake_gps/gps_rate: 5.0
       * /mavros/fake_gps/mocap_transform: True
       * /mavros/fake_gps/satellites_visible: 5
       * /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_mocap: True
       * /mavros/fake_gps/use_vision: False
       * /mavros/fcu_protocol: v2.0
       * /mavros/fcu_url: udp://127.0.0.1:1...
       * /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/mount/debounce_s: 4.0
       * /mavros/mount/err_threshold_deg: 10.0
       * /mavros/mount/negate_measured_pitch: False
       * /mavros/mount/negate_measured_roll: False
       * /mavros/mount/negate_measured_yaw: False
       * /mavros/odometry/fcu/odom_child_id_des: base_link
       * /mavros/odometry/fcu/odom_parent_id_des: map
       * /mavros/plugin_blacklist: ['safety_area', '...
       * /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: odom
       * /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: odom
       * /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: odom
       * /mavros/wheel_odometry/tf/send: False
       * /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.13
      
      NODES
        /
          mavros (mavros/mavros_node)
          mavros_test_node (mavros_test/mavros_test_node)
      
      auto-starting new master
      process[master]: started with pid [5072]
      ROS_MASTER_URI=http://127.0.0.1:11311/
      
      setting /run_id to 740b46ce-42c4-11ef-b08e-00c0cab5abe5
      process[rosout-1]: started with pid [5083]
      started core service [/rosout]
      process[mavros-2]: started with pid [5091]
      process[mavros_test_node-3]: started with pid [5092]
      [ INFO] [1721059701.053944604]: simple_demo
      [ INFO] [1721059701.184390643]: FCU URL: udp://127.0.0.1:14551@:14551
      [ INFO] [1721059701.186887064]: udp0: Bind address: 127.0.0.1:14551
      [ INFO] [1721059701.186984362]: GCS bridge disabled
      [ INFO] [1721059701.198153822]: Plugin 3dr_radio loaded
      [ INFO] [1721059701.206209164]: Plugin 3dr_radio initialized
      [ INFO] [1721059701.206311202]: Plugin actuator_control loaded
      [ INFO] [1721059701.209795450]: Plugin actuator_control initialized
      [ INFO] [1721059701.215531831]: Plugin adsb loaded
      [ INFO] [1721059701.220162824]: Plugin adsb initialized
      [ INFO] [1721059701.220375235]: Plugin altitude loaded
      [ INFO] [1721059701.223591756]: Plugin altitude initialized
      [ INFO] [1721059701.224009285]: Plugin cam_imu_sync loaded
      [ INFO] [1721059701.224724230]: Plugin cam_imu_sync initialized
      [ INFO] [1721059701.224842050]: Plugin camera loaded
      [ INFO] [1721059701.225575017]: Plugin camera initialized
      [ INFO] [1721059701.225867745]: Plugin cellular_status loaded
      [ INFO] [1721059701.228871335]: Plugin cellular_status initialized
      [ INFO] [1721059701.229033274]: Plugin command loaded
      [ INFO] [1721059701.234510887]: Plugin command initialized
      [ INFO] [1721059701.234635114]: Plugin companion_process_status loaded
      [ INFO] [1721059701.236884851]: Plugin companion_process_status initialized
      [ INFO] [1721059701.237013975]: Plugin debug_value loaded
      [ INFO] [1721059701.240331753]: Plugin debug_value initialized
      [ INFO] [1721059701.240368943]: Plugin distance_sensor blacklisted
      [ INFO] [1721059701.240454939]: Plugin esc_status loaded
      [ INFO] [1721059701.241189572]: Plugin esc_status initialized
      [ INFO] [1721059701.241286818]: Plugin esc_telemetry loaded
      [ INFO] [1721059701.242087394]: Plugin esc_telemetry initialized
      [ INFO] [1721059701.242218392]: Plugin fake_gps loaded
      [ INFO] [1721059701.255931099]: Plugin fake_gps initialized
      [ INFO] [1721059701.256196169]: Plugin ftp loaded
      [ INFO] [1721059701.262559781]: Plugin ftp initialized
      [ INFO] [1721059701.262688435]: Plugin geofence loaded
      [ INFO] [1721059701.264421262]: Plugin geofence initialized
      [ INFO] [1721059701.264509289]: Plugin global_position loaded
      [ INFO] [1721059701.274271205]: Plugin global_position initialized
      [ INFO] [1721059701.274368920]: Plugin gps_input loaded
      [ INFO] [1721059701.276500941]: Plugin gps_input initialized
      [ INFO] [1721059701.276609125]: Plugin gps_rtk loaded
      [ INFO] [1721059701.278799535]: Plugin gps_rtk initialized
      [ INFO] [1721059701.278885739]: Plugin gps_status loaded
      [ INFO] [1721059701.280354224]: Plugin gps_status initialized
      [ INFO] [1721059701.280445950]: Plugin guided_target loaded
      [ INFO] [1721059701.282821528]: Plugin guided_target initialized
      [ INFO] [1721059701.282942057]: Plugin hil loaded
      [ INFO] [1721059701.291681143]: Plugin hil initialized
      [ INFO] [1721059701.291835894]: Plugin home_position loaded
      [ INFO] [1721059701.294077349]: Plugin home_position initialized
      [ INFO] [1721059701.294178085]: Plugin imu loaded
      [ INFO] [1721059701.300978601]: Plugin imu initialized
      [ INFO] [1721059701.301082046]: Plugin landing_target loaded
      [ INFO] [1721059701.319874526]: Plugin landing_target initialized
      [ INFO] [1721059701.320027037]: Plugin local_position loaded
      [ INFO] [1721059701.324364728]: Plugin local_position initialized
      [ INFO] [1721059701.324495102]: Plugin log_transfer loaded
      [ INFO] [1721059701.329005201]: Plugin log_transfer initialized
      [ INFO] [1721059701.329123543]: Plugin mag_calibration_status loaded
      [ INFO] [1721059701.329793693]: Plugin mag_calibration_status initialized
      [ INFO] [1721059701.329883803]: Plugin manual_control loaded
      [ INFO] [1721059701.331578919]: Plugin manual_control initialized
      [ INFO] [1721059701.331655799]: Plugin mocap_pose_estimate loaded
      [ INFO] [1721059701.333844907]: Plugin mocap_pose_estimate initialized
      [ INFO] [1721059701.333922933]: Plugin mount_control loaded
      [ WARN] [1721059701.336751772]: Could not retrive negate_measured_roll parameter value, using default (0)
      [ WARN] [1721059701.336996216]: Could not retrive negate_measured_pitch parameter value, using default (0)
      [ WARN] [1721059701.337240659]: Could not retrive negate_measured_yaw parameter value, using default (0)
      [ WARN] [1721059701.338031234]: Could not retrive debounce_s parameter value, using default (4.000000)
      [ WARN] [1721059701.338254374]: Could not retrive err_threshold_deg parameter value, using default (10.000000)
      [ INFO] [1721059701.338292658]: Plugin mount_control initialized
      [ INFO] [1721059701.338385269]: Plugin nav_controller_output loaded
      [ INFO] [1721059701.338699821]: Plugin nav_controller_output initialized
      [ INFO] [1721059701.338771649]: Plugin obstacle_distance loaded
      [ INFO] [1721059701.340162109]: Plugin obstacle_distance initialized
      [ INFO] [1721059701.340228520]: Plugin odom loaded
      [ INFO] [1721059701.342990427]: Plugin odom initialized
      [ INFO] [1721059701.343101841]: Plugin onboard_computer_status loaded
      [ INFO] [1721059701.344622934]: Plugin onboard_computer_status initialized
      [ INFO] [1721059701.344730337]: Plugin param loaded
      [ INFO] [1721059701.347169931]: Plugin param initialized
      [ INFO] [1721059701.347327546]: Plugin play_tune loaded
      [ INFO] [1721059701.349693801]: Plugin play_tune initialized
      [ INFO] [1721059701.349777765]: Plugin px4flow loaded
      [ INFO] [1721059701.354768887]: Plugin px4flow initialized
      [ INFO] [1721059701.355008018]: Plugin rallypoint loaded
      [ INFO] [1721059701.357594340]: Plugin rallypoint initialized
      [ INFO] [1721059701.357646896]: Plugin rangefinder blacklisted
      [ INFO] [1721059701.357734819]: Plugin rc_io loaded
      [ INFO] [1721059701.360371405]: Plugin rc_io initialized
      [ INFO] [1721059701.360420887]: Plugin safety_area blacklisted
      [ INFO] [1721059701.360521363]: Plugin setpoint_accel loaded
      [ INFO] [1721059701.362749275]: Plugin setpoint_accel initialized
      [ INFO] [1721059701.362888295]: Plugin setpoint_attitude loaded
      [ INFO] [1721059701.369753920]: Plugin setpoint_attitude initialized
      [ INFO] [1721059701.369872991]: Plugin setpoint_position loaded
      [ INFO] [1721059701.379478126]: Plugin setpoint_position initialized
      [ INFO] [1721059701.379646210]: Plugin setpoint_raw loaded
      [ INFO] [1721059701.385296127]: Plugin setpoint_raw initialized
      [ INFO] [1721059701.385406291]: Plugin setpoint_trajectory loaded
      [ INFO] [1721059701.390939481]: Plugin setpoint_trajectory initialized
      [ INFO] [1721059701.391086262]: Plugin setpoint_velocity loaded
      [ INFO] [1721059701.394824486]: Plugin setpoint_velocity initialized
      [ INFO] [1721059701.394964912]: Plugin sys_status loaded
      [ INFO] [1721059701.408650950]: Plugin sys_status initialized
      [ INFO] [1721059701.408896332]: Plugin sys_time loaded
      [ INFO] [1721059701.414709801]: TM: Timesync mode: MAVLINK
      [ INFO] [1721059701.415076233]: TM: Not publishing sim time
      [ INFO] [1721059701.416871928]: Plugin sys_time initialized
      [ INFO] [1721059701.416999020]: Plugin terrain loaded
      [ INFO] [1721059701.419657066]: Plugin terrain initialized
      [ INFO] [1721059701.419786294]: Plugin trajectory loaded
      [ INFO] [1721059701.426208555]: Plugin trajectory initialized
      [ INFO] [1721059701.426340699]: Plugin tunnel loaded
      [ INFO] [1721059701.428138166]: Plugin tunnel initialized
      [ INFO] [1721059701.428232912]: Plugin vfr_hud loaded
      [ INFO] [1721059701.428621063]: Plugin vfr_hud initialized
      [ INFO] [1721059701.428662681]: Plugin vibration blacklisted
      [ INFO] [1721059701.428737113]: Plugin vision_pose_estimate loaded
      [ INFO] [1721059701.435602217]: Plugin vision_pose_estimate initialized
      [ INFO] [1721059701.435714933]: Plugin vision_speed_estimate loaded
      [ INFO] [1721059701.437805857]: Plugin vision_speed_estimate initialized
      [ INFO] [1721059701.437895342]: Plugin waypoint loaded
      [ INFO] [1721059701.440488800]: Plugin waypoint initialized
      [ INFO] [1721059701.440527449]: Plugin wheel_odometry blacklisted
      [ INFO] [1721059701.440773507]: Plugin wind_estimation loaded
      [ INFO] [1721059701.442031249]: Plugin wind_estimation initialized
      [ INFO] [1721059701.442183187]: Built-in SIMD instructions: ARM NEON
      [ INFO] [1721059701.442203397]: Built-in MAVLink package version: 2022.12.30
      [ INFO] [1721059701.442223242]: Known MAVLink dialects: common ardupilotmega ASLUAV AVSSUAS all cubepilot development icarous matrixpilot paparazzi standard storm32 uAvionix ualberta
      [ INFO] [1721059701.442239128]: MAVROS started. MY ID 1.240, TARGET ID 1.1
      [ INFO] [1721059706.087746519]: waiting for offboard mode
      . The problem is here: When I switch between manual and offboard, the drone does not arm/disarm as expected in the video tutorial and instructions!
      
      Note 1: Here is my IP address, and detail of the config files:
      
      amirmahdi@amirmahdi:~$ ifconfig 
      docker0: flags=4099<UP,BROADCAST,MULTICAST>  mtu 1500
              inet 172.17.0.1  netmask 255.255.0.0  broadcast 172.17.255.255
              ether 02:42:72:03:47:05  txqueuelen 0  (Ethernet)
              RX packets 0  bytes 0 (0.0 B)
              RX errors 0  dropped 0  overruns 0  frame 0
              TX packets 0  bytes 0 (0.0 B)
              TX errors 0  dropped 0 overruns 0  carrier 0  collisions 0
      
      enp45s0: flags=4099<UP,BROADCAST,MULTICAST>  mtu 1500
              ether b4:45:06:94:a8:b6  txqueuelen 1000  (Ethernet)
              RX packets 0  bytes 0 (0.0 B)
              RX errors 0  dropped 0  overruns 0  frame 0
              TX packets 0  bytes 0 (0.0 B)
              TX errors 0  dropped 0 overruns 0  carrier 0  collisions 0
      
      lo: flags=73<UP,LOOPBACK,RUNNING>  mtu 65536
              inet 127.0.0.1  netmask 255.0.0.0
              inet6 ::1  prefixlen 128  scopeid 0x10<host>
              loop  txqueuelen 1000  (Local Loopback)
              RX packets 14480  bytes 1380176 (1.3 MB)
              RX errors 0  dropped 0  overruns 0  frame 0
              TX packets 14480  bytes 1380176 (1.3 MB)
              TX errors 0  dropped 0 overruns 0  carrier 0  collisions 0
      
      wlp0s20f3: flags=4163<UP,BROADCAST,RUNNING,MULTICAST>  mtu 1500
              inet 192.168.1.5  netmask 255.255.255.0  broadcast 192.168.1.255
              inet6 fe80::e9cf:ce9f:8897:56e4  prefixlen 64  scopeid 0x20<link>
              ether cc:15:31:2b:bc:95  txqueuelen 1000  (Ethernet)
              RX packets 4029202  bytes 3659491459 (3.6 GB)
              RX errors 0  dropped 0  overruns 0  frame 0
              TX packets 318206  bytes 62215059 (62.2 MB)
              TX errors 0  dropped 0 overruns 0  carrier 0  collisions 0
      

      amirmahdi@amirmahdi:~$ ssh -X root@192.168.1.45
      root@192.168.1.45's password: 
      Welcome to Ubuntu 18.04.6 LTS (GNU/Linux 4.19.125 aarch64)
      
       * Documentation:  https://help.ubuntu.com
       * Management:     https://landscape.canonical.com
       * Support:        https://ubuntu.com/pro
      This system has been minimized by removing packages and content that are
      not required on a system that users do not log into.
      
      To restore this content, you can run the 'unminimize' command.
      Last login: Mon Jul 15 15:58:42 2024 from 192.168.1.5
      
                                                               ▂▂▂▂▂▂▂▂▂▂▂▂▂            
                                                          ▂▄▆▆██▛▀▀▀▀▀▀▀▀▜████▆▆▄▂      
       ███╗   ███╗ ██████╗ ██████╗  █████╗ ██╗         ▗▆████▀▔             ▔▔▀▀▀▀▚▄    
       ████╗ ████║██╔═══██╗██╔══██╗██╔══██╗██║       ▗▟████▀     ▗██▖    ▐█   ▝▀▆▄▄▄    
       ██╔████╔██║██║   ██║██║  ██║███████║██║      ▟████▀      ▗█▘▝█▖   ▐█       ▜█▀█▄ 
       ██║╚██╔╝██║██║   ██║██║  ██║██╔══██║██║      █▌ ▐█▌     ▗█▘  ▝█▖  ▐█       ▐▄ ▄█ 
       ██║ ╚═╝ ██║╚██████╔╝██████╔╝██║  ██║███████╗  ▀████    ▗█▘    ▝█▖ ▐█     ▂▄███▀  
       ╚═╝     ╚═╝ ╚═════╝ ╚═════╝ ╚═╝  ╚═╝╚══════╝    ▀▀██▄▄                ▂▆███▀     
                                                           ▀▀██▄▄ ▀▀▆▄▄▄▄▆██▀▀▀▘        
      
      
      --------------------------------------------------------------------------------
      system-image: 1.7.8-M0054-14.1a-perf
      kernel:       #1 SMP PREEMPT Fri May 17 23:29:23 UTC 2024 4.19.125
      --------------------------------------------------------------------------------
      hw platform:  M0054
      mach.var:     1.0.0
      --------------------------------------------------------------------------------
      voxl-suite:   1.3.1~beta1
      --------------------------------------------------------------------------------
      current IP:   wlan0: 192.168.1.45
      --------------
      

      voxl2:~$ more /home/mavros_test/ros_environment.sh
      #!/bin/bash
      #
      
      # load main ros environment
      if [ -f /opt/ros/melodic/setup.bash ]; then
          source /opt/ros/melodic/setup.bash
      elif [ -f /opt/ros/kinetic/setup.bash ]; then
          source /opt/ros/kinetic/setup.bash
      elif [ -f /opt/ros/indigo/setup.bash ]; then
          source /opt/ros/indigo/setup.bash
      fi
      
      source catkin_ws/install/setup.bash
      unset ROS_HOSTNAME
      
      # configure ROS IPs here
      export ROS_MASTER_IP=127.0.0.1
      export ROS_IP=192.168.1.45
      export ROS_MASTER_URI=http://${ROS_MASTER_IP}:11311/
      # mavros needs to know what PX4's system id is
      export PX4_SYS_ID=1
      

      And here is the voxl-vision-hub.conf:

      voxl2:~$ more /etc/modalai/voxl-vision-hub.conf
      .
      .
      .
      {
      	"config_file_version":	1,
      	"qgc_ip":                     "192.168.1.5",
      	"en_localhost_mavlink_udp":	true,
      	"localhost_udp_port_number":	14551,
      	"en_vio":	true,
      	"vio_pipe":	"qvio",
      	"secondary_vio_pipe":	"ov",
      	"en_reset_vio_if_initialized_inverted":	true,
      	"vio_warmup_s":	3,
      	"send_odom_while_failed":	true,
      	"horizon_cal_tolerance":	0.5,
      	"offboard_mode":	"off",
      	"follow_tag_id":	0,
      	"figure_eight_move_home":	true,
      	"robot_radius":	0.300000011920929,
      	"collision_sampling_dt":	0.1,
      	"max_lookahead_distance":	1,
      	"backtrack_seconds":	5,
      	"wps_move_home":	true,
      	"wps_stride":	0,
      	"wps_timeout":	0,
      	"wps_damp":	1,
      	"en_tag_fixed_frame":	false,
      	"fixed_frame_filter_len":	5,
      	"en_transform_mavlink_pos_setpoints_from_fixed_frame":	false,
      	"en_voa":	true,
      	"voa_upper_bound_m":	-0.15000000596046448,
      	"voa_lower_bound_m":	0.15000000596046448,
      	"voa_voa_memory_s":	1,
      	"voa_max_pc_per_fusion":	100,
      	"voa_pie_max_dist_m":	20,
      	"voa_pie_min_dist_m":	0.25,
      	"voa_pie_under_trim_m":	1,
      	"voa_pie_threshold":	3,
      	"voa_send_rate_hz":	20,
      	"voa_pie_slices":	36,
      	"voa_pie_bin_depth_m":	0.15000000596046448,
      	"voa_inputs":	[{
      			"enabled":	true,
      			"type":	"point_cloud",
      			"input_pipe":	"dfs_point_cloud",
      			"frame":	"stereo_l",
      			"max_depth":	8,
      			"min_depth":	0.300000011920929,
      			"cell_size":	0.079999998211860657,
      			"threshold":	4,
      			"x_fov_deg":	68,
      			"y_fov_deg":	56,
      			"conf_cutoff":	0
      		}, {
      			"enabled":	true,
      			"type":	"point_cloud",
      			"input_pipe":	"stereo_front_pc",
      			"frame":	"stereo_front_l",
      			"max_depth":	8,
      			"min_depth":	0.300000011920929,
      			"cell_size":	0.079999998211860657,
      			"threshold":	4,
      			"x_fov_deg":	68,
      			"y_fov_deg":	56,
      			"conf_cutoff":	0
      		}, {
      			"enabled":	true,
      			"type":	"point_cloud",
      			"input_pipe":	"stereo_rear_pc",
      			"frame":	"stereo_rear_l",
      			"max_depth":	8,
      			"min_depth":	0.300000011920929,
      			"cell_size":	0.079999998211860657,
      			"threshold":	4,
      			"x_fov_deg":	68,
      			"y_fov_deg":	56,
      			"conf_cutoff":	0
      		}, {
      			"enabled":	true,
      			"type":	"tof",
      			"input_pipe":	"tof",
      			"frame":	"tof",
      			"max_depth":	6,
      			"min_depth":	0.15000000596046448,
      			"cell_size":	0.079999998211860657,
      			"threshold":	3,
      			"x_fov_deg":	106.5,
      			"y_fov_deg":	85.0999984741211,
      			"conf_cutoff":	125
      		}, {
      			"enabled":	true,
      			"type":	"rangefinder",
      			"input_pipe":	"rangefinders",
      			"frame":	"body",
      			"max_depth":	8,
      			"min_depth":	0.300000011920929,
      			"cell_size":	0.079999998211860657,
      			"threshold":	4,
      			"x_fov_deg":	68,
      			"y_fov_deg":	56,
      			"conf_cutoff":	0
      		}]
      }
      

      Note 2: I could manually arm/disarm the Sentinel drone with QGC and RC. The motors are working properly. But this ros example is not working here! Can anyone help me?

      Note 3: I also tried to change the mode channel to 5 and 6, but still not working!
      This is a photo for QGC. As you can see, I could manually arm the drone and have a connection to the drone.
      whatsapp-image-2024-07-15-at-18.27.52.jpeg

      posted in ROS
      Captain 7thC
      Captain 7th
    • RE: The GPS is not working on auto-start

      @Eric-Katzfey @Jetson-Nano Here is a photo fo my QGC:
      =WhatsApp Image 2024-07-15 at 18.27.52.jpeg

      posted in Software Development
      Captain 7thC
      Captain 7th
    • RE: The GPS is not working on auto-start

      @Jetson-Nano said in The GPS is not working on auto-start:

      Reply

      @Jetson-Nano @Eric-Katzfey Thank you for your reply. I have trouble running the mavros_test Project (simple-example) (https://docs.modalai.com/mavros/#mavros_test-project-simple-example).

      I followed all the instructions carefully, and when I ran:

      cd /home/mavros_test
      ./run_mavros_test.sh
      

      I got this on the terminal:

      voxl2:/home/mavros_test(simple-example)$ ./run_mavros_test.sh
      ... logging to /home/root/.ros/log/740b46ce-42c4-11ef-b08e-00c0cab5abe5/roslaunch-m0054-5058.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://192.168.1.45:39563/
      
      SUMMARY
      ========
      
      CLEAR PARAMETERS
       * /mavros/
      
      PARAMETERS
       * /mavros/camera/frame_id: base_link
       * /mavros/cmd/use_comp_id_system_control: False
       * /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/hrlv_ez4_pub/field_of_view: 0.0
       * /mavros/distance_sensor/hrlv_ez4_pub/frame_id: hrlv_ez4_sonar
       * /mavros/distance_sensor/hrlv_ez4_pub/id: 0
       * /mavros/distance_sensor/hrlv_ez4_pub/orientation: PITCH_270
       * /mavros/distance_sensor/hrlv_ez4_pub/send_tf: True
       * /mavros/distance_sensor/hrlv_ez4_pub/sensor_position/x: 0.0
       * /mavros/distance_sensor/hrlv_ez4_pub/sensor_position/y: 0.0
       * /mavros/distance_sensor/hrlv_ez4_pub/sensor_position/z: -0.1
       * /mavros/distance_sensor/laser_1_sub/id: 3
       * /mavros/distance_sensor/laser_1_sub/orientation: PITCH_270
       * /mavros/distance_sensor/laser_1_sub/subscriber: True
       * /mavros/distance_sensor/lidarlite_pub/field_of_view: 0.0
       * /mavros/distance_sensor/lidarlite_pub/frame_id: lidarlite_laser
       * /mavros/distance_sensor/lidarlite_pub/id: 1
       * /mavros/distance_sensor/lidarlite_pub/orientation: PITCH_270
       * /mavros/distance_sensor/lidarlite_pub/send_tf: True
       * /mavros/distance_sensor/lidarlite_pub/sensor_position/x: 0.0
       * /mavros/distance_sensor/lidarlite_pub/sensor_position/y: 0.0
       * /mavros/distance_sensor/lidarlite_pub/sensor_position/z: -0.1
       * /mavros/distance_sensor/sonar_1_sub/horizontal_fov_ratio: 1.0
       * /mavros/distance_sensor/sonar_1_sub/id: 2
       * /mavros/distance_sensor/sonar_1_sub/orientation: PITCH_270
       * /mavros/distance_sensor/sonar_1_sub/subscriber: True
       * /mavros/distance_sensor/sonar_1_sub/vertical_fov_ratio: 1.0
       * /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/lat: 47.3667
       * /mavros/fake_gps/geo_origin/lon: 8.55
       * /mavros/fake_gps/gps_rate: 5.0
       * /mavros/fake_gps/mocap_transform: True
       * /mavros/fake_gps/satellites_visible: 5
       * /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_mocap: True
       * /mavros/fake_gps/use_vision: False
       * /mavros/fcu_protocol: v2.0
       * /mavros/fcu_url: udp://127.0.0.1:1...
       * /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/mount/debounce_s: 4.0
       * /mavros/mount/err_threshold_deg: 10.0
       * /mavros/mount/negate_measured_pitch: False
       * /mavros/mount/negate_measured_roll: False
       * /mavros/mount/negate_measured_yaw: False
       * /mavros/odometry/fcu/odom_child_id_des: base_link
       * /mavros/odometry/fcu/odom_parent_id_des: map
       * /mavros/plugin_blacklist: ['safety_area', '...
       * /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: odom
       * /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: odom
       * /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: odom
       * /mavros/wheel_odometry/tf/send: False
       * /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.13
      
      NODES
        /
          mavros (mavros/mavros_node)
          mavros_test_node (mavros_test/mavros_test_node)
      
      auto-starting new master
      process[master]: started with pid [5072]
      ROS_MASTER_URI=http://127.0.0.1:11311/
      
      setting /run_id to 740b46ce-42c4-11ef-b08e-00c0cab5abe5
      process[rosout-1]: started with pid [5083]
      started core service [/rosout]
      process[mavros-2]: started with pid [5091]
      process[mavros_test_node-3]: started with pid [5092]
      [ INFO] [1721059701.053944604]: simple_demo
      [ INFO] [1721059701.184390643]: FCU URL: udp://127.0.0.1:14551@:14551
      [ INFO] [1721059701.186887064]: udp0: Bind address: 127.0.0.1:14551
      [ INFO] [1721059701.186984362]: GCS bridge disabled
      [ INFO] [1721059701.198153822]: Plugin 3dr_radio loaded
      [ INFO] [1721059701.206209164]: Plugin 3dr_radio initialized
      [ INFO] [1721059701.206311202]: Plugin actuator_control loaded
      [ INFO] [1721059701.209795450]: Plugin actuator_control initialized
      [ INFO] [1721059701.215531831]: Plugin adsb loaded
      [ INFO] [1721059701.220162824]: Plugin adsb initialized
      [ INFO] [1721059701.220375235]: Plugin altitude loaded
      [ INFO] [1721059701.223591756]: Plugin altitude initialized
      [ INFO] [1721059701.224009285]: Plugin cam_imu_sync loaded
      [ INFO] [1721059701.224724230]: Plugin cam_imu_sync initialized
      [ INFO] [1721059701.224842050]: Plugin camera loaded
      [ INFO] [1721059701.225575017]: Plugin camera initialized
      [ INFO] [1721059701.225867745]: Plugin cellular_status loaded
      [ INFO] [1721059701.228871335]: Plugin cellular_status initialized
      [ INFO] [1721059701.229033274]: Plugin command loaded
      [ INFO] [1721059701.234510887]: Plugin command initialized
      [ INFO] [1721059701.234635114]: Plugin companion_process_status loaded
      [ INFO] [1721059701.236884851]: Plugin companion_process_status initialized
      [ INFO] [1721059701.237013975]: Plugin debug_value loaded
      [ INFO] [1721059701.240331753]: Plugin debug_value initialized
      [ INFO] [1721059701.240368943]: Plugin distance_sensor blacklisted
      [ INFO] [1721059701.240454939]: Plugin esc_status loaded
      [ INFO] [1721059701.241189572]: Plugin esc_status initialized
      [ INFO] [1721059701.241286818]: Plugin esc_telemetry loaded
      [ INFO] [1721059701.242087394]: Plugin esc_telemetry initialized
      [ INFO] [1721059701.242218392]: Plugin fake_gps loaded
      [ INFO] [1721059701.255931099]: Plugin fake_gps initialized
      [ INFO] [1721059701.256196169]: Plugin ftp loaded
      [ INFO] [1721059701.262559781]: Plugin ftp initialized
      [ INFO] [1721059701.262688435]: Plugin geofence loaded
      [ INFO] [1721059701.264421262]: Plugin geofence initialized
      [ INFO] [1721059701.264509289]: Plugin global_position loaded
      [ INFO] [1721059701.274271205]: Plugin global_position initialized
      [ INFO] [1721059701.274368920]: Plugin gps_input loaded
      [ INFO] [1721059701.276500941]: Plugin gps_input initialized
      [ INFO] [1721059701.276609125]: Plugin gps_rtk loaded
      [ INFO] [1721059701.278799535]: Plugin gps_rtk initialized
      [ INFO] [1721059701.278885739]: Plugin gps_status loaded
      [ INFO] [1721059701.280354224]: Plugin gps_status initialized
      [ INFO] [1721059701.280445950]: Plugin guided_target loaded
      [ INFO] [1721059701.282821528]: Plugin guided_target initialized
      [ INFO] [1721059701.282942057]: Plugin hil loaded
      [ INFO] [1721059701.291681143]: Plugin hil initialized
      [ INFO] [1721059701.291835894]: Plugin home_position loaded
      [ INFO] [1721059701.294077349]: Plugin home_position initialized
      [ INFO] [1721059701.294178085]: Plugin imu loaded
      [ INFO] [1721059701.300978601]: Plugin imu initialized
      [ INFO] [1721059701.301082046]: Plugin landing_target loaded
      [ INFO] [1721059701.319874526]: Plugin landing_target initialized
      [ INFO] [1721059701.320027037]: Plugin local_position loaded
      [ INFO] [1721059701.324364728]: Plugin local_position initialized
      [ INFO] [1721059701.324495102]: Plugin log_transfer loaded
      [ INFO] [1721059701.329005201]: Plugin log_transfer initialized
      [ INFO] [1721059701.329123543]: Plugin mag_calibration_status loaded
      [ INFO] [1721059701.329793693]: Plugin mag_calibration_status initialized
      [ INFO] [1721059701.329883803]: Plugin manual_control loaded
      [ INFO] [1721059701.331578919]: Plugin manual_control initialized
      [ INFO] [1721059701.331655799]: Plugin mocap_pose_estimate loaded
      [ INFO] [1721059701.333844907]: Plugin mocap_pose_estimate initialized
      [ INFO] [1721059701.333922933]: Plugin mount_control loaded
      [ WARN] [1721059701.336751772]: Could not retrive negate_measured_roll parameter value, using default (0)
      [ WARN] [1721059701.336996216]: Could not retrive negate_measured_pitch parameter value, using default (0)
      [ WARN] [1721059701.337240659]: Could not retrive negate_measured_yaw parameter value, using default (0)
      [ WARN] [1721059701.338031234]: Could not retrive debounce_s parameter value, using default (4.000000)
      [ WARN] [1721059701.338254374]: Could not retrive err_threshold_deg parameter value, using default (10.000000)
      [ INFO] [1721059701.338292658]: Plugin mount_control initialized
      [ INFO] [1721059701.338385269]: Plugin nav_controller_output loaded
      [ INFO] [1721059701.338699821]: Plugin nav_controller_output initialized
      [ INFO] [1721059701.338771649]: Plugin obstacle_distance loaded
      [ INFO] [1721059701.340162109]: Plugin obstacle_distance initialized
      [ INFO] [1721059701.340228520]: Plugin odom loaded
      [ INFO] [1721059701.342990427]: Plugin odom initialized
      [ INFO] [1721059701.343101841]: Plugin onboard_computer_status loaded
      [ INFO] [1721059701.344622934]: Plugin onboard_computer_status initialized
      [ INFO] [1721059701.344730337]: Plugin param loaded
      [ INFO] [1721059701.347169931]: Plugin param initialized
      [ INFO] [1721059701.347327546]: Plugin play_tune loaded
      [ INFO] [1721059701.349693801]: Plugin play_tune initialized
      [ INFO] [1721059701.349777765]: Plugin px4flow loaded
      [ INFO] [1721059701.354768887]: Plugin px4flow initialized
      [ INFO] [1721059701.355008018]: Plugin rallypoint loaded
      [ INFO] [1721059701.357594340]: Plugin rallypoint initialized
      [ INFO] [1721059701.357646896]: Plugin rangefinder blacklisted
      [ INFO] [1721059701.357734819]: Plugin rc_io loaded
      [ INFO] [1721059701.360371405]: Plugin rc_io initialized
      [ INFO] [1721059701.360420887]: Plugin safety_area blacklisted
      [ INFO] [1721059701.360521363]: Plugin setpoint_accel loaded
      [ INFO] [1721059701.362749275]: Plugin setpoint_accel initialized
      [ INFO] [1721059701.362888295]: Plugin setpoint_attitude loaded
      [ INFO] [1721059701.369753920]: Plugin setpoint_attitude initialized
      [ INFO] [1721059701.369872991]: Plugin setpoint_position loaded
      [ INFO] [1721059701.379478126]: Plugin setpoint_position initialized
      [ INFO] [1721059701.379646210]: Plugin setpoint_raw loaded
      [ INFO] [1721059701.385296127]: Plugin setpoint_raw initialized
      [ INFO] [1721059701.385406291]: Plugin setpoint_trajectory loaded
      [ INFO] [1721059701.390939481]: Plugin setpoint_trajectory initialized
      [ INFO] [1721059701.391086262]: Plugin setpoint_velocity loaded
      [ INFO] [1721059701.394824486]: Plugin setpoint_velocity initialized
      [ INFO] [1721059701.394964912]: Plugin sys_status loaded
      [ INFO] [1721059701.408650950]: Plugin sys_status initialized
      [ INFO] [1721059701.408896332]: Plugin sys_time loaded
      [ INFO] [1721059701.414709801]: TM: Timesync mode: MAVLINK
      [ INFO] [1721059701.415076233]: TM: Not publishing sim time
      [ INFO] [1721059701.416871928]: Plugin sys_time initialized
      [ INFO] [1721059701.416999020]: Plugin terrain loaded
      [ INFO] [1721059701.419657066]: Plugin terrain initialized
      [ INFO] [1721059701.419786294]: Plugin trajectory loaded
      [ INFO] [1721059701.426208555]: Plugin trajectory initialized
      [ INFO] [1721059701.426340699]: Plugin tunnel loaded
      [ INFO] [1721059701.428138166]: Plugin tunnel initialized
      [ INFO] [1721059701.428232912]: Plugin vfr_hud loaded
      [ INFO] [1721059701.428621063]: Plugin vfr_hud initialized
      [ INFO] [1721059701.428662681]: Plugin vibration blacklisted
      [ INFO] [1721059701.428737113]: Plugin vision_pose_estimate loaded
      [ INFO] [1721059701.435602217]: Plugin vision_pose_estimate initialized
      [ INFO] [1721059701.435714933]: Plugin vision_speed_estimate loaded
      [ INFO] [1721059701.437805857]: Plugin vision_speed_estimate initialized
      [ INFO] [1721059701.437895342]: Plugin waypoint loaded
      [ INFO] [1721059701.440488800]: Plugin waypoint initialized
      [ INFO] [1721059701.440527449]: Plugin wheel_odometry blacklisted
      [ INFO] [1721059701.440773507]: Plugin wind_estimation loaded
      [ INFO] [1721059701.442031249]: Plugin wind_estimation initialized
      [ INFO] [1721059701.442183187]: Built-in SIMD instructions: ARM NEON
      [ INFO] [1721059701.442203397]: Built-in MAVLink package version: 2022.12.30
      [ INFO] [1721059701.442223242]: Known MAVLink dialects: common ardupilotmega ASLUAV AVSSUAS all cubepilot development icarous matrixpilot paparazzi standard storm32 uAvionix ualberta
      [ INFO] [1721059701.442239128]: MAVROS started. MY ID 1.240, TARGET ID 1.1
      [ INFO] [1721059706.087746519]: waiting for offboard mode
      

      . The problem is here: When I switch between manual and offboard, the drone does not arm/disarm as expected in the video tutorial and instructions!

      Note 1: Here is my IP address, and detail of the config files:

      amirmahdi@amirmahdi:~$ ifconfig 
      docker0: flags=4099<UP,BROADCAST,MULTICAST>  mtu 1500
              inet 172.17.0.1  netmask 255.255.0.0  broadcast 172.17.255.255
              ether 02:42:72:03:47:05  txqueuelen 0  (Ethernet)
              RX packets 0  bytes 0 (0.0 B)
              RX errors 0  dropped 0  overruns 0  frame 0
              TX packets 0  bytes 0 (0.0 B)
              TX errors 0  dropped 0 overruns 0  carrier 0  collisions 0
      
      enp45s0: flags=4099<UP,BROADCAST,MULTICAST>  mtu 1500
              ether b4:45:06:94:a8:b6  txqueuelen 1000  (Ethernet)
              RX packets 0  bytes 0 (0.0 B)
              RX errors 0  dropped 0  overruns 0  frame 0
              TX packets 0  bytes 0 (0.0 B)
              TX errors 0  dropped 0 overruns 0  carrier 0  collisions 0
      
      lo: flags=73<UP,LOOPBACK,RUNNING>  mtu 65536
              inet 127.0.0.1  netmask 255.0.0.0
              inet6 ::1  prefixlen 128  scopeid 0x10<host>
              loop  txqueuelen 1000  (Local Loopback)
              RX packets 14480  bytes 1380176 (1.3 MB)
              RX errors 0  dropped 0  overruns 0  frame 0
              TX packets 14480  bytes 1380176 (1.3 MB)
              TX errors 0  dropped 0 overruns 0  carrier 0  collisions 0
      
      wlp0s20f3: flags=4163<UP,BROADCAST,RUNNING,MULTICAST>  mtu 1500
              inet 192.168.1.5  netmask 255.255.255.0  broadcast 192.168.1.255
              inet6 fe80::e9cf:ce9f:8897:56e4  prefixlen 64  scopeid 0x20<link>
              ether cc:15:31:2b:bc:95  txqueuelen 1000  (Ethernet)
              RX packets 4029202  bytes 3659491459 (3.6 GB)
              RX errors 0  dropped 0  overruns 0  frame 0
              TX packets 318206  bytes 62215059 (62.2 MB)
              TX errors 0  dropped 0 overruns 0  carrier 0  collisions 0
      
      amirmahdi@amirmahdi:~$ ssh -X root@192.168.1.45
      root@192.168.1.45's password: 
      Welcome to Ubuntu 18.04.6 LTS (GNU/Linux 4.19.125 aarch64)
      
       * Documentation:  https://help.ubuntu.com
       * Management:     https://landscape.canonical.com
       * Support:        https://ubuntu.com/pro
      This system has been minimized by removing packages and content that are
      not required on a system that users do not log into.
      
      To restore this content, you can run the 'unminimize' command.
      Last login: Mon Jul 15 15:58:42 2024 from 192.168.1.5
      
                                                               ▂▂▂▂▂▂▂▂▂▂▂▂▂            
                                                          ▂▄▆▆██▛▀▀▀▀▀▀▀▀▜████▆▆▄▂      
       ███╗   ███╗ ██████╗ ██████╗  █████╗ ██╗         ▗▆████▀▔             ▔▔▀▀▀▀▚▄    
       ████╗ ████║██╔═══██╗██╔══██╗██╔══██╗██║       ▗▟████▀     ▗██▖    ▐█   ▝▀▆▄▄▄    
       ██╔████╔██║██║   ██║██║  ██║███████║██║      ▟████▀      ▗█▘▝█▖   ▐█       ▜█▀█▄ 
       ██║╚██╔╝██║██║   ██║██║  ██║██╔══██║██║      █▌ ▐█▌     ▗█▘  ▝█▖  ▐█       ▐▄ ▄█ 
       ██║ ╚═╝ ██║╚██████╔╝██████╔╝██║  ██║███████╗  ▀████    ▗█▘    ▝█▖ ▐█     ▂▄███▀  
       ╚═╝     ╚═╝ ╚═════╝ ╚═════╝ ╚═╝  ╚═╝╚══════╝    ▀▀██▄▄                ▂▆███▀     
                                                           ▀▀██▄▄ ▀▀▆▄▄▄▄▆██▀▀▀▘        
      
      
      --------------------------------------------------------------------------------
      system-image: 1.7.8-M0054-14.1a-perf
      kernel:       #1 SMP PREEMPT Fri May 17 23:29:23 UTC 2024 4.19.125
      --------------------------------------------------------------------------------
      hw platform:  M0054
      mach.var:     1.0.0
      --------------------------------------------------------------------------------
      voxl-suite:   1.3.1~beta1
      --------------------------------------------------------------------------------
      current IP:   wlan0: 192.168.1.45
      --------------------------------------------------------------------------------
      
      voxl2:~$ more /home/mavros_test/ros_environment.sh
      #!/bin/bash
      #
      
      # load main ros environment
      if [ -f /opt/ros/melodic/setup.bash ]; then
          source /opt/ros/melodic/setup.bash
      elif [ -f /opt/ros/kinetic/setup.bash ]; then
          source /opt/ros/kinetic/setup.bash
      elif [ -f /opt/ros/indigo/setup.bash ]; then
          source /opt/ros/indigo/setup.bash
      fi
      
      source catkin_ws/install/setup.bash
      unset ROS_HOSTNAME
      
      # configure ROS IPs here
      export ROS_MASTER_IP=127.0.0.1
      export ROS_IP=192.168.1.45
      export ROS_MASTER_URI=http://${ROS_MASTER_IP}:11311/
      # mavros needs to know what PX4's system id is
      export PX4_SYS_ID=1
      
      

      And here is the voxl-vision-hub.conf:

      voxl2:~$ more /etc/modalai/voxl-vision-hub.conf
      .
      .
      .
      {
      	"config_file_version":	1,
      	"qgc_ip":                     "192.168.1.5",
      	"en_localhost_mavlink_udp":	true,
      	"localhost_udp_port_number":	14551,
      	"en_vio":	true,
      	"vio_pipe":	"qvio",
      	"secondary_vio_pipe":	"ov",
      	"en_reset_vio_if_initialized_inverted":	true,
      	"vio_warmup_s":	3,
      	"send_odom_while_failed":	true,
      	"horizon_cal_tolerance":	0.5,
      	"offboard_mode":	"off",
      	"follow_tag_id":	0,
      	"figure_eight_move_home":	true,
      	"robot_radius":	0.300000011920929,
      	"collision_sampling_dt":	0.1,
      	"max_lookahead_distance":	1,
      	"backtrack_seconds":	5,
      	"wps_move_home":	true,
      	"wps_stride":	0,
      	"wps_timeout":	0,
      	"wps_damp":	1,
      	"en_tag_fixed_frame":	false,
      	"fixed_frame_filter_len":	5,
      	"en_transform_mavlink_pos_setpoints_from_fixed_frame":	false,
      	"en_voa":	true,
      	"voa_upper_bound_m":	-0.15000000596046448,
      	"voa_lower_bound_m":	0.15000000596046448,
      	"voa_voa_memory_s":	1,
      	"voa_max_pc_per_fusion":	100,
      	"voa_pie_max_dist_m":	20,
      	"voa_pie_min_dist_m":	0.25,
      	"voa_pie_under_trim_m":	1,
      	"voa_pie_threshold":	3,
      	"voa_send_rate_hz":	20,
      	"voa_pie_slices":	36,
      	"voa_pie_bin_depth_m":	0.15000000596046448,
      	"voa_inputs":	[{
      			"enabled":	true,
      			"type":	"point_cloud",
      			"input_pipe":	"dfs_point_cloud",
      			"frame":	"stereo_l",
      			"max_depth":	8,
      			"min_depth":	0.300000011920929,
      			"cell_size":	0.079999998211860657,
      			"threshold":	4,
      			"x_fov_deg":	68,
      			"y_fov_deg":	56,
      			"conf_cutoff":	0
      		}, {
      			"enabled":	true,
      			"type":	"point_cloud",
      			"input_pipe":	"stereo_front_pc",
      			"frame":	"stereo_front_l",
      			"max_depth":	8,
      			"min_depth":	0.300000011920929,
      			"cell_size":	0.079999998211860657,
      			"threshold":	4,
      			"x_fov_deg":	68,
      			"y_fov_deg":	56,
      			"conf_cutoff":	0
      		}, {
      			"enabled":	true,
      			"type":	"point_cloud",
      			"input_pipe":	"stereo_rear_pc",
      			"frame":	"stereo_rear_l",
      			"max_depth":	8,
      			"min_depth":	0.300000011920929,
      			"cell_size":	0.079999998211860657,
      			"threshold":	4,
      			"x_fov_deg":	68,
      			"y_fov_deg":	56,
      			"conf_cutoff":	0
      		}, {
      			"enabled":	true,
      			"type":	"tof",
      			"input_pipe":	"tof",
      			"frame":	"tof",
      			"max_depth":	6,
      			"min_depth":	0.15000000596046448,
      			"cell_size":	0.079999998211860657,
      			"threshold":	3,
      			"x_fov_deg":	106.5,
      			"y_fov_deg":	85.0999984741211,
      			"conf_cutoff":	125
      		}, {
      			"enabled":	true,
      			"type":	"rangefinder",
      			"input_pipe":	"rangefinders",
      			"frame":	"body",
      			"max_depth":	8,
      			"min_depth":	0.300000011920929,
      			"cell_size":	0.079999998211860657,
      			"threshold":	4,
      			"x_fov_deg":	68,
      			"y_fov_deg":	56,
      			"conf_cutoff":	0
      		}]
      }
      

      Note 2: I could manually arm/disarm the Sentinel drone with QGC and RC. The motors are working properly. But this ros example is not working here! Can anyone help me?

      Note 3: I also tryied to change the mode channel to 5 and 6, but still not working!

      posted in Software Development
      Captain 7thC
      Captain 7th
    • RE: The GPS is not working on auto-start

      @Eric-Katzfey Could you please tell me which part I should study in the documentation regarding PX4 or QGC?

      posted in Software Development
      Captain 7thC
      Captain 7th
    • RE: The GPS is not working on auto-start

      @Eric-Katzfey Thanks for the reply.

      I have another trouble.

      I am trying to run the first ROS test with https://docs.modalai.com/mavros/. My controller does not work now (previously, I had connected the RC to the drone), and I have trouble switching the drone mode (with ‘offboard’ and ‘manual’ modes). Is there any other approach to switching between modes other than RC?

      Also, is there any other way to arm or disarm the vehicle without RC?

      Thank you for your time and consideration. I am looking forward to hearing from you.@Eric-Katzfey

      posted in Software Development
      Captain 7thC
      Captain 7th
    • RE: The GPS is not working on auto-start

      @Eric-Katzfey, I have tried using a non-hidden network, such as a mobile hotspot, and it works. But I am struggling to connect it to a hidden network.

      I am working with this drone at my university. The university network is hidden (SSID is not visible to everyone!), and you cannot access it without registering your MAC address in uni's systems.

      I have arranged to add the drone's MAC address to the system. I wondered if it recognizes the hidden networks when working with voxel Wi-Fi (station mode). I tried to give the SSID and the password, and it showed a successful configuration message on the terminal. However, when I write voxl-my-ip in the terminal, it does not print anything! Nothing at all! I even tried to ssh to access it, but it does not recognize it! The drone does not get connected to hidden network!

      posted in Software Development
      Captain 7thC
      Captain 7th
    • RE: The GPS is not working on auto-start

      @Captain-7th @Eric-Katzfey Can you help me with this issue? The wifi issue for the hidden network?

      posted in Software Development
      Captain 7thC
      Captain 7th
    • RE: The GPS is not working on auto-start

      @Eric-Katzfey I tried outside with a clear sky, and it is working now. Why it is not working inside?

      posted in Software Development
      Captain 7thC
      Captain 7th
    • RE: The GPS is not working on auto-start

      @Eric-Katzfey I am working with this drone at my university. The university network is hidden (SSID is not visible to everyone!) and you cannot access it without MAC address registration in uni's systems.

      I have arranged to add the drone's MAC address to the system. I was wondering if it recognizes the hidden networks when we are working with voxl-wifi, station mode, or not? Because I tried to give the SSID and the password, and it shows a successful configuration message on the terminal. Then, when I write voxl-my-ip in the terminal, is does not print anything! Nothing at all! I tried even to ssh to have access to it, but is does not recognize it!

      Do you have any idea how I can configure this or not?

      posted in Software Development
      Captain 7thC
      Captain 7th
    • The GPS is not working on auto-start

      Hello,

      Could someone guide me through the following questions:

      Q1:
      I have Sentinel and upgraded the SDK to 1.3.1~Beta. When I connect HTTP://My_DRONE_IP, the number of satellites is 0. Then, I have to turn off manually and on the GPS to see the number of GPS suddenly change to 255. Here are the commands that I use to turn it off and on:

      px4-qshell gps stop
      px4-qshell gps start -b 9600
      reboot
      

      Note: The above method is sometimes working, sometimes not! I don't know why! I could see the robot location in QGC only once! I have located the robot very close to the window in a indoor env.

      Q2: Why does the GPS M8N is blinking RED? Shouldn't that be a blue color? Is something is not working properly? How to check?

      Q3: I am currently working with Sentinel drone and want to connect the drone to a hidden network through station mode in voxl-wifi. The drone's MAC address has been added to the network, but it cannot connect (When I check the voxl-my-ip, it shows nothing!) Can anyone help how I can I do this?

      posted in Software Development
      Captain 7thC
      Captain 7th
    • RE: GPS not working

      @Eric-Katzfey Thanks for the reply. Can you guide me on how can I check what are the problems?

      Also, I have a wifi problem. Can you help me with that? My question is here: https://forum.modalai.com/topic/3600/how-to-set-up-the-voxl-wifi-station-mode-for-hidden-networks?_=1719998452051

      posted in Sentinel
      Captain 7thC
      Captain 7th
    • RE: GPS not working

      @Eric-Katzfey Could you please tell me when the GPS is working, should it start blinking blue or red? Currently, mine is red! Please also let me know how I can check my GPS is working properly or not.

      posted in Sentinel
      Captain 7thC
      Captain 7th
    • RE: GPS not working

      @Eric-Katzfey Dear Eric,

      The log shows that the voxl-px4 is does not get completed and it crashes after a while:

      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      WARN  [uORB] orb_advertise_multi: failed to set queue size
      

      what are these errors? after these messages, I couldn't run again the voxl-px4 again! so I decided the follow this way:

      After reading some posts, I decided to upgrade the SDK version to the latest. I tried to upgrade the SDK from 1.0.0 to 1.3.0. Then running "apt update && apt upgrade"

      Then, followed some hints from you that you mentioned in some other post. I found the /usr/bin/voxl-px4-start file and added these commands at the end of the file:

      1. qshell gps stop
      2. /bin/sleep 1
      3. qshell gps start -b 9600

      Then, in my browser (HTTP://ip.address), it shows 255 satellites, but the GPS is still blinking in red color (should it be blue color?) Also, I checked the QGS app, it does not show the number of satellites and the drone location on the map. (I am in an indoor env, but I put the drone very close to the open window.)

      posted in Sentinel
      Captain 7thC
      Captain 7th
    • How to set up the voxl-wifi, STATION mode for hidden networks?

      I am currently working with Sentinel drone and want to connect the drone to a hidden network through station mode in voxl-wifi. The drone's MAC address has been added to the network, but it cannot connect (When I check the voxl-my-ip, it shows nothing!) Can anyone help how I can I do this?

      posted in Ask your questions right here!
      Captain 7thC
      Captain 7th
    • RE: GPS not working

      @Eric-Katzfey
      I tried this method, but it still is not working! Here is the console:

      Sending initialization request
      Got topic data before configuration complete
      Got topic data before configuration complete
      Got topic data before configuration complete
      Got topic data before configuration complete
      Got topic data before configuration complete
      Got topic data before configuration complete
      Got topic data before configuration complete
      Got topic data before configuration complete
      Got topic data before configuration complete
      Got topic data before configuration complete
      Got topic data before configuration complete
      Got topic data before configuration complete
      Got topic data before configuration complete
      INFO  [muorb] SLPI: muorb aggregator thread running
      INFO  [muorb] muorb protobuf initalize method succeeded
      INFO  [muorb] succesfully did ADVERTISE_TEST_TYPE
      INFO  [muorb] SLPI: Creating pthread test_MUORB
      
      INFO  [muorb] SLPI: Successfully created px4 task PX4_test_MUORB with tid 2097656
      INFO  [muorb] succesfully did SUBSCRIBE_TEST_TYPE
      INFO  [muorb] SLPI: Creating pthread test_MUORB
      
      INFO  [muorb] SLPI: Successfully created px4 task PX4_test_MUORB with tid 2097655
      INFO  [muorb] succesfully did TOPIC_TEST_TYPE
      INFO  [muorb] SLPI: Creating pthread test_MUORB
      
      INFO  [muorb] SLPI: Successfully created px4 task PX4_test_MUORB with tid 2097654
      INFO  [muorb] succesfully did UNSUBSCRIBE_TEST_TYPE
      INFO  [muorb] SLPI: Creating pthread test_MUORB
      
      INFO  [muorb] SLPI: Successfully created px4 task PX4_test_MUORB with tid 2097653
      INFO  [muorb] muorb test passed
      INFO  [muorb] SLPI: Advertising remote topic log_message
      
      ______  __   __    ___ 
      | ___ \ \ \ / /   /   |
      | |_/ /  \ V /   / /| |
      |  __/   /   \  / /_| |
      | |     / /^\ \ \___  |
      \_|     \/   \/     |_/
      
      px4 starting.
      
      INFO  [px4] startup script: /bin/sh /usr/bin/voxl-px4-start 0
      INFO  [parameters] Starting param sync THREAD
      
      *************************
      GPS: HOLYBRO
      RC: SPEKTRUM
      OSD: DISABLE
      EXTRA STEPS:
      	
      *************************
      
      INFO  [muorb] SLPI: Starting param sync THREAD
      Running on M0054
      INFO  [muorb] SLPI: before starting the qshell_entry task
      INFO  [muorb] SLPI: Creating pthread qshell
      
      INFO  [muorb] SLPI: Successfully created px4 task PX4_qshell with tid 2097652
      INFO  [muorb] SLPI: qshell entry.....
      INFO  [muorb] SLPI: after starting the qshell_entry task
      INFO  [muorb] SLPI: Init app map initialized
      INFO  [param] selected parameter default file /data/px4/param/parameters
      INFO  [muorb] SLPI: Marking DeviceNode(parameter_client_reset_request) as advertised in process_remote_topic
      INFO  [uORB] Marking DeviceNode(parameter_client_reset_response) as advertised in process_remote_topic
      INFO  [muorb] SLPI: Advertising remote topic parameter_update
      INFO  [muorb] SLPI: Marking DeviceNode(parameter_client_set_value_request) as advertised in process_remote_to
      INFO  [uORB] Marking DeviceNode(parameter_server_set_used_request) as advertised in process_remote_topic
      INFO  [muorb] SLPI: Marking DeviceNode(parameter_server_set_used_response) as advertised in process_remote_to
      INFO  [uORB] Marking DeviceNode(parameter_client_set_value_response) as advertised in process_remote_topic
      INFO  [parameters] BSON document size 3022 bytes, decoded 3022 bytes (INT32:43, FLOAT:98)
      INFO  [logger] logger started (mode=all)
      Starting IMU driver with no rotation
      INFO  [qshell] Send cmd: 'icm42688p start -s'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: icm42688p start -s
      INFO  [muorb] SLPI:   arg0 = 'icm42688p'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [muorb] SLPI:   arg2 = '-s'
      
      INFO  [muorb] SLPI: *** SPI Device ID 0x26000a 2490378
      INFO  [uORB] Advertising remote topic sensor_accel
      INFO  [uORB] Advertising remote topic sensor_gyro
      INFO  [muorb] SLPI: ICM42688P::probe successful!
      INFO  [muorb] SLPI: on SPI bus 1
      INFO  [muorb] SLPI: >>> ICM42688P this: 3176e460
      INFO  [muorb] SLPI: icm42688p #0 on SPI bus 1
      INFO  [muorb] SLPI: 
      
      INFO  [muorb] SLPI: Ok executing command: icm42688p start -s
      INFO  [uORB] Advertising remote topic qshell_retval
      INFO  [muorb] SLPI: >>> ICM42688P this: 3176e460
      INFO  [qshell] qshell return value timestamp: 63895427, local time: 63898740
      INFO  [muorb] SLPI: >>> ICM42688P this: 3176e460
      INFO  [muorb] SLPI: Register interrupt b21d3164 e620e69c 3176e460
      INFO  [uORB] Advertising remote topic sensor_gyro_fifo
      INFO  [uORB] Advertising remote topic sensor_accel_fifo
      INFO  [uORB] Advertising remote topic imu_server
      INFO  [muorb] SLPI: >>> ICM42688P this: 3176e460
      INFO  [qshell] Send cmd: 'icp101xx start -I -b 5'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: icp101xx start -I -b 5
      INFO  [muorb] SLPI:   arg0 = 'icp101xx'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [muorb] SLPI:   arg2 = '-I'
      
      INFO  [muorb] SLPI:   arg3 = '-b'
      
      INFO  [muorb] SLPI:   arg4 = '5'
      
      INFO  [muorb] SLPI: *** I2C Device ID 0xb76329 12018473
      INFO  [muorb] SLPI: icp101xx #0 on I2C bus 5
      INFO  [muorb] SLPI:  address 0x63
      INFO  [muorb] SLPI: 
      
      INFO  [muorb] SLPI: Ok executing command: icp101xx start -I -b 5
      INFO  [qshell] qshell return value timestamp: 64943196, local time: 64943952
      Starting Holybro magnetometer
      INFO  [qshell] Send cmd: 'ist8310 start -R 10 -X -b 1'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: ist8310 start -R 10 -X -b 1
      INFO  [muorb] SLPI:   arg0 = 'ist8310'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [muorb] SLPI:   arg2 = '-R'
      
      INFO  [muorb] SLPI:   arg3 = '10'
      
      INFO  [muorb] SLPI:   arg4 = '-X'
      
      INFO  [muorb] SLPI:   arg5 = '-b'
      
      INFO  [muorb] SLPI:   arg6 = '1'
      
      INFO  [muorb] SLPI: *** I2C Device ID 0x60e09 396809
      INFO  [muorb] SLPI: ist8310 #0 on I2C bus 1
      INFO  [muorb] SLPI:  (external)
      INFO  [muorb] SLPI:  address 0xE
      INFO  [muorb] SLPI:  rotation 10
      INFO  [muorb] SLPI: 
      
      INFO  [muorb] SLPI: Ok executing command: ist8310 start -R 10 -X -b 1
      INFO  [qshell] qshell return value timestamp: 64990484, local time: 64992712
      INFO  [qshell] Send cmd: 'gps start'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: gps start
      INFO  [muorb] SLPI:   arg0 = 'gps'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [muorb] SLPI: Creating pthread gps
      
      INFO  [muorb] SLPI: Successfully created px4 task PX4_gps with tid 2097648
      INFO  [muorb] SLPI: Ok executing command: gps start
      INFO  [qshell] qshell return value timestamp: 65023088, local time: 65025096
      Starting Holybro LED driver
      INFO  [qshell] Send cmd: 'rgbled_ncp5623c start -X -b 1 -f 400 -a 56'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: rgbled_ncp5623c start -X -b 1 -f 400 -a 56
      INFO  [muorb] SLPI:   arg0 = 'rgbled_ncp5623c'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [muorb] SLPI:   arg2 = '-X'
      
      INFO  [muorb] SLPI:   arg3 = '-b'
      
      INFO  [muorb] SLPI:   arg4 = '1'
      
      INFO  [muorb] SLPI:   arg5 = '-f'
      
      INFO  [muorb] SLPI:   arg6 = '400'
      
      INFO  [muorb] SLPI:   arg7 = '-a'
      
      INFO  [muorb] SLPI:   arg8 = '56'
      
      INFO  [muorb] SLPI: *** I2C Device ID 0x7b3809 8075273
      INFO  [muorb] SLPI: rgbled_ncp5623c #0 on I2C bus 1
      INFO  [muorb] SLPI:  (external)
      INFO  [muorb] SLPI:  address 0x38
      INFO  [muorb] SLPI: 
      
      INFO  [muorb] SLPI: Ok executing command: rgbled_ncp5623c start -X -b 1 -f 400 -a 56
      INFO  [qshell] qshell return value timestamp: 65062554, local time: 65063907
      INFO  [uORB] Advertising remote topic sensor_mag
      INFO  [qshell] Send cmd: 'modal_io start'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: modal_io start
      INFO  [muorb] SLPI:   arg0 = 'modal_io'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [uORB] Advertising remote topic actuator_outputs
      INFO  [uORB] Advertising remote topic sensor_baro
      INFO  [muorb] SLPI: Ok executing command: modal_io start
      INFO  [muorb] SLPI: Opened UART ESC device
      INFO  [qshell] qshell return value timestamp: 65169377, local time: 65171079
      INFO  [uORB] Advertising remote topic actuator_outputs_debug
      INFO  [uORB] Advertising remote topic esc_status
      Starting Spektrum RC
      INFO  [qshell] Send cmd: 'spektrum_rc start'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: spektrum_rc start
      INFO  [muorb] SLPI:   arg0 = 'spektrum_rc'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [muorb] SLPI: Creating pthread spektrum_rc_main
      
      INFO  [muorb] SLPI: Successfully created px4 task PX4_spektrum_rc_main with tid 2097645
      INFO  [muorb] SLPI: Ok executing command: spektrum_rc start
      INFO  [qshell] qshell return value timestamp: 66215910, local time: 66216633
      INFO  [qshell] Send cmd: 'voxlpm start -X -b 2'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: voxlpm start -X -b 2
      INFO  [muorb] SLPI:   arg0 = 'voxlpm'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [muorb] SLPI:   arg2 = '-X'
      
      INFO  [muorb] SLPI:   arg3 = '-b'
      
      INFO  [muorb] SLPI:   arg4 = '2'
      
      INFO  [muorb] SLPI: *** I2C Device ID 0xd24411 13779985
      INFO  [muorb] SLPI: Set i2c address 0x6a, fd 3
      INFO  [muorb] SLPI: Set i2c address 0x44, fd 3
      INFO  [uORB] Advertising remote topic battery_status
      INFO  [muorb] SLPI: voxlpm #0 on I2C bus 2
      INFO  [muorb] SLPI:  (external)
      INFO  [muorb] SLPI:  address 0x44
      INFO  [muorb] SLPI: 
      
      INFO  [muorb] SLPI: Ok executing command: voxlpm start -X -b 2
      INFO  [uORB] Advertising remote topic power_monitor
      INFO  [qshell] qshell return value timestamp: 67272854, local time: 67275718
      INFO  [qshell] Send cmd: 'sensors start'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: sensors start
      INFO  [muorb] SLPI:   arg0 = 'sensors'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [uORB] Advertising remote topic sensor_selection
      INFO  [uORB] Advertising remote topic sensors_status_imu
      INFO  [uORB] Advertising remote topic vehicle_acceleration
      INFO  [uORB] Advertising remote topic vehicle_angular_velocity
      INFO  [uORB] Advertising remote topic sensor_combined
      INFO  [uORB] Advertising remote topic vehicle_air_data
      INFO  [uORB] Advertising remote topic vehicle_gps_position
      INFO  [uORB] Advertising remote topic vehicle_magnetometer
      INFO  [uORB] Advertising remote topic sensor_preflight_mag
      INFO  [uORB] Advertising remote topic vehicle_imu
      INFO  [uORB] Advertising remote topic vehicle_imu_status
      INFO  [muorb] SLPI: Ok executing command: sensors start
      INFO  [uORB] Advertising remote topic sensors_status_mag
      INFO  [qshell] qshell return value timestamp: 67434965, local time: 67437421
      INFO  [uORB] Advertising remote topic sensors_status_baro
      INFO  [qshell] Send cmd: 'ekf2 start'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: ekf2 start
      INFO  [muorb] SLPI:   arg0 = 'ekf2'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [uORB] Advertising remote topic vehicle_attitude
      INFO  [uORB] Advertising remote topic vehicle_local_position
      INFO  [uORB] Advertising remote topic estimator_event_flags
      INFO  [uORB] Advertising remote topic estimator_innovation_test_ratios
      INFO  [uORB] Advertising remote topic estimator_innovation_variances
      INFO  [uORB] Advertising remote topic estimator_innovations
      INFO  [uORB] Advertising remote topic estimator_sensor_bias
      INFO  [uORB] Advertising remote topic estimator_states
      INFO  [uORB] Advertising remote topic estimator_status_flags
      INFO  [uORB] Advertising remote topic estimator_status
      INFO  [muorb] SLPI: Ok executing command: ekf2 start
      INFO  [qshell] qshell return value timestamp: 67750482, local time: 67753672
      INFO  [uORB] Advertising remote topic ekf2_timestamps
      INFO  [uORB] Advertising remote topic vehicle_odometry
      INFO  [uORB] Advertising remote topic estimator_aid_src_baro_hgt
      INFO  [uORB] Advertising remote topic estimator_aid_src_fake_pos
      INFO  [uORB] Advertising remote topic estimator_aid_src_fake_hgt
      INFO  [uORB] Advertising remote topic estimator_aid_src_mag_heading
      INFO  [uORB] Advertising remote topic estimator_aid_src_mag
      INFO  [uORB] Advertising remote topic estimator_aid_src_gravity
      INFO  [qshell] Send cmd: 'mc_pos_control start'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: mc_pos_control start
      INFO  [muorb] SLPI:   arg0 = 'mc_pos_control'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [uORB] Advertising remote topic takeoff_status
      INFO  [muorb] SLPI: Ok executing command: mc_pos_control start
      INFO  [qshell] qshell return value timestamp: 67859638, local time: 67861554
      INFO  [qshell] Send cmd: 'mc_att_control start'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: mc_att_control start
      INFO  [muorb] SLPI:   arg0 = 'mc_att_control'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [muorb] SLPI: Ok executing command: mc_att_control start
      INFO  [qshell] qshell return value timestamp: 67918747, local time: 67920290
      INFO  [qshell] Send cmd: 'mc_rate_control start'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: mc_rate_control start
      INFO  [muorb] SLPI:   arg0 = 'mc_rate_control'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [uORB] Advertising remote topic rate_ctrl_status
      INFO  [muorb] SLPI: Ok executing command: mc_rate_control start
      INFO  [qshell] qshell return value timestamp: 68027813, local time: 68030404
      INFO  [qshell] Send cmd: 'mc_hover_thrust_estimator start'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: mc_hover_thrust_estimator start
      INFO  [muorb] SLPI:   arg0 = 'mc_hover_thrust_estimator'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [muorb] SLPI: Ok executing command: mc_hover_thrust_estimator start
      INFO  [qshell] qshell return value timestamp: 68087592, local time: 68089224
      INFO  [qshell] Send cmd: 'mc_autotune_attitude_control start'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: mc_autotune_attitude_control start
      INFO  [muorb] SLPI:   arg0 = 'mc_autotune_attitude_control'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [uORB] Advertising remote topic autotune_attitude_control_status
      INFO  [muorb] SLPI: Ok executing command: mc_autotune_attitude_control start
      INFO  [qshell] qshell return value timestamp: 68137157, local time: 68138847
      INFO  [qshell] Send cmd: 'land_detector start multicopter'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: land_detector start multicopter
      INFO  [muorb] SLPI:   arg0 = 'land_detector'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [muorb] SLPI:   arg2 = 'multicopter'
      
      INFO  [muorb] SLPI: Ok executing command: land_detector start multicopter
      INFO  [qshell] qshell return value timestamp: 68188877, local time: 68189722
      INFO  [uORB] Advertising remote topic vehicle_land_detected
      INFO  [qshell] Send cmd: 'manual_control start'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: manual_control start
      INFO  [muorb] SLPI:   arg0 = 'manual_control'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [muorb] SLPI: Ok executing command: manual_control start
      INFO  [uORB] Advertising remote topic manual_control_setpoint
      INFO  [qshell] qshell return value timestamp: 68237903, local time: 68239705
      INFO  [qshell] Send cmd: 'control_allocator start'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: control_allocator start
      INFO  [muorb] SLPI:   arg0 = 'control_allocator'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [uORB] Advertising remote topic control_allocator_status
      INFO  [uORB] Marking DeviceNode(control_allocator_status) as advertised in process_remote_topic
      INFO  [uORB] Advertising remote topic actuator_motors
      INFO  [uORB] Advertising remote topic actuator_servos
      INFO  [uORB] Advertising remote topic actuator_servos_trim
      INFO  [muorb] SLPI: Ok executing command: control_allocator start
      INFO  [qshell] qshell return value timestamp: 68577984, local time: 68579385
      INFO  [qshell] Send cmd: 'rc_update start'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: rc_update start
      INFO  [muorb] SLPI:   arg0 = 'rc_update'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [muorb] SLPI: Ok executing command: rc_update start
      INFO  [qshell] qshell return value timestamp: 68873945, local time: 68874998
      INFO  [qshell] Send cmd: 'commander start'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: commander start
      INFO  [muorb] SLPI:   arg0 = 'commander'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [muorb] SLPI: Creating pthread commander
      
      INFO  [muorb] SLPI: Successfully created px4 task PX4_commander with tid 2097641
      INFO  [uORB] Advertising remote topic led_control
      INFO  [muorb] SLPI: LED: open /dev/led0 failed (22)
      INFO  [muorb] SLPI: Ok executing command: commander start
      INFO  [uORB] Advertising remote topic tune_control
      INFO  [qshell] qshell return value timestamp: 69104924, local time: 69107190
      INFO  [uORB] Advertising remote topic event
      INFO  [uORB] Advertising remote topic health_report
      INFO  [uORB] Advertising remote topic failsafe_flags
      INFO  [uORB] Advertising remote topic actuator_armed
      INFO  [uORB] Advertising remote topic vehicle_control_mode
      INFO  [uORB] Advertising remote topic vehicle_thrust_setpoint
      INFO  [uORB] Advertising remote topic vehicle_torque_setpoint
      INFO  [uORB] Advertising remote topic vehicle_rates_setpoint
      INFO  [uORB] Advertising remote topic vehicle_status
      INFO  [uORB] Advertising remote topic failure_detector_status
      INFO  [uORB] Advertising remote topic vehicle_local_position_setpoint
      INFO  [uORB] Advertising remote topic vehicle_attitude_setpoint
      INFO  [qshell] Send cmd: 'commander mode manual'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: commander mode manual
      INFO  [muorb] SLPI:   arg0 = 'commander'
      
      INFO  [muorb] SLPI:   arg1 = 'mode'
      
      INFO  [muorb] SLPI:   arg2 = 'manual'
      
      INFO  [uORB] Advertising remote topic vehicle_command
      INFO  [muorb] SLPI: Ok executing command: commander mode manual
      INFO  [qshell] qshell return value timestamp: 69148498, local time: 69150136
      INFO  [uORB] Advertising remote topic vehicle_command_ack
      INFO  [uORB] Marking DeviceNode(vehicle_attitude_setpoint) as advertised in process_remote_topic
      INFO  [qshell] Send cmd: 'param_set_selector start'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: param_set_selector start
      INFO  [muorb] SLPI:   arg0 = 'param_set_selector'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [muorb] SLPI: Ok executing command: param_set_selector start
      INFO  [qshell] qshell return value timestamp: 69186104, local time: 69187696
      INFO  [qshell] Send cmd: 'flight_mode_manager start'
      INFO  [muorb] SLPI: Marking DeviceNode(qshell_req) as advertised in process_remote_topic
      INFO  [muorb] SLPI: qshell gotten: flight_mode_manager start
      INFO  [muorb] SLPI:   arg0 = 'flight_mode_manager'
      
      INFO  [muorb] SLPI:   arg1 = 'start'
      
      INFO  [uORB] Marking DeviceNode(vehicle_command) as advertised in process_remote_topic
      INFO  [muorb] SLPI: Ok executing command: flight_mode_manager start
      INFO  [qshell] qshell return value timestamp: 69346243, local time: 69347753
      INFO  [uORB] Advertising remote topic actuator_controls_status_0
      INFO  [dataman] data manager file '/data/px4/dataman' size is 7866640 bytes
      INFO  [muorb] SLPI: Advertising remote topic transponder_report
      INFO  [muorb] SLPI: Advertising remote topic rtl_time_estimate
      INFO  [muorb] SLPI: Advertising remote topic position_setpoint_triplet
      INFO  [mavlink] mode: Onboard, data rate: 100000 B/s on udp port 14556 remote port 14557
      INFO  [muorb] SLPI: Advertising remote topic telemetry_status
      INFO  [mavlink] partner IP: 127.0.0.1
      INFO  [muorb] SLPI: Advertising remote topic vehicle_visual_odometry
      INFO  [muorb] SLPI: Advertising remote topic obstacle_distance
      INFO  [muorb] SLPI: Advertising remote topic offboard_control_mode
      INFO  [muorb] SLPI: Advertising remote topic timesync_status
      INFO  [uORB] Advertising remote topic estimator_aid_src_ev_hgt
      INFO  [uORB] Advertising remote topic estimator_aid_src_ev_pos
      INFO  [uORB] Advertising remote topic estimator_aid_src_ev_vel
      INFO  [uORB] Advertising remote topic estimator_aid_src_ev_yaw
      INFO  [mavlink] mode: Normal, data rate: 100000 B/s on udp port 14558 remote port 14559
      INFO  [muorb] SLPI: Marking DeviceNode(telemetry_status) as advertised in process_remote_topic
      INFO  [mavlink] partner IP: 127.0.0.1
      INFO  [mavlink] MAVLink only on localhost (set param MAV_{i}_BROADCAST = 1 to enable network)
      INFO  [px4] Startup script returned successfully
      INFO  [muorb] SLPI: u-blox firmware version: SPG 3.01
      INFO  [muorb] SLPI: u-blox protocol version: 18.00
      INFO  [muorb] SLPI: u-blox module: NEO-M8N-0
      INFO  [uORB] Advertising remote topic sensor_gps
      INFO  [muorb] SLPI: Advertising remote topic ping
      INFO  [uORB] Advertising remote topic mavlink_log
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      INFO  [muorb] SLPI: Connection to ground station lost	
      INFO  [muorb] SLPI: GCS connection regained	
      WARN  [uORB] orb_advertise_multi: failed to set queue size
      
      
      posted in Sentinel
      Captain 7thC
      Captain 7th