ardupilot_gazebo icon indicating copy to clipboard operation
ardupilot_gazebo copied to clipboard

Results 25 ardupilot_gazebo issues
Sort by recently updated
recently updated
newest added

In a terminal, I started Gazebo by gazebo --verbose worlds/iris_arducopter_runway.world and in another terminal I started SITL simulation by cd ~/ardupilot/ArduCopter ../Tools/autotest/sim_vehicle.py -f gazebo-iris --console --map However, the drone is...

Hi, I try build this plugin but I get this error after run `sudo cmake ..` I use `fedora35` so I cant run `apt-get install libgazeboX-dev` what can I do...

Hi! I have the file worlds/iris_ardupilot_multi.world available but I am still getting this error. I used the command `gazebo --verbose worlds/iris_ardupilot_multi.world `

Hello dear contributors of this repository I want to simulate a zephyr fixed-wing and an iris copter in one gazebo simulation using the forked version of this repository, [SwiftGust/ardupilot_gazebo](https://github.com/SwiftGust/ardupilot_gazebo) repository....

sorry for dirty commit check commit Added Sikorsky-X2 model and ardupilot demo world only. Others would be irrelvant.

" Error [parser.cc:525] parse as sdf version 1.7 failed, should try to parse as old deprecated format Error Code 4 Msg: Required attribute[xmlns:xacro] in element[sdf] is not specified in SDF....

CMake VERSION_GREATER_EQUAL macro is not implemented until CMake 3.7, so [this line](https://github.com/khancyr/ardupilot_gazebo/blob/gazebo7/CMakeLists.txt#L18) cause a problem (default CMake version on Ubuntu 16.04 is 3.5.1). Change minimum required CMake version to 3.7,...

I am currently working on getting the ardupilot plugin to work with multiple UAVs that are launched via URDF files. I was able to transition the SDF models to URDFs...

Hello, I'm trying to use the ardupilot_gazebo plugin on Ubuntu 18.04 and Gazebo 9, However after making the build directory and attempting to do: cmake .. it gives this error:...