![]() |
px4 package from uavprojectilecatcher repopx4 catkin_tools_prebuild mavlink drone_ball_catcher libmavconn mavros mavros_extras mavros_msgs test_mavros realsense2_description realsense_gazebo_plugin |
Package Summary
Tags | No category tags. |
Version | 1.0.0 |
License | BSD |
Build type | CATKIN |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/arijitnoobstar/uavprojectilecatcher.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2021-05-16 |
Dev Status | UNMAINTAINED |
CI status | No Continuous Integration |
Released | UNRELEASED |
Tags | uav mav mavlink plugin apm px4 |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- Lorenz Meier
Authors
PX4 Drone Autopilot
This repository holds the PX4 flight control solution for drones, with the main applications located in the src/modules directory. It also contains the PX4 Drone Middleware Platform, which provides drivers and middleware to run drones.
- Official Website: http://px4.io (License: BSD 3-clause, LICENSE)
-
Supported airframes (portfolio):
- Multicopters
- Fixed wing
- VTOL
- many more experimental types (Rovers, Blimps, Boats, Submarines, Autogyros, etc)
- Releases: Downloads
PX4 Users
The PX4 User Guide explains how to assemble supported vehicles and fly drones with PX4. See the forum and chat if you need help!
PX4 Developers
This Developer Guide is for software developers who want to modify the flight stack and middleware (e.g. to add new flight modes), hardware integrators who want to support new flight controller boards and peripherals, and anyone who wants to get PX4 working on a new (unsupported) airframe/vehicle.
Developers should read the Guide for Contributions. See the forum and chat if you need help!
Weekly Dev Call
The PX4 Dev Team syncs up on a weekly dev call.
Note The dev call is open to all interested developers (not just the core dev team). This is a great opportunity to meet the team and contribute to the ongoing development of the platform. It includes a QA session for newcomers. All regular calls are listed in the Dronecode calendar.
Maintenance Team
- Project: Founder
- Architecture
- Dev Call
- Communication Architecture
- UI in QGroundControl
- Multicopter Flight Control
- Multicopter Software Architecture
- VTOL Flight Control
- Fixed Wing Flight Control
- OS / NuttX
- Driver Architecture
- Commander Architecture
- UAVCAN
- State Estimation
- Vision based navigation
- Obstacle Avoidance
- RTPS/ROS2 Interface
See also maintainers list (px4.io) and the contributors list (Github).
Supported Hardware
This repository contains code supporting these boards:
- FMUv2
- FMUv3
- FMUv4
- FMUv5 (ARM Cortex M7)
- Airmind MindPX V2.8
- Airmind MindRacer V1.2
- Bitcraze Crazyflie 2.0
- Omnibus F4 SD
- Holybro Durandal
- Holybro Kakute F7
- Raspberry PI with Navio 2
Additional information about supported hardware can be found in PX4 user Guide > Autopilot Hardware.
Project Roadmap
A high level project roadmap is available here.
Wiki Tutorials
Package Dependencies
Deps | Name |
---|---|
message_generation | |
roscpp | |
rospy | |
std_msgs | |
libmavconn | |
tf | |
rostest | |
mav_msgs | |
catkin | |
message_runtime |
System Dependencies
Dependant Packages
Launch files
- launch/mavros_posix_sitl.launch
-
- x [default: 0]
- y [default: 0]
- z [default: 0]
- R [default: 0]
- P [default: 0]
- Y [default: 0]
- est [default: ekf2]
- vehicle [default: iris]
- world [default: $(find mavlink_sitl_gazebo)/worlds/empty.world]
- sdf [default: $(find mavlink_sitl_gazebo)/models/$(arg vehicle)/$(arg vehicle).sdf]
- gui [default: true]
- debug [default: false]
- verbose [default: false]
- paused [default: false]
- respawn_gazebo [default: false]
- fcu_url [default: udp://:14540@localhost:14557]
- respawn_mavros [default: false]
- interactive [default: true]
- launch/single_vehicle_spawn.launch
-
- x [default: 0]
- y [default: 0]
- z [default: 0]
- R [default: 0]
- P [default: 0]
- Y [default: 0]
- est [default: ekf2]
- vehicle [default: iris]
- ID [default: 1]
- mavlink_udp_port [default: 14560]
- mavlink_tcp_port [default: 4560]
- gst_udp_port [default: 5600]
- video_uri [default: 5600]
- mavlink_cam_udp_port [default: 14530]
- interactive [default: true]
- cmd [default: $(find mavlink_sitl_gazebo)/scripts/jinja_gen.py --stdout --mavlink_id=$(arg mavlink_id) --mavlink_udp_port=$(arg mavlink_udp_port) --mavlink_tcp_port=$(arg mavlink_tcp_port) --gst_udp_port=$(arg gst_udp_port) --video_uri=$(arg video_uri) --mavlink_cam_udp_port=$(arg mavlink_cam_udp_port) $(find mavlink_sitl_gazebo)/models/$(arg vehicle)/$(arg vehicle).sdf.jinja $(find mavlink_sitl_gazebo)]
- launch/multi_uav_mavros_sitl.launch
- to add more UAVs (up to 10): Increase the id Change the name space Set the FCU to default="udp://:14540+id@localhost:14550+id" Set the malink_udp_port to 14560+id)
-
- est [default: ekf2]
- vehicle [default: iris]
- world [default: $(find mavlink_sitl_gazebo)/worlds/empty.world]
- gui [default: true]
- debug [default: false]
- verbose [default: false]
- paused [default: false]
- fcu_url [default: udp://:14540@localhost:14580]
- fcu_url [default: udp://:14541@localhost:14581]
- fcu_url [default: udp://:14542@localhost:14582]
- launch/multi_uav_mavros_sitl_sdf.launch
- to add more UAVs (up to 10): Increase the id Change the name space Set the FCU to default="udp://:14540+id@localhost:14550+id" Set the malink_udp_port to 14560+id)
-
- est [default: ekf2]
- vehicle [default: plane]
- world [default: $(find mavlink_sitl_gazebo)/worlds/empty.world]
- gui [default: true]
- debug [default: false]
- verbose [default: false]
- paused [default: false]
- fcu_url [default: udp://:14540@localhost:14580]
- fcu_url [default: udp://:14541@localhost:14581]
- fcu_url [default: udp://:14542@localhost:14582]
- launch/pub_test.launch
- launch/posix_sitl.launch
- export GAZEBO_MODEL_PATH=$PX4-Autopilot/Tools/sitl_gazebo/models:$GAZEBO_MODEL_PATH
-
- x [default: 0]
- y [default: 0]
- z [default: 0]
- R [default: 0]
- P [default: 0]
- Y [default: 0]
- est [default: ekf2]
- vehicle [default: iris]
- vehicle1 [default: iris_depth_camera]
- world [default: $(find mavlink_sitl_gazebo)/worlds/empty.world]
- sdf [default: $(find mavlink_sitl_gazebo)/models/$(arg vehicle1)/$(arg vehicle1).sdf]
- gui [default: true]
- debug [default: false]
- verbose [default: false]
- paused [default: false]
- respawn_gazebo [default: false]
- interactive [default: true]
- launch/px4.launch
-
- est [default: ekf2]
- vehicle [default: iris]
- ID [default: 0]
- interactive [default: true]
- launch/single_vehicle_spawn_sdf.launch
-
- x [default: 0]
- y [default: 0]
- z [default: 0]
- R [default: 0]
- P [default: 0]
- Y [default: 0]
- est [default: ekf2]
- vehicle [default: plane]
- ID [default: 1]
- mavlink_udp_port [default: 14560]
- mavlink_tcp_port [default: 4560]
- interactive [default: true]
- cmd [default: xmlstarlet ed -d '//plugin[@name="mavlink_interface"]/mavlink_tcp_port' -s '//plugin[@name="mavlink_interface"]' -t elem -n mavlink_tcp_port -v $(arg mavlink_tcp_port) $(find px4)/Tools/sitl_gazebo/models/$(arg vehicle)/$(arg vehicle).sdf]
- src/examples/gyro_fft/CMSIS_5/CMSIS/DSP/DSP_Lib_TestSuite/DspLibTest_FVP_A5/DspLibTest_FVP_A5.launch
- Tools/jsbsim_bridge/launch/px4_jsbsim_bridge.launch
-
- est [default: ekf2]
- vehicle [default: rascal]
- fcu_url [default: udp://:14540@127.0.0.1:14557]
- gcs_url [default: ]
- tgt_system [default: 1]
- tgt_component [default: 1]
- command_input [default: 2]
- gazebo_simulation [default: true]
- visualization [default: true]
- log_output [default: screen]
- fcu_protocol [default: v2.0]
- respawn_mavros [default: false]
- respawn_mavros [default: $(arg respawn_mavros)]
- interactive [default: true]
Messages
- msg/position_controller_landing_status.msg
- msg/tecs_status.msg
- msg/mission_result.msg
- msg/irlock_report.msg
- msg/wheel_encoders.msg
- msg/ulog_stream.msg
- msg/estimator_innovations.msg
- msg/rc_channels.msg
- msg/sensor_mag.msg
- msg/estimator_status.msg
- msg/uavcan_parameter_value.msg
- msg/vehicle_angular_velocity.msg
- msg/vehicle_local_position_setpoint.msg
- msg/estimator_sensor_bias.msg
- msg/input_rc.msg
- msg/landing_target_pose.msg
- msg/trajectory_waypoint.msg
- msg/pwm_input.msg
- msg/px4io_status.msg
- msg/wind_estimate.msg
- msg/actuator_controls.msg
- msg/vehicle_magnetometer.msg
- msg/vehicle_global_position.msg
- msg/optical_flow.msg
- msg/vehicle_status_flags.msg
- msg/offboard_control_mode.msg
- msg/camera_capture.msg
- msg/system_power.msg
- msg/orb_test_medium.msg
- msg/commander_state.msg
- msg/vehicle_attitude.msg
- msg/yaw_estimator_status.msg
- msg/cellular_status.msg
- msg/vehicle_land_detected.msg
- msg/hover_thrust_estimate.msg
- msg/vehicle_trajectory_waypoint.msg
- msg/sensor_correction.msg
- msg/rtl_flight_time.msg
- msg/vehicle_control_mode.msg
- msg/estimator_selector_status.msg
- msg/power_monitor.msg
- msg/landing_gear.msg
- msg/geofence_result.msg
- msg/manual_control_switches.msg
- msg/satellite_info.msg
- msg/camera_trigger.msg
- msg/ekf_gps_drift.msg
- msg/esc_report.msg
- msg/orb_test_large.msg
- msg/timesync_status.msg
- msg/qshell_retval.msg
- msg/navigator_mission_item.msg
- msg/vehicle_imu_status.msg
- msg/sensors_status_imu.msg
- msg/vehicle_angular_acceleration_setpoint.msg
- msg/vehicle_rates_setpoint.msg
- msg/onboard_computer_status.msg
- msg/landing_target_innovations.msg
- msg/test_motor.msg
- msg/sensor_accel_fifo.msg
- msg/tune_control.msg
- msg/vehicle_trajectory_bezier.msg
- msg/sensor_gps.msg
- msg/sensor_accel.msg
- msg/vehicle_status.msg
- msg/position_setpoint.msg
- msg/vehicle_attitude_setpoint.msg
- msg/iridiumsbd_status.msg
- msg/transponder_report.msg
- msg/vehicle_local_position.msg
- msg/power_button_state.msg
- msg/sensor_gyro_fft.msg
- msg/differential_pressure.msg
- msg/vehicle_acceleration.msg
- msg/collision_constraints.msg
- msg/sensor_preflight_mag.msg
- msg/logger_status.msg
- msg/home_position.msg
- msg/vehicle_actuator_setpoint.msg
- msg/vehicle_constraints.msg
- msg/airspeed_validated.msg
- msg/parameter_update.msg
- msg/multirotor_motor_limits.msg
- msg/estimator_status_flags.msg
- msg/orb_test.msg
- msg/debug_key_value.msg
- msg/sensor_gyro_fifo.msg
- msg/vehicle_gps_position.msg
- msg/safety.msg
- msg/vehicle_command.msg
- msg/esc_status.msg
- msg/led_control.msg
- msg/vehicle_command_ack.msg
- msg/vehicle_roi.msg
- msg/vehicle_odometry.msg
- msg/control_allocator_status.msg
- msg/rc_parameter_map.msg
- msg/estimator_optical_flow_vel.msg
- msg/vehicle_thrust_setpoint.msg
- msg/distance_sensor.msg
- msg/radio_status.msg
- msg/battery_status.msg
- msg/mavlink_log.msg
- msg/collision_report.msg
- msg/airspeed.msg
- msg/ekf2_timestamps.msg
- msg/trajectory_bezier.msg
- msg/generator_status.msg
- msg/vehicle_angular_acceleration.msg
- msg/sensor_selection.msg
- msg/gps_inject_data.msg
- msg/actuator_armed.msg
- msg/vtol_vehicle_status.msg
- msg/mount_orientation.msg
- msg/uavcan_parameter_request.msg
- msg/follow_target.msg
- msg/manual_control_setpoint.msg
- msg/ping.msg
- msg/timesync.msg
- msg/mission.msg
- msg/gps_dump.msg
- msg/orbit_status.msg
- msg/position_setpoint_triplet.msg
- msg/sensor_combined.msg
- msg/ulog_stream_ack.msg
- msg/vehicle_imu.msg
- msg/rpm.msg
- msg/estimator_states.msg
- msg/qshell_req.msg
- msg/debug_array.msg
- msg/vehicle_torque_setpoint.msg
- msg/telemetry_status.msg
- msg/cpuload.msg
- msg/sensor_gyro.msg
- msg/obstacle_distance.msg
- msg/mag_worker_data.msg
- msg/log_message.msg
- msg/debug_vect.msg
- msg/sensor_baro.msg
- msg/adc_report.msg
- msg/vehicle_air_data.msg
- msg/rate_ctrl_status.msg
- msg/debug_value.msg
- msg/actuator_outputs.msg
- msg/task_stack_info.msg
- msg/position_controller_status.msg