Giter VIP home page Giter VIP logo

aurelappius / px4-autopilot Goto Github PK

View Code? Open in Web Editor NEW

This project forked from px4/px4-autopilot

1.0 0.0 0.0 197.55 MB

PX4 Autopilot Software

Home Page: https://px4.io

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

Shell 1.07% C++ 49.04% Python 4.99% Perl 0.04% C 39.45% Groovy 0.19% MATLAB 0.56% Nix 0.01% EmberScript 0.10% Makefile 0.09% HTML 0.06% CMake 4.39% GDB 0.01% Dockerfile 0.01% Jinja 0.01%

px4-autopilot's Introduction

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

Recommend Projects

  • React photo React

    A declarative, efficient, and flexible JavaScript library for building user interfaces.

  • Vue.js photo Vue.js

    🖖 Vue.js is a progressive, incrementally-adoptable JavaScript framework for building UI on the web.

  • Typescript photo Typescript

    TypeScript is a superset of JavaScript that compiles to clean JavaScript output.

  • TensorFlow photo TensorFlow

    An Open Source Machine Learning Framework for Everyone

  • Django photo Django

    The Web framework for perfectionists with deadlines.

  • D3 photo D3

    Bring data to life with SVG, Canvas and HTML. 📊📈🎉

Recommend Topics

  • javascript

    JavaScript (JS) is a lightweight interpreted programming language with first-class functions.

  • web

    Some thing interesting about web. New door for the world.

  • server

    A server is a program made to process requests and deliver data to clients.

  • Machine learning

    Machine learning is a way of modeling and interpreting data that allows a piece of software to respond intelligently.

  • Game

    Some thing interesting about game, make everyone happy.

Recommend Org

  • Facebook photo Facebook

    We are working to build community through open source technology. NB: members must have two-factor auth.

  • Microsoft photo Microsoft

    Open source projects and samples from Microsoft.

  • Google photo Google

    Google ❤️ Open Source for everyone.

  • D3 photo D3

    Data-Driven Documents codes.