PX4-SITL_gazebo-classic icon indicating copy to clipboard operation
PX4-SITL_gazebo-classic copied to clipboard

Set of plugins, models and worlds to use with OSRF Gazebo Simulator in SITL and HITL.

Results 107 PX4-SITL_gazebo-classic issues
Sort by recently updated
recently updated
newest added

I'm seeing some errors similar to those reported in #699 at installation time. I am following the instructions from this [wiki](https://github.com/grvcTeam/grvc-ual/wiki/Setup-instructions:-PX4-SITL). The relevant error that shows up at the `make...

question

Hello folks, I have created an iris drone with r200. I have followed model creation guideline and I believe it is ok. https://gazebosim.org/tutorials?tut=build_model Then I changed the sitl_run.sh to use...

question

I am able to do simulations using the standard VTOL, but the VTOL drop model is suffering from an airspeed sensor alarm `INFO [airspeed_selector] No airspeed sensor detected. Switch to...

Hi All, I have been working on getting SITL with gazebo running and have run against a bit of a wall. I'm fairly sure it's a python looking in the...

bug

**Description** The rear thruster of the Gazebo-SITL Cloudship does not spin or create a force when it should be activating. **To Reproduce** 1. Boot Ubuntu 20.04 2. Boot QGroundControl (v4.1.6)...

ubuntu20.04 when i try to make px4_sitl gazebo ,here is some errors: [0/4] Performing build step for 'sitl_gazebo' ninja: no work to do. [3/4] cd /home/tangqi/project/...irmware/build/px4_sitl_default SITL ARGS sitl_bin: /home/tangqi/project/Firmware/build/px4_sitl_default/bin/px4...

```Console mengchaoheng@mengchaohengdeMacBook-Pro PX4-Autopilot % make px4_sitl gazebo -- PX4 version: v1.13.0-alpha1-4371-gc2c455be0d -- Found PythonInterp: /usr/local/bin/python3 (found suitable version "3.9.10", minimum required is "3") -- PX4 config file: /Users/mengchaoheng/Downloads/PX4-Autopilot/boards/px4/sitl/default.px4board -- PLATFORM...

Hi, I'm triying to run HITL simulation with a pixhawk connected via USB to a companion computer. The problem is that this computer doesn't have a GUI. To run my...

Hi everyone, I have managed to build PX4-SITL_jmavsim but I have encountered multiple errors when trying to build with gazebo after following the steps [here](https://docs.px4.io/master/en/dev_setup/dev_env_mac.html). I get the following one...

Hello, I have 2 questions regarding the motor_failure_plugin: 1) What is the command to publish to `/gazebo/motor_failure_num`? i have tried `pub = rospy.Publisher("/gazebo/motor_failure_num", String, queue_size=10)` and `pub.publish("2")` 2)How to you...

question