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

Hello, in the gazebo_barometer_plugin.cpp, the noise is generated using polar form of Box-Muller transformation ``` // generate Gaussian noise sequence using polar form of Box-Muller transformation double y1; { double...

Hello, according to the following code ``` // Gyrosocpe double tau_g = imu_parameters_.gyroscope_bias_correlation_time; // Discrete-time standard deviation equivalent to an "integrating" sampler // with integration time dt. double sigma_g_d =...

Hello, I think the expression of the GPS bias integration mistake in gazebo_gps_plugin.cpp is wrong. ``` // gps bias integration gps_bias_.X() += random_walk_gps_.X() * dt - gps_bias_.X() / gps_corellation_time_; gps_bias_.Y()...

am having an issue while using multiple iris vehicles in Gazebo using ros melodic. I am currently using 3 iris, sometimes the 3rd iris doesn't take off, so I have...

I just want to inform you that the CMakeLists.txt file needs to be updated to include physics_msgs: `install(TARGETS ${plugins} mav_msgs nav_msgs std_msgs sensor_msgs physics_msgs DESTINATION ${PLUGIN_PATH})` This is important if...

I'm running Gazebo HITL simulations using a PX4. Everything works fine until I attempt to take off, at which point the vehicle begins flipping around uncontrollably. I'm following the instructions...

## Question How to run to successfully run `make px4_sitl gazebo` without the error: `-- No package 'bullet' found` ## Context I'm trying to run PX4 stil on gazebo on...

My vehicle2's status present ''not ready '' in QGroundControl And this is my situation please somebody help me . https://user-images.githubusercontent.com/83861951/117953792-f71fb680-b348-11eb-8771-13c5aea22c1c.mp4

``` [17/109] Linking CXX shared library libphysics_msgs.so FAILED: : && /usr/bin/c++ -fPIC -O2 -g -DNDEBUG -shared -Wl,-soname,libphysics_msgs.so -o libphysics_msgs.so CMakeFiles/physics_msgs.dir/Wind.pb.cc.o -L/usr/lib/x86_64-linux-gnu/gazebo-9/plugins -L/home/sandesh/Documents/DroneSimulationDownloads/Firmware/build/px4_sitl_default/build_gazebo /usr/lib/x86_64-linux-gnu/libboost_system.so /usr/lib/x86_64-linux-gnu/libboost_thread.so -lBulletSoftBody -lBulletDynamics -lBulletCollision -lLinearMath /usr/lib/x86_64-linux-gnu/libSimTKsimbody.so /usr/lib/x86_64-linux-gnu/libSimTKmath.so...

While working with the LiftDragPlugin I found several issues. I'd like to discuss them here before I start drafting a pull request. ### 1. Missing coefficients: cd_alpha0 and cm_alpha0 The...

feature request