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

**Problem Description** This is a minor cleanup of initializing variables inline for the multirotor motor model

**Problem Description** Catkin build tests has been recently failing: ``` Errors

bug

This problem originates from setting global real_time_update_rate without checking if it has been set before. To fix this, we check if we've done the calculation before, then do the calculation...

bug

I want gazebo to connect to different tcp port other than tcp 4560 ,px4 must open 4560 I want to intercept the msgs and redirect it to gazebo

question

Whenever setting the `PX4_SIM_SPEED_FACTOR` with multiple aircraft in Gazebo, it accumulates `real_time_update_rate` and thus the correctness math checking is incorrect, where it checks if the reciprocal of `real_time_update_rate` is equal...

bug

adds missing mavlink includes which resolves the missing mavlink types: * MAV_CMD_REQUEST_STORAGE_INFORMATION * MAV_CMD_SET_CAMERA_ZOOM * MAV_CMD_SET_CAMERA_MODE * MAV_CMD_REQUEST_VIDEO_STREAM_INFORMATION * MAV_CMD_REQUEST_VIDEO_STREAM_STATUS All these are found in the file generated by mavlink,...

bug

I'm on Ubuntu 20.04 trying to follow the procedure described in [here](https://docs.px4.io/main/en/ros/ros2_comm.html#install-fast-dds) to work with ROS2. I have ROS2 Foxy installed by following the procedure from the ROS website. I...

> Work in progress! ## Improvements 1. Previously the PID based force was always being applied to velocity controlled joints (basically all rotors / motors), but this shouldn't be the...

In the header of the odometer message the size of the message is specified. Adding 'repeating' fields for covariance according to the `odometer.proto` definition, increases the size of the message....

Hi, I'm trying to run simple SITL with the r1_rover on v1.13.0 on MAVROS with gazebo11. When sending position setpoints through MAVROS, the rover enters offboard mode with `rosrun mavros...