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

When launching multiple vehicles in lockstep simulation (i.e. with `PX4_SIM_SPEED_FACTOR != 1`), the Gazebo world parameter `real_time_update_rate` is scaled by the given speed factor from the environment variable *every time*...

bug

**Problem Description** This PR adds a camera sensor to the believer fixedwing camera model

**Problem Description** While the Gazebo environment is the most widely used environments for PX4 SITL simulation, the rendering quality of gazebo makes it hard to test vision based applications. While...

Hello, This PR updates the boost library `#include ` to the new directory of the current library, ``. Updating these #include directory locations aids the migration to Ubuntu 20.04's native...

This PR allows for full control over modifying models and world files on launch through jinja and optionally json. After more adoption the static world files can be completely removed....

enhancement

When i use make -j(nproc) -l(nproc),i met this question, > h:39:10: fatal error: development/mavlink.h: 没有那个文件或目录 39 | #include | ^~~~~~~~~~~~~~~~~~~~~~~ compilation terminated.

Hello folks, Has anyone ever tried to calculate the thrust and torque coefficients (Kt and Kq) from the coefficients already given in the px4vision model for the iris propellers ?

question

Hello Github. After compiling and installing the libs and plugins on my computer, I want to use it in my project, especially the libgazebo_motor_model.so plugin. How can I integrate it...

The instructions in https://docs.px4.io/master/en/simulation/gazebo.html#simulated-parachute-flight-termination explain that you can simulate parachute deployment by first launching the simulator with: ``` make px4_sitl gazebo_if750a ``` Then force flight termination. I tested this by...

bug

For my research, I want to implement a tracking controller with MAVROS, PX4 and Gazebo. This requires resetting the simulation several times for tuning the controller parameters. I discovered via...