A package to control multi-copters using PX4-Autopilot platform. Implement following functions:
- Process EKF2 fusion from SLAM, Gazebo, MoCap, etc. Publish to
/mavros/vision_pose/pose
- Control drone to
Arm
,Takeoff
,Offboard
,Move
,Hold
,Land
, Return, etc. Publish to/mavros/setpoint_raw/local
- Process control command from path-planner, with format
quadrotor_msgs::PositionCommand
- Interact with a terminal to control drone, with format
easondrone_msgs::ControlCommand
Visit this yuque doc for detailed information.
git clone https://github.com/HuaYuXiao/px4ctrl.git ~/easondrone_ws/module/px4ctrl
cd ~/easondrone_ws && catkin_make --source module/px4ctrl --build module/px4ctrl/build
roslaunch px4ctrl px4ctrl.launch
Thanks for following packages:
Related docs: