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

Following the tutorials on https://docs.px4.io/main/en/dev_setup/building_px4.html I am using Ubuntu 18.04 VM and trying to do a basic install and when i put the command `make px4_fmu-v5_default` am getting the error...

Hi I am following the official documentation in PX4 for a simulation in Gazebo for a HITL. I am able to spawn the plane in gazebo and i put a...

Hello everyone, I have been trying to run the px4-sitl-gazebo with different worlds and iris model. Initially, it was all working fine but after modifying a the sonoma_raceway.world a bit...

**Problem Description** This PR adds supports to simulate monocopters in PX4 SITL Gazebo - Implementation of monocopter dynamics (WIP) - Mesh file representing a monocopter (WIP) One can run the...

FAILED: external/Stamp/sitl_gazebo/sitl_gazebo-configure cd /home/vir/PX4_Firmware/build/px4_sitl_default/build_gazebo && /usr/bin/cmake -DCMAKE_INSTALL_PREFIX=/usr/local -DSEND_VISION_ESTIMATION_DATA=ON -GNinja /home/vir/PX4_Firmware/Tools/sitl_gazebo && /usr/bin/cmake -E touch /home/vir/PX4_Firmware/build/px4_sitl_default/external/Stamp/sitl_gazebo/sitl_gazebo-configure [220/740] Building CXX object src/lib/.../avoidance.dir/ObstacleAvoidance.cpp.o ninja: build stopped: subcommand failed. make: *** [Makefile:200: px4_sitl_default] Error...

I have some doubts regarding how GPS noise is being computed. https://github.com/PX4/PX4-SITL_gazebo-classic/blob/f754540e714642fea897445e69a675245bc6306a/src/gazebo_gps_plugin.cpp#L262-L272 Noise density for XY has, as unit, `(m) / sqrt(hz) ` and the noise has as unit `(m)`....

@Jaeyoung-Lim some changes were needed for the libraries to build (probably a mavlink mismatch on PX4 side. Commands are now received on the plugin but platform moves much slower than...