Open sergioma295 opened 5 years ago
If you're also running QGroundControl port 14557 can be occupied. Try 14556.
Im not running QGroundControl. But i try your advise right now. Can you tell me how can i change the port?
How did you start mavros? I always start it like this: roslaunch mavros px4.launch fcu_url:="udp://:14550@localhost:14556"
I have started with this: roslaunch mavros px4.launch
However, Also i have started with this: roslaunch mavros px4.launch fcu_url:="udp://:14550@localhost:14556"
And i have the same problem...
@sergioma295 stop spamming
@sergioma295 stop spamming
@sergioma295 stop spamming @sergioma295 @sergioma295 @sergioma295
@sergioma295 stop spamming @sergioma295 @sergioma295 @sergioma295
@khancyr I'm just trying to find someone who's going through the same thing with me. You've already written to me once and I haven't put anything back. Please stop bothering me
@hardeman Do you have any suggestions? Thank you very much for your help
@sergioma295 spamming your problem in multiple places is not going to solve your problem faster. Did you try to follow what's in https://dev.px4.io/master/en/simulation/ros_interface.html?
Im so sorry. Yes i have followed what's in https://dev.px4.io/master/en/simulation/ros_interface.html
I have a repository in my github https://github.com/sergioma295/Drone_Ros where there are all my project.
I can't found the problem..
Have you tried running the simulator as sudo?
sudo make px4_sitl gazebo
I also found this in your log: INFO [mavlink] mode: Normal, data rate: 4000000 B/s on udp port 14570 remote port 14550
try: roslaunch mavros px4.launch fcu_url:="udp://:14550@localhost:14570"
Issue details
I need some help. I'm doing the offboard tutorial explained in https://dev.px4.io/en/ros/mavros_offboard.html. I have followed all the steps and finally when I launch the node no topic publishes anything. I have installed and deleted the packages 6 times, I have tried to install from source or binary. I have consulted many forums and I can not know what is the problem I have and because my drone does not take off. Please, I need someone's help because I'm desperate.
I have uploaded all my configuration of both ros, catkin workspace and PX4/Firmware in my github repository because I don't find the problem https://github.com/sergioma295/Drone_Ros
I explain the most important steps I have taken below:
For "make px4_sitl gazebo": `sergio@sergio-ing:~/catkin_ws$ cd sergio@sergio-ing:~$ cd src/Firmware/ sergio@sergio-ing:~/src/Firmware$ make px4_sitl gazebo -- PX4 config file: /home/sergio/src/Firmware/boards/px4/sitl/default.cmake -- PX4 config: px4_sitl_default -- PX4 platform: posix -- PX4 lockstep: enabled -- PX4 version: v1.9.0-199-gbe02ad3 -- cmake build type: RelWithDebInfo -- The CXX compiler identification is GNU 5.4.0 -- The C compiler identification is GNU 5.4.0 -- The ASM compiler identification is GNU -- Found assembler: /usr/bin/cc -- Check for working CXX compiler using: Ninja -- Check for working CXX compiler using: Ninja -- works -- Detecting CXX compiler ABI info -- Detecting CXX compiler ABI info - done -- Detecting CXX compile features -- Detecting CXX compile features - done -- Check for working C compiler using: Ninja -- Check for working C compiler using: Ninja -- works -- Detecting C compiler ABI info -- Detecting C compiler ABI info - done -- Detecting C compile features -- Detecting C compile features - done -- Found PythonInterp: /usr/bin/python (found version "2.7.12") -- Found PY_jinja2: /usr/local/lib/python2.7/dist-packages/jinja2
-- PX4 ECL: Very lightweight Estimation & Control Library v1.9.0-rc1-5-g54ac147 -- Configuring done -- Generating done -- Build files have been written to: /home/sergio/src/Firmware/build/px4_sitl_default [20/687] git submodule src/drivers/gps/devices [24/687] git submodule src/lib/ecl [25/687] git submodule mavlink/include/mavlink/v2.0 [26/687] git submodule Tools/sitl_gazebo [234/687] Performing configure step for 'sitl_gazebo' -- install-prefix: /usr/local -- The C compiler identification is GNU 5.4.0 -- The CXX compiler identification is GNU 5.4.0 -- Check for working C compiler using: Ninja -- Check for working C compiler using: Ninja -- works -- Detecting C compiler ABI info -- Detecting C compiler ABI info - done -- Detecting C compile features -- Detecting C compile features - done -- Check for working CXX compiler using: Ninja -- Check for working CXX compiler using: Ninja -- works -- Detecting CXX compiler ABI info -- Detecting CXX compiler ABI info - done -- Detecting CXX compile features -- Detecting CXX compile features - done -- Performing Test COMPILER_SUPPORTS_CXX17 -- Performing Test COMPILER_SUPPORTS_CXX17 - Success -- Performing Test COMPILER_SUPPORTS_CXX14 -- Performing Test COMPILER_SUPPORTS_CXX14 - Success -- Performing Test COMPILER_SUPPORTS_CXX11 -- Performing Test COMPILER_SUPPORTS_CXX11 - Success -- Performing Test COMPILER_SUPPORTS_CXX0X -- Performing Test COMPILER_SUPPORTS_CXX0X - Success -- Using C++14 compiler -- Looking for pthread.h -- Looking for pthread.h - found -- Looking for pthread_create -- Looking for pthread_create - not found -- Looking for pthread_create in pthreads -- Looking for pthread_create in pthreads - not found -- Looking for pthread_create in pthread -- Looking for pthread_create in pthread - found -- Found Threads: TRUE
-- Boost version: 1.58.0 -- Found the following Boost libraries: -- system -- thread -- filesystem -- chrono -- date_time -- atomic -- Found Protobuf: /usr/lib/x86_64-linux-gnu/libprotobuf.so
-- Boost version: 1.58.0 -- Looking for OGRE... -- OGRE_PREFIX_WATCH changed. -- Found PkgConfig: /usr/bin/pkg-config (found version "0.29.1") -- Checking for module 'OGRE' -- Found OGRE, version 1.9.0 -- Found Ogre Ghadamon (1.9.0) -- Found OGRE: optimized;/usr/lib/x86_64-linux-gnu/libOgreMain.so;debug;/usr/lib/x86_64-linux-gnu/libOgreMain.so -- Looking for OGRE_Paging... -- Found OGRE_Paging: optimized;/usr/lib/x86_64-linux-gnu/libOgrePaging.so;debug;/usr/lib/x86_64-linux-gnu/libOgrePaging.so -- Looking for OGRE_Terrain... -- Found OGRE_Terrain: optimized;/usr/lib/x86_64-linux-gnu/libOgreTerrain.so;debug;/usr/lib/x86_64-linux-gnu/libOgreTerrain.so -- Looking for OGRE_Property... -- Found OGRE_Property: optimized;/usr/lib/x86_64-linux-gnu/libOgreProperty.so;debug;/usr/lib/x86_64-linux-gnu/libOgreProperty.so -- Looking for OGRE_RTShaderSystem... -- Found OGRE_RTShaderSystem: optimized;/usr/lib/x86_64-linux-gnu/libOgreRTShaderSystem.so;debug;/usr/lib/x86_64-linux-gnu/libOgreRTShaderSystem.so -- Looking for OGRE_Volume... -- Found OGRE_Volume: optimized;/usr/lib/x86_64-linux-gnu/libOgreVolume.so;debug;/usr/lib/x86_64-linux-gnu/libOgreVolume.so -- Looking for OGRE_Overlay... -- Found OGRE_Overlay: optimized;/usr/lib/x86_64-linux-gnu/libOgreOverlay.so;debug;/usr/lib/x86_64-linux-gnu/libOgreOverlay.so -- Found PythonInterp: /usr/bin/python (found version "2.7.12") -- Found OpenCV: /opt/ros/kinetic (found version "3.3.1") -- Found TinyXML: /usr/lib/x86_64-linux-gnu/libtinyxml.so
-- Checking for module 'OGRE' -- Found OGRE, version 1.9.0 -- Building klt_feature_tracker without catkin -- Building OpticalFlow with OpenCV -- Found MAVLink: /home/sergio/src/Firmware/mavlink/include (found version "2.0") -- catkin DISABLED -- Checking for module 'protobuf' -- Found protobuf, version 2.6.1 Gazebo version: 7.15 -- Configuring done -- Generating done -- Build files have been written to: /home/sergio/src/Firmware/build/px4_sitl_default/build_gazebo [684/687] Performing build step for 'sitl_gazebo' [1/86] Generating /home/sergio/src/Firmware/Tools/sitl_gazebo/models/px4flow/px4flow-gen.sdf [2/86] Generating /home/sergio/src/Firmware/Tools/sitl_gazebo/models/pixhawk/pixhawk-gen.sdf [3/86] Generating /home/sergio/src/Firmware/Tools/sitl_gazebo/models/3DR_gps_mag/3DR_gps_mag-gen.sdf [4/86] Running C++ protocol buffer compiler on msgs/CommandMotorSpeed.proto [5/86] Running C++ protocol buffer compiler on msgs/MotorSpeed.proto [6/86] Generating /home/sergio/src/Firmware/Tools/sitl_gazebo/models/sf10a/sf10a-gen.sdf [7/86] Running C++ protocol buffer compiler on msgs/Wind.proto [8/86] Running C++ protocol buffer compiler on msgs/Odometry.proto [9/86] Generating /home/sergio/src/Firmware/Tools/sitl_gazebo/models/matrice_100/matrice_100-gen.sdf [10/86] Generating /home/sergio/src/Firmware/Tools/sitl_gazebo/models/mb1240-xl-ez4/mb1240-xl-ez4-gen.sdf [11/86] Generating /home/sergio/src/Firmware/Tools/sitl_gazebo/models/iris/iris.sdf [12/86] Generating /home/sergio/src/Firmware/Tools/sitl_gazebo/models/r200/r200-gen.sdf [13/86] Generating /home/sergio/src/Firmware/Tools/sitl_gazebo/models/c920/c920-gen.sdf [14/86] Running C++ protocol buffer compiler on msgs/Int32.proto [15/86] Running C++ protocol buffer compiler on msgs/IRLock.proto [16/86] Building CXX object CMakeFiles/physics_msgs.dir/Wind.pb.cc.o [17/86] Building CXX object CMakeFiles/mav_msgs.dir/MotorSpeed.pb.cc.o [18/86] Building CXX object CMakeFiles/mav_msgs.dir/CommandMotorSpeed.pb.cc.o [19/86] Building CXX object CMakeFiles/std_msgs.dir/Int32.pb.cc.o [20/86] Building CXX object CMakeFiles/nav_msgs.dir/Odometry.pb.cc.o /home/sergio/src/Firmware/Tools/sitl_gazebo/models/c920/c920.sdf.jinja -> /home/sergio/src/Firmware/Tools/sitl_gazebo/models/c920/c920-gen.sdf [21/86] Running C++ protocol buffer compiler on msgs/Imu.proto [22/86] Running C++ protocol buffer compiler on msgs/Groundtruth.proto /home/sergio/src/Firmware/Tools/sitl_gazebo/models/r200/r200.sdf.jinja -> /home/sergio/src/Firmware/Tools/sitl_gazebo/models/r200/r200-gen.sdf [23/86] Running C++ protocol buffer compiler on msgs/Float.proto [24/86] Running C++ protocol buffer compiler on msgs/Range.proto [25/86] Running C++ protocol buffer compiler on msgs/SITLGps.proto [26/86] Running C++ protocol buffer compiler on msgs/OpticalFlow.proto [27/86] Running C++ protocol buffer compiler on msgs/MagneticField.proto [28/86] Running C++ protocol buffer compiler on msgs/Pressure.proto /home/sergio/src/Firmware/Tools/sitl_gazebo/models/pixhawk/pixhawk.sdf.jinja -> /home/sergio/src/Firmware/Tools/sitl_gazebo/models/pixhawk/pixhawk-gen.sdf [29/86] Building CXX object OpticalFlow/klt_feature_tracker/CMakeFiles/klt_feature_tracker.dir/src/trackFeatures.cpp.o /home/sergio/src/Firmware/Tools/sitl_gazebo/models/3DR_gps_mag/3DR_gps_mag.sdf.jinja -> /home/sergio/src/Firmware/Tools/sitl_gazebo/models/3DR_gps_mag/3DR_gps_mag-gen.sdf /home/sergio/src/Firmware/Tools/sitl_gazebo/models/px4flow/px4flow.sdf.jinja -> /home/sergio/src/Firmware/Tools/sitl_gazebo/models/px4flow/px4flow-gen.sdf /home/sergio/src/Firmware/Tools/sitl_gazebo/models/mb1240-xl-ez4/mb1240-xl-ez4.sdf.jinja -> /home/sergio/src/Firmware/Tools/sitl_gazebo/models/mb1240-xl-ez4/mb1240-xl-ez4-gen.sdf [30/86] Building CXX object CMakeFiles/sensor_msgs.dir/Imu.pb.cc.o [31/86] Building CXX object CMakeFiles/sensor_msgs.dir/Groundtruth.pb.cc.o [32/86] Building CXX object CMakeFiles/sensor_msgs.dir/IRLock.pb.cc.o [33/86] Building CXX object CMakeFiles/sensor_msgs.dir/Float.pb.cc.o [34/86] Building CXX object CMakeFiles/sensor_msgs.dir/OpticalFlow.pb.cc.o /home/sergio/src/Firmware/Tools/sitl_gazebo/models/sf10a/sf10a.sdf.jinja -> /home/sergio/src/Firmware/Tools/sitl_gazebo/models/sf10a/sf10a-gen.sdf [35/86] Building CXX object CMakeFiles/sensor_msgs.dir/Pressure.pb.cc.o /home/sergio/src/Firmware/Tools/sitl_gazebo/models/matrice_100/matrice_100.sdf.jinja -> /home/sergio/src/Firmware/Tools/sitl_gazebo/models/matrice_100/matrice_100-gen.sdf [36/86] Building CXX object CMakeFiles/sensor_msgs.dir/MagneticField.pb.cc.o
[37/86] Building CXX object CMakeFiles/sensor_msgs.dir/SITLGps.pb.cc.o [38/86] Building CXX object CMakeFiles/sensor_msgs.dir/Range.pb.cc.o [39/86] Linking CXX shared library libstd_msgs.so [40/86] Linking CXX shared library libnav_msgs.so [41/86] Linking CXX shared library libmav_msgs.so [42/86] Linking CXX shared library libphysics_msgs.so [43/86] Linking CXX static library OpticalFlow/klt_feature_tracker/libklt_feature_tracker.a [44/86] Building CXX object OpticalFlow/CMakeFiles/OpticalFlow.dir/src/optical_flow.cpp.o [45/86] Building CXX object OpticalFlow/CMakeFiles/OpticalFlow.dir/src/px4flow.cpp.o [46/86] Building CXX object OpticalFlow/CMakeFiles/OpticalFlow.dir/src/flow_px4.cpp.o [47/86] Building CXX object OpticalFlow/CMakeFiles/OpticalFlow.dir/src/flow_opencv.cpp.o [48/86] Linking CXX shared library libsensor_msgs.so [49/86] Building CXX object CMakeFiles/gazebo_uuv_plugin.dir/src/gazebo_uuv_plugin.cpp.o [50/86] Building CXX object CMakeFiles/LiftDragPlugin.dir/src/liftdrag_plugin/liftdrag_plugin.cpp.o [51/86] Building CXX object CMakeFiles/gazebo_barometer_plugin.dir/src/gazebo_barometer_plugin.cpp.o [52/86] Building CXX object CMakeFiles/gazebo_geotagged_images_plugin.dir/src/gazebo_geotagged_images_plugin.cpp.o [53/86] Building CXX object CMakeFiles/gazebo_gps_plugin.dir/src/gazebo_gps_plugin.cpp.o [54/86] Building CXX object CMakeFiles/gazebo_magnetometer_plugin.dir/src/geo_mag_declination.cpp.o [55/86] Building CXX object CMakeFiles/gazebo_irlock_plugin.dir/src/gazebo_irlock_plugin.cpp.o [56/86] Building CXX object CMakeFiles/gazebo_multirotor_base_plugin.dir/src/gazebo_multirotor_base_plugin.cpp.o [57/86] Building CXX object CMakeFiles/gazebo_magnetometer_plugin.dir/src/gazebo_magnetometer_plugin.cpp.o [58/86] Building CXX object CMakeFiles/gazebo_wind_plugin.dir/src/gazebo_wind_plugin.cpp.o [59/86] Building CXX object CMakeFiles/gazebo_controller_interface.dir/src/gazebo_controller_interface.cpp.o [60/86] Building CXX object CMakeFiles/gazebo_mavlink_interface.dir/src/gazebo_mavlink_interface.cpp.o [61/86] Building CXX object CMakeFiles/gazebo_sonar_plugin.dir/src/gazebo_sonar_plugin.cpp.o [62/86] Building CXX object CMakeFiles/gazebo_lidar_plugin.dir/src/gazebo_lidar_plugin.cpp.o [63/86] Building CXX object CMakeFiles/gazebo_vision_plugin.dir/src/gazebo_vision_plugin.cpp.o [64/86] Linking CXX shared library libgazebo_multirotor_base_plugin.so [65/86] Linking CXX shared library libgazebo_sonar_plugin.so [66/86] Linking CXX shared library libLiftDragPlugin.so [67/86] Linking CXX shared library libgazebo_barometer_plugin.so [68/86] Linking CXX shared library libgazebo_gps_plugin.so [69/86] Linking CXX shared library libgazebo_controller_interface.so [70/86] Building CXX object CMakeFiles/gazebo_imu_plugin.dir/src/gazebo_imu_plugin.cpp.o [71/86] Linking CXX shared library libgazebo_magnetometer_plugin.so [72/86] Linking CXX shared library libgazebo_wind_plugin.so [73/86] Linking CXX shared library libgazebo_irlock_plugin.so [74/86] Building CXX object CMakeFiles/gazebo_gimbal_controller_plugin.dir/src/gazebo_gimbal_controller_plugin.cpp.o [75/86] Linking CXX shared library libgazebo_lidar_plugin.so [76/86] Linking CXX shared library libgazebo_uuv_plugin.so [77/86] Building CXX object CMakeFiles/gazebo_motor_model.dir/src/gazebo_motor_model.cpp.o [78/86] Linking CXX shared library OpticalFlow/libOpticalFlow.so [79/86] Linking CXX shared library libgazebo_mavlink_interface.so [80/86] Building CXX object CMakeFiles/gazebo_opticalflow_plugin.dir/src/gazebo_opticalflow_plugin.cpp.o [81/86] Linking CXX shared library libgazebo_imu_plugin.so [82/86] Linking CXX shared library libgazebo_vision_plugin.so [83/86] Linking CXX shared library libgazebo_gimbal_controller_plugin.so [84/86] Linking CXX shared library libgazebo_motor_model.so [85/86] Linking CXX shared library libgazebo_geotagged_images_plugin.so [86/86] Linking CXX shared library libgazebo_opticalflow_plugin.so [687/687] cd /home/sergio/src/Firmware/build/px4_sitl_de...irmware /home/sergio/src/Firmware/build/px4_sitl_default SITL ARGS sitl_bin: /home/sergio/src/Firmware/build/px4_sitl_default/bin/px4 debugger: none program: gazebo model: none src_path: /home/sergio/src/Firmware build_path: /home/sergio/src/Firmware/build/px4_sitl_default empty model, setting iris as default GAZEBO_PLUGIN_PATH :/home/sergio/src/Firmware/build/px4_sitl_default/build_gazebo GAZEBO_MODEL_PATH :/home/sergio/src/Firmware/Tools/sitl_gazebo/models LD_LIBRARY_PATH /opt/ros/kinetic/lib:/opt/ros/kinetic/lib/x86_64-linux-gnu:/usr/local/cuda-9.0/lib64:/home/sergio/src/Firmware/build/px4_sitl_default/build_gazebo SITL COMMAND: "/home/sergio/src/Firmware/build/px4_sitl_default/bin/px4" "/home/sergio/src/Firmware"/ROMFS/px4fmu_common -s etc/init.d-posix/rcS -t "/home/sergio/src/Firmware"/test_data INFO [px4] Creating symlink /home/sergio/src/Firmware/ROMFS/px4fmu_common -> /home/sergio/src/Firmware/build/px4_sitl_default/tmp/rootfs/etc 0 WARNING: setRealtimeSched failed (not run as root?)
| \ \ \ / / / | | |/ / \ V / / /| | | / / \ / /_| | | | / /^\ \ __ | _| \/ \/ |/
px4 starting.
INFO [px4] Calling startup script: /bin/sh etc/init.d-posix/rcS 0 SYS_AUTOSTART: curr: 0 -> new: 10016 BAT_N_CELLS: curr: 0 -> new: 3 CAL_ACC0_ID: curr: 0 -> new: 1311244 CAL_ACC_PRIME: curr: 0 -> new: 1311244 CAL_GYRO0_ID: curr: 0 -> new: 2294028 CAL_GYRO_PRIME: curr: 0 -> new: 2294028 CAL_MAG0_ID: curr: 0 -> new: 197388 CAL_MAG_PRIME: curr: 0 -> new: 197388 CAL_BARO_PRIME: curr: 0 -> new: 6620172 COM_DISARM_LAND: curr: -1.0000 -> new: 0.1000 COM_OBL_ACT: curr: 0 -> new: 2 COM_OF_LOSS_T: curr: 0.0000 -> new: 5.0000 COM_RC_IN_MODE: curr: 0 -> new: 1 EKF2_ANGERR_INIT: curr: 0.1000 -> new: 0.0100 EKF2_GBIAS_INIT: curr: 0.1000 -> new: 0.0100 EKF2_REQ_GPS_H: curr: 10.0000 -> new: 0.5000 MC_PITCH_P: curr: 6.5000 -> new: 6.0000 MC_PITCHRATE_P: curr: 0.1500 -> new: 0.2000 MC_ROLL_P: curr: 6.5000 -> new: 6.0000 MC_ROLLRATE_P: curr: 0.1500 -> new: 0.2000 MPC_HOLD_MAX_Z: curr: 0.6000 -> new: 2.0000 MPC_Z_VEL_I: curr: 0.0200 -> new: 0.1500 MPC_Z_VEL_P: curr: 0.2000 -> new: 0.6000 MPC_XY_P: curr: 0.9500 -> new: 0.8000 MPC_XY_VEL_P: curr: 0.0900 -> new: 0.2000 MPC_XY_VEL_D: curr: 0.0100 -> new: 0.0160 MPC_JERK_MIN: curr: 8.0000 -> new: 10.0000 MPC_ACC_HOR_MAX: curr: 10.0000 -> new: 3.0000 NAV_ACC_RAD: curr: 10.0000 -> new: 2.0000 NAV_DLL_ACT: curr: 0 -> new: 2 RTL_DESCEND_ALT: curr: 30.0000 -> new: 5.0000 RTL_LAND_DELAY: curr: -1.0000 -> new: 5.0000 RTL_RETURN_ALT: curr: 60.0000 -> new: 30.0000 SDLOG_MODE: curr: 0 -> new: 1 SDLOG_PROFILE: curr: 3 -> new: 131 SDLOG_DIRS_MAX: curr: 0 -> new: 7 SENS_BOARD_X_OFF: curr: 0.0000 -> new: 0.0000 SENS_DPRES_OFF: curr: 0.0000 -> new: 0.0010
Gazebo multi-robot simulator, version 7.15.0 Copyright (C) 2012 Open Source Robotics Foundation. Released under the Apache 2 License. http://gazebosim.org
[Msg] Waiting for master. [Msg] Connected to gazebo master @ http://127.0.0.1:11345 [Msg] Publicized address: 161.111.30.114 [Msg] Waiting for master. [Msg] Connected to gazebo master @ http://127.0.0.1:11345 [Msg] Publicized address: 161.111.30.114 INFO [init] Mixer: etc/mixers/quad_w.main.mix on /dev/pwm_output0 ERROR [land_detector] Timed out while waiting for thread to start INFO [mavlink] mode: Normal, data rate: 4000000 B/s on udp port 14570 remote port 14550 INFO [mavlink] mode: Onboard, data rate: 4000000 B/s on udp port 14580 remote port 14540 INFO [logger] logger started (mode=all) INFO [logger] Start file log (type: full) INFO [logger] Opened full log file: ./log/2019-06-07/08_22_08.ulg INFO [mavlink] MAVLink only on localhost (set param MAV_BROADCAST = 1 to enable network) INFO [px4] Startup script returned successfully pxh> [Wrn] [gazebo_barometer_plugin.cpp:66] [gazebo_barometer_plugin] Using default home altitude of 488 m [Dbg] [gazebo_mavlink_interface.cpp:135] not found for channel[0] no joint control will be performed for this channel.
[Dbg] [gazebo_mavlink_interface.cpp:135] not found for channel[1] no joint control will be performed for this channel.
[Dbg] [gazebo_mavlink_interface.cpp:135] not found for channel[2] no joint control will be performed for this channel.
[Dbg] [gazebo_mavlink_interface.cpp:135] not found for channel[3] no joint control will be performed for this channel.
[Wrn] [gazebo_mavlink_interface.cpp:124] joint [zephyr_delta_wing::propeller_joint] not found for channel[4] no joint control for this channel.
[Wrn] [gazebo_mavlink_interface.cpp:124] joint [zephyr_delta_wing::flap_left_joint] not found for channel[5] no joint control for this channel.
[Wrn] [gazebo_mavlink_interface.cpp:124] joint [zephyr_delta_wing::flap_right_joint] not found for channel[6] no joint control for this channel.
[Dbg] [gazebo_mavlink_interface.cpp:135] not found for channel[7] no joint control will be performed for this channel.
[Msg] Connecting to PX4 SITL using TCP
[Msg] Lockstep is enabled
[Msg] Speed factor set to: 1
INFO [simulator] Simulator connected on TCP port 4560.
[Msg] Using MAVLink protocol v2.0
INFO [ekf2] Mag sensor ID changed to 197388
INFO [ecl/EKF] EKF aligned, (pressure height, IMU buf: 22, OBS buf: 14)
INFO [ecl/EKF] EKF GPS checks passed (WGS-84 origin set)
INFO [ecl/EKF] EKF commencing GPS fusion
pxh> commander arm
pxh> INFO [logger] closed logfile, bytes written: 21910810`
INFO [commander] Takeoff detected
WARN [commander] Failsafe enabled: no datalink
INFO [navigator] RTL HOME activated
INFO [navigator] RTL: climb to 499 m (10 m above home)
INFO [navigator] RTL: return at 499 m (10 m above home)
INFO [navigator] RTL: land at home
INFO [commander] Landing detected
INFO [logger] closed logfile, bytes written: 1922394
Then Iris in Gazebo simulator is armed and take off.
After that:
cd ~/src/Firmware/ make px4_sitl_default gazebo source Tools/setup_gazebo.bash $(pwd) $(pwd)/build/px4_sitl_default export ROS_PACKAGE_PATH=$ROS_PACKAGE_PATH:$(pwd) export ROS_PACKAGE_PATH=$ROS_PACKAGE_PATH:$(pwd)/Tools/sitl_gazebo roslaunch px4 posix_sitl.launch
Then output is: `sergio@sergio-ing:~/src/Firmware$ roslaunch px4 posix_sitl.launch ... logging to /home/sergio/.ros/log/5bdfcef4-8900-11e9-bdb6-309c23913dfd/roslaunch-sergio-ing-1006.log Checking log directory for disk usage. This may take awhile. Press Ctrl-C to interrupt Done checking log file disk usage. Usage is <1GB.
started roslaunch server http://localhost:38591/
SUMMARY
PARAMETERS
NODES / gazebo (gazebo_ros/gzserver) gazebo_gui (gazebo_ros/gzclient) sitl (px4/px4) vehicle_spawn_sergio_ing_1006_2060964585012166005 (gazebo_ros/spawn_model)
auto-starting new master process[master]: started with pid [1016] ROS_MASTER_URI=http://localhost:11311
setting /run_id to 5bdfcef4-8900-11e9-bdb6-309c23913dfd process[rosout-1]: started with pid [1029] started core service [/rosout] process[sitl-2]: started with pid [1053] INFO [px4] Creating symlink /home/sergio/src/Firmware/ROMFS/px4fmu_common -> /home/sergio/.ros/etc 0 WARNING: setRealtimeSched failed (not run as root?)
| \ \ \ / / / | | |/ / \ V / / /| | | / / \ / /_| | | | / /^\ \ __ | _| \/ \/ |/
px4 starting.
INFO [px4] Calling startup script: /bin/sh etc/init.d-posix/rcS 0 process[gazebo-3]: started with pid [1068] process[gazebo_gui-4]: started with pid [1080] process[vehicle_spawn_sergio_ing_1006_2060964585012166005-5]: started with pid [1096] INFO [dataman] Unknown restart, data manager file './dataman' size is 11798680 bytes INFO [simulator] Waiting for simulator to connect on TCP port 4560 [ INFO] [1559897025.894939070]: Finished loading Gazebo ROS API Plugin. [ INFO] [1559897025.896867480]: waitForService: Service [/gazebo/set_physics_properties] has not been advertised, waiting... [ INFO] [1559897025.938681649]: Finished loading Gazebo ROS API Plugin. [ INFO] [1559897025.939349371]: waitForService: Service [/gazebo/set_physics_properties] has not been advertised, waiting... SpawnModel script started [INFO] [1559897026.353814, 0.000000]: Loading model XML from file [INFO] [1559897026.354221, 0.000000]: Waiting for service /gazebo/spawn_sdf_model INFO [px4_work_queue] creating: wq:hp_default, priority: 88, stack: 16384 bytes INFO [init] Mixer: etc/mixers/quad_w.main.mix on /dev/pwm_output0 [ INFO] [1559897027.435024683, 0.024000000]: waitForService: Service [/gazebo/set_physics_properties] is now available. [ INFO] [1559897027.498284585, 0.088000000]: Physics dynamic reconfigure ready. [INFO] [1559897027.563114, 0.148000]: Calling service /gazebo/spawn_sdf_model [ INFO] [1559897027.601051270, 0.188000000]: waitForService: Service [/gazebo/set_physics_properties] is now available. ERROR [land_detector] Timed out while waiting for thread to start INFO [mavlink] mode: Normal, data rate: 4000000 B/s on udp port 14570 remote port 14550 INFO [mavlink] mode: Onboard, data rate: 4000000 B/s on udp port 14580 remote port 14540 INFO [logger] logger started (mode=all) INFO [logger] Start file log (type: full) INFO [logger] Opened full log file: ./log/2019-06-07/08_43_47.ulg INFO [mavlink] MAVLink only on localhost (set param MAV_BROADCAST = 1 to enable network) INFO [px4] Startup script returned successfully pxh> [INFO] [1559897027.833433, 0.348000]: Spawn status: SpawnModel: Successfully spawned entity [ INFO] [1559897027.848933997, 0.348000000]: Physics dynamic reconfigure ready. [vehicle_spawn_sergio_ing_1006_2060964585012166005-5] process has finished cleanly log file: /home/sergio/.ros/log/5bdfcef4-8900-11e9-bdb6-309c23913dfd/vehicle_spawn_sergio_ing_1006_2060964585012166005-5*.log INFO [simulator] Simulator connected on TCP port 4560. INFO [ecl/EKF] EKF aligned, (pressure height, IMU buf: 22, OBS buf: 14) INFO [ecl/EKF] EKF GPS checks passed (WGS-84 origin set) INFO [ecl/EKF] EKF commencing GPS fusion pxh> commander takeoff pxh> INFO [commander] Takeoff detected WARN [commander] Failsafe enabled: no datalink INFO [navigator] RTL HOME activated INFO [navigator] RTL: climb to 499 m (10 m above home) `
Finally, I launch the scripts:
`sergio@sergio-ing:~/catkin_ws$ ./launch-offb.sh GAZEBO_PLUGIN_PATH :/home/sergio/src/Firmware/build/posix_sitl_default/build_gazebo GAZEBO_MODEL_PATH :/home/sergio/src/Firmware/Tools/sitl_gazebo/models LD_LIBRARY_PATH /home/sergio/catkin_ws/devel/lib:/opt/ros/kinetic/lib:/opt/ros/kinetic/lib/x86_64-linux-gnu:/usr/local/cuda-9.0/lib64:/home/sergio/src/Firmware/build/posix_sitl_default/build_gazebo ... logging to /home/sergio/.ros/log/08d278c6-8903-11e9-bdb6-309c23913dfd/roslaunch-sergio-ing-7231.log Checking log directory for disk usage. This may take awhile. Press Ctrl-C to interrupt Done checking log file disk usage. Usage is <1GB.
started roslaunch server http://localhost:36531/
SUMMARY
CLEAR PARAMETERS
PARAMETERS
NODES / gazebo (gazebo_ros/gzserver) gazebo_gui (gazebo_ros/gzclient) mavros (mavros/mavros_node) offb (offb/offb_node) sitl (px4/px4) vehicle_spawn_sergio_ing_7231_1852301138231235699 (gazebo_ros/spawn_model)
auto-starting new master process[master]: started with pid [7241] ROS_MASTER_URI=http://localhost:11311
setting /run_id to 08d278c6-8903-11e9-bdb6-309c23913dfd process[rosout-1]: started with pid [7254] started core service [/rosout] process[sitl-2]: started with pid [7279] INFO [px4] Creating symlink /home/sergio/src/Firmware/ROMFS/px4fmu_common -> /home/sergio/.ros/etc 0 WARNING: setRealtimeSched failed (not run as root?)
| \ \ \ / / / | | |/ / \ V / / /| | | / / \ / /_| | | | / /^\ \ __ | _| \/ \/ |/
px4 starting.
INFO [px4] Calling startup script: /bin/sh etc/init.d-posix/rcS 0 process[gazebo-3]: started with pid [7293] process[gazebo_gui-4]: started with pid [7305] process[vehicle_spawn_sergio_ing_7231_1852301138231235699-5]: started with pid [7317] process[mavros-6]: started with pid [7327] process[offb-7]: started with pid [7328] INFO [dataman] Unknown restart, data manager file './dataman' size is 11798680 bytes INFO [simulator] Waiting for simulator to connect on TCP port 4560 [ INFO] [1559898174.912521090]: FCU URL: udp://:14540@localhost:14557 [ INFO] [1559898174.914508111]: udp0: Bind address: 0.0.0.0:14540 [ INFO] [1559898174.914615898]: udp0: Remote address: 127.0.0.1:14557 [ INFO] [1559898174.914742947]: GCS bridge disabled [ INFO] [1559898174.927921550]: Plugin 3dr_radio loaded [ INFO] [1559898174.930565952]: Plugin 3dr_radio initialized [ INFO] [1559898174.930704507]: Plugin actuator_control loaded [ INFO] [1559898174.935967886]: Plugin actuator_control initialized [ INFO] [1559898174.941312046]: Plugin adsb loaded [ INFO] [1559898174.946614031]: Plugin adsb initialized [ INFO] [1559898174.946819652]: Plugin altitude loaded [ INFO] [1559898174.948471510]: Plugin altitude initialized [ INFO] [1559898174.948621570]: Plugin cam_imu_sync loaded [ INFO] [1559898174.949432886]: Plugin cam_imu_sync initialized [ INFO] [1559898174.949610728]: Plugin command loaded [ INFO] [1559898174.957671510]: Plugin command initialized [ INFO] [1559898174.957851991]: Plugin companion_process_status loaded [ INFO] [1559898174.962040050]: Plugin companion_process_status initialized [ INFO] [1559898174.962191272]: Plugin debug_value loaded [ INFO] [1559898174.969710177]: Plugin debug_value initialized [ INFO] [1559898174.969759683]: Plugin distance_sensor blacklisted [ INFO] [1559898174.969910495]: Plugin fake_gps loaded [ INFO] [1559898175.056055401]: Plugin fake_gps initialized [ INFO] [1559898175.056289392]: Plugin ftp loaded [ INFO] [1559898175.139792471]: Plugin ftp initialized [ INFO] [1559898175.139984306]: Plugin global_position loaded [ INFO] [1559898175.178514847]: Plugin global_position initialized [ INFO] [1559898175.178682697]: Plugin gps_rtk loaded [ INFO] [1559898175.183358648]: Plugin gps_rtk initialized [ INFO] [1559898175.183524922]: Plugin hil loaded [ INFO] [1559898175.207798349]: Plugin hil initialized [ INFO] [1559898175.207962505]: Plugin home_position loaded [ INFO] [1559898175.223265309]: Plugin home_position initialized [ INFO] [1559898175.223449845]: Plugin imu loaded [ INFO] [1559898175.228942816]: Finished loading Gazebo ROS API Plugin. [ INFO] [1559898175.233254715]: waitForService: Service [/gazebo/set_physics_properties] has not been advertised, waiting... [ INFO] [1559898175.235026418]: Finished loading Gazebo ROS API Plugin. [ INFO] [1559898175.238488379]: waitForService: Service [/gazebo/set_physics_properties] has not been advertised, waiting... [ INFO] [1559898175.248873388]: Plugin imu initialized [ INFO] [1559898175.249094620]: Plugin local_position loaded [ INFO] [1559898175.268839607]: Plugin local_position initialized [ INFO] [1559898175.269005450]: Plugin log_transfer loaded [ INFO] [1559898175.275142986]: Plugin log_transfer initialized [ INFO] [1559898175.275301339]: Plugin manual_control loaded [ INFO] [1559898175.280880148]: Plugin manual_control initialized [ INFO] [1559898175.281021850]: Plugin mocap_pose_estimate loaded [ INFO] [1559898175.288288902]: Plugin mocap_pose_estimate initialized [ INFO] [1559898175.288464679]: Plugin obstacle_distance loaded [ INFO] [1559898175.292646804]: Plugin obstacle_distance initialized [ INFO] [1559898175.292817951]: Plugin odom loaded [ INFO] [1559898175.305114310]: Plugin odom initialized [ INFO] [1559898175.305290527]: Plugin param loaded [ INFO] [1559898175.310075890]: Plugin param initialized [ INFO] [1559898175.310252882]: Plugin px4flow loaded [ INFO] [1559898175.324466154]: Plugin px4flow initialized [ INFO] [1559898175.324513973]: Plugin rangefinder blacklisted [ INFO] [1559898175.324651671]: Plugin rc_io loaded [ INFO] [1559898175.331773292]: Plugin rc_io initialized [ INFO] [1559898175.331816476]: Plugin safety_area blacklisted [ INFO] [1559898175.331954312]: Plugin setpoint_accel loaded [ INFO] [1559898175.338063473]: Plugin setpoint_accel initialized [ INFO] [1559898175.338257158]: Plugin setpoint_attitude loaded [ INFO] [1559898175.354773135]: Plugin setpoint_attitude initialized [ INFO] [1559898175.354973781]: Plugin setpoint_position loaded [ INFO] [1559898175.378792321]: Plugin setpoint_position initialized [ INFO] [1559898175.378998332]: Plugin setpoint_raw loaded [ INFO] [1559898175.394074355]: Plugin setpoint_raw initialized [ INFO] [1559898175.394267011]: Plugin setpoint_velocity loaded [ INFO] [1559898175.453966087]: Plugin setpoint_velocity initialized [ INFO] [1559898175.454264724]: Plugin sys_status loaded SpawnModel script started [ INFO] [1559898175.526969426]: Plugin sys_status initialized [ INFO] [1559898175.527155038]: Plugin sys_time loaded [ INFO] [1559898175.537084792]: TM: Timesync mode: MAVLINK [ INFO] [1559898175.538972943]: Plugin sys_time initialized [ INFO] [1559898175.539133473]: Plugin trajectory loaded [ INFO] [1559898175.547921651]: Plugin trajectory initialized [ INFO] [1559898175.548074619]: Plugin vfr_hud loaded [ INFO] [1559898175.548866805]: Plugin vfr_hud initialized [ INFO] [1559898175.548909943]: Plugin vibration blacklisted [ INFO] [1559898175.549016078]: Plugin vision_pose_estimate loaded [ INFO] [1559898175.562479466]: Plugin vision_pose_estimate initialized [ INFO] [1559898175.562641220]: Plugin vision_speed_estimate loaded [ INFO] [1559898175.569256195]: Plugin vision_speed_estimate initialized [ INFO] [1559898175.569437756]: Plugin waypoint loaded [ INFO] [1559898175.576329392]: Plugin waypoint initialized [ INFO] [1559898175.576386745]: Plugin wheel_odometry blacklisted [ INFO] [1559898175.576523289]: Plugin wind_estimation loaded [ INFO] [1559898175.577302657]: Plugin wind_estimation initialized [ INFO] [1559898175.577339999]: Autostarting mavlink via USB on PX4 [ INFO] [1559898175.577386756]: Built-in SIMD instructions: SSE, SSE2 [ INFO] [1559898175.577409109]: Built-in MAVLink package version: 2019.4.4 [ INFO] [1559898175.577447966]: Known MAVLink dialects: common ardupilotmega ASLUAV autoquad icarous matrixpilot paparazzi slugs standard uAvionix ualberta [ INFO] [1559898175.577485993]: MAVROS started. MY ID 1.240, TARGET ID 1.1 [INFO] [1559898175.670262, 0.000000]: Loading model XML from file [INFO] [1559898175.670666, 0.000000]: Waiting for service /gazebo/spawn_sdf_model INFO [px4_work_queue] creating: wq:hp_default, priority: 88, stack: 16384 bytes INFO [init] Mixer: etc/mixers/quad_w.main.mix on /dev/pwm_output0 [ INFO] [1559898176.823720386, 0.024000000]: waitForService: Service [/gazebo/set_physics_properties] is now available. [INFO] [1559898176.879336, 0.080000]: Calling service /gazebo/spawn_sdf_model [ INFO] [1559898176.889392763, 0.088000000]: Physics dynamic reconfigure ready. ERROR [land_detector] Timed out while waiting for thread to start INFO [mavlink] mode: Normal, data rate: 4000000 B/s on udp port 14570 remote port 14550 INFO [mavlink] mode: Onboard, data rate: 4000000 B/s on udp port 14580 remote port 14540 [INFO] [1559898177.017965, 0.148000]: Spawn status: SpawnModel: Successfully spawned entity INFO [logger] logger started (mode=all) INFO [logger] Start file log (type: full) INFO [logger] Opened full log file: ./log/2019-06-07/09_02_57.ulg INFO [mavlink] MAVLink only on localhost (set param MAV_BROADCAST = 1 to enable network) [ INFO] [1559898177.028490137, 0.160000000]: udp0: Remote address: 127.0.0.1:14580 [ INFO] [1559898177.028763192, 0.160000000]: IMU: Scaled IMU message used. [ INFO] [1559898177.028900233, 0.160000000]: CON: Got HEARTBEAT, connected. FCU: PX4 Autopilot INFO [px4] Startup script returned successfully pxh> [ INFO] [1559898177.030204101, 0.160000000]: IMU: Scaled IMU message used. [ INFO] [1559898177.057716367, 0.188000000]: waitForService: Service [/gazebo/set_physics_properties] is now available. [ INFO] [1559898177.106038589, 0.236000000]: Physics dynamic reconfigure ready. INFO [mavlink] partner IP: 127.0.0.1 [vehicle_spawn_sergio_ing_7231_1852301138231235699-5] process has finished cleanly log file: /home/sergio/.ros/log/08d278c6-8903-11e9-bdb6-309c23913dfd/vehicle_spawn_sergio_ing_7231_1852301138231235699-5*.log [ INFO] [1559898178.037292366, 1.160000000]: VER: 1.1: Capabilities 0x000000000000e4ef [ INFO] [1559898178.037350508, 1.160000000]: VER: 1.1: Flight software: 01090000 (be02ad3514000000) [ INFO] [1559898178.037392655, 1.160000000]: VER: 1.1: Middleware software: 01090000 (be02ad3514000000) [ INFO] [1559898178.037426422, 1.160000000]: VER: 1.1: OS software: 040f00ff (0000000000000000) [ INFO] [1559898178.037461812, 1.160000000]: VER: 1.1: Board hardware: 00000001 [ INFO] [1559898178.037494882, 1.160000000]: VER: 1.1: VID/PID: 0000:0000 [ INFO] [1559898178.037526415, 1.160000000]: VER: 1.1: UID: 4954414c44494e4f [ INFO] [1559898187.045531485, 10.160000000]: HP: requesting home position [ INFO] [1559898187.144277585, 10.256000000]: Offboard enabled [ WARN] [1559898187.146044501, 10.260000000]: CMD: Unexpected command 176, result 1 [ WARN] [1559898188.045856588, 11.160000000]: PR: request list timeout, retries left 2 [ WARN] [1559898189.047114676, 12.160000000]: PR: request list timeout, retries left 1 [ WARN] [1559898190.048111543, 13.160000000]: PR: request list timeout, retries left 0 [ INFO] [1559898192.050817063, 15.160000000]: WP: mission received [ INFO] [1559898192.197008796, 15.304000000]: Offboard enabled [ INFO] [1559898197.055292345, 20.160000000]: HP: requesting home position [ INFO] [1559898197.253746088, 20.356000000]: Offboard enabled [ WARN] [1559898197.261384827, 20.364000000]: CMD: Unexpected command 176, result 1 [ INFO] [1559898202.305945931, 25.404000000]: Offboard enabled [ INFO] [1559898207.064616506, 30.160000000]: HP: requesting home position [ INFO] [1559898207.363416383, 30.456000000]: Offboard enabled ` Propellers are in movement in gazebo, but it does not takeoff. Rqt graph show:
But, topics are not publishing nothing. I have tried: rostopic echo /tf rostopic echo /mavros/local_position/pose rostopic echo /mavros/global_position/global rostopic echo /mavros/setpoint_position/local
rostopic echo /mavros/state header: seq: 152136 stamp: secs: 259 nsecs: 484000000 frame_id: '' connected: True armed: False guided: False mode: "MANUAL" system_status: 3
rostopic echo /offb rostopic echo /mavros rostopic echo /tf_static
The rest show: WARNING: topic [/offb] does not appear to be published yet
MAVROS version and platform
Mavros: ?0.18.4? ROS: Kinetic Ubuntu: 16.04 Gazebo: 7.15.0
Autopilot type and version
[ ] ArduPilot [ x ] PX4
Version: Git clone from PX4/Firmware --> master branch
Node logs
Diagnostics
Check ID