mavros_extras package from mavros repo

libmavconn mavros mavros_extras mavros_msgs

Package Summary

Tags uav mav mavlink plugin apm px4
Version 2.7.0
License GPLv3
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/mavlink/mavros.git
VCS Type git
VCS Version ros2
Last Updated 2024-03-03
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags uav mav mavlink plugin apm px4
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Extra nodes and plugins for

Additional Links

Maintainers

  • Vladimir Ermakov

Authors

  • Vladimir Ermakov
  • Amilcar Lucas

mavros extras

Some extra plugins and nodes for mavros.

ADSB

Publish/subscribe to the location and information of an ADS-B vehicle.

cam_imu_sync

Publish camera trigger data for synchronisation of IMU and camera frames.

debug_value

Subs/Pubs debug msgs from and to the FCU.

distance_sensor

Publish DISTANCE_SENSOR message data from FCU or connected sensors in companion computer.

fake_gps

Sends fake GPS from local position estimation source data (motion capture, vision) to FCU.

gps_input

Send GPS_INPUT messages to the FCU.

gps_status

Publish GPS_RAW and GPS_RTK messages from FCU.

gps_rtk

Sends the RTCM messages to the FCU for the RTK Fix.

log_transfer

Expose firmware functionality, that is related to log transfer

mocap_pose_estimate

Send motion capture pose estimate to FCU. Currently, not used by the FCU. Data can be send via vision_position plugin.

obstacle_distance

Send obstacle distance report to the FCU.

odom

Send odometry to FCU from another estimator.

px4flow

Publish OPTICAL_FLOW_RAD data from FCU or PX4Flow module.

rangefinder

Publish RANGEFINDER message data from FCU sensors in companion computer.

trajectory

Receive planned path from the FCU and send back corrected path (collision free, smoothed) to the FCU.

wheel_odometry

Compute and publish wheel odometry coming from FCU sensors.

vibration

Publish VIBRATION message data from FCU.

vision_pose_estimate

Send vision pose estimate to FCU.

vision_speed_estimate

Send vision speed estimate to FCU.

companion_process_status

Send companion process status report to the FCU.

servo_state_publisher

Convert mavros_msgs/RCOut to sensor_msgs/JointState messages. It is required to bind URDF model and real servos.

px-ros-pkg replacement

Use roslaunch mavros_extras px4flow.launch for that.

CHANGELOG

Changelog for package mavros_extras

2.7.0 (2024-03-03)

  • re-generate with cogall.sh
  • Merge branch \'master\' into ros2 * master: 1.18.0 update changelog sys_status.cpp: improve timeout code sys_status.cpp: Add a SYS_STATUS message publisher [camera plugin] Fix image_index and capture_result not properly filled Fix missing semi-colon GPS_STATUS Plugin: Fill in available messages for ROS1 legacy

  • 1.18.0

  • update changelog

  • [camera plugin] Fix image_index and capture_result not properly filled

  • [camera plugin] Fix image_index and capture_result not properly filled

  • Update mavros_plugins.xml

  • Update wheel_odometry.cpp fix typo

  • Fix typo fix typo in odometry frame child id

  • Removed unused variable

  • Use SensorDataQoS for gp_origin subscriber

  • Fix missing semi-colon

  • GPS_STATUS Plugin: Fill in available messages for ROS1 legacy Filled in available fields in GPS_RAW_INT & GPS2_RAW messages p.s. seems GPS2_RAW more complete than original GPS_RAW_INT

  • Define _frd frames in odom plugin based on parent/child frame parametrs

  • Contributors: Beniamino Pozzan, Kristoffer Bergman, Matteo Molinari, Mattia Giurato, Mohamed Abdelkader, Seunghwan Jo, Vladimir Ermakov, hpbrandal

1.18.0 (2024-03-03)

  • [camera plugin] Fix image_index and capture_result not properly filled
  • Fix missing semi-colon
  • GPS_STATUS Plugin: Fill in available messages for ROS1 legacy Filled in available fields in GPS_RAW_INT & GPS2_RAW messages p.s. seems GPS2_RAW more complete than original GPS_RAW_INT
  • Contributors: Beniamino Pozzan, Seunghwan Jo

2.6.0 (2023-09-09)

  • switch to use tf2_eigen.hpp, but that drops support for EOL distros
  • ament uncrustify
  • cog: regenerate all
  • Merge branch \'master\' into ros2 * master: 1.17.0 update changelog cog: regenerate all Bugfix/update map origin with home position (#1892) mavros: Remove extra \';\' mavros_extras: Fix some init order warnings Suppress warnings from included headers 1.16.0 update changelog made it such that the gp_origin topic published latched. use hpp instead of deprecated .h pluginlib headers

  • 1.17.0

  • update changelog

  • Merge pull request #1889 from MKargus0/feature/fix_landing_target_time_conversion Fixed header.stamp conversion in landing target

  • fixed style

  • fixed header.stamp conversion in landing target

  • Merge pull request #1871 from Vladislavert/feature/optical_flow_msg Addition of New OpticalFlow.msg

  • Added geometry_msgs/Vector3 to OpticalFlow.msg

  • Added vectors to the message OpticalFlow.msg

  • Added message optical flow

  • Merge pull request #1865 from scoutdi/warnings Fix / suppress some build warnings

  • mavros_extras: Fix some init order warnings

  • Suppress warnings from included headers

  • 1.16.0

  • update changelog

  • Merge pull request #1817 from lucasw/pluginlib_hpp use hpp instead of deprecated .h pluginlib headers

  • use hpp instead of deprecated .h pluginlib headers

  • Contributors: Lucas Walter, Mikhail Kolodochka, Morten Fyhn Amundsen, Vladimir Ermakov, Vladislavert

2.5.0 (2023-05-05)

2.4.0 (2022-12-30)

  • extras: uncrustify
  • extras: fix build, 2
  • extras: fix build
  • extras: fix cog
  • Merge branch \'master\' into ros2 * master: 1.15.0 update changelog ci: update actions Implement debug float array handler mavros_extras: Fix a sequence point warning mavros_extras: Fix a comparison that shouldn\'t be bitwise mavros: Fix some warnings mavros_extras: Fix buggy check for lat/lon ignored libmavconn: fix MAVLink v1.0 output selection

  • 1.15.0

  • update changelog

  • Merge pull request #1811 from scoutdi/debug-float-array Implement debug float array handler

  • Implement debug float array handler Co-authored-by: Morten Fyhn Amundsen <morten.f.amundsen@scoutdi.com>

  • Merge pull request #1807 from scoutdi/fix-bitwise-comparison mavros_extras: Fix a comparison that shouldn\'t be bitwise

  • Merge pull request #1808 from scoutdi/fix-sequence-point-warning mavros_extras: Fix a sequence point warning

  • mavros_extras: Fix a sequence point warning

  • mavros_extras: Fix a comparison that shouldn\'t be bitwise

  • Merge pull request #1805 from scoutdi/fix-latlon-check mavros_extras: Fix buggy check for lat/lon ignored

  • mavros_extras: Fix buggy check for lat/lon ignored

  • Contributors: Morten Fyhn Amundsen, Sverre Velten Rothmund, Vladimir Ermakov

2.3.0 (2022-09-24)

  • extras: fix linter errors
  • extras: fix toMsg
  • extras: fix build
  • extras: port guided_target
  • mavros: remove custom find script, re-generate
  • Merge branch \'master\' into ros2 * master: 1.14.0 update changelog scripts: waypoint and param files are text, not binary libmavconn: fix MAVLink v1.0 output selection plugins: add guided_target to accept offboard position targets add cmake module path for geographiclib on debian based systems use already installed FindGeographicLib.cmake

  • 1.14.0

  • update changelog

  • Merge pull request #1780 from snktshrma/master guided_target: accept position-target-global-int messages

  • plugins: add guided_target to accept offboard position targets Update guided_target.cpp Update guided_target.cpp Update mavros_plugins.xml Update CMakeLists.txt Added offboard_position.cpp Update apm_config.yaml Update offboard_position.cpp Update offboard_position.cpp Rename offboard_position.cpp to guided_target.cpp Update CMakeLists.txt Update mavros_plugins.xml Update apm_config.yaml Update guided_target.cpp

  • Contributors: Sanket Sharma, Vladimir Ermakov

2.2.0 (2022-06-27)

  • extras: fix build
  • extras: fix build
  • Merge branch \'master\' into ros2 * master: mount_control.cpp: detect MOUNT_ORIENTATION stale messages ESCTelemetryItem.msg: correct RPM units apm_config.yaml: add mount configuration sys_status.cpp fix free memory for values > 64KiB uncrustify cellular_status.cpp Add CellularStatus plugin and message *_config.yaml: document usage of multiple batteries diagnostics sys_status.cpp: fix compilation sys_status.cpp: support diagnostics on up-to 10 batteries sys_status.cpp: do not use harcoded constants sys_status.cpp: Timeout on MEMINFO and HWSTATUS mavlink messages and publish on the diagnostics sys_status.cpp: fix enabling of mem_diag and hwst_diag sys_status.cpp: Do not use battery1 voltage as voltage for all other batteries (bugfix). sys_status.cpp: ignore sys_status mavlink messages from gimbals mount_control.cpp: use mount_nh for params to keep similarities with other plugins set diag settings before add() sys_status.cpp: remove deprecated BATTERY2 mavlink message support Mount control plugin: add configurable diagnostics Bugfix: increment_f had no value asigned when input LaserScan was bigger than obstacle.distances.size() Bugfix: wrong interpolation when the reduction ratio (scale_factor) is not integer. Disable startup_px4_usb_quirk in px4_config.yaml

  • cmake: style fix

  • cmake: downgrade to C++17 as 20 breaks something in rclcpp

  • cmake: hide -std=c++2a

  • Merge pull request #1744 from amilcarlucas/pr_gimbal_diagnostics_fixes mount_control.cpp: detect MOUNT_ORIENTATION stale messages

  • extras: fix cog re to extract plugin name

1.17.0 (2023-09-09)

  • Merge pull request #1865 from scoutdi/warnings Fix / suppress some build warnings
  • mavros_extras: Fix some init order warnings
  • Suppress warnings from included headers
  • Contributors: Morten Fyhn Amundsen, Vladimir Ermakov

1.16.0 (2023-05-05)

  • Merge pull request #1817 from lucasw/pluginlib_hpp use hpp instead of deprecated .h pluginlib headers
  • use hpp instead of deprecated .h pluginlib headers
  • Contributors: Lucas Walter, Vladimir Ermakov

1.15.0 (2022-12-30)

  • Merge pull request #1811 from scoutdi/debug-float-array Implement debug float array handler
  • Implement debug float array handler Co-authored-by: Morten Fyhn Amundsen <morten.f.amundsen@scoutdi.com>
  • Merge pull request #1807 from scoutdi/fix-bitwise-comparison mavros_extras: Fix a comparison that shouldn\'t be bitwise
  • Merge pull request #1808 from scoutdi/fix-sequence-point-warning mavros_extras: Fix a sequence point warning
  • mavros_extras: Fix a sequence point warning
  • mavros_extras: Fix a comparison that shouldn\'t be bitwise
  • Merge pull request #1805 from scoutdi/fix-latlon-check mavros_extras: Fix buggy check for lat/lon ignored
  • mavros_extras: Fix buggy check for lat/lon ignored
  • Contributors: Morten Fyhn Amundsen, Sverre Velten Rothmund, Vladimir Ermakov

1.14.0 (2022-09-24)

  • Merge pull request #1780 from snktshrma/master guided_target: accept position-target-global-int messages
  • plugins: add guided_target to accept offboard position targets Update guided_target.cpp Update guided_target.cpp Update mavros_plugins.xml Update CMakeLists.txt Added offboard_position.cpp Update apm_config.yaml Update offboard_position.cpp Update offboard_position.cpp Rename offboard_position.cpp to guided_target.cpp Update CMakeLists.txt Update mavros_plugins.xml Update apm_config.yaml Update guided_target.cpp
  • Merge pull request #1744 from amilcarlucas/pr_gimbal_diagnostics_fixes mount_control.cpp: detect MOUNT_ORIENTATION stale messages
  • mount_control.cpp: detect MOUNT_ORIENTATION stale messages correct MountConfigure response success correct constructor initialization order some gimbals send negated/inverted angle measurements, correct that to obey the MAVLink frame convention using run-time parameters
  • Merge pull request #1735 from clydemcqueen/fix_1734 Fix crash in vision_pose plugin
  • Remove unrelated log message
  • Initialize last_transform_stamp with RCL_ROS_TIME, fixes #1734
  • Merge pull request #1727 from BV-OpenSource/pr-cellular-status Pr cellular status
  • uncrustify cellular_status.cpp
  • Add CellularStatus plugin and message
  • Merge pull request #1702 from amilcarlucas/mount_diagnostics Mount control plugin: add configurable diagnostics
  • mount_control.cpp: use mount_nh for params to keep similarities with other plugins set diag settings before add()
  • Mount control plugin: add configurable diagnostics
  • Merge pull request #1700 from oroelipas/fix-obstacle-distance Fix obstacle distance
  • Bugfix: increment_f had no value asigned when input LaserScan was bigger than obstacle.distances.size()
  • Bugfix: wrong interpolation when the reduction ratio (scale_factor) is not integer.
  • Contributors: Clyde McQueen, Dr.-Ing. Amilcar do Carmo Lucas, Rui Mendes, Vladimir Ermakov, oroel

2.1.1 (2022-03-02)

  • plugins: Fix misprint Fix #1709
  • Contributors: Vladimir Ermakov

2.1.0 (2022-02-02)

  • plugins: fix topic names to use prefix for namespaced ones
  • plugins: fix topic names to use prefix for namespaced ones
  • ci: fix several lint warnings
  • extras: terrain: fix copy-paste artifact
  • extras: port terrain plugin
  • Merge branch \'master\' into ros2 * master: 1.13.0 update changelog py-lib: fix compatibility with py3 for Noetic re-generate all coglets test: add checks for ROTATION_CUSTOM lib: Fix rotation search for CUSTOM Removed CamelCase for class members. Publish to \"report\" More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages Fixed callback name to match [handle_{MESSAGE_NAME.lower()}]{.title-ref} convention Add extra MAV_FRAMES to waypoint message as defined in https://mavlink.io/en/messages/common.html Fixed topic names to match more closely what other plugins use. Fixed a typo. Add plugin for reporting terrain height estimate from FCU 1.12.2 update changelog Set time/publish_sim_time to false by default plugin: setpoint_raw: move getParam to initializer extras: trajectory: backport #1667

  • 1.13.0

  • update changelog

  • Merge pull request #1677 from AndersonRayner/add_terrain Add plugin for reporting terrain height estimate from the FCU

  • Removed CamelCase for class members. Publish to \"report\"

  • More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages

  • Fixed callback name to match [handle_{MESSAGE_NAME.lower()}]{.title-ref} convention

  • Fixed topic names to match more closely what other plugins use. Fixed a typo.

  • Add plugin for reporting terrain height estimate from FCU

  • 1.12.2

  • update changelog

  • Merge pull request #1675 from BOB4Drone/ros2 fix bof

  • Update mag_calibration_status.cpp

  • fix code style fix code style

  • Update mag_calibration_status.cpp

  • fix misprint and use size() fix misprint and use size()

  • fix bof fix #1668

  • extras: trajectory: backport #1667

  • extras: trajectory: make linter happy after #1667

  • Merge pull request #1667 from BOB4Drone/ros2 fix bof

  • fix bof

  • Merge branch \'master\' into ros2 * master: 1.12.1 update changelog mavconn: fix connection issue introduced by #1658 mavros_extras: Fix some warnings mavros: Fix some warnings

  • 1.12.1

  • update changelog

  • Merge pull request #1660 from scoutdi/fix-warnings Fix warnings

  • mavros_extras: Fix some warnings

  • extras: fix parameter name

  • extras: fix topic names

  • Contributors: BOB4Drone, Morten Fyhn Amundsen, Vladimir Ermakov, matt

2.0.5 (2021-11-28)

  • extras: make cpplint happy
  • extras: fix most of build errors of SSP
  • extras: servo_state_publisher ported. almost...
  • extras: start porting servo_state_publisher
  • extras: make cpplint happy
  • extras: fix some linter errors. Do you know how to make me mad? Just let ament_uncrustify and ament_cpplint require opposite requirements!
  • fix some build warnings; drop old copter vis
  • Merge branch \'master\' into ros2 * master: 1.12.0 update changelog Fix multiple bugs lib: fix mission frame debug print extras: distance_sensor: revert back to zero quaternion

  • 1.12.0

  • update changelog

  • extras: fix some more lint warns

  • plugin: fix some compile warnings

  • cmake: require C++20 to build all modules

  • extras: port distance_sensor plugin

  • extras: fix camera plugin

  • extras: port camera plugin

  • lib: ignore MAVPACKED-related warnings from mavlink

  • extras: distance_sensor: revert back to zero quaternion Fix #1653

  • msgs: update conversion header

  • Merge branch \'master\' into ros2 * master: 1.11.1 update changelog lib: fix build

  • 1.11.1

  • update changelog

  • Merge branch \'master\' into ros2 * master: 1.11.0 update changelog lib: fix ftf warnings msgs: use pragmas to ignore unaligned pointer warnings extras: landing_target: fix misprint msgs: fix convert const plugin: setpoint_raw: fix misprint msgs: try to hide \'unaligned pointer\' warning plugin: sys: fix compillation error plugin: initialize quaternions with identity plugin: sys: Use wall timers for connection management Use meters for relative altitude distance_sensor: Initialize sensor orientation quaternion to zero Address review comments Add camera plugin for interfacing with mavlink camera protocol

  • 1.11.0

  • update changelog

  • extras: landing_target: fix misprint

  • plugin: initialize quaternions with identity Eigen::Quaternion[d|f] () does not initialize with zeroes or identity. So we must initialize with identity vector objects that can be left unassigned. Related to #1652

  • Merge pull request #1651 from Jaeyoung-Lim/pr-image-capture-plugin Add camera plugin for interfacing with mavlink camera protocol

  • Merge pull request #1652 from scoutdi/avoid-uninit-orientation distance_sensor: Initialize sensor orientation quaternion to zero

  • Use meters for relative altitude

  • distance_sensor: Initialize sensor orientation quaternion to zero Without this, you\'ll get random garbage data for the quaternion field of the DISTANCE_SENSOR MAVLink messages sent to the autopilot. The quaternion field should be set to zero when unused, according to the MAVLink message\'s field description.

  • Address review comments

  • Add camera plugin for interfacing with mavlink camera protocol Add camera image captured message for handling camera trigger information

  • extras: port fake_gps

  • extras: port tunnel

  • extras: update metadata

  • extras: port hil

  • extras: fix odom

  • extras: port odom

  • extras: port px4flow

  • extras: fix some linter warnings

  • extras: fix some linter warnings

  • extras: fix some linter warnings

  • extras: fix some linter warnings

  • extras: port wheel_odometry (partially)

  • extras: port vision_speed

  • extras: port vibration

  • extras: port vfr_hud

  • extras: port trajectory

  • extras: port rangefinder

  • extras: port onboard computer status, play_tune

  • extras: fix linter warnings

  • extras: port obstacle_distance

  • extras: update metadata xml

  • extras: port mount_control

  • extras: fix build for Foxy

  • extras: port mocap

  • extras: port mag cal status

  • extras: port log_transfer

  • extras: fix rtcm seq

  • extras: port gps_rtk

  • extras: port gps_input

  • extras: fixing some linter warnings

  • extras: fixing some linter warnings

  • Contributors: Jaeyoung-Lim, Morten Fyhn Amundsen, Vladimir Ermakov

2.0.4 (2021-11-04)

  • Merge branch \'master\' into ros2 * master: 1.10.0 prepare release

  • 1.10.0

  • prepare release

  • extras: remove safety_area as outdated

  • extras: port esc_telemetry

  • extras: port esc_status plugin

  • extras: porting gps_status

  • Merge branch \'master\' into ros2 * master: (25 commits) Remove reference Catch std::length_error in send_message Show ENOTCONN error instead of crash Tunnel: Check for invalid payload length Tunnel.msg: Generate enum with cog mavros_extras: Create tunnel plugin mavros_msgs: Add Tunnel message MountControl.msg: fix copy-paste sys_time.cpp: typo sys_time: publish /clock for simulation times 1.9.0 update changelog Spelling corrections Changed OverrideRCIn to 18 channels This adds functionality to erase all logs on the SD card via mavlink publish BATTERY2 message as /mavros/battery2 topic Mavlink v2.0 specs for RC_CHANNELS_OVERRIDE accepts upto 18 channels. The plugin publishes channels 9 to 18 if the FCU protocol version is 2.0 Added NAV_CONTROLLER_OUTPUT Plugin Added GPS_INPUT plugin Update esc_status plugin with datatype change on MAVLink. ...

  • Merge pull request #1625 from scoutdi/tunnel-plugin Plugin for TUNNEL messages

  • Tunnel: Check for invalid payload length

  • mavros_extras: Create tunnel plugin

  • Merge pull request #1605 from Peter010103/ros2 mavros_extras: Ported vision_pose_estimate plugin for ROS2

  • 1.9.0

  • update changelog

  • Merge pull request #1621 from amilcarlucas/pr/mount-control-spelling Spelling corrections

  • Spelling corrections

  • Merge pull request #1615 from amilcarlucas/pr/erase-logs This adds functionality to erase all logs on the SD card via mavlink

  • Merge pull request #1618 from amilcarlucas/pr/GPS_INPUT-plugin Added GPS_INPUT plugin

  • This adds functionality to erase all logs on the SD card via mavlink

  • Added GPS_INPUT plugin

  • Merge pull request #1606 from BV-OpenSource/master Add Mount angles message for communications with ardupilotmega.

  • Merge branch \'master\' into master

  • Update esc_status plugin with datatype change on MAVLink. ESC_INFO MAVLink message was updated to have negative temperates and also at a different resolution. This commit updates those changes on this side.

  • Convert status data from cdeg to rad.

  • Publish quaternion information with Mount Status mavlink message.

  • Add missing subscription.

  • extras: port cam_imu_sync

  • extras: re-generate cog

  • extras: port debug_value

  • Remove Mount_Status plugin. Add Status data to Mount_Control plugin. Remove Mount_Status message.

  • extras: fix build, add UAS::send_massage(msg, compid)

  • extras: port companion_process_status

  • msgs: re-generate file lists

  • style: apply ament_uncrustify --reformat

  • Merge branch \'master\' into ros2 * master: extras: esc_telemetry: fix build extras: fix esc_telemetry centi-volt/amp conversion extras: uncrustify all plugins plugins: reformat xml extras: reformat plugins xml extras: fix apm esc_telemetry msgs: fix types for apm\'s esc telemetry actually allocate memory for the telemetry information fixed some compile errors added esc_telemetry plugin Reset calibration flag when re-calibrating. Prevent wrong data output. Exclude changes to launch files. Delete debug files. Apply uncrustify changes. Set progress array to global to prevent erasing data. Move Compass calibration report to extras. Rewrite code based on instructions. Remove extra message from CMakeLists. Add message and service definition. Add compass calibration feedback status. Add service to call the \'Next\' button in calibrations.

  • extras: esc_telemetry: fix build

  • extras: fix esc_telemetry centi-volt/amp conversion

  • extras: uncrustify all plugins

  • extras: reformat plugins xml

  • extras: fix apm esc_telemetry

  • actually allocate memory for the telemetry information

  • fixed some compile errors

  • added esc_telemetry plugin

  • Add Mount angles message for communications with ardupilotmega.

  • Added subscriber callback function for ROS2

  • Added initialise function in vision_pose_estimate

  • Boilerplate vision_pose_estimate plugin

  • extras: landing_target: disable tf listener, it segfaults

  • extras: regenerate plugins xml, ament_uncrustify

  • mavros_extras: improve landing_target logging

  • mavros_extras: ported landing_target plugin to ros2

  • Reset calibration flag when re-calibrating. Prevent wrong data output.

  • Delete debug files.

  • Apply uncrustify changes.

  • Set progress array to global to prevent erasing data.

  • Move Compass calibration report to extras. Rewrite code based on instructions.

  • extras: port 3dr radio

  • extras: add urdf package

  • extras: adsb: begin porting to ros2

  • Contributors: Abhijith Thottumadayil Jagadeesh, Andr

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

  • launch/px4flow.launch
      • fcu_url [default: serial:///dev/ttyACM0:921600]
      • gcs_url [default: ]
      • tgt_system [default: 81]
      • tgt_component [default: 50]

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged mavros_extras at Robotics Stack Exchange

mavros_extras package from mavros repo

libmavconn mavros mavros_extras mavros_msgs

Package Summary

Tags uav mav mavlink plugin apm px4
Version 2.7.0
License GPLv3
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/mavlink/mavros.git
VCS Type git
VCS Version ros2
Last Updated 2024-03-03
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags uav mav mavlink plugin apm px4
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Extra nodes and plugins for

Additional Links

Maintainers

  • Vladimir Ermakov

Authors

  • Vladimir Ermakov
  • Amilcar Lucas

mavros extras

Some extra plugins and nodes for mavros.

ADSB

Publish/subscribe to the location and information of an ADS-B vehicle.

cam_imu_sync

Publish camera trigger data for synchronisation of IMU and camera frames.

debug_value

Subs/Pubs debug msgs from and to the FCU.

distance_sensor

Publish DISTANCE_SENSOR message data from FCU or connected sensors in companion computer.

fake_gps

Sends fake GPS from local position estimation source data (motion capture, vision) to FCU.

gps_input

Send GPS_INPUT messages to the FCU.

gps_status

Publish GPS_RAW and GPS_RTK messages from FCU.

gps_rtk

Sends the RTCM messages to the FCU for the RTK Fix.

log_transfer

Expose firmware functionality, that is related to log transfer

mocap_pose_estimate

Send motion capture pose estimate to FCU. Currently, not used by the FCU. Data can be send via vision_position plugin.

obstacle_distance

Send obstacle distance report to the FCU.

odom

Send odometry to FCU from another estimator.

px4flow

Publish OPTICAL_FLOW_RAD data from FCU or PX4Flow module.

rangefinder

Publish RANGEFINDER message data from FCU sensors in companion computer.

trajectory

Receive planned path from the FCU and send back corrected path (collision free, smoothed) to the FCU.

wheel_odometry

Compute and publish wheel odometry coming from FCU sensors.

vibration

Publish VIBRATION message data from FCU.

vision_pose_estimate

Send vision pose estimate to FCU.

vision_speed_estimate

Send vision speed estimate to FCU.

companion_process_status

Send companion process status report to the FCU.

servo_state_publisher

Convert mavros_msgs/RCOut to sensor_msgs/JointState messages. It is required to bind URDF model and real servos.

px-ros-pkg replacement

Use roslaunch mavros_extras px4flow.launch for that.

CHANGELOG

Changelog for package mavros_extras

2.7.0 (2024-03-03)

  • re-generate with cogall.sh
  • Merge branch \'master\' into ros2 * master: 1.18.0 update changelog sys_status.cpp: improve timeout code sys_status.cpp: Add a SYS_STATUS message publisher [camera plugin] Fix image_index and capture_result not properly filled Fix missing semi-colon GPS_STATUS Plugin: Fill in available messages for ROS1 legacy

  • 1.18.0

  • update changelog

  • [camera plugin] Fix image_index and capture_result not properly filled

  • [camera plugin] Fix image_index and capture_result not properly filled

  • Update mavros_plugins.xml

  • Update wheel_odometry.cpp fix typo

  • Fix typo fix typo in odometry frame child id

  • Removed unused variable

  • Use SensorDataQoS for gp_origin subscriber

  • Fix missing semi-colon

  • GPS_STATUS Plugin: Fill in available messages for ROS1 legacy Filled in available fields in GPS_RAW_INT & GPS2_RAW messages p.s. seems GPS2_RAW more complete than original GPS_RAW_INT

  • Define _frd frames in odom plugin based on parent/child frame parametrs

  • Contributors: Beniamino Pozzan, Kristoffer Bergman, Matteo Molinari, Mattia Giurato, Mohamed Abdelkader, Seunghwan Jo, Vladimir Ermakov, hpbrandal

1.18.0 (2024-03-03)

  • [camera plugin] Fix image_index and capture_result not properly filled
  • Fix missing semi-colon
  • GPS_STATUS Plugin: Fill in available messages for ROS1 legacy Filled in available fields in GPS_RAW_INT & GPS2_RAW messages p.s. seems GPS2_RAW more complete than original GPS_RAW_INT
  • Contributors: Beniamino Pozzan, Seunghwan Jo

2.6.0 (2023-09-09)

  • switch to use tf2_eigen.hpp, but that drops support for EOL distros
  • ament uncrustify
  • cog: regenerate all
  • Merge branch \'master\' into ros2 * master: 1.17.0 update changelog cog: regenerate all Bugfix/update map origin with home position (#1892) mavros: Remove extra \';\' mavros_extras: Fix some init order warnings Suppress warnings from included headers 1.16.0 update changelog made it such that the gp_origin topic published latched. use hpp instead of deprecated .h pluginlib headers

  • 1.17.0

  • update changelog

  • Merge pull request #1889 from MKargus0/feature/fix_landing_target_time_conversion Fixed header.stamp conversion in landing target

  • fixed style

  • fixed header.stamp conversion in landing target

  • Merge pull request #1871 from Vladislavert/feature/optical_flow_msg Addition of New OpticalFlow.msg

  • Added geometry_msgs/Vector3 to OpticalFlow.msg

  • Added vectors to the message OpticalFlow.msg

  • Added message optical flow

  • Merge pull request #1865 from scoutdi/warnings Fix / suppress some build warnings

  • mavros_extras: Fix some init order warnings

  • Suppress warnings from included headers

  • 1.16.0

  • update changelog

  • Merge pull request #1817 from lucasw/pluginlib_hpp use hpp instead of deprecated .h pluginlib headers

  • use hpp instead of deprecated .h pluginlib headers

  • Contributors: Lucas Walter, Mikhail Kolodochka, Morten Fyhn Amundsen, Vladimir Ermakov, Vladislavert

2.5.0 (2023-05-05)

2.4.0 (2022-12-30)

  • extras: uncrustify
  • extras: fix build, 2
  • extras: fix build
  • extras: fix cog
  • Merge branch \'master\' into ros2 * master: 1.15.0 update changelog ci: update actions Implement debug float array handler mavros_extras: Fix a sequence point warning mavros_extras: Fix a comparison that shouldn\'t be bitwise mavros: Fix some warnings mavros_extras: Fix buggy check for lat/lon ignored libmavconn: fix MAVLink v1.0 output selection

  • 1.15.0

  • update changelog

  • Merge pull request #1811 from scoutdi/debug-float-array Implement debug float array handler

  • Implement debug float array handler Co-authored-by: Morten Fyhn Amundsen <morten.f.amundsen@scoutdi.com>

  • Merge pull request #1807 from scoutdi/fix-bitwise-comparison mavros_extras: Fix a comparison that shouldn\'t be bitwise

  • Merge pull request #1808 from scoutdi/fix-sequence-point-warning mavros_extras: Fix a sequence point warning

  • mavros_extras: Fix a sequence point warning

  • mavros_extras: Fix a comparison that shouldn\'t be bitwise

  • Merge pull request #1805 from scoutdi/fix-latlon-check mavros_extras: Fix buggy check for lat/lon ignored

  • mavros_extras: Fix buggy check for lat/lon ignored

  • Contributors: Morten Fyhn Amundsen, Sverre Velten Rothmund, Vladimir Ermakov

2.3.0 (2022-09-24)

  • extras: fix linter errors
  • extras: fix toMsg
  • extras: fix build
  • extras: port guided_target
  • mavros: remove custom find script, re-generate
  • Merge branch \'master\' into ros2 * master: 1.14.0 update changelog scripts: waypoint and param files are text, not binary libmavconn: fix MAVLink v1.0 output selection plugins: add guided_target to accept offboard position targets add cmake module path for geographiclib on debian based systems use already installed FindGeographicLib.cmake

  • 1.14.0

  • update changelog

  • Merge pull request #1780 from snktshrma/master guided_target: accept position-target-global-int messages

  • plugins: add guided_target to accept offboard position targets Update guided_target.cpp Update guided_target.cpp Update mavros_plugins.xml Update CMakeLists.txt Added offboard_position.cpp Update apm_config.yaml Update offboard_position.cpp Update offboard_position.cpp Rename offboard_position.cpp to guided_target.cpp Update CMakeLists.txt Update mavros_plugins.xml Update apm_config.yaml Update guided_target.cpp

  • Contributors: Sanket Sharma, Vladimir Ermakov

2.2.0 (2022-06-27)

  • extras: fix build
  • extras: fix build
  • Merge branch \'master\' into ros2 * master: mount_control.cpp: detect MOUNT_ORIENTATION stale messages ESCTelemetryItem.msg: correct RPM units apm_config.yaml: add mount configuration sys_status.cpp fix free memory for values > 64KiB uncrustify cellular_status.cpp Add CellularStatus plugin and message *_config.yaml: document usage of multiple batteries diagnostics sys_status.cpp: fix compilation sys_status.cpp: support diagnostics on up-to 10 batteries sys_status.cpp: do not use harcoded constants sys_status.cpp: Timeout on MEMINFO and HWSTATUS mavlink messages and publish on the diagnostics sys_status.cpp: fix enabling of mem_diag and hwst_diag sys_status.cpp: Do not use battery1 voltage as voltage for all other batteries (bugfix). sys_status.cpp: ignore sys_status mavlink messages from gimbals mount_control.cpp: use mount_nh for params to keep similarities with other plugins set diag settings before add() sys_status.cpp: remove deprecated BATTERY2 mavlink message support Mount control plugin: add configurable diagnostics Bugfix: increment_f had no value asigned when input LaserScan was bigger than obstacle.distances.size() Bugfix: wrong interpolation when the reduction ratio (scale_factor) is not integer. Disable startup_px4_usb_quirk in px4_config.yaml

  • cmake: style fix

  • cmake: downgrade to C++17 as 20 breaks something in rclcpp

  • cmake: hide -std=c++2a

  • Merge pull request #1744 from amilcarlucas/pr_gimbal_diagnostics_fixes mount_control.cpp: detect MOUNT_ORIENTATION stale messages

  • extras: fix cog re to extract plugin name

1.17.0 (2023-09-09)

  • Merge pull request #1865 from scoutdi/warnings Fix / suppress some build warnings
  • mavros_extras: Fix some init order warnings
  • Suppress warnings from included headers
  • Contributors: Morten Fyhn Amundsen, Vladimir Ermakov

1.16.0 (2023-05-05)

  • Merge pull request #1817 from lucasw/pluginlib_hpp use hpp instead of deprecated .h pluginlib headers
  • use hpp instead of deprecated .h pluginlib headers
  • Contributors: Lucas Walter, Vladimir Ermakov

1.15.0 (2022-12-30)

  • Merge pull request #1811 from scoutdi/debug-float-array Implement debug float array handler
  • Implement debug float array handler Co-authored-by: Morten Fyhn Amundsen <morten.f.amundsen@scoutdi.com>
  • Merge pull request #1807 from scoutdi/fix-bitwise-comparison mavros_extras: Fix a comparison that shouldn\'t be bitwise
  • Merge pull request #1808 from scoutdi/fix-sequence-point-warning mavros_extras: Fix a sequence point warning
  • mavros_extras: Fix a sequence point warning
  • mavros_extras: Fix a comparison that shouldn\'t be bitwise
  • Merge pull request #1805 from scoutdi/fix-latlon-check mavros_extras: Fix buggy check for lat/lon ignored
  • mavros_extras: Fix buggy check for lat/lon ignored
  • Contributors: Morten Fyhn Amundsen, Sverre Velten Rothmund, Vladimir Ermakov

1.14.0 (2022-09-24)

  • Merge pull request #1780 from snktshrma/master guided_target: accept position-target-global-int messages
  • plugins: add guided_target to accept offboard position targets Update guided_target.cpp Update guided_target.cpp Update mavros_plugins.xml Update CMakeLists.txt Added offboard_position.cpp Update apm_config.yaml Update offboard_position.cpp Update offboard_position.cpp Rename offboard_position.cpp to guided_target.cpp Update CMakeLists.txt Update mavros_plugins.xml Update apm_config.yaml Update guided_target.cpp
  • Merge pull request #1744 from amilcarlucas/pr_gimbal_diagnostics_fixes mount_control.cpp: detect MOUNT_ORIENTATION stale messages
  • mount_control.cpp: detect MOUNT_ORIENTATION stale messages correct MountConfigure response success correct constructor initialization order some gimbals send negated/inverted angle measurements, correct that to obey the MAVLink frame convention using run-time parameters
  • Merge pull request #1735 from clydemcqueen/fix_1734 Fix crash in vision_pose plugin
  • Remove unrelated log message
  • Initialize last_transform_stamp with RCL_ROS_TIME, fixes #1734
  • Merge pull request #1727 from BV-OpenSource/pr-cellular-status Pr cellular status
  • uncrustify cellular_status.cpp
  • Add CellularStatus plugin and message
  • Merge pull request #1702 from amilcarlucas/mount_diagnostics Mount control plugin: add configurable diagnostics
  • mount_control.cpp: use mount_nh for params to keep similarities with other plugins set diag settings before add()
  • Mount control plugin: add configurable diagnostics
  • Merge pull request #1700 from oroelipas/fix-obstacle-distance Fix obstacle distance
  • Bugfix: increment_f had no value asigned when input LaserScan was bigger than obstacle.distances.size()
  • Bugfix: wrong interpolation when the reduction ratio (scale_factor) is not integer.
  • Contributors: Clyde McQueen, Dr.-Ing. Amilcar do Carmo Lucas, Rui Mendes, Vladimir Ermakov, oroel

2.1.1 (2022-03-02)

  • plugins: Fix misprint Fix #1709
  • Contributors: Vladimir Ermakov

2.1.0 (2022-02-02)

  • plugins: fix topic names to use prefix for namespaced ones
  • plugins: fix topic names to use prefix for namespaced ones
  • ci: fix several lint warnings
  • extras: terrain: fix copy-paste artifact
  • extras: port terrain plugin
  • Merge branch \'master\' into ros2 * master: 1.13.0 update changelog py-lib: fix compatibility with py3 for Noetic re-generate all coglets test: add checks for ROTATION_CUSTOM lib: Fix rotation search for CUSTOM Removed CamelCase for class members. Publish to \"report\" More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages Fixed callback name to match [handle_{MESSAGE_NAME.lower()}]{.title-ref} convention Add extra MAV_FRAMES to waypoint message as defined in https://mavlink.io/en/messages/common.html Fixed topic names to match more closely what other plugins use. Fixed a typo. Add plugin for reporting terrain height estimate from FCU 1.12.2 update changelog Set time/publish_sim_time to false by default plugin: setpoint_raw: move getParam to initializer extras: trajectory: backport #1667

  • 1.13.0

  • update changelog

  • Merge pull request #1677 from AndersonRayner/add_terrain Add plugin for reporting terrain height estimate from the FCU

  • Removed CamelCase for class members. Publish to \"report\"

  • More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages

  • Fixed callback name to match [handle_{MESSAGE_NAME.lower()}]{.title-ref} convention

  • Fixed topic names to match more closely what other plugins use. Fixed a typo.

  • Add plugin for reporting terrain height estimate from FCU

  • 1.12.2

  • update changelog

  • Merge pull request #1675 from BOB4Drone/ros2 fix bof

  • Update mag_calibration_status.cpp

  • fix code style fix code style

  • Update mag_calibration_status.cpp

  • fix misprint and use size() fix misprint and use size()

  • fix bof fix #1668

  • extras: trajectory: backport #1667

  • extras: trajectory: make linter happy after #1667

  • Merge pull request #1667 from BOB4Drone/ros2 fix bof

  • fix bof

  • Merge branch \'master\' into ros2 * master: 1.12.1 update changelog mavconn: fix connection issue introduced by #1658 mavros_extras: Fix some warnings mavros: Fix some warnings

  • 1.12.1

  • update changelog

  • Merge pull request #1660 from scoutdi/fix-warnings Fix warnings

  • mavros_extras: Fix some warnings

  • extras: fix parameter name

  • extras: fix topic names

  • Contributors: BOB4Drone, Morten Fyhn Amundsen, Vladimir Ermakov, matt

2.0.5 (2021-11-28)

  • extras: make cpplint happy
  • extras: fix most of build errors of SSP
  • extras: servo_state_publisher ported. almost...
  • extras: start porting servo_state_publisher
  • extras: make cpplint happy
  • extras: fix some linter errors. Do you know how to make me mad? Just let ament_uncrustify and ament_cpplint require opposite requirements!
  • fix some build warnings; drop old copter vis
  • Merge branch \'master\' into ros2 * master: 1.12.0 update changelog Fix multiple bugs lib: fix mission frame debug print extras: distance_sensor: revert back to zero quaternion

  • 1.12.0

  • update changelog

  • extras: fix some more lint warns

  • plugin: fix some compile warnings

  • cmake: require C++20 to build all modules

  • extras: port distance_sensor plugin

  • extras: fix camera plugin

  • extras: port camera plugin

  • lib: ignore MAVPACKED-related warnings from mavlink

  • extras: distance_sensor: revert back to zero quaternion Fix #1653

  • msgs: update conversion header

  • Merge branch \'master\' into ros2 * master: 1.11.1 update changelog lib: fix build

  • 1.11.1

  • update changelog

  • Merge branch \'master\' into ros2 * master: 1.11.0 update changelog lib: fix ftf warnings msgs: use pragmas to ignore unaligned pointer warnings extras: landing_target: fix misprint msgs: fix convert const plugin: setpoint_raw: fix misprint msgs: try to hide \'unaligned pointer\' warning plugin: sys: fix compillation error plugin: initialize quaternions with identity plugin: sys: Use wall timers for connection management Use meters for relative altitude distance_sensor: Initialize sensor orientation quaternion to zero Address review comments Add camera plugin for interfacing with mavlink camera protocol

  • 1.11.0

  • update changelog

  • extras: landing_target: fix misprint

  • plugin: initialize quaternions with identity Eigen::Quaternion[d|f] () does not initialize with zeroes or identity. So we must initialize with identity vector objects that can be left unassigned. Related to #1652

  • Merge pull request #1651 from Jaeyoung-Lim/pr-image-capture-plugin Add camera plugin for interfacing with mavlink camera protocol

  • Merge pull request #1652 from scoutdi/avoid-uninit-orientation distance_sensor: Initialize sensor orientation quaternion to zero

  • Use meters for relative altitude

  • distance_sensor: Initialize sensor orientation quaternion to zero Without this, you\'ll get random garbage data for the quaternion field of the DISTANCE_SENSOR MAVLink messages sent to the autopilot. The quaternion field should be set to zero when unused, according to the MAVLink message\'s field description.

  • Address review comments

  • Add camera plugin for interfacing with mavlink camera protocol Add camera image captured message for handling camera trigger information

  • extras: port fake_gps

  • extras: port tunnel

  • extras: update metadata

  • extras: port hil

  • extras: fix odom

  • extras: port odom

  • extras: port px4flow

  • extras: fix some linter warnings

  • extras: fix some linter warnings

  • extras: fix some linter warnings

  • extras: fix some linter warnings

  • extras: port wheel_odometry (partially)

  • extras: port vision_speed

  • extras: port vibration

  • extras: port vfr_hud

  • extras: port trajectory

  • extras: port rangefinder

  • extras: port onboard computer status, play_tune

  • extras: fix linter warnings

  • extras: port obstacle_distance

  • extras: update metadata xml

  • extras: port mount_control

  • extras: fix build for Foxy

  • extras: port mocap

  • extras: port mag cal status

  • extras: port log_transfer

  • extras: fix rtcm seq

  • extras: port gps_rtk

  • extras: port gps_input

  • extras: fixing some linter warnings

  • extras: fixing some linter warnings

  • Contributors: Jaeyoung-Lim, Morten Fyhn Amundsen, Vladimir Ermakov

2.0.4 (2021-11-04)

  • Merge branch \'master\' into ros2 * master: 1.10.0 prepare release

  • 1.10.0

  • prepare release

  • extras: remove safety_area as outdated

  • extras: port esc_telemetry

  • extras: port esc_status plugin

  • extras: porting gps_status

  • Merge branch \'master\' into ros2 * master: (25 commits) Remove reference Catch std::length_error in send_message Show ENOTCONN error instead of crash Tunnel: Check for invalid payload length Tunnel.msg: Generate enum with cog mavros_extras: Create tunnel plugin mavros_msgs: Add Tunnel message MountControl.msg: fix copy-paste sys_time.cpp: typo sys_time: publish /clock for simulation times 1.9.0 update changelog Spelling corrections Changed OverrideRCIn to 18 channels This adds functionality to erase all logs on the SD card via mavlink publish BATTERY2 message as /mavros/battery2 topic Mavlink v2.0 specs for RC_CHANNELS_OVERRIDE accepts upto 18 channels. The plugin publishes channels 9 to 18 if the FCU protocol version is 2.0 Added NAV_CONTROLLER_OUTPUT Plugin Added GPS_INPUT plugin Update esc_status plugin with datatype change on MAVLink. ...

  • Merge pull request #1625 from scoutdi/tunnel-plugin Plugin for TUNNEL messages

  • Tunnel: Check for invalid payload length

  • mavros_extras: Create tunnel plugin

  • Merge pull request #1605 from Peter010103/ros2 mavros_extras: Ported vision_pose_estimate plugin for ROS2

  • 1.9.0

  • update changelog

  • Merge pull request #1621 from amilcarlucas/pr/mount-control-spelling Spelling corrections

  • Spelling corrections

  • Merge pull request #1615 from amilcarlucas/pr/erase-logs This adds functionality to erase all logs on the SD card via mavlink

  • Merge pull request #1618 from amilcarlucas/pr/GPS_INPUT-plugin Added GPS_INPUT plugin

  • This adds functionality to erase all logs on the SD card via mavlink

  • Added GPS_INPUT plugin

  • Merge pull request #1606 from BV-OpenSource/master Add Mount angles message for communications with ardupilotmega.

  • Merge branch \'master\' into master

  • Update esc_status plugin with datatype change on MAVLink. ESC_INFO MAVLink message was updated to have negative temperates and also at a different resolution. This commit updates those changes on this side.

  • Convert status data from cdeg to rad.

  • Publish quaternion information with Mount Status mavlink message.

  • Add missing subscription.

  • extras: port cam_imu_sync

  • extras: re-generate cog

  • extras: port debug_value

  • Remove Mount_Status plugin. Add Status data to Mount_Control plugin. Remove Mount_Status message.

  • extras: fix build, add UAS::send_massage(msg, compid)

  • extras: port companion_process_status

  • msgs: re-generate file lists

  • style: apply ament_uncrustify --reformat

  • Merge branch \'master\' into ros2 * master: extras: esc_telemetry: fix build extras: fix esc_telemetry centi-volt/amp conversion extras: uncrustify all plugins plugins: reformat xml extras: reformat plugins xml extras: fix apm esc_telemetry msgs: fix types for apm\'s esc telemetry actually allocate memory for the telemetry information fixed some compile errors added esc_telemetry plugin Reset calibration flag when re-calibrating. Prevent wrong data output. Exclude changes to launch files. Delete debug files. Apply uncrustify changes. Set progress array to global to prevent erasing data. Move Compass calibration report to extras. Rewrite code based on instructions. Remove extra message from CMakeLists. Add message and service definition. Add compass calibration feedback status. Add service to call the \'Next\' button in calibrations.

  • extras: esc_telemetry: fix build

  • extras: fix esc_telemetry centi-volt/amp conversion

  • extras: uncrustify all plugins

  • extras: reformat plugins xml

  • extras: fix apm esc_telemetry

  • actually allocate memory for the telemetry information

  • fixed some compile errors

  • added esc_telemetry plugin

  • Add Mount angles message for communications with ardupilotmega.

  • Added subscriber callback function for ROS2

  • Added initialise function in vision_pose_estimate

  • Boilerplate vision_pose_estimate plugin

  • extras: landing_target: disable tf listener, it segfaults

  • extras: regenerate plugins xml, ament_uncrustify

  • mavros_extras: improve landing_target logging

  • mavros_extras: ported landing_target plugin to ros2

  • Reset calibration flag when re-calibrating. Prevent wrong data output.

  • Delete debug files.

  • Apply uncrustify changes.

  • Set progress array to global to prevent erasing data.

  • Move Compass calibration report to extras. Rewrite code based on instructions.

  • extras: port 3dr radio

  • extras: add urdf package

  • extras: adsb: begin porting to ros2

  • Contributors: Abhijith Thottumadayil Jagadeesh, Andr

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

  • launch/px4flow.launch
      • fcu_url [default: serial:///dev/ttyACM0:921600]
      • gcs_url [default: ]
      • tgt_system [default: 81]
      • tgt_component [default: 50]

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged mavros_extras at Robotics Stack Exchange

mavros_extras package from mavros repo

libmavconn mavros mavros_extras mavros_msgs

Package Summary

Tags uav mav mavlink plugin apm px4
Version 2.7.0
License GPLv3
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/mavlink/mavros.git
VCS Type git
VCS Version ros2
Last Updated 2024-03-03
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags uav mav mavlink plugin apm px4
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Extra nodes and plugins for

Additional Links

Maintainers

  • Vladimir Ermakov

Authors

  • Vladimir Ermakov
  • Amilcar Lucas

mavros extras

Some extra plugins and nodes for mavros.

ADSB

Publish/subscribe to the location and information of an ADS-B vehicle.

cam_imu_sync

Publish camera trigger data for synchronisation of IMU and camera frames.

debug_value

Subs/Pubs debug msgs from and to the FCU.

distance_sensor

Publish DISTANCE_SENSOR message data from FCU or connected sensors in companion computer.

fake_gps

Sends fake GPS from local position estimation source data (motion capture, vision) to FCU.

gps_input

Send GPS_INPUT messages to the FCU.

gps_status

Publish GPS_RAW and GPS_RTK messages from FCU.

gps_rtk

Sends the RTCM messages to the FCU for the RTK Fix.

log_transfer

Expose firmware functionality, that is related to log transfer

mocap_pose_estimate

Send motion capture pose estimate to FCU. Currently, not used by the FCU. Data can be send via vision_position plugin.

obstacle_distance

Send obstacle distance report to the FCU.

odom

Send odometry to FCU from another estimator.

px4flow

Publish OPTICAL_FLOW_RAD data from FCU or PX4Flow module.

rangefinder

Publish RANGEFINDER message data from FCU sensors in companion computer.

trajectory

Receive planned path from the FCU and send back corrected path (collision free, smoothed) to the FCU.

wheel_odometry

Compute and publish wheel odometry coming from FCU sensors.

vibration

Publish VIBRATION message data from FCU.

vision_pose_estimate

Send vision pose estimate to FCU.

vision_speed_estimate

Send vision speed estimate to FCU.

companion_process_status

Send companion process status report to the FCU.

servo_state_publisher

Convert mavros_msgs/RCOut to sensor_msgs/JointState messages. It is required to bind URDF model and real servos.

px-ros-pkg replacement

Use roslaunch mavros_extras px4flow.launch for that.

CHANGELOG

Changelog for package mavros_extras

2.7.0 (2024-03-03)

  • re-generate with cogall.sh
  • Merge branch \'master\' into ros2 * master: 1.18.0 update changelog sys_status.cpp: improve timeout code sys_status.cpp: Add a SYS_STATUS message publisher [camera plugin] Fix image_index and capture_result not properly filled Fix missing semi-colon GPS_STATUS Plugin: Fill in available messages for ROS1 legacy

  • 1.18.0

  • update changelog

  • [camera plugin] Fix image_index and capture_result not properly filled

  • [camera plugin] Fix image_index and capture_result not properly filled

  • Update mavros_plugins.xml

  • Update wheel_odometry.cpp fix typo

  • Fix typo fix typo in odometry frame child id

  • Removed unused variable

  • Use SensorDataQoS for gp_origin subscriber

  • Fix missing semi-colon

  • GPS_STATUS Plugin: Fill in available messages for ROS1 legacy Filled in available fields in GPS_RAW_INT & GPS2_RAW messages p.s. seems GPS2_RAW more complete than original GPS_RAW_INT

  • Define _frd frames in odom plugin based on parent/child frame parametrs

  • Contributors: Beniamino Pozzan, Kristoffer Bergman, Matteo Molinari, Mattia Giurato, Mohamed Abdelkader, Seunghwan Jo, Vladimir Ermakov, hpbrandal

1.18.0 (2024-03-03)

  • [camera plugin] Fix image_index and capture_result not properly filled
  • Fix missing semi-colon
  • GPS_STATUS Plugin: Fill in available messages for ROS1 legacy Filled in available fields in GPS_RAW_INT & GPS2_RAW messages p.s. seems GPS2_RAW more complete than original GPS_RAW_INT
  • Contributors: Beniamino Pozzan, Seunghwan Jo

2.6.0 (2023-09-09)

  • switch to use tf2_eigen.hpp, but that drops support for EOL distros
  • ament uncrustify
  • cog: regenerate all
  • Merge branch \'master\' into ros2 * master: 1.17.0 update changelog cog: regenerate all Bugfix/update map origin with home position (#1892) mavros: Remove extra \';\' mavros_extras: Fix some init order warnings Suppress warnings from included headers 1.16.0 update changelog made it such that the gp_origin topic published latched. use hpp instead of deprecated .h pluginlib headers

  • 1.17.0

  • update changelog

  • Merge pull request #1889 from MKargus0/feature/fix_landing_target_time_conversion Fixed header.stamp conversion in landing target

  • fixed style

  • fixed header.stamp conversion in landing target

  • Merge pull request #1871 from Vladislavert/feature/optical_flow_msg Addition of New OpticalFlow.msg

  • Added geometry_msgs/Vector3 to OpticalFlow.msg

  • Added vectors to the message OpticalFlow.msg

  • Added message optical flow

  • Merge pull request #1865 from scoutdi/warnings Fix / suppress some build warnings

  • mavros_extras: Fix some init order warnings

  • Suppress warnings from included headers

  • 1.16.0

  • update changelog

  • Merge pull request #1817 from lucasw/pluginlib_hpp use hpp instead of deprecated .h pluginlib headers

  • use hpp instead of deprecated .h pluginlib headers

  • Contributors: Lucas Walter, Mikhail Kolodochka, Morten Fyhn Amundsen, Vladimir Ermakov, Vladislavert

2.5.0 (2023-05-05)

2.4.0 (2022-12-30)

  • extras: uncrustify
  • extras: fix build, 2
  • extras: fix build
  • extras: fix cog
  • Merge branch \'master\' into ros2 * master: 1.15.0 update changelog ci: update actions Implement debug float array handler mavros_extras: Fix a sequence point warning mavros_extras: Fix a comparison that shouldn\'t be bitwise mavros: Fix some warnings mavros_extras: Fix buggy check for lat/lon ignored libmavconn: fix MAVLink v1.0 output selection

  • 1.15.0

  • update changelog

  • Merge pull request #1811 from scoutdi/debug-float-array Implement debug float array handler

  • Implement debug float array handler Co-authored-by: Morten Fyhn Amundsen <morten.f.amundsen@scoutdi.com>

  • Merge pull request #1807 from scoutdi/fix-bitwise-comparison mavros_extras: Fix a comparison that shouldn\'t be bitwise

  • Merge pull request #1808 from scoutdi/fix-sequence-point-warning mavros_extras: Fix a sequence point warning

  • mavros_extras: Fix a sequence point warning

  • mavros_extras: Fix a comparison that shouldn\'t be bitwise

  • Merge pull request #1805 from scoutdi/fix-latlon-check mavros_extras: Fix buggy check for lat/lon ignored

  • mavros_extras: Fix buggy check for lat/lon ignored

  • Contributors: Morten Fyhn Amundsen, Sverre Velten Rothmund, Vladimir Ermakov

2.3.0 (2022-09-24)

  • extras: fix linter errors
  • extras: fix toMsg
  • extras: fix build
  • extras: port guided_target
  • mavros: remove custom find script, re-generate
  • Merge branch \'master\' into ros2 * master: 1.14.0 update changelog scripts: waypoint and param files are text, not binary libmavconn: fix MAVLink v1.0 output selection plugins: add guided_target to accept offboard position targets add cmake module path for geographiclib on debian based systems use already installed FindGeographicLib.cmake

  • 1.14.0

  • update changelog

  • Merge pull request #1780 from snktshrma/master guided_target: accept position-target-global-int messages

  • plugins: add guided_target to accept offboard position targets Update guided_target.cpp Update guided_target.cpp Update mavros_plugins.xml Update CMakeLists.txt Added offboard_position.cpp Update apm_config.yaml Update offboard_position.cpp Update offboard_position.cpp Rename offboard_position.cpp to guided_target.cpp Update CMakeLists.txt Update mavros_plugins.xml Update apm_config.yaml Update guided_target.cpp

  • Contributors: Sanket Sharma, Vladimir Ermakov

2.2.0 (2022-06-27)

  • extras: fix build
  • extras: fix build
  • Merge branch \'master\' into ros2 * master: mount_control.cpp: detect MOUNT_ORIENTATION stale messages ESCTelemetryItem.msg: correct RPM units apm_config.yaml: add mount configuration sys_status.cpp fix free memory for values > 64KiB uncrustify cellular_status.cpp Add CellularStatus plugin and message *_config.yaml: document usage of multiple batteries diagnostics sys_status.cpp: fix compilation sys_status.cpp: support diagnostics on up-to 10 batteries sys_status.cpp: do not use harcoded constants sys_status.cpp: Timeout on MEMINFO and HWSTATUS mavlink messages and publish on the diagnostics sys_status.cpp: fix enabling of mem_diag and hwst_diag sys_status.cpp: Do not use battery1 voltage as voltage for all other batteries (bugfix). sys_status.cpp: ignore sys_status mavlink messages from gimbals mount_control.cpp: use mount_nh for params to keep similarities with other plugins set diag settings before add() sys_status.cpp: remove deprecated BATTERY2 mavlink message support Mount control plugin: add configurable diagnostics Bugfix: increment_f had no value asigned when input LaserScan was bigger than obstacle.distances.size() Bugfix: wrong interpolation when the reduction ratio (scale_factor) is not integer. Disable startup_px4_usb_quirk in px4_config.yaml

  • cmake: style fix

  • cmake: downgrade to C++17 as 20 breaks something in rclcpp

  • cmake: hide -std=c++2a

  • Merge pull request #1744 from amilcarlucas/pr_gimbal_diagnostics_fixes mount_control.cpp: detect MOUNT_ORIENTATION stale messages

  • extras: fix cog re to extract plugin name

1.17.0 (2023-09-09)

  • Merge pull request #1865 from scoutdi/warnings Fix / suppress some build warnings
  • mavros_extras: Fix some init order warnings
  • Suppress warnings from included headers
  • Contributors: Morten Fyhn Amundsen, Vladimir Ermakov

1.16.0 (2023-05-05)

  • Merge pull request #1817 from lucasw/pluginlib_hpp use hpp instead of deprecated .h pluginlib headers
  • use hpp instead of deprecated .h pluginlib headers
  • Contributors: Lucas Walter, Vladimir Ermakov

1.15.0 (2022-12-30)

  • Merge pull request #1811 from scoutdi/debug-float-array Implement debug float array handler
  • Implement debug float array handler Co-authored-by: Morten Fyhn Amundsen <morten.f.amundsen@scoutdi.com>
  • Merge pull request #1807 from scoutdi/fix-bitwise-comparison mavros_extras: Fix a comparison that shouldn\'t be bitwise
  • Merge pull request #1808 from scoutdi/fix-sequence-point-warning mavros_extras: Fix a sequence point warning
  • mavros_extras: Fix a sequence point warning
  • mavros_extras: Fix a comparison that shouldn\'t be bitwise
  • Merge pull request #1805 from scoutdi/fix-latlon-check mavros_extras: Fix buggy check for lat/lon ignored
  • mavros_extras: Fix buggy check for lat/lon ignored
  • Contributors: Morten Fyhn Amundsen, Sverre Velten Rothmund, Vladimir Ermakov

1.14.0 (2022-09-24)

  • Merge pull request #1780 from snktshrma/master guided_target: accept position-target-global-int messages
  • plugins: add guided_target to accept offboard position targets Update guided_target.cpp Update guided_target.cpp Update mavros_plugins.xml Update CMakeLists.txt Added offboard_position.cpp Update apm_config.yaml Update offboard_position.cpp Update offboard_position.cpp Rename offboard_position.cpp to guided_target.cpp Update CMakeLists.txt Update mavros_plugins.xml Update apm_config.yaml Update guided_target.cpp
  • Merge pull request #1744 from amilcarlucas/pr_gimbal_diagnostics_fixes mount_control.cpp: detect MOUNT_ORIENTATION stale messages
  • mount_control.cpp: detect MOUNT_ORIENTATION stale messages correct MountConfigure response success correct constructor initialization order some gimbals send negated/inverted angle measurements, correct that to obey the MAVLink frame convention using run-time parameters
  • Merge pull request #1735 from clydemcqueen/fix_1734 Fix crash in vision_pose plugin
  • Remove unrelated log message
  • Initialize last_transform_stamp with RCL_ROS_TIME, fixes #1734
  • Merge pull request #1727 from BV-OpenSource/pr-cellular-status Pr cellular status
  • uncrustify cellular_status.cpp
  • Add CellularStatus plugin and message
  • Merge pull request #1702 from amilcarlucas/mount_diagnostics Mount control plugin: add configurable diagnostics
  • mount_control.cpp: use mount_nh for params to keep similarities with other plugins set diag settings before add()
  • Mount control plugin: add configurable diagnostics
  • Merge pull request #1700 from oroelipas/fix-obstacle-distance Fix obstacle distance
  • Bugfix: increment_f had no value asigned when input LaserScan was bigger than obstacle.distances.size()
  • Bugfix: wrong interpolation when the reduction ratio (scale_factor) is not integer.
  • Contributors: Clyde McQueen, Dr.-Ing. Amilcar do Carmo Lucas, Rui Mendes, Vladimir Ermakov, oroel

2.1.1 (2022-03-02)

  • plugins: Fix misprint Fix #1709
  • Contributors: Vladimir Ermakov

2.1.0 (2022-02-02)

  • plugins: fix topic names to use prefix for namespaced ones
  • plugins: fix topic names to use prefix for namespaced ones
  • ci: fix several lint warnings
  • extras: terrain: fix copy-paste artifact
  • extras: port terrain plugin
  • Merge branch \'master\' into ros2 * master: 1.13.0 update changelog py-lib: fix compatibility with py3 for Noetic re-generate all coglets test: add checks for ROTATION_CUSTOM lib: Fix rotation search for CUSTOM Removed CamelCase for class members. Publish to \"report\" More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages Fixed callback name to match [handle_{MESSAGE_NAME.lower()}]{.title-ref} convention Add extra MAV_FRAMES to waypoint message as defined in https://mavlink.io/en/messages/common.html Fixed topic names to match more closely what other plugins use. Fixed a typo. Add plugin for reporting terrain height estimate from FCU 1.12.2 update changelog Set time/publish_sim_time to false by default plugin: setpoint_raw: move getParam to initializer extras: trajectory: backport #1667

  • 1.13.0

  • update changelog

  • Merge pull request #1677 from AndersonRayner/add_terrain Add plugin for reporting terrain height estimate from the FCU

  • Removed CamelCase for class members. Publish to \"report\"

  • More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages

  • Fixed callback name to match [handle_{MESSAGE_NAME.lower()}]{.title-ref} convention

  • Fixed topic names to match more closely what other plugins use. Fixed a typo.

  • Add plugin for reporting terrain height estimate from FCU

  • 1.12.2

  • update changelog

  • Merge pull request #1675 from BOB4Drone/ros2 fix bof

  • Update mag_calibration_status.cpp

  • fix code style fix code style

  • Update mag_calibration_status.cpp

  • fix misprint and use size() fix misprint and use size()

  • fix bof fix #1668

  • extras: trajectory: backport #1667

  • extras: trajectory: make linter happy after #1667

  • Merge pull request #1667 from BOB4Drone/ros2 fix bof

  • fix bof

  • Merge branch \'master\' into ros2 * master: 1.12.1 update changelog mavconn: fix connection issue introduced by #1658 mavros_extras: Fix some warnings mavros: Fix some warnings

  • 1.12.1

  • update changelog

  • Merge pull request #1660 from scoutdi/fix-warnings Fix warnings

  • mavros_extras: Fix some warnings

  • extras: fix parameter name

  • extras: fix topic names

  • Contributors: BOB4Drone, Morten Fyhn Amundsen, Vladimir Ermakov, matt

2.0.5 (2021-11-28)

  • extras: make cpplint happy
  • extras: fix most of build errors of SSP
  • extras: servo_state_publisher ported. almost...
  • extras: start porting servo_state_publisher
  • extras: make cpplint happy
  • extras: fix some linter errors. Do you know how to make me mad? Just let ament_uncrustify and ament_cpplint require opposite requirements!
  • fix some build warnings; drop old copter vis
  • Merge branch \'master\' into ros2 * master: 1.12.0 update changelog Fix multiple bugs lib: fix mission frame debug print extras: distance_sensor: revert back to zero quaternion

  • 1.12.0

  • update changelog

  • extras: fix some more lint warns

  • plugin: fix some compile warnings

  • cmake: require C++20 to build all modules

  • extras: port distance_sensor plugin

  • extras: fix camera plugin

  • extras: port camera plugin

  • lib: ignore MAVPACKED-related warnings from mavlink

  • extras: distance_sensor: revert back to zero quaternion Fix #1653

  • msgs: update conversion header

  • Merge branch \'master\' into ros2 * master: 1.11.1 update changelog lib: fix build

  • 1.11.1

  • update changelog

  • Merge branch \'master\' into ros2 * master: 1.11.0 update changelog lib: fix ftf warnings msgs: use pragmas to ignore unaligned pointer warnings extras: landing_target: fix misprint msgs: fix convert const plugin: setpoint_raw: fix misprint msgs: try to hide \'unaligned pointer\' warning plugin: sys: fix compillation error plugin: initialize quaternions with identity plugin: sys: Use wall timers for connection management Use meters for relative altitude distance_sensor: Initialize sensor orientation quaternion to zero Address review comments Add camera plugin for interfacing with mavlink camera protocol

  • 1.11.0

  • update changelog

  • extras: landing_target: fix misprint

  • plugin: initialize quaternions with identity Eigen::Quaternion[d|f] () does not initialize with zeroes or identity. So we must initialize with identity vector objects that can be left unassigned. Related to #1652

  • Merge pull request #1651 from Jaeyoung-Lim/pr-image-capture-plugin Add camera plugin for interfacing with mavlink camera protocol

  • Merge pull request #1652 from scoutdi/avoid-uninit-orientation distance_sensor: Initialize sensor orientation quaternion to zero

  • Use meters for relative altitude

  • distance_sensor: Initialize sensor orientation quaternion to zero Without this, you\'ll get random garbage data for the quaternion field of the DISTANCE_SENSOR MAVLink messages sent to the autopilot. The quaternion field should be set to zero when unused, according to the MAVLink message\'s field description.

  • Address review comments

  • Add camera plugin for interfacing with mavlink camera protocol Add camera image captured message for handling camera trigger information

  • extras: port fake_gps

  • extras: port tunnel

  • extras: update metadata

  • extras: port hil

  • extras: fix odom

  • extras: port odom

  • extras: port px4flow

  • extras: fix some linter warnings

  • extras: fix some linter warnings

  • extras: fix some linter warnings

  • extras: fix some linter warnings

  • extras: port wheel_odometry (partially)

  • extras: port vision_speed

  • extras: port vibration

  • extras: port vfr_hud

  • extras: port trajectory

  • extras: port rangefinder

  • extras: port onboard computer status, play_tune

  • extras: fix linter warnings

  • extras: port obstacle_distance

  • extras: update metadata xml

  • extras: port mount_control

  • extras: fix build for Foxy

  • extras: port mocap

  • extras: port mag cal status

  • extras: port log_transfer

  • extras: fix rtcm seq

  • extras: port gps_rtk

  • extras: port gps_input

  • extras: fixing some linter warnings

  • extras: fixing some linter warnings

  • Contributors: Jaeyoung-Lim, Morten Fyhn Amundsen, Vladimir Ermakov

2.0.4 (2021-11-04)

  • Merge branch \'master\' into ros2 * master: 1.10.0 prepare release

  • 1.10.0

  • prepare release

  • extras: remove safety_area as outdated

  • extras: port esc_telemetry

  • extras: port esc_status plugin

  • extras: porting gps_status

  • Merge branch \'master\' into ros2 * master: (25 commits) Remove reference Catch std::length_error in send_message Show ENOTCONN error instead of crash Tunnel: Check for invalid payload length Tunnel.msg: Generate enum with cog mavros_extras: Create tunnel plugin mavros_msgs: Add Tunnel message MountControl.msg: fix copy-paste sys_time.cpp: typo sys_time: publish /clock for simulation times 1.9.0 update changelog Spelling corrections Changed OverrideRCIn to 18 channels This adds functionality to erase all logs on the SD card via mavlink publish BATTERY2 message as /mavros/battery2 topic Mavlink v2.0 specs for RC_CHANNELS_OVERRIDE accepts upto 18 channels. The plugin publishes channels 9 to 18 if the FCU protocol version is 2.0 Added NAV_CONTROLLER_OUTPUT Plugin Added GPS_INPUT plugin Update esc_status plugin with datatype change on MAVLink. ...

  • Merge pull request #1625 from scoutdi/tunnel-plugin Plugin for TUNNEL messages

  • Tunnel: Check for invalid payload length

  • mavros_extras: Create tunnel plugin

  • Merge pull request #1605 from Peter010103/ros2 mavros_extras: Ported vision_pose_estimate plugin for ROS2

  • 1.9.0

  • update changelog

  • Merge pull request #1621 from amilcarlucas/pr/mount-control-spelling Spelling corrections

  • Spelling corrections

  • Merge pull request #1615 from amilcarlucas/pr/erase-logs This adds functionality to erase all logs on the SD card via mavlink

  • Merge pull request #1618 from amilcarlucas/pr/GPS_INPUT-plugin Added GPS_INPUT plugin

  • This adds functionality to erase all logs on the SD card via mavlink

  • Added GPS_INPUT plugin

  • Merge pull request #1606 from BV-OpenSource/master Add Mount angles message for communications with ardupilotmega.

  • Merge branch \'master\' into master

  • Update esc_status plugin with datatype change on MAVLink. ESC_INFO MAVLink message was updated to have negative temperates and also at a different resolution. This commit updates those changes on this side.

  • Convert status data from cdeg to rad.

  • Publish quaternion information with Mount Status mavlink message.

  • Add missing subscription.

  • extras: port cam_imu_sync

  • extras: re-generate cog

  • extras: port debug_value

  • Remove Mount_Status plugin. Add Status data to Mount_Control plugin. Remove Mount_Status message.

  • extras: fix build, add UAS::send_massage(msg, compid)

  • extras: port companion_process_status

  • msgs: re-generate file lists

  • style: apply ament_uncrustify --reformat

  • Merge branch \'master\' into ros2 * master: extras: esc_telemetry: fix build extras: fix esc_telemetry centi-volt/amp conversion extras: uncrustify all plugins plugins: reformat xml extras: reformat plugins xml extras: fix apm esc_telemetry msgs: fix types for apm\'s esc telemetry actually allocate memory for the telemetry information fixed some compile errors added esc_telemetry plugin Reset calibration flag when re-calibrating. Prevent wrong data output. Exclude changes to launch files. Delete debug files. Apply uncrustify changes. Set progress array to global to prevent erasing data. Move Compass calibration report to extras. Rewrite code based on instructions. Remove extra message from CMakeLists. Add message and service definition. Add compass calibration feedback status. Add service to call the \'Next\' button in calibrations.

  • extras: esc_telemetry: fix build

  • extras: fix esc_telemetry centi-volt/amp conversion

  • extras: uncrustify all plugins

  • extras: reformat plugins xml

  • extras: fix apm esc_telemetry

  • actually allocate memory for the telemetry information

  • fixed some compile errors

  • added esc_telemetry plugin

  • Add Mount angles message for communications with ardupilotmega.

  • Added subscriber callback function for ROS2

  • Added initialise function in vision_pose_estimate

  • Boilerplate vision_pose_estimate plugin

  • extras: landing_target: disable tf listener, it segfaults

  • extras: regenerate plugins xml, ament_uncrustify

  • mavros_extras: improve landing_target logging

  • mavros_extras: ported landing_target plugin to ros2

  • Reset calibration flag when re-calibrating. Prevent wrong data output.

  • Delete debug files.

  • Apply uncrustify changes.

  • Set progress array to global to prevent erasing data.

  • Move Compass calibration report to extras. Rewrite code based on instructions.

  • extras: port 3dr radio

  • extras: add urdf package

  • extras: adsb: begin porting to ros2

  • Contributors: Abhijith Thottumadayil Jagadeesh, Andr

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

  • launch/px4flow.launch
      • fcu_url [default: serial:///dev/ttyACM0:921600]
      • gcs_url [default: ]
      • tgt_system [default: 81]
      • tgt_component [default: 50]

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged mavros_extras at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.18.0
License GPLv3
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/mavlink/mavros.git
VCS Type git
VCS Version master
Last Updated 2024-03-03
Dev Status DEVELOPED
CI status
Released RELEASED
Tags uav mav mavlink plugin apm px4
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Extra nodes and plugins for

Additional Links

Maintainers

  • Vladimir Ermakov

Authors

  • Vladimir Ermakov
  • Amilcar Lucas

mavros extras

Some extra plugins and nodes for mavros.

ADSB

Publish/subscribe to the location and information of an ADS-B vehicle.

cam_imu_sync

Publish camera trigger data for synchronisation of IMU and camera frames.

debug_value

Subs/Pubs debug msgs from and to the FCU.

distance_sensor

Publish DISTANCE_SENSOR message data from FCU or connected sensors in companion computer.

fake_gps

Sends fake GPS from local position estimation source data (motion capture, vision) to FCU.

gps_input

Send GPS_INPUT messages to the FCU.

gps_status

Publish GPS_RAW and GPS_RTK messages from FCU.

gps_rtk

Sends the RTCM messages to the FCU for the RTK Fix.

log_transfer

Expose firmware functionality, that is related to log transfer

mocap_pose_estimate

Send motion capture pose estimate to FCU. Currently, not used by the FCU. Data can be send via vision_position plugin.

obstacle_distance

Send obstacle distance report to the FCU.

odom

Send odometry to FCU from another estimator.

px4flow

Publish OPTICAL_FLOW_RAD data from FCU or PX4Flow module.

rangefinder

Publish RANGEFINDER message data from FCU sensors in companion computer.

trajectory

Receive planned path from the FCU and send back corrected path (collision free, smoothed) to the FCU.

wheel_odometry

Compute and publish wheel odometry coming from FCU sensors.

vibration

Publish VIBRATION message data from FCU.

vision_pose_estimate

Send vision pose estimate to FCU.

vision_speed_estimate

Send vision speed estimate to FCU.

companion_process_status

Send companion process status report to the FCU.

servo_state_publisher

Convert mavros_msgs/RCOut to sensor_msgs/JointState messages. It is required to bind URDF model and real servos.

px-ros-pkg replacement

Use roslaunch mavros_extras px4flow.launch for that.

CHANGELOG

Changelog for package mavros_extras

1.18.0 (2024-03-03)

  • [camera plugin] Fix image_index and capture_result not properly filled
  • Fix missing semi-colon
  • GPS_STATUS Plugin: Fill in available messages for ROS1 legacy Filled in available fields in GPS_RAW_INT & GPS2_RAW messages p.s. seems GPS2_RAW more complete than original GPS_RAW_INT
  • Contributors: Beniamino Pozzan, Seunghwan Jo

1.17.0 (2023-09-09)

  • Merge pull request #1865 from scoutdi/warnings Fix / suppress some build warnings
  • mavros_extras: Fix some init order warnings
  • Suppress warnings from included headers
  • Contributors: Morten Fyhn Amundsen, Vladimir Ermakov

1.16.0 (2023-05-05)

  • Merge pull request #1817 from lucasw/pluginlib_hpp use hpp instead of deprecated .h pluginlib headers
  • use hpp instead of deprecated .h pluginlib headers
  • Contributors: Lucas Walter, Vladimir Ermakov

1.15.0 (2022-12-30)

  • Merge pull request #1811 from scoutdi/debug-float-array Implement debug float array handler
  • Implement debug float array handler Co-authored-by: Morten Fyhn Amundsen <morten.f.amundsen@scoutdi.com>
  • Merge pull request #1807 from scoutdi/fix-bitwise-comparison mavros_extras: Fix a comparison that shouldn\'t be bitwise
  • Merge pull request #1808 from scoutdi/fix-sequence-point-warning mavros_extras: Fix a sequence point warning
  • mavros_extras: Fix a sequence point warning
  • mavros_extras: Fix a comparison that shouldn\'t be bitwise
  • Merge pull request #1805 from scoutdi/fix-latlon-check mavros_extras: Fix buggy check for lat/lon ignored
  • mavros_extras: Fix buggy check for lat/lon ignored
  • Contributors: Morten Fyhn Amundsen, Sverre Velten Rothmund, Vladimir Ermakov

1.14.0 (2022-09-24)

  • Merge pull request #1780 from snktshrma/master guided_target: accept position-target-global-int messages
  • plugins: add guided_target to accept offboard position targets Update guided_target.cpp Update guided_target.cpp Update mavros_plugins.xml Update CMakeLists.txt Added offboard_position.cpp Update apm_config.yaml Update offboard_position.cpp Update offboard_position.cpp Rename offboard_position.cpp to guided_target.cpp Update CMakeLists.txt Update mavros_plugins.xml Update apm_config.yaml Update guided_target.cpp
  • Merge pull request #1744 from amilcarlucas/pr_gimbal_diagnostics_fixes mount_control.cpp: detect MOUNT_ORIENTATION stale messages
  • mount_control.cpp: detect MOUNT_ORIENTATION stale messages correct MountConfigure response success correct constructor initialization order some gimbals send negated/inverted angle measurements, correct that to obey the MAVLink frame convention using run-time parameters
  • Merge pull request #1727 from BV-OpenSource/pr-cellular-status Pr cellular status
  • uncrustify cellular_status.cpp
  • Add CellularStatus plugin and message
  • Merge pull request #1702 from amilcarlucas/mount_diagnostics Mount control plugin: add configurable diagnostics
  • mount_control.cpp: use mount_nh for params to keep similarities with other plugins set diag settings before add()
  • Mount control plugin: add configurable diagnostics
  • Merge pull request #1700 from oroelipas/fix-obstacle-distance Fix obstacle distance
  • Bugfix: increment_f had no value asigned when input LaserScan was bigger than obstacle.distances.size()
  • Bugfix: wrong interpolation when the reduction ratio (scale_factor) is not integer.
  • Contributors: Dr.-Ing. Amilcar do Carmo Lucas, Rui Mendes, Sanket Sharma, Vladimir Ermakov, oroel

1.13.0 (2022-01-13)

  • Merge pull request #1677 from AndersonRayner/add_terrain Add plugin for reporting terrain height estimate from the FCU
  • Removed CamelCase for class members. Publish to \"report\"
  • More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages
  • Fixed callback name to match [handle_{MESSAGE_NAME.lower()}]{.title-ref} convention
  • Fixed topic names to match more closely what other plugins use. Fixed a typo.
  • Add plugin for reporting terrain height estimate from FCU
  • Contributors: Vladimir Ermakov, matt

1.12.2 (2021-12-12)

  • extras: trajectory: backport #1667
  • Contributors: Vladimir Ermakov

1.12.1 (2021-11-29)

  • Merge pull request #1660 from scoutdi/fix-warnings Fix warnings
  • mavros_extras: Fix some warnings
  • Contributors: Morten Fyhn Amundsen, Vladimir Ermakov

1.12.0 (2021-11-27)

  • extras: distance_sensor: revert back to zero quaternion Fix #1653
  • Contributors: Vladimir Ermakov

1.11.1 (2021-11-24)

1.11.0 (2021-11-24)

  • extras: landing_target: fix misprint
  • plugin: initialize quaternions with identity Eigen::Quaternion[d|f] () does not initialize with zeroes or identity. So we must initialize with identity vector objects that can be left unassigned. Related to #1652
  • Merge pull request #1651 from Jaeyoung-Lim/pr-image-capture-plugin Add camera plugin for interfacing with mavlink camera protocol
  • Merge pull request #1652 from scoutdi/avoid-uninit-orientation distance_sensor: Initialize sensor orientation quaternion to zero
  • Use meters for relative altitude
  • distance_sensor: Initialize sensor orientation quaternion to zero Without this, you\'ll get random garbage data for the quaternion field of the DISTANCE_SENSOR MAVLink messages sent to the autopilot. The quaternion field should be set to zero when unused, according to the MAVLink message\'s field description.
  • Address review comments
  • Add camera plugin for interfacing with mavlink camera protocol Add camera image captured message for handling camera trigger information
  • Contributors: Jaeyoung-Lim, Morten Fyhn Amundsen, Vladimir Ermakov

1.10.0 (2021-11-04)

  • Merge pull request #1625 from scoutdi/tunnel-plugin Plugin for TUNNEL messages
  • Tunnel: Check for invalid payload length
  • mavros_extras: Create tunnel plugin
  • Contributors: Morten Fyhn Amundsen, Vladimir Ermakov

1.9.0 (2021-09-09)

  • Merge pull request #1621 from amilcarlucas/pr/mount-control-spelling Spelling corrections
  • Spelling corrections
  • Merge pull request #1615 from amilcarlucas/pr/erase-logs This adds functionality to erase all logs on the SD card via mavlink
  • Merge pull request #1618 from amilcarlucas/pr/GPS_INPUT-plugin Added GPS_INPUT plugin
  • This adds functionality to erase all logs on the SD card via mavlink
  • Added GPS_INPUT plugin
  • Merge pull request #1606 from BV-OpenSource/master Add Mount angles message for communications with ardupilotmega.
  • Merge branch \'master\' into master
  • Update esc_status plugin with datatype change on MAVLink. ESC_INFO MAVLink message was updated to have negative temperates and also at a different resolution. This commit updates those changes on this side.
  • Convert status data from cdeg to rad.
  • Publish quaternion information with Mount Status mavlink message.
  • Add missing subscription.
  • Remove Mount_Status plugin. Add Status data to Mount_Control plugin. Remove Mount_Status message.
  • extras: esc_telemetry: fix build
  • extras: fix esc_telemetry centi-volt/amp conversion
  • extras: uncrustify all plugins
  • extras: reformat plugins xml
  • extras: fix apm esc_telemetry
  • actually allocate memory for the telemetry information
  • fixed some compile errors
  • added esc_telemetry plugin
  • Add Mount angles message for communications with ardupilotmega.
  • Reset calibration flag when re-calibrating. Prevent wrong data output.
  • Delete debug files.
  • Apply uncrustify changes.
  • Set progress array to global to prevent erasing data.
  • Move Compass calibration report to extras. Rewrite code based on instructions.
  • Contributors: Abhijith Thottumadayil Jagadeesh, Andr

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

  • launch/teleop.launch
      • teleop_args [default: -att]
  • launch/px4flow.launch
      • fcu_url [default: serial:///dev/ttyACM0:921600]
      • gcs_url [default: ]
      • tgt_system [default: 81]
      • tgt_component [default: 50]
  • launch/px4_image.launch
      • fcu_url [default: serial:///dev/ttyACM0:57600]
      • gcs_url [default: udp://@]
      • tgt_system [default: 1]
      • tgt_component [default: 1]

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged mavros_extras at Robotics Stack Exchange

No version for distro ardent. Known supported distros are highlighted in the buttons above.
No version for distro bouncy. Known supported distros are highlighted in the buttons above.
No version for distro crystal. Known supported distros are highlighted in the buttons above.
No version for distro eloquent. Known supported distros are highlighted in the buttons above.
No version for distro dashing. Known supported distros are highlighted in the buttons above.

mavros_extras package from mavros repo

libmavconn mavros mavros_extras mavros_msgs

Package Summary

Tags uav mav mavlink plugin apm px4
Version 2.7.0
License GPLv3
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/mavlink/mavros.git
VCS Type git
VCS Version ros2
Last Updated 2024-03-03
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags uav mav mavlink plugin apm px4
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Extra nodes and plugins for

Additional Links

Maintainers

  • Vladimir Ermakov

Authors

  • Vladimir Ermakov
  • Amilcar Lucas

mavros extras

Some extra plugins and nodes for mavros.

ADSB

Publish/subscribe to the location and information of an ADS-B vehicle.

cam_imu_sync

Publish camera trigger data for synchronisation of IMU and camera frames.

debug_value

Subs/Pubs debug msgs from and to the FCU.

distance_sensor

Publish DISTANCE_SENSOR message data from FCU or connected sensors in companion computer.

fake_gps

Sends fake GPS from local position estimation source data (motion capture, vision) to FCU.

gps_input

Send GPS_INPUT messages to the FCU.

gps_status

Publish GPS_RAW and GPS_RTK messages from FCU.

gps_rtk

Sends the RTCM messages to the FCU for the RTK Fix.

log_transfer

Expose firmware functionality, that is related to log transfer

mocap_pose_estimate

Send motion capture pose estimate to FCU. Currently, not used by the FCU. Data can be send via vision_position plugin.

obstacle_distance

Send obstacle distance report to the FCU.

odom

Send odometry to FCU from another estimator.

px4flow

Publish OPTICAL_FLOW_RAD data from FCU or PX4Flow module.

rangefinder

Publish RANGEFINDER message data from FCU sensors in companion computer.

trajectory

Receive planned path from the FCU and send back corrected path (collision free, smoothed) to the FCU.

wheel_odometry

Compute and publish wheel odometry coming from FCU sensors.

vibration

Publish VIBRATION message data from FCU.

vision_pose_estimate

Send vision pose estimate to FCU.

vision_speed_estimate

Send vision speed estimate to FCU.

companion_process_status

Send companion process status report to the FCU.

servo_state_publisher

Convert mavros_msgs/RCOut to sensor_msgs/JointState messages. It is required to bind URDF model and real servos.

px-ros-pkg replacement

Use roslaunch mavros_extras px4flow.launch for that.

CHANGELOG

Changelog for package mavros_extras

2.7.0 (2024-03-03)

  • re-generate with cogall.sh
  • Merge branch \'master\' into ros2 * master: 1.18.0 update changelog sys_status.cpp: improve timeout code sys_status.cpp: Add a SYS_STATUS message publisher [camera plugin] Fix image_index and capture_result not properly filled Fix missing semi-colon GPS_STATUS Plugin: Fill in available messages for ROS1 legacy

  • 1.18.0

  • update changelog

  • [camera plugin] Fix image_index and capture_result not properly filled

  • [camera plugin] Fix image_index and capture_result not properly filled

  • Update mavros_plugins.xml

  • Update wheel_odometry.cpp fix typo

  • Fix typo fix typo in odometry frame child id

  • Removed unused variable

  • Use SensorDataQoS for gp_origin subscriber

  • Fix missing semi-colon

  • GPS_STATUS Plugin: Fill in available messages for ROS1 legacy Filled in available fields in GPS_RAW_INT & GPS2_RAW messages p.s. seems GPS2_RAW more complete than original GPS_RAW_INT

  • Define _frd frames in odom plugin based on parent/child frame parametrs

  • Contributors: Beniamino Pozzan, Kristoffer Bergman, Matteo Molinari, Mattia Giurato, Mohamed Abdelkader, Seunghwan Jo, Vladimir Ermakov, hpbrandal

1.18.0 (2024-03-03)

  • [camera plugin] Fix image_index and capture_result not properly filled
  • Fix missing semi-colon
  • GPS_STATUS Plugin: Fill in available messages for ROS1 legacy Filled in available fields in GPS_RAW_INT & GPS2_RAW messages p.s. seems GPS2_RAW more complete than original GPS_RAW_INT
  • Contributors: Beniamino Pozzan, Seunghwan Jo

2.6.0 (2023-09-09)

  • switch to use tf2_eigen.hpp, but that drops support for EOL distros
  • ament uncrustify
  • cog: regenerate all
  • Merge branch \'master\' into ros2 * master: 1.17.0 update changelog cog: regenerate all Bugfix/update map origin with home position (#1892) mavros: Remove extra \';\' mavros_extras: Fix some init order warnings Suppress warnings from included headers 1.16.0 update changelog made it such that the gp_origin topic published latched. use hpp instead of deprecated .h pluginlib headers

  • 1.17.0

  • update changelog

  • Merge pull request #1889 from MKargus0/feature/fix_landing_target_time_conversion Fixed header.stamp conversion in landing target

  • fixed style

  • fixed header.stamp conversion in landing target

  • Merge pull request #1871 from Vladislavert/feature/optical_flow_msg Addition of New OpticalFlow.msg

  • Added geometry_msgs/Vector3 to OpticalFlow.msg

  • Added vectors to the message OpticalFlow.msg

  • Added message optical flow

  • Merge pull request #1865 from scoutdi/warnings Fix / suppress some build warnings

  • mavros_extras: Fix some init order warnings

  • Suppress warnings from included headers

  • 1.16.0

  • update changelog

  • Merge pull request #1817 from lucasw/pluginlib_hpp use hpp instead of deprecated .h pluginlib headers

  • use hpp instead of deprecated .h pluginlib headers

  • Contributors: Lucas Walter, Mikhail Kolodochka, Morten Fyhn Amundsen, Vladimir Ermakov, Vladislavert

2.5.0 (2023-05-05)

2.4.0 (2022-12-30)

  • extras: uncrustify
  • extras: fix build, 2
  • extras: fix build
  • extras: fix cog
  • Merge branch \'master\' into ros2 * master: 1.15.0 update changelog ci: update actions Implement debug float array handler mavros_extras: Fix a sequence point warning mavros_extras: Fix a comparison that shouldn\'t be bitwise mavros: Fix some warnings mavros_extras: Fix buggy check for lat/lon ignored libmavconn: fix MAVLink v1.0 output selection

  • 1.15.0

  • update changelog

  • Merge pull request #1811 from scoutdi/debug-float-array Implement debug float array handler

  • Implement debug float array handler Co-authored-by: Morten Fyhn Amundsen <morten.f.amundsen@scoutdi.com>

  • Merge pull request #1807 from scoutdi/fix-bitwise-comparison mavros_extras: Fix a comparison that shouldn\'t be bitwise

  • Merge pull request #1808 from scoutdi/fix-sequence-point-warning mavros_extras: Fix a sequence point warning

  • mavros_extras: Fix a sequence point warning

  • mavros_extras: Fix a comparison that shouldn\'t be bitwise

  • Merge pull request #1805 from scoutdi/fix-latlon-check mavros_extras: Fix buggy check for lat/lon ignored

  • mavros_extras: Fix buggy check for lat/lon ignored

  • Contributors: Morten Fyhn Amundsen, Sverre Velten Rothmund, Vladimir Ermakov

2.3.0 (2022-09-24)

  • extras: fix linter errors
  • extras: fix toMsg
  • extras: fix build
  • extras: port guided_target
  • mavros: remove custom find script, re-generate
  • Merge branch \'master\' into ros2 * master: 1.14.0 update changelog scripts: waypoint and param files are text, not binary libmavconn: fix MAVLink v1.0 output selection plugins: add guided_target to accept offboard position targets add cmake module path for geographiclib on debian based systems use already installed FindGeographicLib.cmake

  • 1.14.0

  • update changelog

  • Merge pull request #1780 from snktshrma/master guided_target: accept position-target-global-int messages

  • plugins: add guided_target to accept offboard position targets Update guided_target.cpp Update guided_target.cpp Update mavros_plugins.xml Update CMakeLists.txt Added offboard_position.cpp Update apm_config.yaml Update offboard_position.cpp Update offboard_position.cpp Rename offboard_position.cpp to guided_target.cpp Update CMakeLists.txt Update mavros_plugins.xml Update apm_config.yaml Update guided_target.cpp

  • Contributors: Sanket Sharma, Vladimir Ermakov

2.2.0 (2022-06-27)

  • extras: fix build
  • extras: fix build
  • Merge branch \'master\' into ros2 * master: mount_control.cpp: detect MOUNT_ORIENTATION stale messages ESCTelemetryItem.msg: correct RPM units apm_config.yaml: add mount configuration sys_status.cpp fix free memory for values > 64KiB uncrustify cellular_status.cpp Add CellularStatus plugin and message *_config.yaml: document usage of multiple batteries diagnostics sys_status.cpp: fix compilation sys_status.cpp: support diagnostics on up-to 10 batteries sys_status.cpp: do not use harcoded constants sys_status.cpp: Timeout on MEMINFO and HWSTATUS mavlink messages and publish on the diagnostics sys_status.cpp: fix enabling of mem_diag and hwst_diag sys_status.cpp: Do not use battery1 voltage as voltage for all other batteries (bugfix). sys_status.cpp: ignore sys_status mavlink messages from gimbals mount_control.cpp: use mount_nh for params to keep similarities with other plugins set diag settings before add() sys_status.cpp: remove deprecated BATTERY2 mavlink message support Mount control plugin: add configurable diagnostics Bugfix: increment_f had no value asigned when input LaserScan was bigger than obstacle.distances.size() Bugfix: wrong interpolation when the reduction ratio (scale_factor) is not integer. Disable startup_px4_usb_quirk in px4_config.yaml

  • cmake: style fix

  • cmake: downgrade to C++17 as 20 breaks something in rclcpp

  • cmake: hide -std=c++2a

  • Merge pull request #1744 from amilcarlucas/pr_gimbal_diagnostics_fixes mount_control.cpp: detect MOUNT_ORIENTATION stale messages

  • extras: fix cog re to extract plugin name

1.17.0 (2023-09-09)

  • Merge pull request #1865 from scoutdi/warnings Fix / suppress some build warnings
  • mavros_extras: Fix some init order warnings
  • Suppress warnings from included headers
  • Contributors: Morten Fyhn Amundsen, Vladimir Ermakov

1.16.0 (2023-05-05)

  • Merge pull request #1817 from lucasw/pluginlib_hpp use hpp instead of deprecated .h pluginlib headers
  • use hpp instead of deprecated .h pluginlib headers
  • Contributors: Lucas Walter, Vladimir Ermakov

1.15.0 (2022-12-30)

  • Merge pull request #1811 from scoutdi/debug-float-array Implement debug float array handler
  • Implement debug float array handler Co-authored-by: Morten Fyhn Amundsen <morten.f.amundsen@scoutdi.com>
  • Merge pull request #1807 from scoutdi/fix-bitwise-comparison mavros_extras: Fix a comparison that shouldn\'t be bitwise
  • Merge pull request #1808 from scoutdi/fix-sequence-point-warning mavros_extras: Fix a sequence point warning
  • mavros_extras: Fix a sequence point warning
  • mavros_extras: Fix a comparison that shouldn\'t be bitwise
  • Merge pull request #1805 from scoutdi/fix-latlon-check mavros_extras: Fix buggy check for lat/lon ignored
  • mavros_extras: Fix buggy check for lat/lon ignored
  • Contributors: Morten Fyhn Amundsen, Sverre Velten Rothmund, Vladimir Ermakov

1.14.0 (2022-09-24)

  • Merge pull request #1780 from snktshrma/master guided_target: accept position-target-global-int messages
  • plugins: add guided_target to accept offboard position targets Update guided_target.cpp Update guided_target.cpp Update mavros_plugins.xml Update CMakeLists.txt Added offboard_position.cpp Update apm_config.yaml Update offboard_position.cpp Update offboard_position.cpp Rename offboard_position.cpp to guided_target.cpp Update CMakeLists.txt Update mavros_plugins.xml Update apm_config.yaml Update guided_target.cpp
  • Merge pull request #1744 from amilcarlucas/pr_gimbal_diagnostics_fixes mount_control.cpp: detect MOUNT_ORIENTATION stale messages
  • mount_control.cpp: detect MOUNT_ORIENTATION stale messages correct MountConfigure response success correct constructor initialization order some gimbals send negated/inverted angle measurements, correct that to obey the MAVLink frame convention using run-time parameters
  • Merge pull request #1735 from clydemcqueen/fix_1734 Fix crash in vision_pose plugin
  • Remove unrelated log message
  • Initialize last_transform_stamp with RCL_ROS_TIME, fixes #1734
  • Merge pull request #1727 from BV-OpenSource/pr-cellular-status Pr cellular status
  • uncrustify cellular_status.cpp
  • Add CellularStatus plugin and message
  • Merge pull request #1702 from amilcarlucas/mount_diagnostics Mount control plugin: add configurable diagnostics
  • mount_control.cpp: use mount_nh for params to keep similarities with other plugins set diag settings before add()
  • Mount control plugin: add configurable diagnostics
  • Merge pull request #1700 from oroelipas/fix-obstacle-distance Fix obstacle distance
  • Bugfix: increment_f had no value asigned when input LaserScan was bigger than obstacle.distances.size()
  • Bugfix: wrong interpolation when the reduction ratio (scale_factor) is not integer.
  • Contributors: Clyde McQueen, Dr.-Ing. Amilcar do Carmo Lucas, Rui Mendes, Vladimir Ermakov, oroel

2.1.1 (2022-03-02)

  • plugins: Fix misprint Fix #1709
  • Contributors: Vladimir Ermakov

2.1.0 (2022-02-02)

  • plugins: fix topic names to use prefix for namespaced ones
  • plugins: fix topic names to use prefix for namespaced ones
  • ci: fix several lint warnings
  • extras: terrain: fix copy-paste artifact
  • extras: port terrain plugin
  • Merge branch \'master\' into ros2 * master: 1.13.0 update changelog py-lib: fix compatibility with py3 for Noetic re-generate all coglets test: add checks for ROTATION_CUSTOM lib: Fix rotation search for CUSTOM Removed CamelCase for class members. Publish to \"report\" More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages Fixed callback name to match [handle_{MESSAGE_NAME.lower()}]{.title-ref} convention Add extra MAV_FRAMES to waypoint message as defined in https://mavlink.io/en/messages/common.html Fixed topic names to match more closely what other plugins use. Fixed a typo. Add plugin for reporting terrain height estimate from FCU 1.12.2 update changelog Set time/publish_sim_time to false by default plugin: setpoint_raw: move getParam to initializer extras: trajectory: backport #1667

  • 1.13.0

  • update changelog

  • Merge pull request #1677 from AndersonRayner/add_terrain Add plugin for reporting terrain height estimate from the FCU

  • Removed CamelCase for class members. Publish to \"report\"

  • More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages

  • Fixed callback name to match [handle_{MESSAGE_NAME.lower()}]{.title-ref} convention

  • Fixed topic names to match more closely what other plugins use. Fixed a typo.

  • Add plugin for reporting terrain height estimate from FCU

  • 1.12.2

  • update changelog

  • Merge pull request #1675 from BOB4Drone/ros2 fix bof

  • Update mag_calibration_status.cpp

  • fix code style fix code style

  • Update mag_calibration_status.cpp

  • fix misprint and use size() fix misprint and use size()

  • fix bof fix #1668

  • extras: trajectory: backport #1667

  • extras: trajectory: make linter happy after #1667

  • Merge pull request #1667 from BOB4Drone/ros2 fix bof

  • fix bof

  • Merge branch \'master\' into ros2 * master: 1.12.1 update changelog mavconn: fix connection issue introduced by #1658 mavros_extras: Fix some warnings mavros: Fix some warnings

  • 1.12.1

  • update changelog

  • Merge pull request #1660 from scoutdi/fix-warnings Fix warnings

  • mavros_extras: Fix some warnings

  • extras: fix parameter name

  • extras: fix topic names

  • Contributors: BOB4Drone, Morten Fyhn Amundsen, Vladimir Ermakov, matt

2.0.5 (2021-11-28)

  • extras: make cpplint happy
  • extras: fix most of build errors of SSP
  • extras: servo_state_publisher ported. almost...
  • extras: start porting servo_state_publisher
  • extras: make cpplint happy
  • extras: fix some linter errors. Do you know how to make me mad? Just let ament_uncrustify and ament_cpplint require opposite requirements!
  • fix some build warnings; drop old copter vis
  • Merge branch \'master\' into ros2 * master: 1.12.0 update changelog Fix multiple bugs lib: fix mission frame debug print extras: distance_sensor: revert back to zero quaternion

  • 1.12.0

  • update changelog

  • extras: fix some more lint warns

  • plugin: fix some compile warnings

  • cmake: require C++20 to build all modules

  • extras: port distance_sensor plugin

  • extras: fix camera plugin

  • extras: port camera plugin

  • lib: ignore MAVPACKED-related warnings from mavlink

  • extras: distance_sensor: revert back to zero quaternion Fix #1653

  • msgs: update conversion header

  • Merge branch \'master\' into ros2 * master: 1.11.1 update changelog lib: fix build

  • 1.11.1

  • update changelog

  • Merge branch \'master\' into ros2 * master: 1.11.0 update changelog lib: fix ftf warnings msgs: use pragmas to ignore unaligned pointer warnings extras: landing_target: fix misprint msgs: fix convert const plugin: setpoint_raw: fix misprint msgs: try to hide \'unaligned pointer\' warning plugin: sys: fix compillation error plugin: initialize quaternions with identity plugin: sys: Use wall timers for connection management Use meters for relative altitude distance_sensor: Initialize sensor orientation quaternion to zero Address review comments Add camera plugin for interfacing with mavlink camera protocol

  • 1.11.0

  • update changelog

  • extras: landing_target: fix misprint

  • plugin: initialize quaternions with identity Eigen::Quaternion[d|f] () does not initialize with zeroes or identity. So we must initialize with identity vector objects that can be left unassigned. Related to #1652

  • Merge pull request #1651 from Jaeyoung-Lim/pr-image-capture-plugin Add camera plugin for interfacing with mavlink camera protocol

  • Merge pull request #1652 from scoutdi/avoid-uninit-orientation distance_sensor: Initialize sensor orientation quaternion to zero

  • Use meters for relative altitude

  • distance_sensor: Initialize sensor orientation quaternion to zero Without this, you\'ll get random garbage data for the quaternion field of the DISTANCE_SENSOR MAVLink messages sent to the autopilot. The quaternion field should be set to zero when unused, according to the MAVLink message\'s field description.

  • Address review comments

  • Add camera plugin for interfacing with mavlink camera protocol Add camera image captured message for handling camera trigger information

  • extras: port fake_gps

  • extras: port tunnel

  • extras: update metadata

  • extras: port hil

  • extras: fix odom

  • extras: port odom

  • extras: port px4flow

  • extras: fix some linter warnings

  • extras: fix some linter warnings

  • extras: fix some linter warnings

  • extras: fix some linter warnings

  • extras: port wheel_odometry (partially)

  • extras: port vision_speed

  • extras: port vibration

  • extras: port vfr_hud

  • extras: port trajectory

  • extras: port rangefinder

  • extras: port onboard computer status, play_tune

  • extras: fix linter warnings

  • extras: port obstacle_distance

  • extras: update metadata xml

  • extras: port mount_control

  • extras: fix build for Foxy

  • extras: port mocap

  • extras: port mag cal status

  • extras: port log_transfer

  • extras: fix rtcm seq

  • extras: port gps_rtk

  • extras: port gps_input

  • extras: fixing some linter warnings

  • extras: fixing some linter warnings

  • Contributors: Jaeyoung-Lim, Morten Fyhn Amundsen, Vladimir Ermakov

2.0.4 (2021-11-04)

  • Merge branch \'master\' into ros2 * master: 1.10.0 prepare release

  • 1.10.0

  • prepare release

  • extras: remove safety_area as outdated

  • extras: port esc_telemetry

  • extras: port esc_status plugin

  • extras: porting gps_status

  • Merge branch \'master\' into ros2 * master: (25 commits) Remove reference Catch std::length_error in send_message Show ENOTCONN error instead of crash Tunnel: Check for invalid payload length Tunnel.msg: Generate enum with cog mavros_extras: Create tunnel plugin mavros_msgs: Add Tunnel message MountControl.msg: fix copy-paste sys_time.cpp: typo sys_time: publish /clock for simulation times 1.9.0 update changelog Spelling corrections Changed OverrideRCIn to 18 channels This adds functionality to erase all logs on the SD card via mavlink publish BATTERY2 message as /mavros/battery2 topic Mavlink v2.0 specs for RC_CHANNELS_OVERRIDE accepts upto 18 channels. The plugin publishes channels 9 to 18 if the FCU protocol version is 2.0 Added NAV_CONTROLLER_OUTPUT Plugin Added GPS_INPUT plugin Update esc_status plugin with datatype change on MAVLink. ...

  • Merge pull request #1625 from scoutdi/tunnel-plugin Plugin for TUNNEL messages

  • Tunnel: Check for invalid payload length

  • mavros_extras: Create tunnel plugin

  • Merge pull request #1605 from Peter010103/ros2 mavros_extras: Ported vision_pose_estimate plugin for ROS2

  • 1.9.0

  • update changelog

  • Merge pull request #1621 from amilcarlucas/pr/mount-control-spelling Spelling corrections

  • Spelling corrections

  • Merge pull request #1615 from amilcarlucas/pr/erase-logs This adds functionality to erase all logs on the SD card via mavlink

  • Merge pull request #1618 from amilcarlucas/pr/GPS_INPUT-plugin Added GPS_INPUT plugin

  • This adds functionality to erase all logs on the SD card via mavlink

  • Added GPS_INPUT plugin

  • Merge pull request #1606 from BV-OpenSource/master Add Mount angles message for communications with ardupilotmega.

  • Merge branch \'master\' into master

  • Update esc_status plugin with datatype change on MAVLink. ESC_INFO MAVLink message was updated to have negative temperates and also at a different resolution. This commit updates those changes on this side.

  • Convert status data from cdeg to rad.

  • Publish quaternion information with Mount Status mavlink message.

  • Add missing subscription.

  • extras: port cam_imu_sync

  • extras: re-generate cog

  • extras: port debug_value

  • Remove Mount_Status plugin. Add Status data to Mount_Control plugin. Remove Mount_Status message.

  • extras: fix build, add UAS::send_massage(msg, compid)

  • extras: port companion_process_status

  • msgs: re-generate file lists

  • style: apply ament_uncrustify --reformat

  • Merge branch \'master\' into ros2 * master: extras: esc_telemetry: fix build extras: fix esc_telemetry centi-volt/amp conversion extras: uncrustify all plugins plugins: reformat xml extras: reformat plugins xml extras: fix apm esc_telemetry msgs: fix types for apm\'s esc telemetry actually allocate memory for the telemetry information fixed some compile errors added esc_telemetry plugin Reset calibration flag when re-calibrating. Prevent wrong data output. Exclude changes to launch files. Delete debug files. Apply uncrustify changes. Set progress array to global to prevent erasing data. Move Compass calibration report to extras. Rewrite code based on instructions. Remove extra message from CMakeLists. Add message and service definition. Add compass calibration feedback status. Add service to call the \'Next\' button in calibrations.

  • extras: esc_telemetry: fix build

  • extras: fix esc_telemetry centi-volt/amp conversion

  • extras: uncrustify all plugins

  • extras: reformat plugins xml

  • extras: fix apm esc_telemetry

  • actually allocate memory for the telemetry information

  • fixed some compile errors

  • added esc_telemetry plugin

  • Add Mount angles message for communications with ardupilotmega.

  • Added subscriber callback function for ROS2

  • Added initialise function in vision_pose_estimate

  • Boilerplate vision_pose_estimate plugin

  • extras: landing_target: disable tf listener, it segfaults

  • extras: regenerate plugins xml, ament_uncrustify

  • mavros_extras: improve landing_target logging

  • mavros_extras: ported landing_target plugin to ros2

  • Reset calibration flag when re-calibrating. Prevent wrong data output.

  • Delete debug files.

  • Apply uncrustify changes.

  • Set progress array to global to prevent erasing data.

  • Move Compass calibration report to extras. Rewrite code based on instructions.

  • extras: port 3dr radio

  • extras: add urdf package

  • extras: adsb: begin porting to ros2

  • Contributors: Abhijith Thottumadayil Jagadeesh, Andr

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

  • launch/px4flow.launch
      • fcu_url [default: serial:///dev/ttyACM0:921600]
      • gcs_url [default: ]
      • tgt_system [default: 81]
      • tgt_component [default: 50]

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged mavros_extras at Robotics Stack Exchange

mavros_extras package from mavros repo

libmavconn mavros mavros_extras mavros_msgs

Package Summary

Tags uav mav mavlink plugin apm px4
Version 2.7.0
License GPLv3
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/mavlink/mavros.git
VCS Type git
VCS Version ros2
Last Updated 2024-03-03
Dev Status DEVELOPED
CI status No Continuous Integration
Released RELEASED
Tags uav mav mavlink plugin apm px4
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Extra nodes and plugins for

Additional Links

Maintainers

  • Vladimir Ermakov

Authors

  • Vladimir Ermakov
  • Amilcar Lucas

mavros extras

Some extra plugins and nodes for mavros.

ADSB

Publish/subscribe to the location and information of an ADS-B vehicle.

cam_imu_sync

Publish camera trigger data for synchronisation of IMU and camera frames.

debug_value

Subs/Pubs debug msgs from and to the FCU.

distance_sensor

Publish DISTANCE_SENSOR message data from FCU or connected sensors in companion computer.

fake_gps

Sends fake GPS from local position estimation source data (motion capture, vision) to FCU.

gps_input

Send GPS_INPUT messages to the FCU.

gps_status

Publish GPS_RAW and GPS_RTK messages from FCU.

gps_rtk

Sends the RTCM messages to the FCU for the RTK Fix.

log_transfer

Expose firmware functionality, that is related to log transfer

mocap_pose_estimate

Send motion capture pose estimate to FCU. Currently, not used by the FCU. Data can be send via vision_position plugin.

obstacle_distance

Send obstacle distance report to the FCU.

odom

Send odometry to FCU from another estimator.

px4flow

Publish OPTICAL_FLOW_RAD data from FCU or PX4Flow module.

rangefinder

Publish RANGEFINDER message data from FCU sensors in companion computer.

trajectory

Receive planned path from the FCU and send back corrected path (collision free, smoothed) to the FCU.

wheel_odometry

Compute and publish wheel odometry coming from FCU sensors.

vibration

Publish VIBRATION message data from FCU.

vision_pose_estimate

Send vision pose estimate to FCU.

vision_speed_estimate

Send vision speed estimate to FCU.

companion_process_status

Send companion process status report to the FCU.

servo_state_publisher

Convert mavros_msgs/RCOut to sensor_msgs/JointState messages. It is required to bind URDF model and real servos.

px-ros-pkg replacement

Use roslaunch mavros_extras px4flow.launch for that.

CHANGELOG

Changelog for package mavros_extras

2.7.0 (2024-03-03)

  • re-generate with cogall.sh
  • Merge branch \'master\' into ros2 * master: 1.18.0 update changelog sys_status.cpp: improve timeout code sys_status.cpp: Add a SYS_STATUS message publisher [camera plugin] Fix image_index and capture_result not properly filled Fix missing semi-colon GPS_STATUS Plugin: Fill in available messages for ROS1 legacy

  • 1.18.0

  • update changelog

  • [camera plugin] Fix image_index and capture_result not properly filled

  • [camera plugin] Fix image_index and capture_result not properly filled

  • Update mavros_plugins.xml

  • Update wheel_odometry.cpp fix typo

  • Fix typo fix typo in odometry frame child id

  • Removed unused variable

  • Use SensorDataQoS for gp_origin subscriber

  • Fix missing semi-colon

  • GPS_STATUS Plugin: Fill in available messages for ROS1 legacy Filled in available fields in GPS_RAW_INT & GPS2_RAW messages p.s. seems GPS2_RAW more complete than original GPS_RAW_INT

  • Define _frd frames in odom plugin based on parent/child frame parametrs

  • Contributors: Beniamino Pozzan, Kristoffer Bergman, Matteo Molinari, Mattia Giurato, Mohamed Abdelkader, Seunghwan Jo, Vladimir Ermakov, hpbrandal

1.18.0 (2024-03-03)

  • [camera plugin] Fix image_index and capture_result not properly filled
  • Fix missing semi-colon
  • GPS_STATUS Plugin: Fill in available messages for ROS1 legacy Filled in available fields in GPS_RAW_INT & GPS2_RAW messages p.s. seems GPS2_RAW more complete than original GPS_RAW_INT
  • Contributors: Beniamino Pozzan, Seunghwan Jo

2.6.0 (2023-09-09)

  • switch to use tf2_eigen.hpp, but that drops support for EOL distros
  • ament uncrustify
  • cog: regenerate all
  • Merge branch \'master\' into ros2 * master: 1.17.0 update changelog cog: regenerate all Bugfix/update map origin with home position (#1892) mavros: Remove extra \';\' mavros_extras: Fix some init order warnings Suppress warnings from included headers 1.16.0 update changelog made it such that the gp_origin topic published latched. use hpp instead of deprecated .h pluginlib headers

  • 1.17.0

  • update changelog

  • Merge pull request #1889 from MKargus0/feature/fix_landing_target_time_conversion Fixed header.stamp conversion in landing target

  • fixed style

  • fixed header.stamp conversion in landing target

  • Merge pull request #1871 from Vladislavert/feature/optical_flow_msg Addition of New OpticalFlow.msg

  • Added geometry_msgs/Vector3 to OpticalFlow.msg

  • Added vectors to the message OpticalFlow.msg

  • Added message optical flow

  • Merge pull request #1865 from scoutdi/warnings Fix / suppress some build warnings

  • mavros_extras: Fix some init order warnings

  • Suppress warnings from included headers

  • 1.16.0

  • update changelog

  • Merge pull request #1817 from lucasw/pluginlib_hpp use hpp instead of deprecated .h pluginlib headers

  • use hpp instead of deprecated .h pluginlib headers

  • Contributors: Lucas Walter, Mikhail Kolodochka, Morten Fyhn Amundsen, Vladimir Ermakov, Vladislavert

2.5.0 (2023-05-05)

2.4.0 (2022-12-30)

  • extras: uncrustify
  • extras: fix build, 2
  • extras: fix build
  • extras: fix cog
  • Merge branch \'master\' into ros2 * master: 1.15.0 update changelog ci: update actions Implement debug float array handler mavros_extras: Fix a sequence point warning mavros_extras: Fix a comparison that shouldn\'t be bitwise mavros: Fix some warnings mavros_extras: Fix buggy check for lat/lon ignored libmavconn: fix MAVLink v1.0 output selection

  • 1.15.0

  • update changelog

  • Merge pull request #1811 from scoutdi/debug-float-array Implement debug float array handler

  • Implement debug float array handler Co-authored-by: Morten Fyhn Amundsen <morten.f.amundsen@scoutdi.com>

  • Merge pull request #1807 from scoutdi/fix-bitwise-comparison mavros_extras: Fix a comparison that shouldn\'t be bitwise

  • Merge pull request #1808 from scoutdi/fix-sequence-point-warning mavros_extras: Fix a sequence point warning

  • mavros_extras: Fix a sequence point warning

  • mavros_extras: Fix a comparison that shouldn\'t be bitwise

  • Merge pull request #1805 from scoutdi/fix-latlon-check mavros_extras: Fix buggy check for lat/lon ignored

  • mavros_extras: Fix buggy check for lat/lon ignored

  • Contributors: Morten Fyhn Amundsen, Sverre Velten Rothmund, Vladimir Ermakov

2.3.0 (2022-09-24)

  • extras: fix linter errors
  • extras: fix toMsg
  • extras: fix build
  • extras: port guided_target
  • mavros: remove custom find script, re-generate
  • Merge branch \'master\' into ros2 * master: 1.14.0 update changelog scripts: waypoint and param files are text, not binary libmavconn: fix MAVLink v1.0 output selection plugins: add guided_target to accept offboard position targets add cmake module path for geographiclib on debian based systems use already installed FindGeographicLib.cmake

  • 1.14.0

  • update changelog

  • Merge pull request #1780 from snktshrma/master guided_target: accept position-target-global-int messages

  • plugins: add guided_target to accept offboard position targets Update guided_target.cpp Update guided_target.cpp Update mavros_plugins.xml Update CMakeLists.txt Added offboard_position.cpp Update apm_config.yaml Update offboard_position.cpp Update offboard_position.cpp Rename offboard_position.cpp to guided_target.cpp Update CMakeLists.txt Update mavros_plugins.xml Update apm_config.yaml Update guided_target.cpp

  • Contributors: Sanket Sharma, Vladimir Ermakov

2.2.0 (2022-06-27)

  • extras: fix build
  • extras: fix build
  • Merge branch \'master\' into ros2 * master: mount_control.cpp: detect MOUNT_ORIENTATION stale messages ESCTelemetryItem.msg: correct RPM units apm_config.yaml: add mount configuration sys_status.cpp fix free memory for values > 64KiB uncrustify cellular_status.cpp Add CellularStatus plugin and message *_config.yaml: document usage of multiple batteries diagnostics sys_status.cpp: fix compilation sys_status.cpp: support diagnostics on up-to 10 batteries sys_status.cpp: do not use harcoded constants sys_status.cpp: Timeout on MEMINFO and HWSTATUS mavlink messages and publish on the diagnostics sys_status.cpp: fix enabling of mem_diag and hwst_diag sys_status.cpp: Do not use battery1 voltage as voltage for all other batteries (bugfix). sys_status.cpp: ignore sys_status mavlink messages from gimbals mount_control.cpp: use mount_nh for params to keep similarities with other plugins set diag settings before add() sys_status.cpp: remove deprecated BATTERY2 mavlink message support Mount control plugin: add configurable diagnostics Bugfix: increment_f had no value asigned when input LaserScan was bigger than obstacle.distances.size() Bugfix: wrong interpolation when the reduction ratio (scale_factor) is not integer. Disable startup_px4_usb_quirk in px4_config.yaml

  • cmake: style fix

  • cmake: downgrade to C++17 as 20 breaks something in rclcpp

  • cmake: hide -std=c++2a

  • Merge pull request #1744 from amilcarlucas/pr_gimbal_diagnostics_fixes mount_control.cpp: detect MOUNT_ORIENTATION stale messages

  • extras: fix cog re to extract plugin name

1.17.0 (2023-09-09)

  • Merge pull request #1865 from scoutdi/warnings Fix / suppress some build warnings
  • mavros_extras: Fix some init order warnings
  • Suppress warnings from included headers
  • Contributors: Morten Fyhn Amundsen, Vladimir Ermakov

1.16.0 (2023-05-05)

  • Merge pull request #1817 from lucasw/pluginlib_hpp use hpp instead of deprecated .h pluginlib headers
  • use hpp instead of deprecated .h pluginlib headers
  • Contributors: Lucas Walter, Vladimir Ermakov

1.15.0 (2022-12-30)

  • Merge pull request #1811 from scoutdi/debug-float-array Implement debug float array handler
  • Implement debug float array handler Co-authored-by: Morten Fyhn Amundsen <morten.f.amundsen@scoutdi.com>
  • Merge pull request #1807 from scoutdi/fix-bitwise-comparison mavros_extras: Fix a comparison that shouldn\'t be bitwise
  • Merge pull request #1808 from scoutdi/fix-sequence-point-warning mavros_extras: Fix a sequence point warning
  • mavros_extras: Fix a sequence point warning
  • mavros_extras: Fix a comparison that shouldn\'t be bitwise
  • Merge pull request #1805 from scoutdi/fix-latlon-check mavros_extras: Fix buggy check for lat/lon ignored
  • mavros_extras: Fix buggy check for lat/lon ignored
  • Contributors: Morten Fyhn Amundsen, Sverre Velten Rothmund, Vladimir Ermakov

1.14.0 (2022-09-24)

  • Merge pull request #1780 from snktshrma/master guided_target: accept position-target-global-int messages
  • plugins: add guided_target to accept offboard position targets Update guided_target.cpp Update guided_target.cpp Update mavros_plugins.xml Update CMakeLists.txt Added offboard_position.cpp Update apm_config.yaml Update offboard_position.cpp Update offboard_position.cpp Rename offboard_position.cpp to guided_target.cpp Update CMakeLists.txt Update mavros_plugins.xml Update apm_config.yaml Update guided_target.cpp
  • Merge pull request #1744 from amilcarlucas/pr_gimbal_diagnostics_fixes mount_control.cpp: detect MOUNT_ORIENTATION stale messages
  • mount_control.cpp: detect MOUNT_ORIENTATION stale messages correct MountConfigure response success correct constructor initialization order some gimbals send negated/inverted angle measurements, correct that to obey the MAVLink frame convention using run-time parameters
  • Merge pull request #1735 from clydemcqueen/fix_1734 Fix crash in vision_pose plugin
  • Remove unrelated log message
  • Initialize last_transform_stamp with RCL_ROS_TIME, fixes #1734
  • Merge pull request #1727 from BV-OpenSource/pr-cellular-status Pr cellular status
  • uncrustify cellular_status.cpp
  • Add CellularStatus plugin and message
  • Merge pull request #1702 from amilcarlucas/mount_diagnostics Mount control plugin: add configurable diagnostics
  • mount_control.cpp: use mount_nh for params to keep similarities with other plugins set diag settings before add()
  • Mount control plugin: add configurable diagnostics
  • Merge pull request #1700 from oroelipas/fix-obstacle-distance Fix obstacle distance
  • Bugfix: increment_f had no value asigned when input LaserScan was bigger than obstacle.distances.size()
  • Bugfix: wrong interpolation when the reduction ratio (scale_factor) is not integer.
  • Contributors: Clyde McQueen, Dr.-Ing. Amilcar do Carmo Lucas, Rui Mendes, Vladimir Ermakov, oroel

2.1.1 (2022-03-02)

  • plugins: Fix misprint Fix #1709
  • Contributors: Vladimir Ermakov

2.1.0 (2022-02-02)

  • plugins: fix topic names to use prefix for namespaced ones
  • plugins: fix topic names to use prefix for namespaced ones
  • ci: fix several lint warnings
  • extras: terrain: fix copy-paste artifact
  • extras: port terrain plugin
  • Merge branch \'master\' into ros2 * master: 1.13.0 update changelog py-lib: fix compatibility with py3 for Noetic re-generate all coglets test: add checks for ROTATION_CUSTOM lib: Fix rotation search for CUSTOM Removed CamelCase for class members. Publish to \"report\" More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages Fixed callback name to match [handle_{MESSAGE_NAME.lower()}]{.title-ref} convention Add extra MAV_FRAMES to waypoint message as defined in https://mavlink.io/en/messages/common.html Fixed topic names to match more closely what other plugins use. Fixed a typo. Add plugin for reporting terrain height estimate from FCU 1.12.2 update changelog Set time/publish_sim_time to false by default plugin: setpoint_raw: move getParam to initializer extras: trajectory: backport #1667

  • 1.13.0

  • update changelog

  • Merge pull request #1677 from AndersonRayner/add_terrain Add plugin for reporting terrain height estimate from the FCU

  • Removed CamelCase for class members. Publish to \"report\"

  • More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages

  • Fixed callback name to match [handle_{MESSAGE_NAME.lower()}]{.title-ref} convention

  • Fixed topic names to match more closely what other plugins use. Fixed a typo.

  • Add plugin for reporting terrain height estimate from FCU

  • 1.12.2

  • update changelog

  • Merge pull request #1675 from BOB4Drone/ros2 fix bof

  • Update mag_calibration_status.cpp

  • fix code style fix code style

  • Update mag_calibration_status.cpp

  • fix misprint and use size() fix misprint and use size()

  • fix bof fix #1668

  • extras: trajectory: backport #1667

  • extras: trajectory: make linter happy after #1667

  • Merge pull request #1667 from BOB4Drone/ros2 fix bof

  • fix bof

  • Merge branch \'master\' into ros2 * master: 1.12.1 update changelog mavconn: fix connection issue introduced by #1658 mavros_extras: Fix some warnings mavros: Fix some warnings

  • 1.12.1

  • update changelog

  • Merge pull request #1660 from scoutdi/fix-warnings Fix warnings

  • mavros_extras: Fix some warnings

  • extras: fix parameter name

  • extras: fix topic names

  • Contributors: BOB4Drone, Morten Fyhn Amundsen, Vladimir Ermakov, matt

2.0.5 (2021-11-28)

  • extras: make cpplint happy
  • extras: fix most of build errors of SSP
  • extras: servo_state_publisher ported. almost...
  • extras: start porting servo_state_publisher
  • extras: make cpplint happy
  • extras: fix some linter errors. Do you know how to make me mad? Just let ament_uncrustify and ament_cpplint require opposite requirements!
  • fix some build warnings; drop old copter vis
  • Merge branch \'master\' into ros2 * master: 1.12.0 update changelog Fix multiple bugs lib: fix mission frame debug print extras: distance_sensor: revert back to zero quaternion

  • 1.12.0

  • update changelog

  • extras: fix some more lint warns

  • plugin: fix some compile warnings

  • cmake: require C++20 to build all modules

  • extras: port distance_sensor plugin

  • extras: fix camera plugin

  • extras: port camera plugin

  • lib: ignore MAVPACKED-related warnings from mavlink

  • extras: distance_sensor: revert back to zero quaternion Fix #1653

  • msgs: update conversion header

  • Merge branch \'master\' into ros2 * master: 1.11.1 update changelog lib: fix build

  • 1.11.1

  • update changelog

  • Merge branch \'master\' into ros2 * master: 1.11.0 update changelog lib: fix ftf warnings msgs: use pragmas to ignore unaligned pointer warnings extras: landing_target: fix misprint msgs: fix convert const plugin: setpoint_raw: fix misprint msgs: try to hide \'unaligned pointer\' warning plugin: sys: fix compillation error plugin: initialize quaternions with identity plugin: sys: Use wall timers for connection management Use meters for relative altitude distance_sensor: Initialize sensor orientation quaternion to zero Address review comments Add camera plugin for interfacing with mavlink camera protocol

  • 1.11.0

  • update changelog

  • extras: landing_target: fix misprint

  • plugin: initialize quaternions with identity Eigen::Quaternion[d|f] () does not initialize with zeroes or identity. So we must initialize with identity vector objects that can be left unassigned. Related to #1652

  • Merge pull request #1651 from Jaeyoung-Lim/pr-image-capture-plugin Add camera plugin for interfacing with mavlink camera protocol

  • Merge pull request #1652 from scoutdi/avoid-uninit-orientation distance_sensor: Initialize sensor orientation quaternion to zero

  • Use meters for relative altitude

  • distance_sensor: Initialize sensor orientation quaternion to zero Without this, you\'ll get random garbage data for the quaternion field of the DISTANCE_SENSOR MAVLink messages sent to the autopilot. The quaternion field should be set to zero when unused, according to the MAVLink message\'s field description.

  • Address review comments

  • Add camera plugin for interfacing with mavlink camera protocol Add camera image captured message for handling camera trigger information

  • extras: port fake_gps

  • extras: port tunnel

  • extras: update metadata

  • extras: port hil

  • extras: fix odom

  • extras: port odom

  • extras: port px4flow

  • extras: fix some linter warnings

  • extras: fix some linter warnings

  • extras: fix some linter warnings

  • extras: fix some linter warnings

  • extras: port wheel_odometry (partially)

  • extras: port vision_speed

  • extras: port vibration

  • extras: port vfr_hud

  • extras: port trajectory

  • extras: port rangefinder

  • extras: port onboard computer status, play_tune

  • extras: fix linter warnings

  • extras: port obstacle_distance

  • extras: update metadata xml

  • extras: port mount_control

  • extras: fix build for Foxy

  • extras: port mocap

  • extras: port mag cal status

  • extras: port log_transfer

  • extras: fix rtcm seq

  • extras: port gps_rtk

  • extras: port gps_input

  • extras: fixing some linter warnings

  • extras: fixing some linter warnings

  • Contributors: Jaeyoung-Lim, Morten Fyhn Amundsen, Vladimir Ermakov

2.0.4 (2021-11-04)

  • Merge branch \'master\' into ros2 * master: 1.10.0 prepare release

  • 1.10.0

  • prepare release

  • extras: remove safety_area as outdated

  • extras: port esc_telemetry

  • extras: port esc_status plugin

  • extras: porting gps_status

  • Merge branch \'master\' into ros2 * master: (25 commits) Remove reference Catch std::length_error in send_message Show ENOTCONN error instead of crash Tunnel: Check for invalid payload length Tunnel.msg: Generate enum with cog mavros_extras: Create tunnel plugin mavros_msgs: Add Tunnel message MountControl.msg: fix copy-paste sys_time.cpp: typo sys_time: publish /clock for simulation times 1.9.0 update changelog Spelling corrections Changed OverrideRCIn to 18 channels This adds functionality to erase all logs on the SD card via mavlink publish BATTERY2 message as /mavros/battery2 topic Mavlink v2.0 specs for RC_CHANNELS_OVERRIDE accepts upto 18 channels. The plugin publishes channels 9 to 18 if the FCU protocol version is 2.0 Added NAV_CONTROLLER_OUTPUT Plugin Added GPS_INPUT plugin Update esc_status plugin with datatype change on MAVLink. ...

  • Merge pull request #1625 from scoutdi/tunnel-plugin Plugin for TUNNEL messages

  • Tunnel: Check for invalid payload length

  • mavros_extras: Create tunnel plugin

  • Merge pull request #1605 from Peter010103/ros2 mavros_extras: Ported vision_pose_estimate plugin for ROS2

  • 1.9.0

  • update changelog

  • Merge pull request #1621 from amilcarlucas/pr/mount-control-spelling Spelling corrections

  • Spelling corrections

  • Merge pull request #1615 from amilcarlucas/pr/erase-logs This adds functionality to erase all logs on the SD card via mavlink

  • Merge pull request #1618 from amilcarlucas/pr/GPS_INPUT-plugin Added GPS_INPUT plugin

  • This adds functionality to erase all logs on the SD card via mavlink

  • Added GPS_INPUT plugin

  • Merge pull request #1606 from BV-OpenSource/master Add Mount angles message for communications with ardupilotmega.

  • Merge branch \'master\' into master

  • Update esc_status plugin with datatype change on MAVLink. ESC_INFO MAVLink message was updated to have negative temperates and also at a different resolution. This commit updates those changes on this side.

  • Convert status data from cdeg to rad.

  • Publish quaternion information with Mount Status mavlink message.

  • Add missing subscription.

  • extras: port cam_imu_sync

  • extras: re-generate cog

  • extras: port debug_value

  • Remove Mount_Status plugin. Add Status data to Mount_Control plugin. Remove Mount_Status message.

  • extras: fix build, add UAS::send_massage(msg, compid)

  • extras: port companion_process_status

  • msgs: re-generate file lists

  • style: apply ament_uncrustify --reformat

  • Merge branch \'master\' into ros2 * master: extras: esc_telemetry: fix build extras: fix esc_telemetry centi-volt/amp conversion extras: uncrustify all plugins plugins: reformat xml extras: reformat plugins xml extras: fix apm esc_telemetry msgs: fix types for apm\'s esc telemetry actually allocate memory for the telemetry information fixed some compile errors added esc_telemetry plugin Reset calibration flag when re-calibrating. Prevent wrong data output. Exclude changes to launch files. Delete debug files. Apply uncrustify changes. Set progress array to global to prevent erasing data. Move Compass calibration report to extras. Rewrite code based on instructions. Remove extra message from CMakeLists. Add message and service definition. Add compass calibration feedback status. Add service to call the \'Next\' button in calibrations.

  • extras: esc_telemetry: fix build

  • extras: fix esc_telemetry centi-volt/amp conversion

  • extras: uncrustify all plugins

  • extras: reformat plugins xml

  • extras: fix apm esc_telemetry

  • actually allocate memory for the telemetry information

  • fixed some compile errors

  • added esc_telemetry plugin

  • Add Mount angles message for communications with ardupilotmega.

  • Added subscriber callback function for ROS2

  • Added initialise function in vision_pose_estimate

  • Boilerplate vision_pose_estimate plugin

  • extras: landing_target: disable tf listener, it segfaults

  • extras: regenerate plugins xml, ament_uncrustify

  • mavros_extras: improve landing_target logging

  • mavros_extras: ported landing_target plugin to ros2

  • Reset calibration flag when re-calibrating. Prevent wrong data output.

  • Delete debug files.

  • Apply uncrustify changes.

  • Set progress array to global to prevent erasing data.

  • Move Compass calibration report to extras. Rewrite code based on instructions.

  • extras: port 3dr radio

  • extras: add urdf package

  • extras: adsb: begin porting to ros2

  • Contributors: Abhijith Thottumadayil Jagadeesh, Andr

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

  • launch/px4flow.launch
      • fcu_url [default: serial:///dev/ttyACM0:921600]
      • gcs_url [default: ]
      • tgt_system [default: 81]
      • tgt_component [default: 50]

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged mavros_extras at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.18.0
License GPLv3
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/mavlink/mavros.git
VCS Type git
VCS Version master
Last Updated 2024-03-03
Dev Status DEVELOPED
CI status Continuous Integration
Released RELEASED
Tags uav mav mavlink plugin apm px4
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Extra nodes and plugins for

Additional Links

Maintainers

  • Vladimir Ermakov

Authors

  • Vladimir Ermakov
  • Amilcar Lucas

mavros extras

Some extra plugins and nodes for mavros.

ADSB

Publish/subscribe to the location and information of an ADS-B vehicle.

cam_imu_sync

Publish camera trigger data for synchronisation of IMU and camera frames.

debug_value

Subs/Pubs debug msgs from and to the FCU.

distance_sensor

Publish DISTANCE_SENSOR message data from FCU or connected sensors in companion computer.

fake_gps

Sends fake GPS from local position estimation source data (motion capture, vision) to FCU.

gps_input

Send GPS_INPUT messages to the FCU.

gps_status

Publish GPS_RAW and GPS_RTK messages from FCU.

gps_rtk

Sends the RTCM messages to the FCU for the RTK Fix.

log_transfer

Expose firmware functionality, that is related to log transfer

mocap_pose_estimate

Send motion capture pose estimate to FCU. Currently, not used by the FCU. Data can be send via vision_position plugin.

obstacle_distance

Send obstacle distance report to the FCU.

odom

Send odometry to FCU from another estimator.

px4flow

Publish OPTICAL_FLOW_RAD data from FCU or PX4Flow module.

rangefinder

Publish RANGEFINDER message data from FCU sensors in companion computer.

trajectory

Receive planned path from the FCU and send back corrected path (collision free, smoothed) to the FCU.

wheel_odometry

Compute and publish wheel odometry coming from FCU sensors.

vibration

Publish VIBRATION message data from FCU.

vision_pose_estimate

Send vision pose estimate to FCU.

vision_speed_estimate

Send vision speed estimate to FCU.

companion_process_status

Send companion process status report to the FCU.

servo_state_publisher

Convert mavros_msgs/RCOut to sensor_msgs/JointState messages. It is required to bind URDF model and real servos.

px-ros-pkg replacement

Use roslaunch mavros_extras px4flow.launch for that.

CHANGELOG

Changelog for package mavros_extras

1.18.0 (2024-03-03)

  • [camera plugin] Fix image_index and capture_result not properly filled
  • Fix missing semi-colon
  • GPS_STATUS Plugin: Fill in available messages for ROS1 legacy Filled in available fields in GPS_RAW_INT & GPS2_RAW messages p.s. seems GPS2_RAW more complete than original GPS_RAW_INT
  • Contributors: Beniamino Pozzan, Seunghwan Jo

1.17.0 (2023-09-09)

  • Merge pull request #1865 from scoutdi/warnings Fix / suppress some build warnings
  • mavros_extras: Fix some init order warnings
  • Suppress warnings from included headers
  • Contributors: Morten Fyhn Amundsen, Vladimir Ermakov

1.16.0 (2023-05-05)

  • Merge pull request #1817 from lucasw/pluginlib_hpp use hpp instead of deprecated .h pluginlib headers
  • use hpp instead of deprecated .h pluginlib headers
  • Contributors: Lucas Walter, Vladimir Ermakov

1.15.0 (2022-12-30)

  • Merge pull request #1811 from scoutdi/debug-float-array Implement debug float array handler
  • Implement debug float array handler Co-authored-by: Morten Fyhn Amundsen <morten.f.amundsen@scoutdi.com>
  • Merge pull request #1807 from scoutdi/fix-bitwise-comparison mavros_extras: Fix a comparison that shouldn\'t be bitwise
  • Merge pull request #1808 from scoutdi/fix-sequence-point-warning mavros_extras: Fix a sequence point warning
  • mavros_extras: Fix a sequence point warning
  • mavros_extras: Fix a comparison that shouldn\'t be bitwise
  • Merge pull request #1805 from scoutdi/fix-latlon-check mavros_extras: Fix buggy check for lat/lon ignored
  • mavros_extras: Fix buggy check for lat/lon ignored
  • Contributors: Morten Fyhn Amundsen, Sverre Velten Rothmund, Vladimir Ermakov

1.14.0 (2022-09-24)

  • Merge pull request #1780 from snktshrma/master guided_target: accept position-target-global-int messages
  • plugins: add guided_target to accept offboard position targets Update guided_target.cpp Update guided_target.cpp Update mavros_plugins.xml Update CMakeLists.txt Added offboard_position.cpp Update apm_config.yaml Update offboard_position.cpp Update offboard_position.cpp Rename offboard_position.cpp to guided_target.cpp Update CMakeLists.txt Update mavros_plugins.xml Update apm_config.yaml Update guided_target.cpp
  • Merge pull request #1744 from amilcarlucas/pr_gimbal_diagnostics_fixes mount_control.cpp: detect MOUNT_ORIENTATION stale messages
  • mount_control.cpp: detect MOUNT_ORIENTATION stale messages correct MountConfigure response success correct constructor initialization order some gimbals send negated/inverted angle measurements, correct that to obey the MAVLink frame convention using run-time parameters
  • Merge pull request #1727 from BV-OpenSource/pr-cellular-status Pr cellular status
  • uncrustify cellular_status.cpp
  • Add CellularStatus plugin and message
  • Merge pull request #1702 from amilcarlucas/mount_diagnostics Mount control plugin: add configurable diagnostics
  • mount_control.cpp: use mount_nh for params to keep similarities with other plugins set diag settings before add()
  • Mount control plugin: add configurable diagnostics
  • Merge pull request #1700 from oroelipas/fix-obstacle-distance Fix obstacle distance
  • Bugfix: increment_f had no value asigned when input LaserScan was bigger than obstacle.distances.size()
  • Bugfix: wrong interpolation when the reduction ratio (scale_factor) is not integer.
  • Contributors: Dr.-Ing. Amilcar do Carmo Lucas, Rui Mendes, Sanket Sharma, Vladimir Ermakov, oroel

1.13.0 (2022-01-13)

  • Merge pull request #1677 from AndersonRayner/add_terrain Add plugin for reporting terrain height estimate from the FCU
  • Removed CamelCase for class members. Publish to \"report\"
  • More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages
  • Fixed callback name to match [handle_{MESSAGE_NAME.lower()}]{.title-ref} convention
  • Fixed topic names to match more closely what other plugins use. Fixed a typo.
  • Add plugin for reporting terrain height estimate from FCU
  • Contributors: Vladimir Ermakov, matt

1.12.2 (2021-12-12)

  • extras: trajectory: backport #1667
  • Contributors: Vladimir Ermakov

1.12.1 (2021-11-29)

  • Merge pull request #1660 from scoutdi/fix-warnings Fix warnings
  • mavros_extras: Fix some warnings
  • Contributors: Morten Fyhn Amundsen, Vladimir Ermakov

1.12.0 (2021-11-27)

  • extras: distance_sensor: revert back to zero quaternion Fix #1653
  • Contributors: Vladimir Ermakov

1.11.1 (2021-11-24)

1.11.0 (2021-11-24)

  • extras: landing_target: fix misprint
  • plugin: initialize quaternions with identity Eigen::Quaternion[d|f] () does not initialize with zeroes or identity. So we must initialize with identity vector objects that can be left unassigned. Related to #1652
  • Merge pull request #1651 from Jaeyoung-Lim/pr-image-capture-plugin Add camera plugin for interfacing with mavlink camera protocol
  • Merge pull request #1652 from scoutdi/avoid-uninit-orientation distance_sensor: Initialize sensor orientation quaternion to zero
  • Use meters for relative altitude
  • distance_sensor: Initialize sensor orientation quaternion to zero Without this, you\'ll get random garbage data for the quaternion field of the DISTANCE_SENSOR MAVLink messages sent to the autopilot. The quaternion field should be set to zero when unused, according to the MAVLink message\'s field description.
  • Address review comments
  • Add camera plugin for interfacing with mavlink camera protocol Add camera image captured message for handling camera trigger information
  • Contributors: Jaeyoung-Lim, Morten Fyhn Amundsen, Vladimir Ermakov

1.10.0 (2021-11-04)

  • Merge pull request #1625 from scoutdi/tunnel-plugin Plugin for TUNNEL messages
  • Tunnel: Check for invalid payload length
  • mavros_extras: Create tunnel plugin
  • Contributors: Morten Fyhn Amundsen, Vladimir Ermakov

1.9.0 (2021-09-09)

  • Merge pull request #1621 from amilcarlucas/pr/mount-control-spelling Spelling corrections
  • Spelling corrections
  • Merge pull request #1615 from amilcarlucas/pr/erase-logs This adds functionality to erase all logs on the SD card via mavlink
  • Merge pull request #1618 from amilcarlucas/pr/GPS_INPUT-plugin Added GPS_INPUT plugin
  • This adds functionality to erase all logs on the SD card via mavlink
  • Added GPS_INPUT plugin
  • Merge pull request #1606 from BV-OpenSource/master Add Mount angles message for communications with ardupilotmega.
  • Merge branch \'master\' into master
  • Update esc_status plugin with datatype change on MAVLink. ESC_INFO MAVLink message was updated to have negative temperates and also at a different resolution. This commit updates those changes on this side.
  • Convert status data from cdeg to rad.
  • Publish quaternion information with Mount Status mavlink message.
  • Add missing subscription.
  • Remove Mount_Status plugin. Add Status data to Mount_Control plugin. Remove Mount_Status message.
  • extras: esc_telemetry: fix build
  • extras: fix esc_telemetry centi-volt/amp conversion
  • extras: uncrustify all plugins
  • extras: reformat plugins xml
  • extras: fix apm esc_telemetry
  • actually allocate memory for the telemetry information
  • fixed some compile errors
  • added esc_telemetry plugin
  • Add Mount angles message for communications with ardupilotmega.
  • Reset calibration flag when re-calibrating. Prevent wrong data output.
  • Delete debug files.
  • Apply uncrustify changes.
  • Set progress array to global to prevent erasing data.
  • Move Compass calibration report to extras. Rewrite code based on instructions.
  • Contributors: Abhijith Thottumadayil Jagadeesh, Andr

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

  • launch/teleop.launch
      • teleop_args [default: -att]
  • launch/px4flow.launch
      • fcu_url [default: serial:///dev/ttyACM0:921600]
      • gcs_url [default: ]
      • tgt_system [default: 81]
      • tgt_component [default: 50]
  • launch/px4_image.launch
      • fcu_url [default: serial:///dev/ttyACM0:57600]
      • gcs_url [default: udp://@]
      • tgt_system [default: 1]
      • tgt_component [default: 1]

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged mavros_extras at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.17.5
License GPLv3
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/mavlink/mavros.git
VCS Type git
VCS Version indigo-devel
Last Updated 2017-02-07
Dev Status DEVELOPED
CI status Continuous Integration
Released RELEASED
Tags uav mav mavlink plugin apm px4
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Extra nodes and plugins for

Additional Links

Maintainers

  • Vladimir Ermakov

Authors

  • Vladimir Ermakov

mavros extras

Some extra plugins and nodes for mavros.

px4flow

Plugin for mavros. Publish OPTICAL_FLOW_RAD data.

image_pub

Plugin for mavros, publish images from mavlink device.

gcs_image_bridge

Variation of gcs_bridge that additionally sends image stream to GCS.

mocap_pose_estimate

Plugin for mavros, to send mocap data to FCU. Currently, not used by the FCU. Data can be send via vision_position plugin.

px-ros-pkg replacement

Use roslaunch mavros_extras px4flow.launch for that.

CHANGELOG

Changelog for package mavros_extras

0.17.5 (2017-02-07)

0.17.4 (2016-06-23)

0.17.3 (2016-05-20)

0.17.2 (2016-04-29)

0.17.1 (2016-03-28)

  • ran uncrustify
  • fixed typos
  • use CUBE_LIST for faster rendering
  • limit track size
  • use local variable
  • fixed indentation
  • added rc modes
  • moved rc to rc_override_control()
  • replaced tabulations with spaces (4)
  • introducing RC modes
  • fixed
  • quality added
  • added visualization for local setpoints
  • Contributors: Joey Gong, francois

0.17.0 (2016-02-09)

  • rebased with master
  • ran uncrustify
  • removed duplicate include
  • use MarkerArray for vehicle model
  • Updated frame transformations and added odom publisher to local position plugin
  • Contributors: Eddy, francois

0.16.6 (2016-02-04)

  • extras: uncrustify
  • added tf
  • comments
  • configurable vehicle model
  • Contributors: Vladimir Ermakov, francois

0.16.5 (2016-01-11)

0.16.4 (2015-12-14)

0.16.3 (2015-11-19)

0.16.2 (2015-11-17)

0.16.1 (2015-11-13)

0.16.0 (2015-11-09)

  • gcs_bridge #394: enable both UDPROS and TCPROS transports
  • extras fix #392: add additional subscription for PoseWithCovarianceStamped
  • Contributors: Vladimir Ermakov

0.15.0 (2015-09-17)

  • extras #387: fix header stamp in joint_states
  • extras fix #387: SSP node done.
  • extras #387: subscriber works, node almost done
  • extras #387: load URDF
  • extras #387: initial import of servo_status_publisher
  • Contributors: Vladimir Ermakov

0.14.2 (2015-08-20)

  • extras: fix catkin lint warnings
  • Contributors: Vladimir Ermakov

0.14.1 (2015-08-19)

0.14.0 (2015-08-17)

  • extras: gcs node: replace deprecated copy function
  • extras: scripts: use API from mavros module
  • package: remove not exist dependency
  • extras: vibration: Fix message include
  • extras: px4flow: Fix message include
  • extras: cam_imu_sync: Fix message include
  • extras: update package description
  • msgs: deprecate mavros::Mavlink and copy utils.
  • msgs #354: move all messages to mavros_msgs package.
  • opencv 3.0/2.4 header compatibility
  • fix orientation empty error
  • Contributors: Vladimir Ermakov, andre-nguyen, v01d

0.13.1 (2015-08-05)

0.13.0 (2015-08-01)

  • extras: mocap fix #352: use new helper for quaternion.
  • Merge pull request #312 from mhkabir/cam_imu_sync Camera IMU synchronisation support added
  • distance_sensor #342: correct orientation parameter handling.
  • distance_sensor: restructure orientation matching and verification
  • lib #319: Return quaternion from UAS::sensor_matching()
  • launch fix #340: update default component id of PX4.
  • extras: distance_sensor #71: Purt to TF2.
  • plugin: Use UAS::syncronized_header() for reduce LOC.
  • extras: vision_pose #71: Use TF2 listener. Also #319.
  • launch: Update configs.
  • extras: viz #336: convert plugin to node.
  • extras: vision_speed #319: use eigen based transform
  • extras: vibration: Use UAS::synchronized_header()
  • extras: px4flow #319: change transform_frame()
  • extras: mocap #319: use eigen based transform
  • Camera IMU synchronisation support added
  • Contributors: Mohammed Kabir, TSC21, Vladimir Ermakov

0.12.0 (2015-07-01)

  • coverity: make them happy
  • frame_conversions: use inline functions to identify direction of conversion
  • changed frame conversion func name; add 3x3 cov matrix frame conversion; general doxygen comment cleanup
  • frame_conversions: added frame_conversion specific lib file; applied correct frame conversion between ENU<->NED
  • vibration_plugin: changed vibration to Vector3
  • vibration_plugin: msg reformulation
  • vibration_plugin: first commit
  • Changes some frames from world to body conversion for NED to ENU.
  • mavros #302: fix style
  • mavros fix #301: move sensor orientation util to UAS
  • distance_sensor: typo; style fixe
  • sensor_orientation: corrected rotation set sequence
  • sensor_orientation: updated orientation enum; updated data type
  • sensor_orientation: removed unecessary sum on setting rotation
  • sensor_orientation: added sensor orientation matching helper func
  • distance_sensor: minor correction
  • distance_sensor: sensor position cond changed
  • distance_sensor: tweak param check; cond routines
  • distance_sensor: removed unnecessary comment line
  • distance_sensor: ctor list update
  • distance_sensor: define sensor position through param config
  • distance_sensor: minor comment identation correction
  • distance_sensor: tf::Transform creation optional
  • distance_sensor: add tf_broadcaster between \'fcu\' and the distance sensor
  • distance_sensor: remove commented code
  • distance_sensor: removed dbg msg
  • distance_sensor: cov condition defined
  • distance_sensor: covariance condition changed
  • distance_sensor: conditional state change
  • distance_sensor: covariance condition set - correction
  • distance_sensor: covariance condition set
  • distance_sensor: ctor list update (corrected)
  • distance_sensor: ctor list update
  • distance_sensor: ctor list update
  • distance_sensor: small correction
  • distance_sensor: uncrustify
  • distance_sensor: array limiting; cast correction; other minor correc
  • distance_sensor: travis build correction
  • distance_sensor: uncrustify distance_sensor.cpp
  • distance_sensor: small corrections on variable definitions, method calls
  • distance_sensor: small enhancements
  • distance_sensor #292: uncrustify
  • distance_sensor #292: fix travis build.
  • distance_sensor #292: implement message handling
  • distance_sensor #292: parse mapping configuration.
  • distance_sensor: remove DistanceSensor.msg from CMakeList
  • distance_sensor: removed DistanceSensor.msg
  • distance_sensor: -> use std Range.msg -> published frame_id in topics are dinamic - depend on type and id of the sensor
  • distance_sensor: comment correction
  • distance_sensor: minor correction
  • distance_sensor: minor fixes that include use Range.msg to Laser data
  • distance_sensor: add plugin file
  • distance_sensor plugin: first commit!
  • Contributors: TSC21, Tony Baltovski, Vladimir Ermakov

0.11.2 (2015-04-26)

  • gcs bridge fix #277: add link diagnostics
  • Contributors: Vladimir Ermakov

0.11.1 (2015-04-06)

  • mavftpfuse #129: done! Fix #129.
  • mavftpfuse #129: cache file attrs
  • mavftpfuse #129: initial import
  • Contributors: Vladimir Ermakov

0.11.0 (2015-03-24)

  • extras: vision_pose #247: rename topic
  • extras: launch #257: use white list for px4flow. Also updates config #211.
  • uncrustify and fix #207
  • uncrustify extras
  • package: update lic
  • license #242: update mavros_extras headers
  • plugin api #241: move diag updater to UAS.
  • plugin api #241: remove global private node handle. Now all plugins should define their local node handle (see dummy.cpp). Also partially does #233 (unmerge setpoint topic namespace).
  • plugin api #241: remove [get_name()]{.title-ref}
  • Add BSD license option #220
  • uncrustify: mocap plugin
  • Switched from mavlink VICON_POSITION_ESTIMATE to ATT_POS_MOCAP.
  • Contributors: Tony Baltovski, Vladimir Ermakov

0.10.2 (2015-02-25)

  • launch: Fix vim modelines #213
  • Contributors: Vladimir Ermakov

0.10.1 (2015-02-02)

  • Fix \@mhkabir name in contributors.
  • Updated mavros_extra README to explain the vision_estimate plugin should be used for the mocap data currently.
  • Update px4flow.cpp
  • plguin: px4flow: Remove all ref to old message
  • Merge remote-tracking branch \'upstream/master\' into optflow_rad Conflicts: mavros_extras/CMakeLists.txt
  • Update
  • Clean up
  • New interface commit
  • Add new interface. Raw message only for now. Removed the tx functionality as it doesn\'t make much sense.
  • Contributors: Mohammed Kabir, Tony Baltovski, Vladimir Ermakov

0.10.0 (2015-01-24)

  • mocap_pose_estimate: Switched from pose to poseStamped.
  • Contributors: Tony Baltovski

0.9.4 (2015-01-06)

0.9.3 (2014-12-30)

  • Initiliser fix
  • plugin: visualisation - Fixes CI build
  • plugin: visualisation
  • plugin: visualization minor patch
  • plugin: visualization finshed
  • Contributors: Mohammed Kabir

0.9.2 (2014-11-04)

0.9.1 (2014-11-03)

0.9.0 (2014-11-03)

0.8.2 (2014-11-03)

  • REP140: update package.xml format. Hydro don\'t accept this format correctly, but after split i can update.
  • Contributors: Vladimir Ermakov

0.8.1 (2014-11-02)

  • mavconn #161: Fix headers used in mavros. Add readme.
  • Update repo links. Package moved to mavlink organization.
  • Contributors: Vladimir Ermakov

0.8.0 (2014-09-22)

  • Revert \"Update package.xml format to REP140 (2).\" This reverts commit 81286eb84090a95759591cfab89dd9718ff35b7e. ROS Hydro don\'t fully support REP140: rospack can\'t find plugin descriptions. Fix #151.
  • Added arming/disarming for att mode.
  • Added arming and disarming via mavteleop.
  • extras: mocap: Fix param/topic namespace. Fix #150.
  • extras: launch: Use includes. Fix #144.
  • Update package.xml format to REP140 (2). Fix #104.
  • extras: launch: Fix typos.
  • extras: launch: Add teleop launch script.
  • extras: mavteleop: Dirty implementation of position control mode. Issue #133.
  • extras: mavteleop: Implement velocity setpoint control. Issue #133.
  • extras: mavteleop: Implement attitude control mode. Issue #133.
  • extras: Use cmake modules. Issue #139.
  • Update doxygen documentation. Add split lines in UAS, and make UAS.connection atomic. Add rosdoc configuration for mavros_extras.
  • scripts: mavsetp: corrected msg API; mavteleop: added prefix to rc override
  • scripts: Initial import mavteleop Now it\'s just proof of concept. Implemented only RC override of RPYT channels. Issue #133.
  • node: Catch URL open exception. Also update connection pointer type.
  • Contributors: Nuno Marques, Tony Baltovski, Vladimir Ermakov

0.7.1 (2014-08-25)

  • plugins: Change UAS FCU link name. Reduce smart pointer count, that hold fcu link object.
  • Plugins: finish moving plugins
  • Closes #122, closes #123; plugins: move mocap & vision plugins to extras, change vision plugins name
  • launch: Add example launch for #103.
  • extras: image_pub: Update plugin API.
  • extras: px4flow: Update plugin API.
  • plugins: disable most of plugins
  • extras: init ctor
  • extras: Fix package URLs
  • test: temporary travis hack (manually download latest mavlink deb)
  • Update readme
  • Contributors: Nuno Marques, Vladimir Ermakov

0.7.0 (2014-08-12)

  • move exras to subdirectory, #101
  • Contributors: Vladimir Ermakov, Mohammed Kabir

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

  • launch/teleop.launch
      • teleop_args [default: -att]
  • launch/px4flow.launch
      • fcu_url [default: serial:///dev/ttyACM0:921600]
      • gcs_url [default: ]
      • tgt_system [default: 81]
      • tgt_component [default: 50]
  • launch/px4_image.launch
      • fcu_url [default: serial:///dev/ttyACM0:57600]
      • gcs_url [default: udp://@]
      • tgt_system [default: 1]
      • tgt_component [default: 1]

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged mavros_extras at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.17.5
License GPLv3
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/mavlink/mavros.git
VCS Type git
VCS Version indigo-devel
Last Updated 2017-02-07
Dev Status DEVELOPED
CI status Continuous Integration
Released RELEASED
Tags uav mav mavlink plugin apm px4
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Extra nodes and plugins for

Additional Links

Maintainers

  • Vladimir Ermakov

Authors

  • Vladimir Ermakov

mavros extras

Some extra plugins and nodes for mavros.

px4flow

Plugin for mavros. Publish OPTICAL_FLOW_RAD data.

image_pub

Plugin for mavros, publish images from mavlink device.

gcs_image_bridge

Variation of gcs_bridge that additionally sends image stream to GCS.

mocap_pose_estimate

Plugin for mavros, to send mocap data to FCU. Currently, not used by the FCU. Data can be send via vision_position plugin.

px-ros-pkg replacement

Use roslaunch mavros_extras px4flow.launch for that.

CHANGELOG

Changelog for package mavros_extras

0.17.5 (2017-02-07)

0.17.4 (2016-06-23)

0.17.3 (2016-05-20)

0.17.2 (2016-04-29)

0.17.1 (2016-03-28)

  • ran uncrustify
  • fixed typos
  • use CUBE_LIST for faster rendering
  • limit track size
  • use local variable
  • fixed indentation
  • added rc modes
  • moved rc to rc_override_control()
  • replaced tabulations with spaces (4)
  • introducing RC modes
  • fixed
  • quality added
  • added visualization for local setpoints
  • Contributors: Joey Gong, francois

0.17.0 (2016-02-09)

  • rebased with master
  • ran uncrustify
  • removed duplicate include
  • use MarkerArray for vehicle model
  • Updated frame transformations and added odom publisher to local position plugin
  • Contributors: Eddy, francois

0.16.6 (2016-02-04)

  • extras: uncrustify
  • added tf
  • comments
  • configurable vehicle model
  • Contributors: Vladimir Ermakov, francois

0.16.5 (2016-01-11)

0.16.4 (2015-12-14)

0.16.3 (2015-11-19)

0.16.2 (2015-11-17)

0.16.1 (2015-11-13)

0.16.0 (2015-11-09)

  • gcs_bridge #394: enable both UDPROS and TCPROS transports
  • extras fix #392: add additional subscription for PoseWithCovarianceStamped
  • Contributors: Vladimir Ermakov

0.15.0 (2015-09-17)

  • extras #387: fix header stamp in joint_states
  • extras fix #387: SSP node done.
  • extras #387: subscriber works, node almost done
  • extras #387: load URDF
  • extras #387: initial import of servo_status_publisher
  • Contributors: Vladimir Ermakov

0.14.2 (2015-08-20)

  • extras: fix catkin lint warnings
  • Contributors: Vladimir Ermakov

0.14.1 (2015-08-19)

0.14.0 (2015-08-17)

  • extras: gcs node: replace deprecated copy function
  • extras: scripts: use API from mavros module
  • package: remove not exist dependency
  • extras: vibration: Fix message include
  • extras: px4flow: Fix message include
  • extras: cam_imu_sync: Fix message include
  • extras: update package description
  • msgs: deprecate mavros::Mavlink and copy utils.
  • msgs #354: move all messages to mavros_msgs package.
  • opencv 3.0/2.4 header compatibility
  • fix orientation empty error
  • Contributors: Vladimir Ermakov, andre-nguyen, v01d

0.13.1 (2015-08-05)

0.13.0 (2015-08-01)

  • extras: mocap fix #352: use new helper for quaternion.
  • Merge pull request #312 from mhkabir/cam_imu_sync Camera IMU synchronisation support added
  • distance_sensor #342: correct orientation parameter handling.
  • distance_sensor: restructure orientation matching and verification
  • lib #319: Return quaternion from UAS::sensor_matching()
  • launch fix #340: update default component id of PX4.
  • extras: distance_sensor #71: Purt to TF2.
  • plugin: Use UAS::syncronized_header() for reduce LOC.
  • extras: vision_pose #71: Use TF2 listener. Also #319.
  • launch: Update configs.
  • extras: viz #336: convert plugin to node.
  • extras: vision_speed #319: use eigen based transform
  • extras: vibration: Use UAS::synchronized_header()
  • extras: px4flow #319: change transform_frame()
  • extras: mocap #319: use eigen based transform
  • Camera IMU synchronisation support added
  • Contributors: Mohammed Kabir, TSC21, Vladimir Ermakov

0.12.0 (2015-07-01)

  • coverity: make them happy
  • frame_conversions: use inline functions to identify direction of conversion
  • changed frame conversion func name; add 3x3 cov matrix frame conversion; general doxygen comment cleanup
  • frame_conversions: added frame_conversion specific lib file; applied correct frame conversion between ENU<->NED
  • vibration_plugin: changed vibration to Vector3
  • vibration_plugin: msg reformulation
  • vibration_plugin: first commit
  • Changes some frames from world to body conversion for NED to ENU.
  • mavros #302: fix style
  • mavros fix #301: move sensor orientation util to UAS
  • distance_sensor: typo; style fixe
  • sensor_orientation: corrected rotation set sequence
  • sensor_orientation: updated orientation enum; updated data type
  • sensor_orientation: removed unecessary sum on setting rotation
  • sensor_orientation: added sensor orientation matching helper func
  • distance_sensor: minor correction
  • distance_sensor: sensor position cond changed
  • distance_sensor: tweak param check; cond routines
  • distance_sensor: removed unnecessary comment line
  • distance_sensor: ctor list update
  • distance_sensor: define sensor position through param config
  • distance_sensor: minor comment identation correction
  • distance_sensor: tf::Transform creation optional
  • distance_sensor: add tf_broadcaster between \'fcu\' and the distance sensor
  • distance_sensor: remove commented code
  • distance_sensor: removed dbg msg
  • distance_sensor: cov condition defined
  • distance_sensor: covariance condition changed
  • distance_sensor: conditional state change
  • distance_sensor: covariance condition set - correction
  • distance_sensor: covariance condition set
  • distance_sensor: ctor list update (corrected)
  • distance_sensor: ctor list update
  • distance_sensor: ctor list update
  • distance_sensor: small correction
  • distance_sensor: uncrustify
  • distance_sensor: array limiting; cast correction; other minor correc
  • distance_sensor: travis build correction
  • distance_sensor: uncrustify distance_sensor.cpp
  • distance_sensor: small corrections on variable definitions, method calls
  • distance_sensor: small enhancements
  • distance_sensor #292: uncrustify
  • distance_sensor #292: fix travis build.
  • distance_sensor #292: implement message handling
  • distance_sensor #292: parse mapping configuration.
  • distance_sensor: remove DistanceSensor.msg from CMakeList
  • distance_sensor: removed DistanceSensor.msg
  • distance_sensor: -> use std Range.msg -> published frame_id in topics are dinamic - depend on type and id of the sensor
  • distance_sensor: comment correction
  • distance_sensor: minor correction
  • distance_sensor: minor fixes that include use Range.msg to Laser data
  • distance_sensor: add plugin file
  • distance_sensor plugin: first commit!
  • Contributors: TSC21, Tony Baltovski, Vladimir Ermakov

0.11.2 (2015-04-26)

  • gcs bridge fix #277: add link diagnostics
  • Contributors: Vladimir Ermakov

0.11.1 (2015-04-06)

  • mavftpfuse #129: done! Fix #129.
  • mavftpfuse #129: cache file attrs
  • mavftpfuse #129: initial import
  • Contributors: Vladimir Ermakov

0.11.0 (2015-03-24)

  • extras: vision_pose #247: rename topic
  • extras: launch #257: use white list for px4flow. Also updates config #211.
  • uncrustify and fix #207
  • uncrustify extras
  • package: update lic
  • license #242: update mavros_extras headers
  • plugin api #241: move diag updater to UAS.
  • plugin api #241: remove global private node handle. Now all plugins should define their local node handle (see dummy.cpp). Also partially does #233 (unmerge setpoint topic namespace).
  • plugin api #241: remove [get_name()]{.title-ref}
  • Add BSD license option #220
  • uncrustify: mocap plugin
  • Switched from mavlink VICON_POSITION_ESTIMATE to ATT_POS_MOCAP.
  • Contributors: Tony Baltovski, Vladimir Ermakov

0.10.2 (2015-02-25)

  • launch: Fix vim modelines #213
  • Contributors: Vladimir Ermakov

0.10.1 (2015-02-02)

  • Fix \@mhkabir name in contributors.
  • Updated mavros_extra README to explain the vision_estimate plugin should be used for the mocap data currently.
  • Update px4flow.cpp
  • plguin: px4flow: Remove all ref to old message
  • Merge remote-tracking branch \'upstream/master\' into optflow_rad Conflicts: mavros_extras/CMakeLists.txt
  • Update
  • Clean up
  • New interface commit
  • Add new interface. Raw message only for now. Removed the tx functionality as it doesn\'t make much sense.
  • Contributors: Mohammed Kabir, Tony Baltovski, Vladimir Ermakov

0.10.0 (2015-01-24)

  • mocap_pose_estimate: Switched from pose to poseStamped.
  • Contributors: Tony Baltovski

0.9.4 (2015-01-06)

0.9.3 (2014-12-30)

  • Initiliser fix
  • plugin: visualisation - Fixes CI build
  • plugin: visualisation
  • plugin: visualization minor patch
  • plugin: visualization finshed
  • Contributors: Mohammed Kabir

0.9.2 (2014-11-04)

0.9.1 (2014-11-03)

0.9.0 (2014-11-03)

0.8.2 (2014-11-03)

  • REP140: update package.xml format. Hydro don\'t accept this format correctly, but after split i can update.
  • Contributors: Vladimir Ermakov

0.8.1 (2014-11-02)

  • mavconn #161: Fix headers used in mavros. Add readme.
  • Update repo links. Package moved to mavlink organization.
  • Contributors: Vladimir Ermakov

0.8.0 (2014-09-22)

  • Revert \"Update package.xml format to REP140 (2).\" This reverts commit 81286eb84090a95759591cfab89dd9718ff35b7e. ROS Hydro don\'t fully support REP140: rospack can\'t find plugin descriptions. Fix #151.
  • Added arming/disarming for att mode.
  • Added arming and disarming via mavteleop.
  • extras: mocap: Fix param/topic namespace. Fix #150.
  • extras: launch: Use includes. Fix #144.
  • Update package.xml format to REP140 (2). Fix #104.
  • extras: launch: Fix typos.
  • extras: launch: Add teleop launch script.
  • extras: mavteleop: Dirty implementation of position control mode. Issue #133.
  • extras: mavteleop: Implement velocity setpoint control. Issue #133.
  • extras: mavteleop: Implement attitude control mode. Issue #133.
  • extras: Use cmake modules. Issue #139.
  • Update doxygen documentation. Add split lines in UAS, and make UAS.connection atomic. Add rosdoc configuration for mavros_extras.
  • scripts: mavsetp: corrected msg API; mavteleop: added prefix to rc override
  • scripts: Initial import mavteleop Now it\'s just proof of concept. Implemented only RC override of RPYT channels. Issue #133.
  • node: Catch URL open exception. Also update connection pointer type.
  • Contributors: Nuno Marques, Tony Baltovski, Vladimir Ermakov

0.7.1 (2014-08-25)

  • plugins: Change UAS FCU link name. Reduce smart pointer count, that hold fcu link object.
  • Plugins: finish moving plugins
  • Closes #122, closes #123; plugins: move mocap & vision plugins to extras, change vision plugins name
  • launch: Add example launch for #103.
  • extras: image_pub: Update plugin API.
  • extras: px4flow: Update plugin API.
  • plugins: disable most of plugins
  • extras: init ctor
  • extras: Fix package URLs
  • test: temporary travis hack (manually download latest mavlink deb)
  • Update readme
  • Contributors: Nuno Marques, Vladimir Ermakov

0.7.0 (2014-08-12)

  • move exras to subdirectory, #101
  • Contributors: Vladimir Ermakov, Mohammed Kabir

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

  • launch/teleop.launch
      • teleop_args [default: -att]
  • launch/px4flow.launch
      • fcu_url [default: serial:///dev/ttyACM0:921600]
      • gcs_url [default: ]
      • tgt_system [default: 81]
      • tgt_component [default: 50]
  • launch/px4_image.launch
      • fcu_url [default: serial:///dev/ttyACM0:57600]
      • gcs_url [default: udp://@]
      • tgt_system [default: 1]
      • tgt_component [default: 1]

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged mavros_extras at Robotics Stack Exchange

mavros_extras package from mavros repo

libmavconn mavros mavros_extras

Package Summary

Tags No category tags.
Version 0.8.6
License GPLv3
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/mavlink/mavros.git
VCS Type git
VCS Version hydro-devel
Last Updated 2015-03-04
Dev Status DEVELOPED
CI status Continuous Integration
Released RELEASED
Tags uav mav mavlink plugin apm px4
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Extra nodes and plugins for mavros

Additional Links

Maintainers

  • Vladimir Ermakov

Authors

  • Vladimir Ermakov

mavros extras

Some extra plugins and nodes for mavros.

px4flow

Plugin for mavros. Publish OPTICAL_FLOW data.

image_pub

Plugin for mavros, publish images from mavlink device.

gcs_image_bridge

Variation of gcs_bridge that additionally sends image stream to GCS.

px-ros-pkg replacement

Use roslaunch mavros_extras px4flow.launch for that.

CHANGELOG

Changelog for package mavros_extras

0.8.6 (2015-03-04)

0.8.5 (2014-11-04)

0.8.4 (2014-11-03)

0.8.3 (2014-11-03)

  • 0.8.2
  • prepare minor release 0.8.2 for hydro
  • Contributors: Vladimir Ermakov

0.8.2 (2014-11-03)

0.8.1 (2014-11-02)

  • mavconn #161: Fix headers used in mavros. Add readme.
  • Update repo links. Package moved to mavlink organization.
  • Contributors: Vladimir Ermakov

0.8.0 (2014-09-22)

  • Revert \"Update package.xml format to REP140 (2).\" This reverts commit 81286eb84090a95759591cfab89dd9718ff35b7e. ROS Hydro don\'t fully support REP140: rospack can\'t find plugin descriptions. Fix #151.
  • Added arming/disarming for att mode.
  • Added arming and disarming via mavteleop.
  • extras: mocap: Fix param/topic namespace. Fix #150.
  • extras: launch: Use includes. Fix #144.
  • Update package.xml format to REP140 (2). Fix #104.
  • extras: launch: Fix typos.
  • extras: launch: Add teleop launch script.
  • extras: mavteleop: Dirty implementation of position control mode. Issue #133.
  • extras: mavteleop: Implement velocity setpoint control. Issue #133.
  • extras: mavteleop: Implement attitude control mode. Issue #133.
  • extras: Use cmake modules. Issue #139.
  • Update doxygen documentation. Add split lines in UAS, and make UAS.connection atomic. Add rosdoc configuration for mavros_extras.
  • scripts: mavsetp: corrected msg API; mavteleop: added prefix to rc override
  • scripts: Initial import mavteleop Now it\'s just proof of concept. Implemented only RC override of RPYT channels. Issue #133.
  • node: Catch URL open exception. Also update connection pointer type.
  • Contributors: Nuno Marques, Tony Baltovski, Vladimir Ermakov

0.7.1 (2014-08-25)

  • plugins: Change UAS FCU link name. Reduce smart pointer count, that hold fcu link object.
  • Plugins: finish moving plugins
  • Closes #122, closes #123; plugins: move mocap & vision plugins to extras, change vision plugins name
  • launch: Add example launch for #103.
  • extras: image_pub: Update plugin API.
  • extras: px4flow: Update plugin API.
  • plugins: disable most of plugins
  • extras: init ctor
  • extras: Fix package URLs
  • test: temporary travis hack (manually download latest mavlink deb)
  • Update readme
  • Contributors: Nuno Marques, Vladimir Ermakov

0.7.0 (2014-08-12)

  • move exras to subdirectory, #101
  • Contributors: Vladimir Ermakov, M.H.Kabir

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

No known dependants.

Launch files

  • launch/teleop.launch
      • teleop_args [default: -att]
  • launch/px4flow.launch
      • fcu_url [default: serial:///dev/ttyACM0:921600]
      • gcs_url [default: ]
      • tgt_system [default: 81]
      • tgt_component [default: 50]
  • launch/px4_image.launch
      • fcu_url [default: serial:///dev/ttyACM0:57600]
      • gcs_url [default: udp://@]
      • tgt_system [default: 1]
      • tgt_component [default: 50]

Services

No service files found

Plugins

Recent questions tagged mavros_extras at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.18.0
License GPLv3
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/mavlink/mavros.git
VCS Type git
VCS Version master
Last Updated 2024-03-03
Dev Status DEVELOPED
CI status Continuous Integration
Released RELEASED
Tags uav mav mavlink plugin apm px4
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Extra nodes and plugins for

Additional Links

Maintainers

  • Vladimir Ermakov

Authors

  • Vladimir Ermakov
  • Amilcar Lucas

mavros extras

Some extra plugins and nodes for mavros.

ADSB

Publish/subscribe to the location and information of an ADS-B vehicle.

cam_imu_sync

Publish camera trigger data for synchronisation of IMU and camera frames.

debug_value

Subs/Pubs debug msgs from and to the FCU.

distance_sensor

Publish DISTANCE_SENSOR message data from FCU or connected sensors in companion computer.

fake_gps

Sends fake GPS from local position estimation source data (motion capture, vision) to FCU.

gps_input

Send GPS_INPUT messages to the FCU.

gps_status

Publish GPS_RAW and GPS_RTK messages from FCU.

gps_rtk

Sends the RTCM messages to the FCU for the RTK Fix.

log_transfer

Expose firmware functionality, that is related to log transfer

mocap_pose_estimate

Send motion capture pose estimate to FCU. Currently, not used by the FCU. Data can be send via vision_position plugin.

obstacle_distance

Send obstacle distance report to the FCU.

odom

Send odometry to FCU from another estimator.

px4flow

Publish OPTICAL_FLOW_RAD data from FCU or PX4Flow module.

rangefinder

Publish RANGEFINDER message data from FCU sensors in companion computer.

trajectory

Receive planned path from the FCU and send back corrected path (collision free, smoothed) to the FCU.

wheel_odometry

Compute and publish wheel odometry coming from FCU sensors.

vibration

Publish VIBRATION message data from FCU.

vision_pose_estimate

Send vision pose estimate to FCU.

vision_speed_estimate

Send vision speed estimate to FCU.

companion_process_status

Send companion process status report to the FCU.

servo_state_publisher

Convert mavros_msgs/RCOut to sensor_msgs/JointState messages. It is required to bind URDF model and real servos.

px-ros-pkg replacement

Use roslaunch mavros_extras px4flow.launch for that.

CHANGELOG

Changelog for package mavros_extras

1.18.0 (2024-03-03)

  • [camera plugin] Fix image_index and capture_result not properly filled
  • Fix missing semi-colon
  • GPS_STATUS Plugin: Fill in available messages for ROS1 legacy Filled in available fields in GPS_RAW_INT & GPS2_RAW messages p.s. seems GPS2_RAW more complete than original GPS_RAW_INT
  • Contributors: Beniamino Pozzan, Seunghwan Jo

1.17.0 (2023-09-09)

  • Merge pull request #1865 from scoutdi/warnings Fix / suppress some build warnings
  • mavros_extras: Fix some init order warnings
  • Suppress warnings from included headers
  • Contributors: Morten Fyhn Amundsen, Vladimir Ermakov

1.16.0 (2023-05-05)

  • Merge pull request #1817 from lucasw/pluginlib_hpp use hpp instead of deprecated .h pluginlib headers
  • use hpp instead of deprecated .h pluginlib headers
  • Contributors: Lucas Walter, Vladimir Ermakov

1.15.0 (2022-12-30)

  • Merge pull request #1811 from scoutdi/debug-float-array Implement debug float array handler
  • Implement debug float array handler Co-authored-by: Morten Fyhn Amundsen <morten.f.amundsen@scoutdi.com>
  • Merge pull request #1807 from scoutdi/fix-bitwise-comparison mavros_extras: Fix a comparison that shouldn\'t be bitwise
  • Merge pull request #1808 from scoutdi/fix-sequence-point-warning mavros_extras: Fix a sequence point warning
  • mavros_extras: Fix a sequence point warning
  • mavros_extras: Fix a comparison that shouldn\'t be bitwise
  • Merge pull request #1805 from scoutdi/fix-latlon-check mavros_extras: Fix buggy check for lat/lon ignored
  • mavros_extras: Fix buggy check for lat/lon ignored
  • Contributors: Morten Fyhn Amundsen, Sverre Velten Rothmund, Vladimir Ermakov

1.14.0 (2022-09-24)

  • Merge pull request #1780 from snktshrma/master guided_target: accept position-target-global-int messages
  • plugins: add guided_target to accept offboard position targets Update guided_target.cpp Update guided_target.cpp Update mavros_plugins.xml Update CMakeLists.txt Added offboard_position.cpp Update apm_config.yaml Update offboard_position.cpp Update offboard_position.cpp Rename offboard_position.cpp to guided_target.cpp Update CMakeLists.txt Update mavros_plugins.xml Update apm_config.yaml Update guided_target.cpp
  • Merge pull request #1744 from amilcarlucas/pr_gimbal_diagnostics_fixes mount_control.cpp: detect MOUNT_ORIENTATION stale messages
  • mount_control.cpp: detect MOUNT_ORIENTATION stale messages correct MountConfigure response success correct constructor initialization order some gimbals send negated/inverted angle measurements, correct that to obey the MAVLink frame convention using run-time parameters
  • Merge pull request #1727 from BV-OpenSource/pr-cellular-status Pr cellular status
  • uncrustify cellular_status.cpp
  • Add CellularStatus plugin and message
  • Merge pull request #1702 from amilcarlucas/mount_diagnostics Mount control plugin: add configurable diagnostics
  • mount_control.cpp: use mount_nh for params to keep similarities with other plugins set diag settings before add()
  • Mount control plugin: add configurable diagnostics
  • Merge pull request #1700 from oroelipas/fix-obstacle-distance Fix obstacle distance
  • Bugfix: increment_f had no value asigned when input LaserScan was bigger than obstacle.distances.size()
  • Bugfix: wrong interpolation when the reduction ratio (scale_factor) is not integer.
  • Contributors: Dr.-Ing. Amilcar do Carmo Lucas, Rui Mendes, Sanket Sharma, Vladimir Ermakov, oroel

1.13.0 (2022-01-13)

  • Merge pull request #1677 from AndersonRayner/add_terrain Add plugin for reporting terrain height estimate from the FCU
  • Removed CamelCase for class members. Publish to \"report\"
  • More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages
  • Fixed callback name to match [handle_{MESSAGE_NAME.lower()}]{.title-ref} convention
  • Fixed topic names to match more closely what other plugins use. Fixed a typo.
  • Add plugin for reporting terrain height estimate from FCU
  • Contributors: Vladimir Ermakov, matt

1.12.2 (2021-12-12)

  • extras: trajectory: backport #1667
  • Contributors: Vladimir Ermakov

1.12.1 (2021-11-29)

  • Merge pull request #1660 from scoutdi/fix-warnings Fix warnings
  • mavros_extras: Fix some warnings
  • Contributors: Morten Fyhn Amundsen, Vladimir Ermakov

1.12.0 (2021-11-27)

  • extras: distance_sensor: revert back to zero quaternion Fix #1653
  • Contributors: Vladimir Ermakov

1.11.1 (2021-11-24)

1.11.0 (2021-11-24)

  • extras: landing_target: fix misprint
  • plugin: initialize quaternions with identity Eigen::Quaternion[d|f] () does not initialize with zeroes or identity. So we must initialize with identity vector objects that can be left unassigned. Related to #1652
  • Merge pull request #1651 from Jaeyoung-Lim/pr-image-capture-plugin Add camera plugin for interfacing with mavlink camera protocol
  • Merge pull request #1652 from scoutdi/avoid-uninit-orientation distance_sensor: Initialize sensor orientation quaternion to zero
  • Use meters for relative altitude
  • distance_sensor: Initialize sensor orientation quaternion to zero Without this, you\'ll get random garbage data for the quaternion field of the DISTANCE_SENSOR MAVLink messages sent to the autopilot. The quaternion field should be set to zero when unused, according to the MAVLink message\'s field description.
  • Address review comments
  • Add camera plugin for interfacing with mavlink camera protocol Add camera image captured message for handling camera trigger information
  • Contributors: Jaeyoung-Lim, Morten Fyhn Amundsen, Vladimir Ermakov

1.10.0 (2021-11-04)

  • Merge pull request #1625 from scoutdi/tunnel-plugin Plugin for TUNNEL messages
  • Tunnel: Check for invalid payload length
  • mavros_extras: Create tunnel plugin
  • Contributors: Morten Fyhn Amundsen, Vladimir Ermakov

1.9.0 (2021-09-09)

  • Merge pull request #1621 from amilcarlucas/pr/mount-control-spelling Spelling corrections
  • Spelling corrections
  • Merge pull request #1615 from amilcarlucas/pr/erase-logs This adds functionality to erase all logs on the SD card via mavlink
  • Merge pull request #1618 from amilcarlucas/pr/GPS_INPUT-plugin Added GPS_INPUT plugin
  • This adds functionality to erase all logs on the SD card via mavlink
  • Added GPS_INPUT plugin
  • Merge pull request #1606 from BV-OpenSource/master Add Mount angles message for communications with ardupilotmega.
  • Merge branch \'master\' into master
  • Update esc_status plugin with datatype change on MAVLink. ESC_INFO MAVLink message was updated to have negative temperates and also at a different resolution. This commit updates those changes on this side.
  • Convert status data from cdeg to rad.
  • Publish quaternion information with Mount Status mavlink message.
  • Add missing subscription.
  • Remove Mount_Status plugin. Add Status data to Mount_Control plugin. Remove Mount_Status message.
  • extras: esc_telemetry: fix build
  • extras: fix esc_telemetry centi-volt/amp conversion
  • extras: uncrustify all plugins
  • extras: reformat plugins xml
  • extras: fix apm esc_telemetry
  • actually allocate memory for the telemetry information
  • fixed some compile errors
  • added esc_telemetry plugin
  • Add Mount angles message for communications with ardupilotmega.
  • Reset calibration flag when re-calibrating. Prevent wrong data output.
  • Delete debug files.
  • Apply uncrustify changes.
  • Set progress array to global to prevent erasing data.
  • Move Compass calibration report to extras. Rewrite code based on instructions.
  • Contributors: Abhijith Thottumadayil Jagadeesh, Andr

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

  • launch/teleop.launch
      • teleop_args [default: -att]
  • launch/px4flow.launch
      • fcu_url [default: serial:///dev/ttyACM0:921600]
      • gcs_url [default: ]
      • tgt_system [default: 81]
      • tgt_component [default: 50]
  • launch/px4_image.launch
      • fcu_url [default: serial:///dev/ttyACM0:57600]
      • gcs_url [default: udp://@]
      • tgt_system [default: 1]
      • tgt_component [default: 1]

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged mavros_extras at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 1.18.0
License GPLv3
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/mavlink/mavros.git
VCS Type git
VCS Version master
Last Updated 2024-03-03
Dev Status DEVELOPED
CI status
Released RELEASED
Tags uav mav mavlink plugin apm px4
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

Extra nodes and plugins for

Additional Links

Maintainers

  • Vladimir Ermakov

Authors

  • Vladimir Ermakov
  • Amilcar Lucas

mavros extras

Some extra plugins and nodes for mavros.

ADSB

Publish/subscribe to the location and information of an ADS-B vehicle.

cam_imu_sync

Publish camera trigger data for synchronisation of IMU and camera frames.

debug_value

Subs/Pubs debug msgs from and to the FCU.

distance_sensor

Publish DISTANCE_SENSOR message data from FCU or connected sensors in companion computer.

fake_gps

Sends fake GPS from local position estimation source data (motion capture, vision) to FCU.

gps_input

Send GPS_INPUT messages to the FCU.

gps_status

Publish GPS_RAW and GPS_RTK messages from FCU.

gps_rtk

Sends the RTCM messages to the FCU for the RTK Fix.

log_transfer

Expose firmware functionality, that is related to log transfer

mocap_pose_estimate

Send motion capture pose estimate to FCU. Currently, not used by the FCU. Data can be send via vision_position plugin.

obstacle_distance

Send obstacle distance report to the FCU.

odom

Send odometry to FCU from another estimator.

px4flow

Publish OPTICAL_FLOW_RAD data from FCU or PX4Flow module.

rangefinder

Publish RANGEFINDER message data from FCU sensors in companion computer.

trajectory

Receive planned path from the FCU and send back corrected path (collision free, smoothed) to the FCU.

wheel_odometry

Compute and publish wheel odometry coming from FCU sensors.

vibration

Publish VIBRATION message data from FCU.

vision_pose_estimate

Send vision pose estimate to FCU.

vision_speed_estimate

Send vision speed estimate to FCU.

companion_process_status

Send companion process status report to the FCU.

servo_state_publisher

Convert mavros_msgs/RCOut to sensor_msgs/JointState messages. It is required to bind URDF model and real servos.

px-ros-pkg replacement

Use roslaunch mavros_extras px4flow.launch for that.

CHANGELOG

Changelog for package mavros_extras

1.18.0 (2024-03-03)

  • [camera plugin] Fix image_index and capture_result not properly filled
  • Fix missing semi-colon
  • GPS_STATUS Plugin: Fill in available messages for ROS1 legacy Filled in available fields in GPS_RAW_INT & GPS2_RAW messages p.s. seems GPS2_RAW more complete than original GPS_RAW_INT
  • Contributors: Beniamino Pozzan, Seunghwan Jo

1.17.0 (2023-09-09)

  • Merge pull request #1865 from scoutdi/warnings Fix / suppress some build warnings
  • mavros_extras: Fix some init order warnings
  • Suppress warnings from included headers
  • Contributors: Morten Fyhn Amundsen, Vladimir Ermakov

1.16.0 (2023-05-05)

  • Merge pull request #1817 from lucasw/pluginlib_hpp use hpp instead of deprecated .h pluginlib headers
  • use hpp instead of deprecated .h pluginlib headers
  • Contributors: Lucas Walter, Vladimir Ermakov

1.15.0 (2022-12-30)

  • Merge pull request #1811 from scoutdi/debug-float-array Implement debug float array handler
  • Implement debug float array handler Co-authored-by: Morten Fyhn Amundsen <morten.f.amundsen@scoutdi.com>
  • Merge pull request #1807 from scoutdi/fix-bitwise-comparison mavros_extras: Fix a comparison that shouldn\'t be bitwise
  • Merge pull request #1808 from scoutdi/fix-sequence-point-warning mavros_extras: Fix a sequence point warning
  • mavros_extras: Fix a sequence point warning
  • mavros_extras: Fix a comparison that shouldn\'t be bitwise
  • Merge pull request #1805 from scoutdi/fix-latlon-check mavros_extras: Fix buggy check for lat/lon ignored
  • mavros_extras: Fix buggy check for lat/lon ignored
  • Contributors: Morten Fyhn Amundsen, Sverre Velten Rothmund, Vladimir Ermakov

1.14.0 (2022-09-24)

  • Merge pull request #1780 from snktshrma/master guided_target: accept position-target-global-int messages
  • plugins: add guided_target to accept offboard position targets Update guided_target.cpp Update guided_target.cpp Update mavros_plugins.xml Update CMakeLists.txt Added offboard_position.cpp Update apm_config.yaml Update offboard_position.cpp Update offboard_position.cpp Rename offboard_position.cpp to guided_target.cpp Update CMakeLists.txt Update mavros_plugins.xml Update apm_config.yaml Update guided_target.cpp
  • Merge pull request #1744 from amilcarlucas/pr_gimbal_diagnostics_fixes mount_control.cpp: detect MOUNT_ORIENTATION stale messages
  • mount_control.cpp: detect MOUNT_ORIENTATION stale messages correct MountConfigure response success correct constructor initialization order some gimbals send negated/inverted angle measurements, correct that to obey the MAVLink frame convention using run-time parameters
  • Merge pull request #1727 from BV-OpenSource/pr-cellular-status Pr cellular status
  • uncrustify cellular_status.cpp
  • Add CellularStatus plugin and message
  • Merge pull request #1702 from amilcarlucas/mount_diagnostics Mount control plugin: add configurable diagnostics
  • mount_control.cpp: use mount_nh for params to keep similarities with other plugins set diag settings before add()
  • Mount control plugin: add configurable diagnostics
  • Merge pull request #1700 from oroelipas/fix-obstacle-distance Fix obstacle distance
  • Bugfix: increment_f had no value asigned when input LaserScan was bigger than obstacle.distances.size()
  • Bugfix: wrong interpolation when the reduction ratio (scale_factor) is not integer.
  • Contributors: Dr.-Ing. Amilcar do Carmo Lucas, Rui Mendes, Sanket Sharma, Vladimir Ermakov, oroel

1.13.0 (2022-01-13)

  • Merge pull request #1677 from AndersonRayner/add_terrain Add plugin for reporting terrain height estimate from the FCU
  • Removed CamelCase for class members. Publish to \"report\"
  • More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages
  • Fixed callback name to match [handle_{MESSAGE_NAME.lower()}]{.title-ref} convention
  • Fixed topic names to match more closely what other plugins use. Fixed a typo.
  • Add plugin for reporting terrain height estimate from FCU
  • Contributors: Vladimir Ermakov, matt

1.12.2 (2021-12-12)

  • extras: trajectory: backport #1667
  • Contributors: Vladimir Ermakov

1.12.1 (2021-11-29)

  • Merge pull request #1660 from scoutdi/fix-warnings Fix warnings
  • mavros_extras: Fix some warnings
  • Contributors: Morten Fyhn Amundsen, Vladimir Ermakov

1.12.0 (2021-11-27)

  • extras: distance_sensor: revert back to zero quaternion Fix #1653
  • Contributors: Vladimir Ermakov

1.11.1 (2021-11-24)

1.11.0 (2021-11-24)

  • extras: landing_target: fix misprint
  • plugin: initialize quaternions with identity Eigen::Quaternion[d|f] () does not initialize with zeroes or identity. So we must initialize with identity vector objects that can be left unassigned. Related to #1652
  • Merge pull request #1651 from Jaeyoung-Lim/pr-image-capture-plugin Add camera plugin for interfacing with mavlink camera protocol
  • Merge pull request #1652 from scoutdi/avoid-uninit-orientation distance_sensor: Initialize sensor orientation quaternion to zero
  • Use meters for relative altitude
  • distance_sensor: Initialize sensor orientation quaternion to zero Without this, you\'ll get random garbage data for the quaternion field of the DISTANCE_SENSOR MAVLink messages sent to the autopilot. The quaternion field should be set to zero when unused, according to the MAVLink message\'s field description.
  • Address review comments
  • Add camera plugin for interfacing with mavlink camera protocol Add camera image captured message for handling camera trigger information
  • Contributors: Jaeyoung-Lim, Morten Fyhn Amundsen, Vladimir Ermakov

1.10.0 (2021-11-04)

  • Merge pull request #1625 from scoutdi/tunnel-plugin Plugin for TUNNEL messages
  • Tunnel: Check for invalid payload length
  • mavros_extras: Create tunnel plugin
  • Contributors: Morten Fyhn Amundsen, Vladimir Ermakov

1.9.0 (2021-09-09)

  • Merge pull request #1621 from amilcarlucas/pr/mount-control-spelling Spelling corrections
  • Spelling corrections
  • Merge pull request #1615 from amilcarlucas/pr/erase-logs This adds functionality to erase all logs on the SD card via mavlink
  • Merge pull request #1618 from amilcarlucas/pr/GPS_INPUT-plugin Added GPS_INPUT plugin
  • This adds functionality to erase all logs on the SD card via mavlink
  • Added GPS_INPUT plugin
  • Merge pull request #1606 from BV-OpenSource/master Add Mount angles message for communications with ardupilotmega.
  • Merge branch \'master\' into master
  • Update esc_status plugin with datatype change on MAVLink. ESC_INFO MAVLink message was updated to have negative temperates and also at a different resolution. This commit updates those changes on this side.
  • Convert status data from cdeg to rad.
  • Publish quaternion information with Mount Status mavlink message.
  • Add missing subscription.
  • Remove Mount_Status plugin. Add Status data to Mount_Control plugin. Remove Mount_Status message.
  • extras: esc_telemetry: fix build
  • extras: fix esc_telemetry centi-volt/amp conversion
  • extras: uncrustify all plugins
  • extras: reformat plugins xml
  • extras: fix apm esc_telemetry
  • actually allocate memory for the telemetry information
  • fixed some compile errors
  • added esc_telemetry plugin
  • Add Mount angles message for communications with ardupilotmega.
  • Reset calibration flag when re-calibrating. Prevent wrong data output.
  • Delete debug files.
  • Apply uncrustify changes.
  • Set progress array to global to prevent erasing data.
  • Move Compass calibration report to extras. Rewrite code based on instructions.
  • Contributors: Abhijith Thottumadayil Jagadeesh, Andr

Wiki Tutorials

See ROS Wiki Tutorials for more details.

Source Tutorials

Not currently indexed.

Launch files

  • launch/teleop.launch
      • teleop_args [default: -att]
  • launch/px4flow.launch
      • fcu_url [default: serial:///dev/ttyACM0:921600]
      • gcs_url [default: ]
      • tgt_system [default: 81]
      • tgt_component [default: 50]
  • launch/px4_image.launch
      • fcu_url [default: serial:///dev/ttyACM0:57600]
      • gcs_url [default: udp://@]
      • tgt_system [default: 1]
      • tgt_component [default: 1]

Messages

No message files found.

Services

No service files found

Plugins

Recent questions tagged mavros_extras at Robotics Stack Exchange