matlabbe / rtabmap_drone_example

Example of using move_base with mavros/px4 and rtabmap visual SLAM
BSD 3-Clause "New" or "Revised" License
100 stars 24 forks source link

Unable to take off #2

Closed iamrajee closed 2 years ago

iamrajee commented 2 years ago

I'm unable to take off the drone in the given gazebo world. Although, when I tried with the default gazebo simulation, it does take off.

Drone does take off this way

Terminal1: roslaunch mavros px4.launch fcu_url:="udp://:14540@127.0.0.1:14557" Terminal2: roslaunch px4 posix_sitl.launch Terminal3: rosrun rtabmap_drone_example offboard

But, doesn't take off this way:

Terminal 1: roslaunch rtabmap_drone_example gazebo.launch Terminal 2: rosrun rtabmap_drone_example offboard

What could be the potential reason for this behaviour? Could it be because of the version miss-match of PX4/ mavros? I'm running this simulation on noetic.

Here is output/error of gazebo.launch(terminal1):

... logging to /home/rajendra/.ros/log/366b5ef6-550c-11ec-b2d5-15a442893f81/roslaunch-u20-384705.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.

xacro: in-order processing became default in ROS Melodic. You can drop the option.
started roslaunch server http://u20:36799/

SUMMARY
========

CLEAR PARAMETERS
 * /mavros/

PARAMETERS
 * /gazebo/enable_ros_network: True
 * /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/id: 2
 * /mavros/distance_sensor/sonar_1_sub/orientation: PITCH_270
 * /mavros/distance_sensor/sonar_1_sub/subscriber: True
 * /mavros/fake_gps/eph: 2.0
 * /mavros/fake_gps/epv: 2.0
 * /mavros/fake_gps/fix_type: 3
 * /mavros/fake_gps/geo_origin/alt: 408.0
 * /mavros/fake_gps/geo_origin/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://:14540@loca...
 * /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.000349065850398...
 * /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/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/mocap/use_pose: True
 * /mavros/mocap/use_tf: False
 * /mavros/odometry/in/child_frame_id: base_link
 * /mavros/odometry/in/frame_id: odom
 * /mavros/odometry/in/frame_tf/body_frame_orientation: flu
 * /mavros/odometry/in/frame_tf/local_frame: local_origin_ned
 * /mavros/odometry/out/frame_tf/body_frame_orientation: frd
 * /mavros/odometry/out/frame_tf/local_frame: vision_ned
 * /mavros/plugin_blacklist: ['safety_area', '...
 * /mavros/plugin_whitelist: []
 * /mavros/px4flow/frame_id: px4flow
 * /mavros/px4flow/ranger_fov: 0.11868238913561441
 * /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: True
 * /mavros/sys/disable_diag: False
 * /mavros/sys/min_voltage: 10.0
 * /mavros/target_component_id: 1
 * /mavros/target_system_id: 1
 * /mavros/tdr_radio/low_rssi: 40
 * /mavros/time/time_ref_source: fcu
 * /mavros/time/timesync_avg_alpha: 0.6
 * /mavros/time/timesync_mode: MAVLINK
 * /mavros/vibration/frame_id: base_link
 * /mavros/vision_pose/tf/child_frame_id: vision_estimate
 * /mavros/vision_pose/tf/frame_id: map
 * /mavros/vision_pose/tf/listen: False
 * /mavros/vision_pose/tf/rate_limit: 10.0
 * /mavros/vision_speed/listen_twist: True
 * /mavros/vision_speed/twist_cov: True
 * /mavros/wheel_odometry/child_frame_id: base_link
 * /mavros/wheel_odometry/count: 2
 * /mavros/wheel_odometry/frame_id: map
 * /mavros/wheel_odometry/send_raw: True
 * /mavros/wheel_odometry/send_twist: False
 * /mavros/wheel_odometry/tf/child_frame_id: base_link
 * /mavros/wheel_odometry/tf/frame_id: map
 * /mavros/wheel_odometry/tf/send: True
 * /mavros/wheel_odometry/use_rpm: False
 * /mavros/wheel_odometry/vel_error: 0.1
 * /mavros/wheel_odometry/wheel0/radius: 0.05
 * /mavros/wheel_odometry/wheel0/x: 0.0
 * /mavros/wheel_odometry/wheel0/y: -0.15
 * /mavros/wheel_odometry/wheel1/radius: 0.05
 * /mavros/wheel_odometry/wheel1/x: 0.0
 * /mavros/wheel_odometry/wheel1/y: 0.15
 * /robot_description: <?xml version="1....
 * /robot_state_publisher/publish_frequency: 30.0
 * /rosdistro: noetic
 * /rosversion: 1.15.13
 * /use_sim_time: True

NODES
  /
    base_link_imu (tf/static_transform_publisher)
    base_link_rotor0 (tf/static_transform_publisher)
    base_link_rotor1 (tf/static_transform_publisher)
    base_link_rotor2 (tf/static_transform_publisher)
    base_link_rotor3 (tf/static_transform_publisher)
    gazebo (gazebo_ros/gzserver)
    gazebo_gui (gazebo_ros/gzclient)
    mavros (mavros/mavros_node)
    robot_state_publisher (robot_state_publisher/robot_state_publisher)
    sitl (px4/px4)
    spawn_model (gazebo_ros/spawn_model)

ROS_MASTER_URI=http://localhost:11311

process[gazebo-1]: started with pid [384750]
process[gazebo_gui-2]: started with pid [384754]
process[sitl-3]: started with pid [384765]
Creating symlink /home/rajendra/drone_ws/src/PX4-Autopilot/build/px4_sitl_default/etc -> /home/rajendra/.ros/etc

______  __   __    ___ 
| ___ \ \ \ / /   /   |
| |_/ /  \ V /   / /| |
|  __/   /   \  / /_| |
| |     / /^\ \ \___  |
\_|     \/   \/     |_/

px4 starting.

INFO  [px4] Calling startup script: /bin/sh /home/rajendra/drone_ws/src/rtabmap_drone_example/config/rcS 0
process[spawn_model-4]: started with pid [384779]
Info: found model autostart file as SYS_AUTOSTART=1099
INFO  [param] selected parameter default file eeprom/parameters_1099
INFO  [parameters] BSON document size 444 bytes, decoded 444 bytes
[param] Loaded: eeprom/parameters_1099
process[robot_state_publisher-5]: started with pid [384800]
process[mavros-6]: started with pid [384834]
process[base_link_imu-7]: started with pid [384853]
process[base_link_rotor0-8]: started with pid [384863]
process[base_link_rotor1-9]: started with pid [384871]
process[base_link_rotor2-10]: started with pid [384882]
process[base_link_rotor3-11]: started with pid [384893]
[ WARN] [1638628422.105417484]: The root link base_link has an inertia specified in the URDF, but KDL does not support a root link with an inertia.  As a workaround, you can add an extra dummy link to your URDF.
[ INFO] [1638628422.257664484]: FCU URL: udp://:14540@localhost:14557
[ INFO] [1638628422.260720893]: udp0: Bind address: 0.0.0.0:14540
[ INFO] [1638628422.260829221]: udp0: Remote address: 127.0.0.1:14557
[ INFO] [1638628422.260937709]: GCS bridge disabled
INFO  [dataman] data manager file './dataman' size is 11798680 bytes
[ INFO] [1638628422.275169969]: Plugin 3dr_radio loaded
PX4 SIM HOST: localhost
[ INFO] [1638628422.277423367]: Plugin 3dr_radio initialized
[ INFO] [1638628422.277542899]: Plugin actuator_control loaded
INFO  [simulator] Waiting for simulator to accept connection on TCP port 4560
[ INFO] [1638628422.280957979]: Plugin actuator_control initialized
[ INFO] [1638628422.285139636]: Plugin adsb loaded
[ INFO] [1638628422.288022863]: Plugin adsb initialized
[ INFO] [1638628422.288141793]: Plugin altitude loaded
[ INFO] [1638628422.289217730]: Plugin altitude initialized
[ INFO] [1638628422.289311288]: Plugin cam_imu_sync loaded
[ INFO] [1638628422.290058866]: Plugin cam_imu_sync initialized
[ INFO] [1638628422.290135577]: Plugin command loaded
[ INFO] [1638628422.299517333]: Plugin command initialized
[ INFO] [1638628422.299648131]: Plugin companion_process_status loaded
[ INFO] [1638628422.303479130]: Plugin companion_process_status initialized
[ INFO] [1638628422.303600979]: Plugin debug_value loaded
[ INFO] [1638628422.310779868]: Plugin debug_value initialized
[ INFO] [1638628422.310815503]: Plugin distance_sensor blacklisted
[ INFO] [1638628422.310904629]: Plugin esc_status loaded
[ INFO] [1638628422.312477410]: Plugin esc_status initialized
[ INFO] [1638628422.312561676]: Plugin esc_telemetry loaded
[ INFO] [1638628422.313444798]: Plugin esc_telemetry initialized
[ INFO] [1638628422.313517673]: Plugin fake_gps loaded
[ INFO] [1638628422.330788146]: Plugin fake_gps initialized
[ INFO] [1638628422.330908327]: Plugin ftp loaded
[ INFO] [1638628422.339595283]: Plugin ftp initialized
[ INFO] [1638628422.339778834]: Plugin geofence loaded
[ INFO] [1638628422.341942339]: Plugin geofence initialized
[ INFO] [1638628422.342067561]: Plugin global_position loaded
[ INFO] [1638628422.353566661]: Plugin global_position initialized
[ INFO] [1638628422.353693727]: Plugin gps_input loaded
[ INFO] [1638628422.355893233]: Plugin gps_input initialized
[ INFO] [1638628422.355980251]: Plugin gps_rtk loaded
[ INFO] [1638628422.359061944]: Plugin gps_rtk initialized
[ INFO] [1638628422.359742799]: Plugin gps_status loaded
[ INFO] [1638628422.361862276]: Plugin gps_status initialized
[ INFO] [1638628422.361967952]: Plugin hil loaded
[ INFO] [1638628422.373920123]: Plugin hil initialized
[ INFO] [1638628422.374030340]: Plugin home_position loaded
[ INFO] [1638628422.380801325]: Plugin home_position initialized
[ INFO] [1638628422.380966182]: Plugin imu loaded
[ INFO] [1638628422.387956898]: Plugin imu initialized
[ INFO] [1638628422.388106196]: Plugin landing_target loaded
[ INFO] [1638628422.395321558]: Plugin landing_target initialized
[ INFO] [1638628422.395466964]: Plugin local_position loaded
[ INFO] [1638628422.418525163]: Plugin local_position initialized
[ INFO] [1638628422.418754747]: Plugin log_transfer loaded
[ INFO] [1638628422.422409852]: Plugin log_transfer initialized
[ INFO] [1638628422.422515691]: Plugin mag_calibration_status loaded
[ INFO] [1638628422.423666362]: Plugin mag_calibration_status initialized
[ INFO] [1638628422.423926224]: Plugin manual_control loaded
[ INFO] [1638628422.427510666]: Plugin manual_control initialized
[ INFO] [1638628422.427687536]: Plugin mocap_pose_estimate loaded
[ INFO] [1638628422.432325788]: Plugin mocap_pose_estimate initialized
[ INFO] [1638628422.432566789]: Plugin mount_control loaded
[ INFO] [1638628422.437214595]: Plugin mount_control initialized
[ INFO] [1638628422.437386094]: Plugin nav_controller_output loaded
[ INFO] [1638628422.437964185]: Plugin nav_controller_output initialized
[ INFO] [1638628422.438195785]: Plugin obstacle_distance loaded
[ INFO] [1638628422.441998728]: Plugin obstacle_distance initialized
[ INFO] [1638628422.442133407]: Plugin odom loaded
[ INFO] [1638628422.445948886]: Plugin odom initialized
[ INFO] [1638628422.446134909]: Plugin onboard_computer_status loaded
[ INFO] [1638628422.448432930]: Plugin onboard_computer_status initialized
[ INFO] [1638628422.448551262]: Plugin param loaded
[ INFO] [1638628422.451625838]: Plugin param initialized
[ INFO] [1638628422.451755832]: Plugin play_tune loaded
[ INFO] [1638628422.458206079]: Plugin play_tune initialized
[ INFO] [1638628422.458327051]: Plugin px4flow loaded
[ INFO] [1638628422.476383071]: Plugin px4flow initialized
[ INFO] [1638628422.476512622]: Plugin rallypoint loaded
[ INFO] [1638628422.483353681]: Plugin rallypoint initialized
[ INFO] [1638628422.483404434]: Plugin rangefinder blacklisted
[ INFO] [1638628422.483555006]: Plugin rc_io loaded
[ INFO] [1638628422.493277859]: Plugin rc_io initialized
[ INFO] [1638628422.493325017]: Plugin safety_area blacklisted
[ INFO] [1638628422.493452606]: Plugin setpoint_accel loaded
[ INFO] [1638628422.501517568]: Plugin setpoint_accel initialized
[ INFO] [1638628422.501654240]: Plugin setpoint_attitude loaded
[ INFO] [1638628422.519559226]: Plugin setpoint_attitude initialized
[ INFO] [1638628422.519673358]: Plugin setpoint_position loaded
[ INFO] [1638628422.532909062]: Plugin setpoint_position initialized
[ INFO] [1638628422.533014066]: Plugin setpoint_raw loaded
[ INFO] [1638628422.539241027]: Plugin setpoint_raw initialized
[ INFO] [1638628422.539369515]: Plugin setpoint_trajectory loaded
[ INFO] [1638628422.544434583]: Plugin setpoint_trajectory initialized
[ INFO] [1638628422.544622954]: Plugin setpoint_velocity loaded
[ INFO] [1638628422.550978511]: Plugin setpoint_velocity initialized
[ INFO] [1638628422.551138637]: Plugin sys_status loaded
[ INFO] [1638628422.558681242]: Plugin sys_status initialized
[ INFO] [1638628422.558807197]: Plugin sys_time loaded
[ INFO] [1638628422.562980808]: TM: Timesync mode: MAVLINK
[ INFO] [1638628422.563268815]: TM: Not publishing sim time
[ INFO] [1638628422.564143595]: Plugin sys_time initialized
[ INFO] [1638628422.564252396]: Plugin trajectory loaded
[ INFO] [1638628422.567969537]: Plugin trajectory initialized
[ INFO] [1638628422.568087443]: Plugin tunnel loaded
[ INFO] [1638628422.570088313]: Plugin tunnel initialized
[ INFO] [1638628422.570226485]: Plugin vfr_hud loaded
[ INFO] [1638628422.570641016]: Plugin vfr_hud initialized
[ INFO] [1638628422.570672014]: Plugin vibration blacklisted
[ INFO] [1638628422.570767074]: Plugin vision_pose_estimate loaded
[ INFO] [1638628422.576291223]: Plugin vision_pose_estimate initialized
[ INFO] [1638628422.576381910]: Plugin vision_speed_estimate loaded
[ INFO] [1638628422.578937928]: Plugin vision_speed_estimate initialized
[ INFO] [1638628422.579033603]: Plugin waypoint loaded
[ INFO] [1638628422.582246033]: Plugin waypoint initialized
[ INFO] [1638628422.582278742]: Plugin wheel_odometry blacklisted
[ INFO] [1638628422.582368611]: Plugin wind_estimation loaded
[ INFO] [1638628422.582889660]: Plugin wind_estimation initialized
[ INFO] [1638628422.582920897]: Autostarting mavlink via USB on PX4
[ INFO] [1638628422.582968028]: Built-in SIMD instructions: SSE, SSE2
[ INFO] [1638628422.583001307]: Built-in MAVLink package version: 2021.10.10
[ INFO] [1638628422.583041326]: Known MAVLink dialects: common ardupilotmega ASLUAV all development icarous matrixpilot paparazzi standard uAvionix ualberta
[ INFO] [1638628422.583075394]: MAVROS started. MY ID 1.240, TARGET ID 1.1
[ INFO] [1638628422.810858236]: Finished loading Gazebo ROS API Plugin.
[ INFO] [1638628422.812031776]: waitForService: Service [/gazebo/set_physics_properties] has not been advertised, waiting...
[ INFO] [1638628422.929369951]: Finished loading Gazebo ROS API Plugin.
[ INFO] [1638628422.930317501]: waitForService: Service [/gazebo_gui/set_physics_properties] has not been advertised, waiting...
[ INFO] [1638628423.799665127]: waitForService: Service [/gazebo/set_physics_properties] is now available.
[ INFO] [1638628424.802669686, 0.001000000]: Physics dynamic reconfigure ready.
[ INFO] [1638628425.050944196, 0.001000000]: <initialOrientationAsReference> is unset, using default value of false to comply with REP 145 (world as orientation reference)
[ INFO] [1638628425.051000754, 0.001000000]: <robotNamespace> set to: //
[ INFO] [1638628425.051018364, 0.001000000]: <topicName> set to: body_imu/data_raw
[ INFO] [1638628425.051030433, 0.001000000]: <frameName> set to: imu_body_link
[ INFO] [1638628425.051052702, 0.001000000]: <updateRateHZ> set to: 100
[ INFO] [1638628425.051068107, 0.001000000]: <gaussianNoise> set to: 0.01
[ INFO] [1638628425.051088512, 0.001000000]: <xyzOffset> set to: 0 0 0
[ INFO] [1638628425.051116044, 0.001000000]: <rpyOffset> set to: 0 -0 0
INFO  [simulator] Simulator connected on TCP port 4560.
[ INFO] [1638628425.170096198, 0.001000000]: Realsense Gazebo ROS plugin loading.

RealSensePlugin: The realsense_camera plugin is attach to model drone
INFO  [commander] Mission #2 loaded, 4 WPs, curr: 0
INFO  [commander] LED: open /dev/led0 failed (22)
INFO  [init] Mixer: etc/mixers/quad_w.main.mix on /dev/pwm_output0
INFO  [init] setting PWM_AUX_OUT none
INFO  [mavlink] mode: Normal, data rate: 4000000 B/s on udp port 18570 remote port 14550
INFO  [mavlink] mode: Onboard, data rate: 4000000 B/s on udp port 14580 remote port 14540
INFO  [mavlink] mode: Onboard, data rate: 4000 B/s on udp port 14280 remote port 14030
INFO  [mavlink] mode: Gimbal, data rate: 400000 B/s on udp port 13030 remote port 13280
[ INFO] [1638628425.466389669, 0.178000000]: udp0: Remote address: 127.0.0.1:14580
[spawn_model-4] process has finished cleanly
log file: /home/rajendra/.ros/log/366b5ef6-550c-11ec-b2d5-15a442893f81/spawn_model-4*.log
[ INFO] [1638628425.474759173, 0.187000000]: IMU: High resolution IMU detected!
INFO  [logger] logger started (mode=all)
INFO  [logger] Start file log (type: full)
INFO  [logger] [logger] ./log/2021-12-04/14_33_45.ulg   
INFO  [logger] Opened full log file: ./log/2021-12-04/14_33_45.ulg
INFO  [mavlink] MAVLink only on localhost (set param MAV_{i}_BROADCAST = 1 to enable network)
INFO  [mavlink] MAVLink only on localhost (set param MAV_{i}_BROADCAST = 1 to enable network)
INFO  [px4] Startup script returned successfully
pxh> INFO  [mavlink] partner IP: 127.0.0.1
[ INFO] [1638628426.460413924, 1.167000000]: CON: Got HEARTBEAT, connected. FCU: PX4 Autopilot
[ INFO] [1638628426.461249663, 1.167000000]: IMU: High resolution IMU detected!
[ INFO] [1638628427.575136414, 2.179000000]: GF: Using MISSION_ITEM_INT
[ INFO] [1638628427.575302195, 2.179000000]: RP: Using MISSION_ITEM_INT
[ INFO] [1638628427.575442728, 2.179000000]: WP: Using MISSION_ITEM_INT
[ INFO] [1638628427.575642756, 2.179000000]: VER: 1.1: Capabilities         0x000000000000e4ef
[ INFO] [1638628427.575796512, 2.179000000]: VER: 1.1: Flight software:     010d0040 (c8c4066a19000000)
[ INFO] [1638628427.575933514, 2.180000000]: VER: 1.1: Middleware software: 010d0040 (c8c4066a19000000)
[ INFO] [1638628427.576122947, 2.180000000]: VER: 1.1: OS software:         050b00ff (ca1938fbcccc1a0a)
[ INFO] [1638628427.576247277, 2.180000000]: VER: 1.1: Board hardware:      00000001
[ INFO] [1638628427.576365489, 2.180000000]: VER: 1.1: VID/PID:             0000:0000
[ INFO] [1638628427.576492164, 2.180000000]: VER: 1.1: UID:                 4954414c44494e4f
[ INFO] [1638628429.694821638, 4.291000000]: IMU: Attitude quaternion IMU detected!
[ INFO] [1638628436.630709733, 11.168000000]: HP: requesting home position
[ INFO] [1638628441.643323808, 16.167000000]: GF: mission received
[ INFO] [1638628441.643434864, 16.167000000]: RP: mission received
[ INFO] [1638628441.643584027, 16.167000000]: WP: item #0* F: C: 16 p: 5 0 0 0 x: 371982920 y: -805782330 z: 20
[ INFO] [1638628441.643666196, 16.167000000]: WP: item #1  F: C: 16 p: 5 0 0 0 x: 371982920 y: -805782330 z: 20
[ INFO] [1638628441.643737075, 16.167000000]: WP: item #2  F: C: 16 p: 5 0 0 0 x: 371987020 y: -805788120 z: 20
[ INFO] [1638628441.643813025, 16.167000000]: WP: item #3  F: C: 16 p: 5 0 0 0 x: 371982920 y: -805782330 z: 20
[ INFO] [1638628441.643837085, 16.167000000]: WP: mission received
[ INFO] [1638628446.655291117, 21.167000000]: HP: requesting home position
[ INFO] [1638628456.679353990, 31.167000000]: HP: requesting home position
[ INFO] [1638628466.717452998, 41.167000000]: HP: requesting home position
INFO  [tone_alarm] notify negative
[ WARN] [1638628468.642238697, 43.082000000]: CMD: Unexpected command 176, result 1
INFO  [commander] Failsafe mode activated   
WARN  [mc_pos_control] invalid setpoints
[ INFO] [1638628476.747530924, 51.167000000]: HP: requesting home position
[ WARN] [1638628478.811294420, 53.127000000]: CMD: Unexpected command 176, result 0
[ INFO] [1638628486.990499149, 61.167000000]: HP: requesting home position
[ WARN] [1638628489.005346539, 63.170000000]: CMD: Unexpected command 176, result 0
[ INFO] [1638628497.034404516, 71.167000000]: HP: requesting home position
[ WARN] [1638628499.085291457, 73.214000000]: CMD: Unexpected command 176, result 0
[ INFO] [1638628507.157299672, 81.167000000]: HP: requesting home position
[ WARN] [1638628509.245491307, 83.247000000]: CMD: Unexpected command 176, result 0
[ INFO] [1638628517.296543228, 91.167000000]: HP: requesting home position
[ WARN] [1638628519.424094646, 93.290000000]: CMD: Unexpected command 176, result 0
[ INFO] [1638628527.321916095, 101.167000000]: HP: requesting home position
[ WARN] [1638628529.502450871, 103.335000000]: CMD: Unexpected command 176, result 0
[ INFO] [1638628537.455140686, 111.168000000]: HP: requesting home position
[ WARN] [1638628539.664747504, 113.366000000]: CMD: Unexpected command 176, result 0

Below are my log

Log(Expand to see.) # rosrun mavros checkid OK. I got messages from 1:1. --- Received 5497 messages, from 1 addresses sys:comp list of messages Exception in thread Thread-5: Traceback (most recent call last): File "/usr/lib/python3.8/threading.py", line 932, in _bootstrap_inner self.run() File "/opt/ros/noetic/lib/python3/dist-packages/rospy/timer.py", line 237, in run self._callback(TimerEvent(last_expected, last_real, current_expected, current_real, last_duration)) File "/home/rajendra/drone_ws/src/mavros/mavros/scripts/checkid", line 82, in timer_cb for address, messages in self.message_sources.iteritems(): AttributeError: 'dict' object has no attribute 'iteritems' # rostopic echo -n 1 /diagnostics header: seq: 86 stamp: secs: 87 nsecs: 500000000 frame_id: '' status: - level: 0 name: "mavros: FCU connection" message: "connected" hardware_id: "udp://:14540@localhost:14557" values: - key: "Received packets:" value: "28621" - key: "Dropped packets:" value: "0" - key: "Buffer overruns:" value: "0" - key: "Parse errors:" value: "0" - key: "Rx sequence number:" value: "205" - key: "Tx sequence number:" value: "0" - key: "Rx total bytes:" value: "1769088" - key: "Tx total bytes:" value: "101219" - key: "Rx speed:" value: "21468.000000" - key: "Tx speed:" value: "9987.000000" - level: 2 name: "mavros: GPS" message: "No satellites" hardware_id: "udp://:14540@localhost:14557" values: - key: "Satellites visible" value: "0" - key: "Fix type" value: "0" - key: "EPH (m)" value: "Unknown" - key: "EPV (m)" value: "Unknown" - level: 0 name: "mavros: Heartbeat" message: "Normal" hardware_id: "udp://:14540@localhost:14557" values: - key: "Heartbeats since startup" value: "87" - key: "Frequency (Hz)" value: "1.047619" - key: "Vehicle type" value: "Quadrotor" - key: "Autopilot type" value: "PX4 Autopilot" - key: "Mode" value: "MANUAL" - key: "System status" value: "Standby" - level: 2 name: "mavros: System" message: "Sensor health" hardware_id: "udp://:14540@localhost:14557" values: - key: "Sensor present" value: "0x1028002C" - key: "Sensor enabled" value: "0x1021000C" - key: "Sensor health" value: "0x102E000F" - key: "3D magnetometer" value: "Ok" - key: "absolute pressure" value: "Ok" - key: "rc receiver" value: "Fail" - key: "AHRS subsystem health" value: "Ok" - key: "pre-arm check status. Always healthy when armed" value: "Ok" - key: "CPU Load (%)" value: "14.0" - key: "Drop rate (%)" value: "0.0" - key: "Errors comm" value: "0" - key: "Errors count #1" value: "0" - key: "Errors count #2" value: "0" - key: "Errors count #3" value: "0" - key: "Errors count #4" value: "0" - level: 0 name: "mavros: Battery" message: "Normal" hardware_id: "udp://:14540@localhost:14557" values: - key: "Voltage" value: "65.54" - key: "Current" value: "-0.0" - key: "Remaining" value: "-1.0" - level: 0 name: "mavros: Time Sync" message: "Normal" hardware_id: "udp://:14540@localhost:14557" values: - key: "Timesyncs since startup" value: "873" - key: "Frequency (Hz)" value: "10.000000" - key: "Last RTT (ms)" value: "0.000000" - key: "Mean RTT (ms)" value: "0.130584" - key: "Last remote time (s)" value: "87.396000000" - key: "Estimated time offset (s)" value: "0.004228993" # rostopic echo /mavros/state (Before running offboard) header: seq: 44 stamp: secs: 44 nsecs: 170000000 frame_id: '' connected: True armed: False guided: False manual_input: True mode: "MANUAL" system_status: 3 # rostopic echo /mavros/state (After running offboard) header: seq: 217 stamp: secs: 217 nsecs: 171000000 frame_id: '' connected: True armed: False guided: True manual_input: False mode: "AUTO.LAND" system_status: 3
iamrajee commented 2 years ago

When I tried with slam, then also it does not works: Terminal 1: roslaunch rtabmap_drone_example gazebo.launch Terminal 2: roslaunch rtabmap_drone_example slam.launch Terminal 3: roslaunch rtabmap_drone_example rviz.launch Terminal 4: rosrun rtabmap_drone_example offboard

See this video, where I describe the issue. Any lead on what might be causing this issue would be of great help, thank you.

Log & Output(Expand to see.) # Output Terminal1 ``` rajendra@u20:~/drone_ws$ roslaunch rtabmap_drone_example gazebo.launch ... logging to /home/rajendra/.ros/log/366b5ef6-550c-11ec-b2d5-15a442893f81/roslaunch-u20-477300.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. xacro: in-order processing became default in ROS Melodic. You can drop the option. started roslaunch server http://u20:36613/ SUMMARY ======== CLEAR PARAMETERS * /mavros/ PARAMETERS * /gazebo/enable_ros_network: True * /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/id: 2 * /mavros/distance_sensor/sonar_1_sub/orientation: PITCH_270 * /mavros/distance_sensor/sonar_1_sub/subscriber: True * /mavros/fake_gps/eph: 2.0 * /mavros/fake_gps/epv: 2.0 * /mavros/fake_gps/fix_type: 3 * /mavros/fake_gps/geo_origin/alt: 408.0 * /mavros/fake_gps/geo_origin/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://:14540@loca... * /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.000349065850398... * /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/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/mocap/use_pose: True * /mavros/mocap/use_tf: False * /mavros/odometry/in/child_frame_id: base_link * /mavros/odometry/in/frame_id: odom * /mavros/odometry/in/frame_tf/body_frame_orientation: flu * /mavros/odometry/in/frame_tf/local_frame: local_origin_ned * /mavros/odometry/out/frame_tf/body_frame_orientation: frd * /mavros/odometry/out/frame_tf/local_frame: vision_ned * /mavros/plugin_blacklist: ['safety_area', '... * /mavros/plugin_whitelist: [] * /mavros/px4flow/frame_id: px4flow * /mavros/px4flow/ranger_fov: 0.11868238913561441 * /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: True * /mavros/sys/disable_diag: False * /mavros/sys/min_voltage: 10.0 * /mavros/target_component_id: 1 * /mavros/target_system_id: 1 * /mavros/tdr_radio/low_rssi: 40 * /mavros/time/time_ref_source: fcu * /mavros/time/timesync_avg_alpha: 0.6 * /mavros/time/timesync_mode: MAVLINK * /mavros/vibration/frame_id: base_link * /mavros/vision_pose/tf/child_frame_id: vision_estimate * /mavros/vision_pose/tf/frame_id: map * /mavros/vision_pose/tf/listen: False * /mavros/vision_pose/tf/rate_limit: 10.0 * /mavros/vision_speed/listen_twist: True * /mavros/vision_speed/twist_cov: True * /mavros/wheel_odometry/child_frame_id: base_link * /mavros/wheel_odometry/count: 2 * /mavros/wheel_odometry/frame_id: map * /mavros/wheel_odometry/send_raw: True * /mavros/wheel_odometry/send_twist: False * /mavros/wheel_odometry/tf/child_frame_id: base_link * /mavros/wheel_odometry/tf/frame_id: map * /mavros/wheel_odometry/tf/send: True * /mavros/wheel_odometry/use_rpm: False * /mavros/wheel_odometry/vel_error: 0.1 * /mavros/wheel_odometry/wheel0/radius: 0.05 * /mavros/wheel_odometry/wheel0/x: 0.0 * /mavros/wheel_odometry/wheel0/y: -0.15 * /mavros/wheel_odometry/wheel1/radius: 0.05 * /mavros/wheel_odometry/wheel1/x: 0.0 * /mavros/wheel_odometry/wheel1/y: 0.15 * /robot_description: /home/rajendra/.ros/etc ______ __ __ ___ | ___ \ \ \ / / / | | |_/ / \ V / / /| | | __/ / \ / /_| | | | / /^\ \ \___ | \_| \/ \/ |_/ px4 starting. INFO [px4] Calling startup script: /bin/sh /home/rajendra/drone_ws/src/rtabmap_drone_example/config/rcS 0 process[spawn_model-4]: started with pid [477384] Info: found model autostart file as SYS_AUTOSTART=1099 INFO [param] selected parameter default file eeprom/parameters_1099 process[robot_state_publisher-5]: started with pid [477414] INFO [parameters] BSON document size 465 bytes, decoded 465 bytes [param] Loaded: eeprom/parameters_1099 process[mavros-6]: started with pid [477435] process[base_link_imu-7]: started with pid [477440] process[rotor_tf-8]: started with pid [477447] [ WARN] [1638664783.854496189]: The root link base_link has an inertia specified in the URDF, but KDL does not support a root link with an inertia. As a workaround, you can add an extra dummy link to your URDF. [ INFO] [1638664783.962679796]: FCU URL: udp://:14540@localhost:14557 [ INFO] [1638664783.966333463]: udp0: Bind address: 0.0.0.0:14540 [ INFO] [1638664783.966599867]: udp0: Remote address: 127.0.0.1:14557 [ INFO] [1638664783.966846985]: GCS bridge disabled [ INFO] [1638664783.984130485]: Plugin 3dr_radio loaded [ INFO] [1638664783.985788909]: Plugin 3dr_radio initialized [ INFO] [1638664783.986010718]: Plugin actuator_control loaded [ INFO] [1638664783.989150693]: Plugin actuator_control initialized [ INFO] [1638664783.994322435]: Plugin adsb loaded [ INFO] [1638664783.997281046]: Plugin adsb initialized [ INFO] [1638664783.997452678]: Plugin altitude loaded [ INFO] [1638664783.998289022]: Plugin altitude initialized [ INFO] [1638664783.998413993]: Plugin cam_imu_sync loaded [ INFO] [1638664783.998987342]: Plugin cam_imu_sync initialized [ INFO] [1638664783.999186523]: Plugin command loaded [ INFO] [1638664784.004504450]: Plugin command initialized [ INFO] [1638664784.004764077]: Plugin companion_process_status loaded [ INFO] [1638664784.007274796]: Plugin companion_process_status initialized [ INFO] [1638664784.007457310]: Plugin debug_value loaded [ INFO] [1638664784.012643978]: Plugin debug_value initialized [ INFO] [1638664784.012782538]: Plugin distance_sensor blacklisted [ INFO] [1638664784.012952210]: Plugin esc_status loaded [ INFO] [1638664784.013985970]: Plugin esc_status initialized [ INFO] [1638664784.014244588]: Plugin esc_telemetry loaded [ INFO] [1638664784.014900219]: Plugin esc_telemetry initialized [ INFO] [1638664784.015077908]: Plugin fake_gps loaded [ INFO] [1638664784.031937592]: Plugin fake_gps initialized [ INFO] [1638664784.032068091]: Plugin ftp loaded [ INFO] [1638664784.037658772]: Plugin ftp initialized [ INFO] [1638664784.037783637]: Plugin geofence loaded [ INFO] [1638664784.040339879]: Plugin geofence initialized [ INFO] [1638664784.040439011]: Plugin global_position loaded INFO [dataman] data manager file './dataman' size is 11798680 bytes PX4 SIM HOST: localhost INFO [simulator] Waiting for simulator to accept connection on TCP port 4560 [ INFO] [1638664784.055704054]: Plugin global_position initialized [ INFO] [1638664784.055803107]: Plugin gps_input loaded [ INFO] [1638664784.058205618]: Plugin gps_input initialized [ INFO] [1638664784.058290136]: Plugin gps_rtk loaded [ INFO] [1638664784.060754188]: Plugin gps_rtk initialized [ INFO] [1638664784.060862439]: Plugin gps_status loaded [ INFO] [1638664784.062833087]: Plugin gps_status initialized [ INFO] [1638664784.062936710]: Plugin hil loaded [ INFO] [1638664784.074121818]: Plugin hil initialized [ INFO] [1638664784.074263226]: Plugin home_position loaded [ INFO] [1638664784.077240907]: Plugin home_position initialized [ INFO] [1638664784.077354515]: Plugin imu loaded [ INFO] [1638664784.083436826]: Plugin imu initialized [ INFO] [1638664784.083535921]: Plugin landing_target loaded [ INFO] [1638664784.091530054]: Plugin landing_target initialized [ INFO] [1638664784.091680685]: Plugin local_position loaded [ INFO] [1638664784.098486553]: Plugin local_position initialized [ INFO] [1638664784.098618341]: Plugin log_transfer loaded [ INFO] [1638664784.101854734]: Plugin log_transfer initialized [ INFO] [1638664784.101952542]: Plugin mag_calibration_status loaded [ INFO] [1638664784.102938050]: Plugin mag_calibration_status initialized [ INFO] [1638664784.103039110]: Plugin manual_control loaded [ INFO] [1638664784.105671529]: Plugin manual_control initialized [ INFO] [1638664784.105783946]: Plugin mocap_pose_estimate loaded [ INFO] [1638664784.109178220]: Plugin mocap_pose_estimate initialized [ INFO] [1638664784.109338484]: Plugin mount_control loaded [ INFO] [1638664784.113758936]: Plugin mount_control initialized [ INFO] [1638664784.113983253]: Plugin nav_controller_output loaded [ INFO] [1638664784.114577774]: Plugin nav_controller_output initialized [ INFO] [1638664784.114720316]: Plugin obstacle_distance loaded [ INFO] [1638664784.117546661]: Plugin obstacle_distance initialized [ INFO] [1638664784.117694211]: Plugin odom loaded [ INFO] [1638664784.157334559]: Plugin odom initialized [ INFO] [1638664784.157489790]: Plugin onboard_computer_status loaded [ INFO] [1638664784.168196665]: Plugin onboard_computer_status initialized [ INFO] [1638664784.168372650]: Plugin param loaded [ INFO] [1638664784.170967445]: Plugin param initialized [ INFO] [1638664784.171093002]: Plugin play_tune loaded [ INFO] [1638664784.173375007]: Plugin play_tune initialized [ INFO] [1638664784.173491416]: Plugin px4flow loaded [ INFO] [1638664784.180947006]: Plugin px4flow initialized [ INFO] [1638664784.181083761]: Plugin rallypoint loaded [ INFO] [1638664784.183820499]: Plugin rallypoint initialized [ INFO] [1638664784.183904265]: Plugin rangefinder blacklisted [ INFO] [1638664784.184073695]: Plugin rc_io loaded [ INFO] [1638664784.187387573]: Plugin rc_io initialized [ INFO] [1638664784.187454931]: Plugin safety_area blacklisted [ INFO] [1638664784.187644182]: Plugin setpoint_accel loaded [ INFO] [1638664784.191187012]: Plugin setpoint_accel initialized [ INFO] [1638664784.191378429]: Plugin setpoint_attitude loaded [ INFO] [1638664784.201500009]: Plugin setpoint_attitude initialized [ INFO] [1638664784.201683938]: Plugin setpoint_position loaded [ INFO] [1638664784.218245748]: Plugin setpoint_position initialized [ INFO] [1638664784.218398710]: Plugin setpoint_raw loaded [ INFO] [1638664784.226034241]: Plugin setpoint_raw initialized [ INFO] [1638664784.226122004]: Plugin setpoint_trajectory loaded [ INFO] [1638664784.230151523]: Plugin setpoint_trajectory initialized [ INFO] [1638664784.230267208]: Plugin setpoint_velocity loaded [ INFO] [1638664784.235336954]: Plugin setpoint_velocity initialized [ INFO] [1638664784.235438989]: Plugin sys_status loaded [ INFO] [1638664784.245941785]: Plugin sys_status initialized [ INFO] [1638664784.246057459]: Plugin sys_time loaded [ INFO] [1638664784.250315396]: TM: Timesync mode: MAVLINK [ INFO] [1638664784.250672485]: TM: Not publishing sim time [ INFO] [1638664784.251639915]: Plugin sys_time initialized [ INFO] [1638664784.251719991]: Plugin trajectory loaded [ INFO] [1638664784.256109055]: Plugin trajectory initialized [ INFO] [1638664784.256202880]: Plugin tunnel loaded [ INFO] [1638664784.258506507]: Plugin tunnel initialized [ INFO] [1638664784.258580233]: Plugin vfr_hud loaded [ INFO] [1638664784.258970235]: Plugin vfr_hud initialized [ INFO] [1638664784.258992953]: Plugin vibration blacklisted [ INFO] [1638664784.259061478]: Plugin vision_pose_estimate loaded [ INFO] [1638664784.265139604]: Plugin vision_pose_estimate initialized [ INFO] [1638664784.265247146]: Plugin vision_speed_estimate loaded [ INFO] [1638664784.268452484]: Plugin vision_speed_estimate initialized [ INFO] [1638664784.268586641]: Plugin waypoint loaded [ INFO] [1638664784.272763859]: Plugin waypoint initialized [ INFO] [1638664784.272800562]: Plugin wheel_odometry blacklisted [ INFO] [1638664784.272880743]: Plugin wind_estimation loaded [ INFO] [1638664784.273245467]: Plugin wind_estimation initialized [ INFO] [1638664784.273271320]: Autostarting mavlink via USB on PX4 [ INFO] [1638664784.273306894]: Built-in SIMD instructions: SSE, SSE2 [ INFO] [1638664784.273335741]: Built-in MAVLink package version: 2021.10.10 [ INFO] [1638664784.273367848]: Known MAVLink dialects: common ardupilotmega ASLUAV all development icarous matrixpilot paparazzi standard uAvionix ualberta [ INFO] [1638664784.273397598]: MAVROS started. MY ID 1.240, TARGET ID 1.1 [ INFO] [1638664784.469687733]: Finished loading Gazebo ROS API Plugin. [ INFO] [1638664784.470548709]: waitForService: Service [/gazebo/set_physics_properties] has not been advertised, waiting... [ INFO] [1638664784.575292855]: Finished loading Gazebo ROS API Plugin. [ INFO] [1638664784.576123928]: waitForService: Service [/gazebo_gui/set_physics_properties] has not been advertised, waiting... [ INFO] [1638664785.412142258]: waitForService: Service [/gazebo/set_physics_properties] is now available. [ INFO] [1638664785.462018720]: Physics dynamic reconfigure ready. [ INFO] [1638664787.340141543, 0.001000000]: is unset, using default value of false to comply with REP 145 (world as orientation reference) [ INFO] [1638664787.340260465, 0.001000000]: set to: // [ INFO] [1638664787.340275517, 0.001000000]: set to: body_imu/data_raw [ INFO] [1638664787.340287837, 0.001000000]: set to: imu_body_link [ INFO] [1638664787.340341931, 0.001000000]: set to: 100 [ INFO] [1638664787.340359203, 0.001000000]: set to: 0.01 [ INFO] [1638664787.340377362, 0.001000000]: set to: 0 0 0 [ INFO] [1638664787.340446313, 0.001000000]: set to: 0 -0 0 INFO [simulator] Simulator connected on TCP port 4560. [ INFO] [1638664787.441596364, 0.001000000]: Realsense Gazebo ROS plugin loading. RealSensePlugin: The realsense_camera plugin is attach to model drone INFO [commander] Mission #2 loaded, 4 WPs, curr: 0 INFO [commander] LED: open /dev/led0 failed (22) INFO [init] Mixer: etc/mixers/quad_w.main.mix on /dev/pwm_output0 INFO [init] setting PWM_AUX_OUT none INFO [mavlink] mode: Normal, data rate: 4000000 B/s on udp port 18570 remote port 14550 INFO [mavlink] mode: Onboard, data rate: 4000000 B/s on udp port 14580 remote port 14540 [spawn_model-4] process has finished cleanly log file: /home/rajendra/.ros/log/366b5ef6-550c-11ec-b2d5-15a442893f81/spawn_model-4*.log INFO [mavlink] mode: Onboard, data rate: 4000 B/s on udp port 14280 remote port 14030 INFO [mavlink] mode: Gimbal, data rate: 400000 B/s on udp port 13030 remote port 13280 [ INFO] [1638664787.755669776, 0.182000000]: udp0: Remote address: 127.0.0.1:14580 [ INFO] [1638664787.764111662, 0.191000000]: IMU: High resolution IMU detected! INFO [logger] logger started (mode=all) INFO [logger] Start file log (type: full) INFO [logger] [logger] ./log/2021-12-05/00_39_47.ulg INFO [logger] Opened full log file: ./log/2021-12-05/00_39_47.ulg INFO [mavlink] MAVLink only on localhost (set param MAV_{i}_BROADCAST = 1 to enable network) INFO [mavlink] MAVLink only on localhost (set param MAV_{i}_BROADCAST = 1 to enable network) INFO [px4] Startup script returned successfully pxh> INFO [mavlink] partner IP: 127.0.0.1 [ INFO] [1638664788.747359977, 1.171000000]: CON: Got HEARTBEAT, connected. FCU: PX4 Autopilot [ INFO] [1638664788.748436732, 1.172000000]: IMU: High resolution IMU detected! [ INFO] [1638664789.765551393, 2.187000000]: GF: Using MISSION_ITEM_INT [ INFO] [1638664789.765625050, 2.187000000]: RP: Using MISSION_ITEM_INT [ INFO] [1638664789.765648629, 2.187000000]: WP: Using MISSION_ITEM_INT [ INFO] [1638664789.765683716, 2.187000000]: VER: 1.1: Capabilities 0x000000000000e4ef [ INFO] [1638664789.765706841, 2.187000000]: VER: 1.1: Flight software: 010d0040 (c8c4066a19000000) [ INFO] [1638664789.765725461, 2.187000000]: VER: 1.1: Middleware software: 010d0040 (c8c4066a19000000) [ INFO] [1638664789.765741697, 2.187000000]: VER: 1.1: OS software: 050b00ff (ca1938fbcccc1a0a) [ INFO] [1638664789.765761771, 2.187000000]: VER: 1.1: Board hardware: 00000001 [ INFO] [1638664789.765776034, 2.187000000]: VER: 1.1: VID/PID: 0000:0000 [ INFO] [1638664789.765798937, 2.187000000]: VER: 1.1: UID: 4954414c44494e4f [ INFO] [1638664791.868738411, 4.286000000]: IMU: Attitude quaternion IMU detected! [ INFO] [1638664798.941659514, 11.172000000]: HP: requesting home position [ INFO] [1638664803.954118096, 16.172000000]: GF: mission received [ INFO] [1638664803.954224519, 16.172000000]: RP: mission received [ INFO] [1638664803.954403816, 16.172000000]: WP: item #0* F: C: 16 p: 5 0 0 0 x: 371982920 y: -805782330 z: 20 [ INFO] [1638664803.954502339, 16.172000000]: WP: item #1 F: C: 16 p: 5 0 0 0 x: 371982920 y: -805782330 z: 20 [ INFO] [1638664803.954567055, 16.172000000]: WP: item #2 F: C: 16 p: 5 0 0 0 x: 371987020 y: -805788120 z: 20 [ INFO] [1638664803.954630502, 16.172000000]: WP: item #3 F: C: 16 p: 5 0 0 0 x: 371982920 y: -805782330 z: 20 [ INFO] [1638664803.954662885, 16.172000000]: WP: mission received [ INFO] [1638664808.965218208, 21.172000000]: HP: requesting home position [ INFO] [1638664819.086268064, 31.172000000]: HP: requesting home position [ INFO] [1638664829.141736302, 41.172000000]: HP: requesting home position [ INFO] [1638664839.283171990, 51.171000000]: HP: requesting home position [ INFO] [1638664849.829308429, 61.171000000]: HP: requesting home position [ INFO] [1638664860.297927970, 71.172000000]: HP: requesting home position [ INFO] [1638664870.560890796, 81.172000000]: HP: requesting home position [ INFO] [1638664880.868915279, 91.172000000]: HP: requesting home position [ INFO] [1638664891.076765889, 101.171000000]: HP: requesting home position INFO [commander] Failsafe mode activated [ WARN] [1638664899.239884488, 108.626000000]: CMD: Unexpected command 176, result 0 [ INFO] [1638664901.915145805, 111.171000000]: HP: requesting home position [ WARN] [1638664909.809633711, 118.667000000]: CMD: Unexpected command 176, result 0 [ INFO] [1638664912.348205080, 121.172000000]: HP: requesting home position [ WARN] [1638664920.047127052, 128.713000000]: CMD: Unexpected command 176, result 0 [ INFO] [1638664922.627237727, 131.171000000]: HP: requesting home position [ WARN] [1638664930.403684362, 138.747000000]: CMD: Unexpected command 176, result 0 [ INFO] [1638664933.056963147, 141.172000000]: HP: requesting home position [ WARN] [1638664941.385611314, 148.790000000]: CMD: Unexpected command 176, result 0 [ INFO] [1638664943.786853687, 151.172000000]: HP: requesting home position [ WARN] [1638664951.615709909, 158.830000000]: CMD: Unexpected command 176, result 0 [ INFO] [1638664954.087108664, 161.171000000]: HP: requesting home position [ WARN] [1638664962.183417678, 168.866000000]: CMD: Unexpected command 176, result 0 [ INFO] [1638664964.613940997, 171.171000000]: HP: requesting home position [ WARN] [1638664975.171476423, 178.907000000]: CMD: Unexpected command 176, result 0 [ INFO] [1638664978.781585266, 181.172000000]: HP: requesting home position [ WARN] [1638664987.545170548, 188.946000000]: CMD: Unexpected command 176, result 0 [ INFO] [1638664989.906227325, 191.171000000]: HP: requesting home position [ WARN] [1638665001.395058204, 198.986000000]: CMD: Unexpected command 176, result 0 [ INFO] [1638665005.620999697, 201.173000000]: HP: requesting home position [ WARN] [1638665013.644259939, 209.019000000]: CMD: Unexpected command 176, result 0 [ INFO] [1638665015.814285264, 211.171000000]: HP: requesting home position [ WARN] [1638665028.515538554, 219.065000000]: CMD: Unexpected command 176, result 0 [ INFO] [1638665031.300777671, 221.171000000]: HP: requesting home position [ WARN] [1638665039.587874302, 229.111000000]: CMD: Unexpected command 176, result 0 [ INFO] [1638665041.801804844, 231.171000000]: HP: requesting home position [ WARN] [1638665050.005406245, 239.155000000]: CMD: Unexpected command 176, result 0 [ INFO] [1638665052.084861793, 241.172000000]: HP: requesting home position [ WARN] [1638665060.344583559, 249.190000000]: CMD: Unexpected command 176, result 0 [ INFO] [1638665062.347132343, 251.172000000]: HP: requesting home position [ WARN] [1638665074.314120028, 259.228000000]: CMD: Unexpected command 176, result 0 [ INFO] [1638665076.328876954, 261.171000000]: HP: requesting home position [ WARN] [1638665084.765151935, 269.278000000]: CMD: Unexpected command 176, result 0 [ INFO] [1638665086.672772967, 271.172000000]: HP: requesting home position [ WARN] [1638665095.322503056, 279.310000000]: CMD: Unexpected command 176, result 0 [ INFO] [1638665097.208301656, 281.172000000]: HP: requesting home position ``` # Output terminal 2 ``` rajendra@u20:~/drone_ws$ roslaunch rtabmap_drone_example slam.launch ... logging to /home/rajendra/.ros/log/366b5ef6-550c-11ec-b2d5-15a442893f81/roslaunch-u20-478079.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://u20:40063/ SUMMARY ======== CLEAR PARAMETERS * /rtabmap/rgbd_odometry/ * /rtabmap/rtabmap/ * /rtabmap/rtabmapviz/ PARAMETERS * /camera_points_xyz/approx_sync: True * /camera_points_xyz/decimation: 4.0 * /camera_points_xyz/voxel_size: 0.0 * /empty_voxels_markers/cell_type: 0 * /imu_to_tf/base_frame_id: base_link * /imu_to_tf/fixed_frame_id: base_link_stabilized * /joy_node/autorepeat_rate: 5 * /move_base/DWAPlannerROS/acc_lim_theta: 3 * /move_base/DWAPlannerROS/acc_lim_trans: 1.5 * /move_base/DWAPlannerROS/acc_lim_x: 1.5 * /move_base/DWAPlannerROS/acc_lim_y: 1.5 * /move_base/DWAPlannerROS/forward_point_distance: 0.325 * /move_base/DWAPlannerROS/global_frame_id: odom * /move_base/DWAPlannerROS/goal_distance_bias: 20 * /move_base/DWAPlannerROS/latch_xy_goal_tolerance: False * /move_base/DWAPlannerROS/max_scaling_factor: 0.2 * /move_base/DWAPlannerROS/max_vel_theta: 1 * /move_base/DWAPlannerROS/max_vel_trans: 0.2 * /move_base/DWAPlannerROS/max_vel_x: 0.2 * /move_base/DWAPlannerROS/max_vel_y: 0.1 * /move_base/DWAPlannerROS/min_vel_theta: 0 * /move_base/DWAPlannerROS/min_vel_trans: 0.01 * /move_base/DWAPlannerROS/min_vel_x: -0.01 * /move_base/DWAPlannerROS/min_vel_y: -0.1 * /move_base/DWAPlannerROS/occdist_scale: 0.04 * /move_base/DWAPlannerROS/oscillation_reset_dist: 0.05 * /move_base/DWAPlannerROS/path_distance_bias: 32 * /move_base/DWAPlannerROS/publish_cost_grid_pc: True * /move_base/DWAPlannerROS/publish_traj_pc: True * /move_base/DWAPlannerROS/scaling_speed: 0.25 * /move_base/DWAPlannerROS/sim_time: 4 * /move_base/DWAPlannerROS/stop_time_buffer: 0.2 * /move_base/DWAPlannerROS/theta_stopped_vel: 0.01 * /move_base/DWAPlannerROS/trans_stopped_vel: 0.01 * /move_base/DWAPlannerROS/vth_samples: 20 * /move_base/DWAPlannerROS/vx_samples: 6 * /move_base/DWAPlannerROS/vy_samples: 6 * /move_base/DWAPlannerROS/xy_goal_tolerance: 0.3 * /move_base/DWAPlannerROS/yaw_goal_tolerance: 0.5 * /move_base/NavfnROS/allow_unknown: False * /move_base/base_local_planner: dwa_local_planner... * /move_base/controller_frequency: 10.0 * /move_base/global_costmap/controller_patience: 2.0 * /move_base/global_costmap/cost_scaling_factor: 2 * /move_base/global_costmap/footprint: [[0.16, 0.16], [-... * /move_base/global_costmap/footprint_padding: 0.05 * /move_base/global_costmap/global_frame: map * /move_base/global_costmap/inflate_unkown: True * /move_base/global_costmap/inflation_radius: 2 * /move_base/global_costmap/obstacle_range: 3.0 * /move_base/global_costmap/plugins: [{'name': 'static... * /move_base/global_costmap/publish_frequency: 1 * /move_base/global_costmap/raytrace_range: 3.5 * /move_base/global_costmap/robot_base_frame: base_link * /move_base/global_costmap/robot_radius: 0.32 * /move_base/global_costmap/static_map: True * /move_base/global_costmap/transform_tolerance: 1 * /move_base/global_costmap/update_frequency: 1 * /move_base/local_costmap/controller_patience: 2.0 * /move_base/local_costmap/cost_scaling_factor: 2 * /move_base/local_costmap/footprint: [[0.16, 0.16], [-... * /move_base/local_costmap/footprint_padding: 0.05 * /move_base/local_costmap/global_frame: map * /move_base/local_costmap/height: 4 * /move_base/local_costmap/inflate_unkown: True * /move_base/local_costmap/inflation_radius: 2 * /move_base/local_costmap/obstacle_range: 3.0 * /move_base/local_costmap/plugins: [{'name': 'voxel_... * /move_base/local_costmap/publish_frequency: 2.0 * /move_base/local_costmap/raytrace_range: 3.5 * /move_base/local_costmap/resolution: 0.05 * /move_base/local_costmap/robot_base_frame: base_link * /move_base/local_costmap/robot_radius: 0.32 * /move_base/local_costmap/rolling_window: True * /move_base/local_costmap/static_map: False * /move_base/local_costmap/transform_tolerance: 0.5 * /move_base/local_costmap/update_frequency: 5.0 * /move_base/local_costmap/voxel_layer/3d_cloud/clearing: True * /move_base/local_costmap/voxel_layer/3d_cloud/data_type: PointCloud2 * /move_base/local_costmap/voxel_layer/3d_cloud/marking: True * /move_base/local_costmap/voxel_layer/3d_cloud/max_obstacle_height: 1000 * /move_base/local_costmap/voxel_layer/3d_cloud/min_obstacle_height: -1000 * /move_base/local_costmap/voxel_layer/3d_cloud/topic: /camera_cloud * /move_base/local_costmap/voxel_layer/enabled: True * /move_base/local_costmap/voxel_layer/footprint_clearing_enabled: False * /move_base/local_costmap/voxel_layer/observation_sources: 3d_cloud * /move_base/local_costmap/voxel_layer/publish_voxel_map: True * /move_base/local_costmap/voxel_layer/z_resolution: 0.05 * /move_base/local_costmap/voxel_layer/z_voxels: 9 * /move_base/local_costmap/width: 4 * /move_base/planner_frequency: 1 * /rosdistro: noetic * /rosversion: 1.15.13 * /rtabmap/rgbd_odometry/approx_sync: True * /rtabmap/rgbd_odometry/config_path: * /rtabmap/rgbd_odometry/expected_update_rate: 0.0 * /rtabmap/rgbd_odometry/frame_id: base_link * /rtabmap/rgbd_odometry/ground_truth_base_frame_id: * /rtabmap/rgbd_odometry/ground_truth_frame_id: * /rtabmap/rgbd_odometry/guess_frame_id: base_link_stabilized * /rtabmap/rgbd_odometry/guess_min_rotation: 0.0 * /rtabmap/rgbd_odometry/guess_min_translation: 0.0 * /rtabmap/rgbd_odometry/keep_color: False * /rtabmap/rgbd_odometry/max_update_rate: 0.0 * /rtabmap/rgbd_odometry/odom_frame_id: odom * /rtabmap/rgbd_odometry/publish_tf: True * /rtabmap/rgbd_odometry/queue_size: 10 * /rtabmap/rgbd_odometry/subscribe_rgbd: False * /rtabmap/rgbd_odometry/wait_for_transform_duration: 0.2 * /rtabmap/rgbd_odometry/wait_imu_to_init: True * /rtabmap/rtabmap/Mem/IncrementalMemory: true * /rtabmap/rtabmap/Mem/InitWMWithAllNodes: false * /rtabmap/rtabmap/approx_sync: True * /rtabmap/rtabmap/config_path: * /rtabmap/rtabmap/database_path: ~/.ros/rtabmap.db * /rtabmap/rtabmap/frame_id: base_link * /rtabmap/rtabmap/gen_depth: False * /rtabmap/rtabmap/gen_depth_decimation: 1 * /rtabmap/rtabmap/gen_depth_fill_holes_error: 0.1 * /rtabmap/rtabmap/gen_depth_fill_holes_size: 0 * /rtabmap/rtabmap/gen_depth_fill_iterations: 1 * /rtabmap/rtabmap/gen_scan: False * /rtabmap/rtabmap/ground_truth_base_frame_id: * /rtabmap/rtabmap/ground_truth_frame_id: * /rtabmap/rtabmap/landmark_angular_variance: 9999.0 * /rtabmap/rtabmap/landmark_linear_variance: 0.0001 * /rtabmap/rtabmap/map_frame_id: map * /rtabmap/rtabmap/odom_frame_id: * /rtabmap/rtabmap/odom_frame_id_init: * /rtabmap/rtabmap/odom_sensor_sync: False * /rtabmap/rtabmap/odom_tf_angular_variance: 1.0 * /rtabmap/rtabmap/odom_tf_linear_variance: 1.0 * /rtabmap/rtabmap/publish_tf: True * /rtabmap/rtabmap/queue_size: 10 * /rtabmap/rtabmap/scan_cloud_max_points: 0 * /rtabmap/rtabmap/subscribe_depth: True * /rtabmap/rtabmap/subscribe_odom_info: True * /rtabmap/rtabmap/subscribe_rgb: True * /rtabmap/rtabmap/subscribe_rgbd: False * /rtabmap/rtabmap/subscribe_scan: False * /rtabmap/rtabmap/subscribe_scan_cloud: False * /rtabmap/rtabmap/subscribe_scan_descriptor: False * /rtabmap/rtabmap/subscribe_stereo: False * /rtabmap/rtabmap/subscribe_user_data: False * /rtabmap/rtabmap/use_action_for_goal: True * /rtabmap/rtabmap/wait_for_transform_duration: 0.2 * /rtabmap/rtabmapviz/approx_sync: True * /rtabmap/rtabmapviz/frame_id: base_link * /rtabmap/rtabmapviz/odom_frame_id: * /rtabmap/rtabmapviz/queue_size: 10 * /rtabmap/rtabmapviz/subscribe_depth: True * /rtabmap/rtabmapviz/subscribe_odom_info: True * /rtabmap/rtabmapviz/subscribe_rgb: True * /rtabmap/rtabmapviz/subscribe_rgbd: False * /rtabmap/rtabmapviz/subscribe_scan: False * /rtabmap/rtabmapviz/subscribe_scan_cloud: False * /rtabmap/rtabmapviz/subscribe_scan_descriptor: False * /rtabmap/rtabmapviz/subscribe_stereo: False * /rtabmap/rtabmapviz/wait_for_transform_duration: 0.2 * /teleop_node/autorepeat_rate: 5 * /teleop_node/axis_angular/yaw: 0 * /teleop_node/axis_linear/x: 4 * /teleop_node/axis_linear/y: 3 * /teleop_node/axis_linear/z: 1 * /teleop_node/enable_button: 4 * /teleop_node/scale_angular/yaw: 1 * /teleop_node/scale_linear/x: 1 * /teleop_node/scale_linear/y: 0.5 * /teleop_node/scale_linear/z: 1 NODES / camera_points_xyz (nodelet/nodelet) empty_voxels_markers (rtabmap_ros/voxel_markers) imu_filter_node (imu_complementary_filter/complementary_filter_node) imu_to_tf (nodelet/nodelet) joy_node (joy/joy_node) marked_voxels_markers (rtabmap_ros/voxel_markers) move_base (move_base/move_base) teleop_node (teleop_twist_joy/teleop_node) /rtabmap/ rgbd_odometry (rtabmap_ros/rgbd_odometry) rtabmap (rtabmap_ros/rtabmap) rtabmapviz (rtabmap_ros/rtabmapviz) ROS_MASTER_URI=http://localhost:11311 process[imu_filter_node-1]: started with pid [478107] process[imu_to_tf-2]: started with pid [478108] process[rtabmap/rgbd_odometry-3]: started with pid [478109] process[rtabmap/rtabmap-4]: started with pid [478111] process[rtabmap/rtabmapviz-5]: started with pid [478116] [ INFO] [1638664846.689365289]: Starting ComplementaryFilterROS process[camera_points_xyz-6]: started with pid [478120] process[move_base-7]: started with pid [478123] process[empty_voxels_markers-8]: started with pid [478124] process[marked_voxels_markers-9]: started with pid [478125] process[joy_node-10]: started with pid [478131] process[teleop_node-11]: started with pid [478172] [ INFO] [1638664846.855669454]: Teleop enable button 4. [ INFO] [1638664846.866319313]: Linear axis x on 4 at scale 1.000000. [ INFO] [1638664846.866384847]: Linear axis y on 3 at scale 0.500000. [ INFO] [1638664846.866414960]: Linear axis z on 1 at scale 1.000000. [ INFO] [1638664846.866440277]: Angular axis yaw on 0 at scale 1.000000. [ERROR] [1638664846.873143783]: Couldn't open joystick /dev/input/js0. Will retry every second. [ WARN] [1638664847.221859319, 58.893000000]: Timed out waiting for transform from base_link to map to become available before running costmap, tf error: canTransform: target_frame map does not exist. canTransform: source_frame base_link does not exist.. canTransform returned after 58.893 timeout was 0.1. [ INFO] [1638664847.271590589]: Starting node... [ INFO] [1638664847.383336487]: Initializing nodelet with 12 worker threads. [ INFO] [1638664847.438814949]: Initializing nodelet with 12 worker threads. [ INFO] [1638664847.611952590]: Odometry: frame_id = base_link [ INFO] [1638664847.611985446]: Odometry: odom_frame_id = odom [ INFO] [1638664847.612005937]: Odometry: publish_tf = true [ INFO] [1638664847.612021516]: Odometry: wait_for_transform = true [ INFO] [1638664847.612046498]: Odometry: wait_for_transform_duration = 0.200000 [ INFO] [1638664847.612084244]: Odometry: initial_pose = xyz=0.000000,0.000000,0.000000 rpy=0.000000,-0.000000,0.000000 [ INFO] [1638664847.612102113]: Odometry: ground_truth_frame_id = [ INFO] [1638664847.612116671]: Odometry: ground_truth_base_frame_id = [ INFO] [1638664847.612131864]: Odometry: config_path = [ INFO] [1638664847.612147104]: Odometry: publish_null_when_lost = true [ INFO] [1638664847.612166505]: Odometry: guess_frame_id = base_link_stabilized [ INFO] [1638664847.612182342]: Odometry: guess_min_translation = 0.000000 [ INFO] [1638664847.612197803]: Odometry: guess_min_rotation = 0.000000 [ INFO] [1638664847.612212754]: Odometry: guess_min_time = 0.000000 [ INFO] [1638664847.612229767]: Odometry: expected_update_rate = 0.000000 Hz [ INFO] [1638664847.612245259]: Odometry: max_update_rate = 0.000000 Hz [ INFO] [1638664847.614436685]: Odometry: wait_imu_to_init = true [ INFO] [1638664847.614492794]: Odometry: stereoParams_=0 visParams_=1 icpParams_=0 [ INFO] [1638664847.631814570]: Starting node... [ INFO] [1638664847.746534627, 59.344000000]: /rtabmap/rtabmap(maps): map_filter_radius = 0.000000 [ INFO] [1638664847.746584598, 59.344000000]: /rtabmap/rtabmap(maps): map_filter_angle = 30.000000 [ INFO] [1638664847.746604013, 59.344000000]: /rtabmap/rtabmap(maps): map_cleanup = true [ INFO] [1638664847.746632459, 59.344000000]: /rtabmap/rtabmap(maps): map_always_update = false [ INFO] [1638664847.746657527, 59.344000000]: /rtabmap/rtabmap(maps): map_empty_ray_tracing = true [ INFO] [1638664847.746680395, 59.344000000]: /rtabmap/rtabmap(maps): cloud_output_voxelized = true [ INFO] [1638664847.746697991, 59.344000000]: /rtabmap/rtabmap(maps): cloud_subtract_filtering = false [ INFO] [1638664847.746716443, 59.344000000]: /rtabmap/rtabmap(maps): cloud_subtract_filtering_min_neighbors = 2 [ INFO] [1638664847.747155056, 59.344000000]: /rtabmap/rtabmap(maps): octomap_tree_depth = 16 [ INFO] [1638664847.818551075, 59.344000000]: rtabmap: frame_id = base_link [ INFO] [1638664847.818593532, 59.344000000]: rtabmap: map_frame_id = map [ INFO] [1638664847.818613835, 59.344000000]: rtabmap: use_action_for_goal = true [ INFO] [1638664847.818646195, 59.344000000]: rtabmap: tf_delay = 0.050000 [ INFO] [1638664847.818667374, 59.344000000]: rtabmap: tf_tolerance = 0.100000 [ INFO] [1638664847.818686680, 59.344000000]: rtabmap: odom_sensor_sync = false [ INFO] [1638664847.819281190, 59.344000000]: rtabmap: gen_scan = false [ INFO] [1638664847.819307647, 59.344000000]: rtabmap: gen_depth = false [ INFO] [1638664847.877456452]: rtabmapviz: Using configuration from "/home/rajendra/.ros/rtabmap_gui.ini" [ INFO] [1638664848.173934168, 59.647000000]: Odometry: Ignored parameter "Grid/MapFrameProjection"="true" from arguments [ INFO] [1638664848.173969578, 59.647000000]: Odometry: Ignored parameter "Grid/MaxGroundHeight"="1" from arguments [ INFO] [1638664848.173981744, 59.647000000]: Odometry: Ignored parameter "Grid/MaxObstacleHeight"="1.6" from arguments [ INFO] [1638664848.173992154, 59.647000000]: Odometry: Ignored parameter "Kp/DetectorStrategy"="10" from arguments [ INFO] [1638664848.174003767, 59.647000000]: Update odometry parameter "Optimizer/GravitySigma"="0.1" from arguments [ INFO] [1638664848.174014036, 59.647000000]: Update odometry parameter "Vis/FeatureType"="10" from arguments [ INFO] [1638664848.191727772, 59.665000000]: Setting RTAB-Map parameter "Mem/IncrementalMemory"="true" [ INFO] [1638664848.192184788, 59.665000000]: Setting RTAB-Map parameter "Mem/InitWMWithAllNodes"="false" [ INFO] [1638664848.453657818, 59.927000000]: odometry: Subscribing to IMU topic /body_imu/data [ INFO] [1638664848.457941368, 59.932000000]: RGBDOdometry: approx_sync = true [ INFO] [1638664848.457972092, 59.932000000]: RGBDOdometry: queue_size = 10 [ INFO] [1638664848.457995510, 59.932000000]: RGBDOdometry: subscribe_rgbd = false [ INFO] [1638664848.458008461, 59.932000000]: RGBDOdometry: rgbd_cameras = 1 [ INFO] [1638664848.458027028, 59.932000000]: RGBDOdometry: keep_color = false [ INFO] [1638664848.478184945, 59.952000000]: /rtabmap/rgbd_odometry subscribed to (approx sync): /r200/camera/color/image_raw \ /r200/camera/depth/image_raw \ /r200/camera/color/camera_info [ INFO] [1638664848.525891182, 59.999000000]: Update RTAB-Map parameter "Grid/MapFrameProjection"="true" from arguments [ INFO] [1638664848.525940763, 59.999000000]: Update RTAB-Map parameter "Grid/MaxGroundHeight"="1" from arguments [ INFO] [1638664848.525957897, 59.999000000]: Update RTAB-Map parameter "Grid/MaxObstacleHeight"="1.6" from arguments [ INFO] [1638664848.525975043, 59.999000000]: Update RTAB-Map parameter "Kp/DetectorStrategy"="10" from arguments [ INFO] [1638664848.525991213, 59.999000000]: Update RTAB-Map parameter "Optimizer/GravitySigma"="0.1" from arguments [ INFO] [1638664848.526004834, 59.999000000]: Update RTAB-Map parameter "Vis/FeatureType"="10" from arguments [ INFO] [1638664848.714804242, 60.176000000]: RTAB-Map detection rate = 1.000000 Hz [ WARN] (2021-12-05 06:10:48.716) Odometry.cpp:315::process() Updated initial pose from xyz=0.000000,0.000000,0.000000 rpy=0.000000,-0.000000,0.000000 to xyz=0.000000,0.000000,0.000000 rpy=0.000319,-0.000688,-0.000130 with IMU orientation [ INFO] [1638664848.729518669, 60.191000000]: Odom: quality=0, std dev=99.995000m|99.995000rad, update time=0.012914s [ INFO] [1638664848.735062293, 60.197000000]: rtabmap: Deleted database "/home/rajendra/.ros/rtabmap.db" (--delete_db_on_start or -d are set). [ INFO] [1638664848.735121425, 60.197000000]: rtabmap: Using database from "/home/rajendra/.ros/rtabmap.db" (0 MB). [ INFO] [1638664848.798040425, 60.251000000]: Odom: quality=466, std dev=0.000032m|0.000032rad, update time=0.040095s libpng warning: iCCP: known incorrect sRGB profile libpng warning: iCCP: known incorrect sRGB profile libpng warning: iCCP: known incorrect sRGB profile [ INFO] [1638664848.846710882, 60.302000000]: Odom: quality=470, std dev=0.000032m|0.000032rad, update time=0.044329s [ INFO] [1638664848.886766785, 60.344000000]: rtabmap: Database version = "0.20.14". [ INFO] [1638664848.886808577, 60.344000000]: rtabmap: SLAM mode (Mem/IncrementalMemory=true) [ INFO] [1638664848.897652332, 60.355000000]: Odom: quality=483, std dev=0.000032m|0.000032rad, update time=0.040532s [ INFO] [1638664848.915549063, 60.372000000]: /rtabmap/rtabmap: subscribe_depth = true [ INFO] [1638664848.915599209, 60.372000000]: /rtabmap/rtabmap: subscribe_rgb = true [ INFO] [1638664848.915634655, 60.372000000]: /rtabmap/rtabmap: subscribe_stereo = false [ INFO] [1638664848.915671003, 60.372000000]: /rtabmap/rtabmap: subscribe_rgbd = false (rgbd_cameras=1) [ INFO] [1638664848.915775391, 60.372000000]: /rtabmap/rtabmap: subscribe_odom_info = true [ INFO] [1638664848.915885452, 60.373000000]: /rtabmap/rtabmap: subscribe_user_data = false [ INFO] [1638664848.915915653, 60.373000000]: /rtabmap/rtabmap: subscribe_scan = false [ INFO] [1638664848.915943310, 60.373000000]: /rtabmap/rtabmap: subscribe_scan_cloud = false [ INFO] [1638664848.915974565, 60.373000000]: /rtabmap/rtabmap: subscribe_scan_descriptor = false [ INFO] [1638664848.916005900, 60.373000000]: /rtabmap/rtabmap: queue_size = 10 [ INFO] [1638664848.916045213, 60.373000000]: /rtabmap/rtabmap: approx_sync = true [ INFO] [1638664848.916146920, 60.373000000]: Setup depth callback [ INFO] [1638664848.936953946, 60.395000000]: /rtabmap/rtabmap subscribed to (approx sync): /rtabmap/odom \ /r200/camera/color/image_raw \ /r200/camera/depth/image_raw \ /r200/camera/color/camera_info \ /rtabmap/odom_info [ INFO] [1638664848.956648215, 60.414000000]: Odom: quality=478, std dev=0.000032m|0.000032rad, update time=0.042877s [ INFO] [1638664849.004969677, 60.463000000]: Odom: quality=481, std dev=0.000032m|0.000032rad, update time=0.043837s [ INFO] [1638664849.058697625, 60.517000000]: Odom: quality=483, std dev=0.000032m|0.000032rad, update time=0.047492s [ INFO] [1638664849.107377888, 60.560000000]: Odom: quality=467, std dev=0.009229m|0.064474rad, update time=0.045246s [ INFO] [1638664849.113186458, 60.566000000]: rtabmap 0.20.14 started... [ INFO] [1638664849.155745900, 60.610000000]: Odom: quality=466, std dev=0.000032m|0.000032rad, update time=0.038769s [ INFO] [1638664849.165072988, 60.619000000]: rtabmapviz: Reading parameters from the ROS server... [ INFO] [1638664849.211348156, 60.666000000]: Odom: quality=477, std dev=0.006262m|0.051274rad, update time=0.047011s [ INFO] [1638664849.215095152, 60.669000000]: rtabmap (1): Rate=1.00s, Limit=0.000s, Conversion=0.0022s, RTAB-Map=0.0556s, Maps update=0.0001s pub=0.0001s (local map=1, WM=1) [ INFO] [1638664849.267791415, 60.722000000]: Odom: quality=457, std dev=0.000032m|0.000032rad, update time=0.050412s [ INFO] [1638664849.312881348, 60.767000000]: Odom: quality=477, std dev=0.004365m|0.050171rad, update time=0.038170s [ INFO] [1638664849.350028764, 60.805000000]: Odom: quality=497, std dev=0.000032m|0.000032rad, update time=0.035061s [ INFO] [1638664849.390528475, 60.845000000]: Odom: quality=485, std dev=0.007283m|0.038960rad, update time=0.035189s [ INFO] [1638664849.421617046, 60.877000000]: rtabmapviz: Parameters read = 352 [ INFO] [1638664849.421648078, 60.877000000]: rtabmapviz: Parameters successfully read. [ INFO] [1638664849.438983801, 60.894000000]: Odom: quality=479, std dev=0.002593m|0.027549rad, update time=0.040697s [ WARN] [1638664849.440653997, 60.896000000]: global_costmap: Pre-Hydro parameter "static_map" unused since "plugins" is provided [ INFO] [1638664849.441395353, 60.896000000]: global_costmap: Using plugin "static_layer" [ INFO] [1638664849.444365677, 60.899000000]: Requesting the map... [ INFO] [1638664849.483211015, 60.938000000]: Odom: quality=481, std dev=0.000032m|0.000032rad, update time=0.034470s [ INFO] [1638664849.524266557, 60.945000000]: Odom: quality=487, std dev=0.008595m|0.038960rad, update time=0.039286s [ INFO] [1638664849.670038753, 61.013000000]: Odom: quality=485, std dev=0.000032m|0.000032rad, update time=0.047009s [ INFO] [1638664849.714893210, 61.057000000]: Odom: quality=468, std dev=0.000032m|0.000032rad, update time=0.039000s [ INFO] [1638664849.739630914, 61.079000000]: /rtabmap/rtabmapviz: subscribe_depth = true [ INFO] [1638664849.739690185, 61.080000000]: /rtabmap/rtabmapviz: subscribe_rgb = true [ INFO] [1638664849.739709507, 61.080000000]: /rtabmap/rtabmapviz: subscribe_stereo = false [ INFO] [1638664849.739725020, 61.080000000]: /rtabmap/rtabmapviz: subscribe_rgbd = false (rgbd_cameras=1) [ INFO] [1638664849.739741330, 61.080000000]: /rtabmap/rtabmapviz: subscribe_odom_info = true [ INFO] [1638664849.739757006, 61.080000000]: /rtabmap/rtabmapviz: subscribe_user_data = false [ INFO] [1638664849.739773049, 61.080000000]: /rtabmap/rtabmapviz: subscribe_scan = false [ INFO] [1638664849.739788126, 61.080000000]: /rtabmap/rtabmapviz: subscribe_scan_cloud = false [ INFO] [1638664849.739804078, 61.080000000]: /rtabmap/rtabmapviz: subscribe_scan_descriptor = false [ INFO] [1638664849.739817578, 61.080000000]: /rtabmap/rtabmapviz: queue_size = 10 [ INFO] [1638664849.739832543, 61.080000000]: /rtabmap/rtabmapviz: approx_sync = true [ INFO] [1638664849.739856639, 61.080000000]: Setup depth callback [ INFO] [1638664849.769889697, 61.110000000]: Odom: quality=475, std dev=0.000032m|0.000032rad, update time=0.042728s [ INFO] [1638664849.816863091, 61.158000000]: Odom: quality=474, std dev=0.004654m|0.032761rad, update time=0.038391s [ INFO] [1638664849.845605655, 61.187000000]: /rtabmap/rtabmapviz subscribed to (approx sync): /rtabmap/odom \ /r200/camera/color/image_raw \ /r200/camera/depth/image_raw \ /r200/camera/color/camera_info \ /rtabmap/odom_info [ INFO] [1638664849.845891010, 61.187000000]: rtabmapviz started. [ INFO] [1638664849.877459929, 61.214000000]: Odom: quality=477, std dev=0.000032m|0.000032rad, update time=0.049140s [ INFO] [1638664849.918145667, 61.254000000]: Odom: quality=466, std dev=0.000032m|0.000032rad, update time=0.039829s [ INFO] [1638664849.966776705, 61.301000000]: Odom: quality=454, std dev=0.000032m|0.000032rad, update time=0.039084s [ INFO] [1638664850.023652413, 61.332000000]: Odom: quality=475, std dev=0.000032m|0.000032rad, update time=0.048165s [ INFO] [1638664850.076431946, 61.405000000]: Odom: quality=474, std dev=0.003788m|0.032761rad, update time=0.039236s [ INFO] [1638664850.117723998, 61.446000000]: Odom: quality=481, std dev=0.002016m|0.000032rad, update time=0.033253s [ INFO] [1638664850.163093203, 61.492000000]: Odom: quality=466, std dev=0.000032m|0.000032rad, update time=0.038723s [ INFO] [1638664850.217294102, 61.546000000]: Odom: quality=478, std dev=0.000032m|0.000032rad, update time=0.042637s [ INFO] [1638664850.265316612, 61.594000000]: Odom: quality=456, std dev=0.000032m|0.000032rad, update time=0.041019s [ INFO] [1638664850.318937426, 61.647000000]: Odom: quality=480, std dev=0.000032m|0.000032rad, update time=0.043016s [ INFO] [1638664850.370067492, 61.694000000]: Odom: quality=474, std dev=0.006728m|0.050171rad, update time=0.044565s [ WARN] [1638664850.373088241, 61.698000000]: /proj_map topic is deprecated! Subscribe to /grid_map topic instead. [ INFO] [1638664850.373295812, 61.698000000]: rtabmap (2): Rate=1.00s, Limit=0.000s, Conversion=0.0012s, RTAB-Map=0.0469s, Maps update=0.0058s pub=0.0002s (local map=1, WM=1) [ INFO] [1638664850.376780775, 61.701000000]: Resizing costmap to 85 X 82 at 0.050000 m/pix [ INFO] [1638664850.429246464, 61.749000000]: Odom: quality=482, std dev=0.002800m|0.032761rad, update time=0.050101s [ INFO] [1638664850.474274905, 61.793000000]: Odom: quality=466, std dev=0.005295m|0.041195rad, update time=0.038948s [ INFO] [1638664850.483166421, 61.801000000]: Received a 85 X 82 map at 0.050000 m/pix [ INFO] [1638664850.488919232, 61.807000000]: global_costmap: Using plugin "inflation_layer" [ INFO] [1638664850.522325109, 61.839000000]: Odom: quality=472, std dev=0.008309m|0.060975rad, update time=0.037826s [ WARN] [1638664850.528645389, 61.846000000]: local_costmap: Pre-Hydro parameter "static_map" unused since "plugins" is provided [ INFO] [1638664850.529328991, 61.846000000]: local_costmap: Using plugin "voxel_layer" [ INFO] [1638664850.531656022, 61.849000000]: Subscribed to Topics: 3d_cloud [ INFO] [1638664850.555461602, 61.873000000]: local_costmap: Using plugin "inflation_layer" [ INFO] [1638664850.566942785, 61.885000000]: Odom: quality=444, std dev=0.013544m|0.047716rad, update time=0.038674s [ INFO] [1638664850.590913459, 61.908000000]: Created local_planner dwa_local_planner/DWAPlannerROS [ INFO] [1638664850.593063371, 61.910000000]: Sim period is set to 0.10 [ INFO] [1638664850.611972161, 61.929000000]: Odom: quality=473, std dev=0.000032m|0.000032rad, update time=0.041132s [ INFO] [1638664850.660097035, 61.975000000]: Odom: quality=474, std dev=0.000032m|0.000032rad, update time=0.040281s [ INFO] [1638664850.705854395, 62.020000000]: Odom: quality=487, std dev=0.000032m|0.000032rad, update time=0.034101s [ INFO] [1638664850.749568493, 62.062000000]: Odom: quality=464, std dev=0.010107m|0.036256rad, update time=0.037590s [ INFO] [1638664850.799823311, 62.112000000]: Odom: quality=469, std dev=0.000032m|0.000032rad, update time=0.042754s [ INFO] [1638664850.849272102, 62.162000000]: Odom: quality=486, std dev=0.000032m|0.000032rad, update time=0.041859s [ INFO] [1638664850.902239429, 62.211000000]: Odom: quality=471, std dev=0.000032m|0.000032rad, update time=0.044437s [ INFO] [1638664850.956468203, 62.265000000]: Odom: quality=473, std dev=0.000032m|0.000032rad, update time=0.045738s [ INFO] [1638664851.002985003, 62.312000000]: Odom: quality=482, std dev=0.006088m|0.038960rad, update time=0.040905s [ INFO] [1638664851.045999338, 62.355000000]: Odom: quality=475, std dev=0.000032m|0.000032rad, update time=0.035472s [ INFO] [1638664851.108840371, 62.417000000]: Odom: quality=473, std dev=0.004158m|0.032761rad, update time=0.047544s [ INFO] [1638664851.165175944, 62.472000000]: Odom: quality=481, std dev=0.000032m|0.000032rad, update time=0.051847s [ INFO] [1638664851.220370200, 62.528000000]: Odom: quality=481, std dev=0.001372m|0.000032rad, update time=0.040413s [ INFO] [1638664851.268866784, 62.576000000]: Odom: quality=484, std dev=0.000032m|0.000032rad, update time=0.038707s [ INFO] [1638664851.316602291, 62.623000000]: Odom: quality=482, std dev=0.000032m|0.000032rad, update time=0.037046s [ INFO] [1638664851.358417100, 62.664000000]: Odom: quality=474, std dev=0.000032m|0.000032rad, update time=0.036231s [ INFO] [1638664851.405770399, 62.711000000]: Odom: quality=459, std dev=0.001919m|0.000032rad, update time=0.039946s [ INFO] [1638664851.410122705, 62.715000000]: rtabmap (3): Rate=1.00s, Limit=0.000s, Conversion=0.0013s, RTAB-Map=0.0430s, Maps update=0.0059s pub=0.0000s (local map=1, WM=1) [ INFO] [1638664851.456025431, 62.761000000]: Odom: quality=490, std dev=0.004474m|0.036256rad, update time=0.042086s [ INFO] [1638664851.497825965, 62.803000000]: Odom: quality=457, std dev=0.003266m|0.027549rad, update time=0.033936s [ INFO] [1638664851.543059684, 62.847000000]: Odom: quality=467, std dev=0.000032m|0.000032rad, update time=0.035963s [ INFO] [1638664851.585066357, 62.888000000]: Odom: quality=459, std dev=0.000032m|0.000032rad, update time=0.035366s [ INFO] [1638664851.607180807, 62.911000000]: Recovery behavior will clear layer 'obstacles' [ INFO] [1638664851.612348452, 62.916000000]: Recovery behavior will clear layer 'obstacles' [ INFO] [1638664851.627638904, 62.931000000]: Odom: quality=480, std dev=0.000032m|0.000032rad, update time=0.039303s [ INFO] [1638664851.643492404, 62.947000000]: odom received! [ INFO] [1638664851.680561003, 62.976000000]: Odom: quality=465, std dev=0.005497m|0.048989rad, update time=0.048425s [ INFO] [1638664851.735006104, 63.030000000]: Odom: quality=462, std dev=0.002929m|0.038960rad, update time=0.045183s [ INFO] [1638664851.784790618, 63.081000000]: Odom: quality=456, std dev=0.009962m|0.070132rad, update time=0.042711s [ INFO] [1638664851.832583768, 63.129000000]: Odom: quality=488, std dev=0.003777m|0.027549rad, update time=0.040276s [ INFO] [1638664851.878651090, 63.175000000]: Odom: quality=462, std dev=0.000032m|0.000032rad, update time=0.037882s [ INFO] [1638664851.928141927, 63.224000000]: Odom: quality=454, std dev=0.005876m|0.027549rad, update time=0.038578s [ INFO] [1638664851.977777763, 63.274000000]: Odom: quality=473, std dev=0.000032m|0.000032rad, update time=0.037967s [ INFO] [1638664852.036451004, 63.332000000]: Odom: quality=472, std dev=0.000032m|0.000032rad, update time=0.043836s [ INFO] [1638664852.088337067, 63.383000000]: Odom: quality=479, std dev=0.007222m|0.036256rad, update time=0.046007s [ INFO] [1638664852.132817245, 63.427000000]: Odom: quality=474, std dev=0.004752m|0.047716rad, update time=0.039414s [ INFO] [1638664852.183857723, 63.478000000]: Odom: quality=468, std dev=0.004027m|0.027549rad, update time=0.041303s [ INFO] [1638664852.229650078, 63.523000000]: Odom: quality=478, std dev=0.001896m|0.000032rad, update time=0.037400s [ INFO] [1638664852.279776061, 63.571000000]: Odom: quality=461, std dev=0.000032m|0.000032rad, update time=0.034763s [ INFO] [1638664852.329183406, 63.621000000]: Odom: quality=467, std dev=0.000032m|0.000032rad, update time=0.034891s ``` # Output of terminal 3 ``` rajendra@u20:~/drone_ws$ roslaunch rtabmap_drone_example rviz.launch ... logging to /home/rajendra/.ros/log/366b5ef6-550c-11ec-b2d5-15a442893f81/roslaunch-u20-478478.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://u20:37309/ SUMMARY ======== PARAMETERS * /rosdistro: noetic * /rosversion: 1.15.13 NODES / rviz (rviz/rviz) ROS_MASTER_URI=http://localhost:11311 process[rviz-1]: started with pid [478516] ``` # Output terminal 4 ``` rajendra@u20:~/drone_ws$ rosrun rtabmap_drone_example offboard [ INFO] [1638664893.550042286, 103.616000000]: Setting offboard mode... (5 seconds) [ INFO] [1638664894.125619364, 104.070000000]: Initial position=(-0.000080,-0.000172,0.000103) yaw=-0.000016 [ INFO] [1638664899.232848557, 108.619000000]: Offboard enabled [ INFO] [1638664899.232883171, 108.620000000]: Vehicle arming... (5 seconds) [ INFO] [1638664904.515509322, 113.638000000]: Offboard enabled [ INFO] [1638664904.515552652, 113.638000000]: Vehicle arming... (5 seconds) [ INFO] [1638664909.804103343, 118.659000000]: Offboard enabled [ INFO] [1638664909.804192563, 118.661000000]: Vehicle arming... (5 seconds) [ INFO] [1638664914.874221923, 123.680000000]: Offboard enabled [ INFO] [1638664914.874320678, 123.680000000]: Vehicle arming... (5 seconds) [ INFO] [1638664920.032219844, 128.700000000]: Offboard enabled [ INFO] [1638664920.032280478, 128.700000000]: Vehicle arming... (5 seconds) [ INFO] [1638664925.326180044, 133.720000000]: Offboard enabled [ INFO] [1638664925.326212379, 133.720000000]: Vehicle arming... (5 seconds) [ INFO] [1638664930.397371717, 138.740000000]: Offboard enabled [ INFO] [1638664930.397410739, 138.740000000]: Vehicle arming... (5 seconds) [ INFO] [1638664936.080380876, 143.757000000]: Offboard enabled [ INFO] [1638664936.080421704, 143.757000000]: Vehicle arming... (5 seconds) [ INFO] [1638664941.374600279, 148.778000000]: Offboard enabled [ INFO] [1638664941.374728019, 148.778000000]: Vehicle arming... (5 seconds) [ INFO] [1638664946.434186344, 153.798000000]: Offboard enabled [ INFO] [1638664946.434266846, 153.798000000]: Vehicle arming... (5 seconds) [ INFO] [1638664951.606175234, 158.821000000]: Offboard enabled [ INFO] [1638664951.606206264, 158.821000000]: Vehicle arming... (5 seconds) [ INFO] [1638664957.000586370, 163.835000000]: Offboard enabled [ INFO] [1638664957.000635786, 163.835000000]: Vehicle arming... (5 seconds) [ INFO] [1638664962.175725202, 168.859000000]: Offboard enabled [ INFO] [1638664962.175789679, 168.859000000]: Vehicle arming... (5 seconds) [ INFO] [1638664967.664721014, 173.877000000]: Offboard enabled [ INFO] [1638664967.664783143, 173.877000000]: Vehicle arming... (5 seconds) [ INFO] [1638664975.153628482, 178.900000000]: Offboard enabled [ INFO] [1638664975.153753525, 178.900000000]: Vehicle arming... (5 seconds) [ INFO] [1638664982.245306327, 183.914000000]: Offboard enabled [ INFO] [1638664982.245360001, 183.914000000]: Vehicle arming... (5 seconds) [ INFO] [1638664987.539873764, 188.941000000]: Offboard enabled [ INFO] [1638664987.539959032, 188.941000000]: Vehicle arming... (5 seconds) [ INFO] [1638664992.852407323, 193.961000000]: Offboard enabled [ INFO] [1638664992.852448740, 193.961000000]: Vehicle arming... (5 seconds) [ INFO] [1638665001.382028383, 198.975000000]: Offboard enabled [ INFO] [1638665001.382166105, 198.975000000]: Vehicle arming... (5 seconds) [ INFO] [1638665008.580849202, 203.995000000]: Offboard enabled [ INFO] [1638665008.580890816, 203.995000000]: Vehicle arming... (5 seconds) [ INFO] [1638665013.643841326, 209.018000000]: Offboard enabled [ INFO] [1638665013.643893777, 209.018000000]: Vehicle arming... (5 seconds) [ INFO] [1638665018.929573447, 214.041000000]: Offboard enabled [ INFO] [1638665018.929611326, 214.041000000]: Vehicle arming... (5 seconds) [ INFO] [1638665028.495230814, 219.056000000]: Offboard enabled [ INFO] [1638665028.495360804, 219.056000000]: Vehicle arming... (5 seconds) [ INFO] [1638665034.497755800, 224.078000000]: Offboard enabled [ INFO] [1638665034.497811910, 224.079000000]: Vehicle arming... (5 seconds) [ INFO] [1638665039.572874262, 229.095000000]: Offboard enabled [ INFO] [1638665039.572950888, 229.095000000]: Vehicle arming... (5 seconds) [ INFO] [1638665044.919968039, 234.117000000]: Offboard enabled [ INFO] [1638665044.920047467, 234.117000000]: Vehicle arming... (5 seconds) [ INFO] [1638665049.992682823, 239.142000000]: Offboard enabled [ INFO] [1638665049.992716992, 239.142000000]: Vehicle arming... (5 seconds) [ INFO] [1638665055.223120519, 244.154000000]: Offboard enabled [ INFO] [1638665055.223185707, 244.154000000]: Vehicle arming... (5 seconds) [ INFO] [1638665060.334487509, 249.181000000]: Offboard enabled [ INFO] [1638665060.334568420, 249.181000000]: Vehicle arming... (5 seconds) [ INFO] [1638665066.272444430, 254.203000000]: Offboard enabled [ INFO] [1638665066.272849466, 254.203000000]: Vehicle arming... (5 seconds) [ INFO] [1638665074.298292798, 259.222000000]: Offboard enabled [ INFO] [1638665074.298445044, 259.222000000]: Vehicle arming... (5 seconds) [ INFO] [1638665079.432659002, 264.238000000]: Offboard enabled [ INFO] [1638665079.432704541, 264.238000000]: Vehicle arming... (5 seconds) [ INFO] [1638665084.749831287, 269.262000000]: Offboard enabled [ INFO] [1638665084.749872146, 269.262000000]: Vehicle arming... (5 seconds) [ INFO] [1638665090.047841476, 274.279000000]: Offboard enabled [ INFO] [1638665090.047931331, 274.279000000]: Vehicle arming... (5 seconds) [ INFO] [1638665095.310403717, 279.297000000]: Offboard enabled [ INFO] [1638665095.310552148, 279.297000000]: Vehicle arming... (5 seconds) [ INFO] [1638665100.389571470, 284.318000000]: Offboard enabled [ INFO] [1638665100.389655446, 284.319000000]: Vehicle arming... (5 seconds) ``` # rajendra@u20:~/drone_ws$ rosrun mavros checkid OK. I got messages from 1:1. Received 5483 messages, from 1 addresses sys:comp list of messages Exception in thread Thread-6: Traceback (most recent call last): File "/usr/lib/python3.8/threading.py", line 932, in _bootstrap_inner self.run() File "/opt/ros/noetic/lib/python3/dist-packages/rospy/timer.py", line 237, in run self._callback(TimerEvent(last_expected, last_real, current_expected, current_real, last_duration)) File "/home/rajendra/drone_ws/src/mavros/mavros/scripts/checkid", line 82, in timer_cb for address, messages in self.message_sources.iteritems(): AttributeError: 'dict' object has no attribute 'iteritems' # rajendra@u20:~/drone_ws$ rostopic echo -n 1 /mavros/state header: seq: 240 stamp: secs: 240 nsecs: 171000000 frame_id: '' connected: True armed: False guided: True manual_input: False mode: "AUTO.LAND" system_status: 3 # rajendra@u20:~/drone_ws$ rostopic echo -n 1 /diagnostics header: seq: 227 stamp: secs: 248 nsecs: 501000000 frame_id: '' status: - level: 0 name: "mavros: FCU connection" message: "connected" hardware_id: "udp://:14540@localhost:14557" values: - key: "Received packets:" value: "21130" - key: "Dropped packets:" value: "0" - key: "Buffer overruns:" value: "0" - key: "Parse errors:" value: "0" - key: "Rx sequence number:" value: "138" - key: "Tx sequence number:" value: "0" - key: "Rx total bytes:" value: "5297085" - key: "Tx total bytes:" value: "1487798" - key: "Rx speed:" value: "22217.000000" - key: "Tx speed:" value: "9987.000000" - level: 2 name: "mavros: GPS" message: "No satellites" hardware_id: "udp://:14540@localhost:14557" values: - key: "Satellites visible" value: "0" - key: "Fix type" value: "0" - key: "EPH (m)" value: "Unknown" - key: "EPV (m)" value: "Unknown" - level: 0 name: "mavros: Heartbeat" message: "Normal" hardware_id: "udp://:14540@localhost:14557" values: - key: "Heartbeats since startup" value: "248" - key: "Frequency (Hz)" value: "1.000000" - key: "Vehicle type" value: "Quadrotor" - key: "Autopilot type" value: "PX4 Autopilot" - key: "Mode" value: "AUTO.LAND" - key: "System status" value: "Standby" - level: 2 name: "mavros: System" message: "Sensor health" hardware_id: "udp://:14540@localhost:14557" values: - key: "Sensor present" value: "0x1028002C" - key: "Sensor enabled" value: "0x1021000C" - key: "Sensor health" value: "0x102E000F" - key: "3D magnetometer" value: "Ok" - key: "absolute pressure" value: "Ok" - key: "rc receiver" value: "Fail" - key: "AHRS subsystem health" value: "Ok" - key: "pre-arm check status. Always healthy when armed" value: "Ok" - key: "CPU Load (%)" value: "19.6" - key: "Drop rate (%)" value: "0.0" - key: "Errors comm" value: "0" - key: "Errors count #1" value: "0" - key: "Errors count #2" value: "0" - key: "Errors count #3" value: "0" - key: "Errors count #4" value: "0" - level: 0 name: "mavros: Battery" message: "Normal" hardware_id: "udp://:14540@localhost:14557" values: - key: "Voltage" value: "65.54" - key: "Current" value: "-0.0" - key: "Remaining" value: "-1.0" - level: 0 name: "mavros: Time Sync" message: "Normal" hardware_id: "udp://:14540@localhost:14557" values: - key: "Timesyncs since startup" value: "2483" - key: "Frequency (Hz)" value: "10.000000" - key: "Last RTT (ms)" value: "0.000000" - key: "Mean RTT (ms)" value: "0.158679" - key: "Last remote time (s)" value: "248.396000000" - key: "Estimated time offset (s)" value: "0.004203860"
matlabbe commented 2 years ago

Here is my log on px4 terminal, it seems the flight software version is different. The EKF on your side is also not initialized.

[ INFO] [1639074645.906335780, 2.179000000]: GF: Using MISSION_ITEM_INT
[ INFO] [1639074645.906392478, 2.179000000]: RP: Using MISSION_ITEM_INT
[ INFO] [1639074645.906424167, 2.179000000]: WP: Using MISSION_ITEM_INT
[ INFO] [1639074645.906462046, 2.179000000]: VER: 1.1: Capabilities         0x000000000000e4ef
[ INFO] [1639074645.906490792, 2.179000000]: VER: 1.1: Flight software:     010c03ff (2e8918da66000000)
[ INFO] [1639074645.906522457, 2.179000000]: VER: 1.1: Middleware software: 010c03ff (2e8918da66000000)
[ INFO] [1639074645.906548027, 2.179000000]: VER: 1.1: OS software:         050b00ff (bf660cba2af81f05)
[ INFO] [1639074645.906574252, 2.179000000]: VER: 1.1: Board hardware:      00000001
[ INFO] [1639074645.906596910, 2.179000000]: VER: 1.1: VID/PID:             0000:0000
[ INFO] [1639074645.906620395, 2.179000000]: VER: 1.1: UID:                 4954414c44494e4f
INFO  [ecl/EKF] 4080000: EKF aligned, (baro hgt, IMU buf: 21, OBS buf: 15)
[ INFO] [1639074648.021382750, 4.291000000]: IMU: Attitude quaternion IMU detected!
INFO  [ecl/EKF] 4148000: EKF aligned, (baro hgt, IMU buf: 21, OBS buf: 15)
INFO  [ecl/EKF] 7080000: EKF aligned, (baro hgt, IMU buf: 21, OBS buf: 15)
INFO  [ecl/EKF] 7084000: EKF aligned, (baro hgt, IMU buf: 21, OBS buf: 15)
INFO  [ecl/EKF] 7084000: EKF aligned, (baro hgt, IMU buf: 21, OBS buf: 15)
INFO  [ecl/EKF] 7088000: EKF aligned, (baro hgt, IMU buf: 21, OBS buf: 15)
[ INFO] [1639074654.927322356, 11.171000000]: HP: requesting home position
INFO  [gyro_calibration] gyro 0 (1310988) updating calibration, [-0.0009, 0.0226, 0.0011] -> [0.0000, 0.0002, -0.0001] 11.8°C
INFO  [gyro_calibration] gyro 1 (1310996) updating calibration, [-0.0009, 0.0231, 0.0012] -> [0.0000, 0.0002, -0.0001] 11.8°C
INFO  [gyro_calibration] gyro 2 (1311004) updating calibration, [-0.0009, 0.0231, 0.0012] -> [0.0000, 0.0002, -0.0001] 11.8°C
INFO  [ekf2] 1 - resetting IMU bias
INFO  [ekf2] 2 - resetting IMU bias
INFO  [ekf2] 0 - resetting IMU bias
INFO  [ekf2] 4 - resetting IMU bias
INFO  [ekf2] 5 - resetting IMU bias
INFO  [ekf2] 3 - resetting IMU bias
[ INFO] [1639074659.968311303, 16.170000000]: GF: mission received
[ INFO] [1639074659.969410314, 16.172000000]: RP: mission received
[ INFO] [1639074659.969475302, 16.172000000]: WP: mission received
[ INFO] [1639074664.988477632, 21.172000000]: HP: requesting home position

What is your commit version of PX4-Autopilot version? Here is mine:

git log
commit 2e8918da66af37922ededee1cc2d2efffec4cfb2 (HEAD, tag: v1.12.3, origin/stable, origin/beta)
Author: Daniel Agar <daniel@agar.ca>
Date:   Mon Sep 6 11:52:58 2021 -0400

    boards: cubepilot_cubeorange only start ADSB mavlink if console not present

     - cubepilot_cubeorange_test has the console enabled (used for test rack and bench debugging)
iamrajee commented 2 years ago

@matlabbe Thank you for your response, yes you're are right problem seems to be with a version mismatch. So I created a new workspace as per your instruction(thanks again for adding detailed instructions in Readme), and I could run it successfully.

matlabbe commented 2 years ago

Note that I just updated the repo to use PX4 v1.12.3 on melodic too because of the losing altitude issue depicted in the overview video. If you are using PX4 v1.8.2, you will be required to update to PX4 v1.12.3 if you pull again this repo.