PX4-Avoidance: Problems in connections with Gazebo Simulator

As I follow instruction on this repo. I came to find some problems with connections.

  1. Problem with the connection with PX4 SITL with Gazebo Simulation It was very easy to miss the problem that no error or warning messages are given. After information message shown, INFO [simulator] Waiting for simulator to connect on TCP port 4560 and no update since unlike basic px4 Gazebo simulation make px4_sitl_default gazebo It does find connection with Gazebo right away and does work with additional mavros launch.
INFO  [simulator] Waiting for simulator to connect on TCP port 4560
INFO  [simulator] Simulator connected on TCP port 4560.
  1. Problem with the connection with MAVROS. I think it’s cause of root is problem 1, MAVROS diagnostics report as it is not connected to FCU, thus nothing can be done.

Hope this could be solved soon. Thanks.

About this issue

  • Original URL
  • State: closed
  • Created 5 years ago
  • Comments: 24 (17 by maintainers)

Commits related to this issue

Most upvoted comments

I have the same problem: https://github.com/PX4/sitl_gazebo/issues/322 I don’t think updating to Gazebo8 is the right solution, also because gazebo7 is installed from the scripts in the instructions.

Moreover it’s weird that the “make px4_sitl_default gazebo” works while the roslaunch doesn’t. Can it be a “timing” issue?

I have the same problem when “make px4_sitl_default jmavsim”, after information message shown, INFO [simulator] Waiting for simulator to connect on TCP port 4560 and no update.