heifu: heifu_bringup | heifu_description | heifu_mavros | heifu_msgs | heifu_safety | heifu_simple_waypoint | heifu_tools

Package Summary

The heifu metapackage that installs all heifu related packages.

  • Maintainer status: maintained
  • Maintainer: André Ferreira <andre.ferreira AT beyond-vision DOT pt>, Fábio Azevedo <fabio.azevedo AT beyond-vision DOT pt>
  • Author: André Ferreira <andre.ferreira AT beyond-vision DOT pt>
  • License: BSD
  • Source: git https://gitlab.pdmfc.com/drones/ros1/heifu.git (branch: releasePackage)

Documentation

Installation

ROS packages dependences:

  • gazebo-ros
  • mavros here

  • mavlink
  • geographic-msgs
  • tf2-eigen
  • control-toolbox
  • GNSS_utils here

GeographicLib dependeces:

sudo apt-get install libgeographic-dev
sudo apt-get install geographiclib-tools

Run the script in: install_geographiclib_datasets.sh

Compile this directory in your ROS workspace.

Then copy the already configured files to the *mavros* directory:

cd ${YOUR_ROS_WORKSPACE}/src/heifu/heifu_scripts_firmware
cp apm_config.yaml $(rospack find mavros)/launch/
cp apm.launch $(rospack find mavros)/launch/
cp node.launch $(rospack find mavros)/launch/

NOTE: Adjust the yaml loader script to deal with the argument substitution in the roslaunch of yaml files:

cd ${YOUR_ROS_WORKSPACE}/src/heifu/heifu_scripts_firmware
cp loader.py /opt/ros/melodic/lib/python2.7/dist-packages/roslaunch/

Dont forget to add gimbal and mavros to the source folder and run catkin build

To run the nodes with a real drone:

Just launch - Heifu_bringup

roslaunch heifu_bringup heifu_bringup.launch

Launch Input arguments:

    argSafety - Activates the safety zone mode and run the node heifu_safety.
    argTakeOffAltitude - Defines the Takeoff altitude.
    argSim - Activates the simulation mode. Loads Gazebo and a pre-configured world with the drone HEIFU.
    argSecredas - Activates the Secredas Usecases. (Needs extra packages secredas).
    argUseCase - Defines witch usecase of Secredas will be loaded.
    argPlanners - Loads the Planners nodes with static colision avoidance (Needs extra packages Planners).


Heifu Simulation:

First make sure that the ArduPilot firmware is correctly installed, by following the steps described https://gitlab.pdmfc.com/drones/heifu/wikis/Install-and-Configure-ArduPilot-Firmware.

To open the simulation:

1st terminal - Launch Heifu_bringup

roslaunch heifu_bringup heifu_bringup.launch argSim:=true

2nd terminal - Launch ArduPilot firmware

cd ~/ardupilot/ArduCopter/
sim_vehicle.py -v ArduCopter -f gazebo-heifu -I1


Packages

Heifu Bringup

Responsible for load all packages.


Heifu Description

This package contains the drone robot HEIFU and the worlds for the simulation.


Heifu Diagnostic

Responsible for verify the GPS fix state of the drone and send the information to the application.

Subscribers:

Publishers:


Heifu Interface

This package is the bridge between the ROS and the application.

Subscribers:

Publishers:

Services:


Heifu Mavros

This is the main package to control the drone. Responsible for message conversions and commands between the packages and the mavros node.

Subscribers:

Publishers:

Services:


Heifu Msgs

This package contain the messages and services necessary to work.


Heifu Safety

If loaded, this package controls the flight area and velocity limit of the drone to a safety real demonstration.

Subscribers:

Publishers:

Services:


Heifu Simple Waypoint

This package receive a setpoint and make the drone fly pointed to desired position.

Subscribers:

Publishers:


Heifu Tools

Responsible for convert the velocity command messages.

Subscribers:

Publishers:


Report a Bug

Use GitHub to report bugs or submit feature requests. [View active issues]

Wiki: heifu (last edited 2021-08-02 09:41:58 by BEVOpenSource)