aurelappius / PX4-Autopilot

PX4 Autopilot Software

Home Page:https://px4.io

Geek Repo:Geek Repo

Github PK Tool:Github PK Tool

PX4 Drone Autopilot

This is the custom simulator for RAPTOR using PX4 gazebo SITL.

Installation

clone repository

git clone --recursive https://github.com/aurelappius/PX4-Autopilot

install dependencies by running

sudo ./Tools/setup/ubuntu.sh

also install ROS2 humble. see: https://docs.ros.org/en/humble/Installation.html)

Run the Simulator

  1. Set up your workspace the following way by cloning raptor: https://github.com/raptor-ethz/raptor.git and this repository in the following file structure:
simulator
├── raptor
└── PX4-Autopilot
  1. source the workspace
source /opt/ros/humble/setup.bash
  1. build the raptor package by running:
colcon build
  1. change your directory to PX4-Autopilot
cd PX4-Autopilot
  1. source the raptor package with the following commmand
. ../install/local_setup.bash
  1. run the simulator
make px4_sitl gazebo_raptor__baylands

the first (here raptor) is the model that is loaded and the second (here baylands) is the world.

##Modify the model.

All parameters of the model can be modified in the file:

Tools/simulation/gazebo/sitl_
gazebo/models/raptor/raptor.sdf

##ROS2 Publishers/Subscribers

The current model publishes the following topics and message types:

/realsense_down_d /realsense_down_ir1 /realsense_down_ir2 /realsense_down_rgb /realsense_front_d /realsense_front_ir1 /realsense_front_ir2 /realsense_front_rgb

sensor_msgs::msg::Image realsense_down_rgb
sensor_msgs::msg::Image realsense_down_ir1
sensor_msgs::msg::Image realsense_down_ir2
sensor_msgs::msg::Image realsense_down_d

sensor_msgs::msg::Image realsense_front_rgb
sensor_msgs::msg::Image realsense_front_ir1
sensor_msgs::msg::Image realsense_front_ir2
sensor_msgs::msg::Image realsense_front_d

and subscribes to the following

std_msgs::msg::Float64 leftGripper_deg
std_msgs::msg::Float64 rightGripper_deg

About

PX4 Autopilot Software

https://px4.io

License:BSD 3-Clause "New" or "Revised" License


Languages

Language:C++ 49.0%Language:C 39.5%Language:Python 5.0%Language:CMake 4.4%Language:Shell 1.1%Language:MATLAB 0.6%Language:Groovy 0.2%Language:EmberScript 0.1%Language:Makefile 0.1%Language:HTML 0.1%Language:Perl 0.0%Language:Jinja 0.0%Language:Nix 0.0%Language:Dockerfile 0.0%Language:GDB 0.0%