![]() |
mavros_msgs package from mavros repolibmavconn mavros mavros_extras mavros_msgs |
|
Package Summary
Tags | No category tags. |
Version | 2.5.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 | 2023-05-05 |
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
Additional Links
Maintainers
- Vladimir Ermakov
Authors
- Vladimir Ermakov
Changelog for package mavros_msgs
2.5.0 (2023-05-05)
2.4.0 (2022-12-30)
- msgs: re-generate
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>
Contributors: Sverre Velten Rothmund, Vladimir Ermakov
2.3.0 (2022-09-24)
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
Contributors: Vladimir Ermakov
2.2.0 (2022-06-27)
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
msgs: support humble
2.1.1 (2022-03-02)
2.1.0 (2022-02-02)
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 #1690 from mavlink/fix-enum_sensor_orientation Fix enum sensor_orientation
re-generate all coglets
Merge pull request #1680 from AndersonRayner/new_mav_frames Add extra MAV_FRAMES to waypoint message
Merge pull request #1677 from AndersonRayner/add_terrain Add plugin for reporting terrain height estimate from the FCU
More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages
Add extra MAV_FRAMES to waypoint message as defined in https://mavlink.io/en/messages/common.html
Add plugin for reporting terrain height estimate from FCU
1.12.2
update changelog
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
Contributors: Vladimir Ermakov, matt
2.0.5 (2021-11-28)
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
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
msgs: use pragmas to ignore unaligned pointer warnings
msgs: fix convert const
msgs: try to hide \'unaligned pointer\' warning
Merge pull request #1651 from Jaeyoung-Lim/pr-image-capture-plugin Add camera plugin for interfacing with mavlink camera protocol
Address review comments
Add camera plugin for interfacing with mavlink camera protocol Add camera image captured message for handling camera trigger information
Merge branch \'master\' into ros2 * master: msgs: add yaw field to GPS_INPUT
msgs: add yaw field to GPS_INPUT
Contributors: Jaeyoung-Lim, Vladimir Ermakov
2.0.4 (2021-11-04)
Merge branch \'master\' into ros2 * master: 1.10.0 prepare release
1.10.0
prepare release
Merge branch \'master\' into ros2 * master: msgs: update gpsraw to have yaw field
msgs: update gpsraw to have yaw field
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.msg: Generate enum with cog
mavros_msgs: Add Tunnel message
Merge pull request #1623 from amilcarlucas/pr/more-typo-fixes More typo fixes
MountControl.msg: fix copy-paste
1.9.0
update changelog
Merge pull request #1616 from amilcarlucas/pr/RC_CHANNELS-mavlink2-extensions Mavlink v2.0 specs for RC_CHANNELS_OVERRIDE accepts upto 18 channels....
Changed OverrideRCIn to 18 channels
Merge pull request #1617 from amilcarlucas/pr/NAV_CONTROLLER_OUTPUT-plugin Added NAV_CONTROLLER_OUTPUT Plugin
Merge pull request #1618 from amilcarlucas/pr/GPS_INPUT-plugin Added GPS_INPUT plugin
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
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.
Remove Mount_Status plugin. Add Status data to Mount_Control plugin. Remove Mount_Status message.
msgs: re-generate file lists
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.
msgs: fix types for apm\'s esc telemetry
actually allocate memory for the telemetry information
added esc_telemetry plugin
Add Mount angles message for communications with ardupilotmega.
Remove extra message from CMakeLists.
Add message and service definition.
Contributors: Abhijith Thottumadayil Jagadeesh, Andr
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
1 | ament_cmake | |
2 | rosidl_default_generators | |
2 | rosidl_default_runtime | |
1 | ament_lint_auto | |
1 | ament_lint_common | |
1 | rcl_interfaces | |
1 | geographic_msgs | |
2 | geometry_msgs | |
2 | sensor_msgs |
System Dependencies
Launch files
Messages
- msg/RCOut.msg
- msg/OpticalFlowRad.msg
- msg/ESCStatus.msg
- msg/Thrust.msg
- msg/WheelOdomStamped.msg
- msg/Altitude.msg
- msg/OnboardComputerStatus.msg
- msg/RTKBaseline.msg
- msg/CameraImageCaptured.msg
- msg/LandingTarget.msg
- msg/LogEntry.msg
- msg/RadioStatus.msg
- msg/HilSensor.msg
- msg/PlayTuneV2.msg
- msg/Param.msg
- msg/CompanionProcessStatus.msg
- msg/Mavlink.msg
- msg/Waypoint.msg
- msg/ESCInfo.msg
- msg/MountControl.msg
- msg/NavControllerOutput.msg
- msg/ADSBVehicle.msg
- msg/TerrainReport.msg
- msg/EstimatorStatus.msg
- msg/ManualControl.msg
- msg/WaypointReached.msg
- msg/WaypointList.msg
- msg/GlobalPositionTarget.msg
- msg/ESCTelemetry.msg
- msg/VfrHud.msg
- msg/HomePosition.msg
- msg/CamIMUStamp.msg
- msg/VehicleInfo.msg
- msg/Vibration.msg
- msg/HilControls.msg
- msg/ESCInfoItem.msg
- msg/HilActuatorControls.msg
- msg/ParamValue.msg
- msg/TimesyncStatus.msg
- msg/ESCTelemetryItem.msg
- msg/PositionTarget.msg
- msg/DebugValue.msg
- msg/GPSRTK.msg
- msg/GPSRAW.msg
- msg/State.msg
- msg/CellularStatus.msg
- msg/GPSINPUT.msg
- msg/FileEntry.msg
- msg/OverrideRCIn.msg
- msg/CommandCode.msg
- msg/StatusText.msg
- msg/ExtendedState.msg
- msg/RCIn.msg
- msg/Tunnel.msg
- msg/HilGPS.msg
- msg/AttitudeTarget.msg
- msg/ESCStatusItem.msg
- msg/RTCM.msg
- msg/Trajectory.msg
- msg/MagnetometerReporter.msg
- msg/HilStateQuaternion.msg
- msg/ActuatorControl.msg
- msg/ParamEvent.msg
- msg/LogData.msg
Services
- srv/CommandTriggerInterval.srv
- srv/CommandAck.srv
- srv/ParamSet.srv
- srv/LogRequestEnd.srv
- srv/CommandVtolTransition.srv
- srv/CommandBool.srv
- srv/CommandHome.srv
- srv/WaypointSetCurrent.srv
- srv/FileRemoveDir.srv
- srv/CommandInt.srv
- srv/CommandTOL.srv
- srv/FileList.srv
- srv/WaypointPush.srv
- srv/CommandLong.srv
- srv/FileTruncate.srv
- srv/ParamGet.srv
- srv/VehicleInfoGet.srv
- srv/FileRemove.srv
- srv/MessageInterval.srv
- srv/ParamSetV2.srv
- srv/FileClose.srv
- srv/WaypointPull.srv
- srv/CommandTriggerControl.srv
- srv/ParamPull.srv
- srv/StreamRate.srv
- srv/LogRequestList.srv
- srv/SetMode.srv
- srv/EndpointDel.srv
- srv/LogRequestData.srv
- srv/EndpointAdd.srv
- srv/SetMavFrame.srv
- srv/MountConfigure.srv
- srv/FileChecksum.srv
- srv/FileRename.srv
- srv/FileMakeDir.srv
- srv/WaypointClear.srv
- srv/FileWrite.srv
- srv/FileRead.srv
- srv/ParamPush.srv
- srv/FileOpen.srv
Plugins
Recent questions tagged mavros_msgs at answers.ros.org
![]() |
mavros_msgs package from mavros repolibmavconn mavros mavros_extras mavros_msgs |
|
Package Summary
Tags | No category tags. |
Version | 2.5.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 | 2023-05-05 |
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
Additional Links
Maintainers
- Vladimir Ermakov
Authors
- Vladimir Ermakov
Changelog for package mavros_msgs
2.5.0 (2023-05-05)
2.4.0 (2022-12-30)
- msgs: re-generate
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>
Contributors: Sverre Velten Rothmund, Vladimir Ermakov
2.3.0 (2022-09-24)
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
Contributors: Vladimir Ermakov
2.2.0 (2022-06-27)
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
msgs: support humble
2.1.1 (2022-03-02)
2.1.0 (2022-02-02)
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 #1690 from mavlink/fix-enum_sensor_orientation Fix enum sensor_orientation
re-generate all coglets
Merge pull request #1680 from AndersonRayner/new_mav_frames Add extra MAV_FRAMES to waypoint message
Merge pull request #1677 from AndersonRayner/add_terrain Add plugin for reporting terrain height estimate from the FCU
More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages
Add extra MAV_FRAMES to waypoint message as defined in https://mavlink.io/en/messages/common.html
Add plugin for reporting terrain height estimate from FCU
1.12.2
update changelog
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
Contributors: Vladimir Ermakov, matt
2.0.5 (2021-11-28)
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
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
msgs: use pragmas to ignore unaligned pointer warnings
msgs: fix convert const
msgs: try to hide \'unaligned pointer\' warning
Merge pull request #1651 from Jaeyoung-Lim/pr-image-capture-plugin Add camera plugin for interfacing with mavlink camera protocol
Address review comments
Add camera plugin for interfacing with mavlink camera protocol Add camera image captured message for handling camera trigger information
Merge branch \'master\' into ros2 * master: msgs: add yaw field to GPS_INPUT
msgs: add yaw field to GPS_INPUT
Contributors: Jaeyoung-Lim, Vladimir Ermakov
2.0.4 (2021-11-04)
Merge branch \'master\' into ros2 * master: 1.10.0 prepare release
1.10.0
prepare release
Merge branch \'master\' into ros2 * master: msgs: update gpsraw to have yaw field
msgs: update gpsraw to have yaw field
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.msg: Generate enum with cog
mavros_msgs: Add Tunnel message
Merge pull request #1623 from amilcarlucas/pr/more-typo-fixes More typo fixes
MountControl.msg: fix copy-paste
1.9.0
update changelog
Merge pull request #1616 from amilcarlucas/pr/RC_CHANNELS-mavlink2-extensions Mavlink v2.0 specs for RC_CHANNELS_OVERRIDE accepts upto 18 channels....
Changed OverrideRCIn to 18 channels
Merge pull request #1617 from amilcarlucas/pr/NAV_CONTROLLER_OUTPUT-plugin Added NAV_CONTROLLER_OUTPUT Plugin
Merge pull request #1618 from amilcarlucas/pr/GPS_INPUT-plugin Added GPS_INPUT plugin
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
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.
Remove Mount_Status plugin. Add Status data to Mount_Control plugin. Remove Mount_Status message.
msgs: re-generate file lists
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.
msgs: fix types for apm\'s esc telemetry
actually allocate memory for the telemetry information
added esc_telemetry plugin
Add Mount angles message for communications with ardupilotmega.
Remove extra message from CMakeLists.
Add message and service definition.
Contributors: Abhijith Thottumadayil Jagadeesh, Andr
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
1 | ament_cmake | |
2 | rosidl_default_generators | |
2 | rosidl_default_runtime | |
1 | ament_lint_auto | |
1 | ament_lint_common | |
1 | rcl_interfaces | |
1 | geographic_msgs | |
2 | geometry_msgs | |
2 | sensor_msgs |
System Dependencies
Dependant Packages
Launch files
Messages
- msg/RCOut.msg
- msg/OpticalFlowRad.msg
- msg/ESCStatus.msg
- msg/Thrust.msg
- msg/WheelOdomStamped.msg
- msg/Altitude.msg
- msg/OnboardComputerStatus.msg
- msg/RTKBaseline.msg
- msg/CameraImageCaptured.msg
- msg/LandingTarget.msg
- msg/LogEntry.msg
- msg/RadioStatus.msg
- msg/HilSensor.msg
- msg/PlayTuneV2.msg
- msg/Param.msg
- msg/CompanionProcessStatus.msg
- msg/Mavlink.msg
- msg/Waypoint.msg
- msg/ESCInfo.msg
- msg/MountControl.msg
- msg/NavControllerOutput.msg
- msg/ADSBVehicle.msg
- msg/TerrainReport.msg
- msg/EstimatorStatus.msg
- msg/ManualControl.msg
- msg/WaypointReached.msg
- msg/WaypointList.msg
- msg/GlobalPositionTarget.msg
- msg/ESCTelemetry.msg
- msg/VfrHud.msg
- msg/HomePosition.msg
- msg/CamIMUStamp.msg
- msg/VehicleInfo.msg
- msg/Vibration.msg
- msg/HilControls.msg
- msg/ESCInfoItem.msg
- msg/HilActuatorControls.msg
- msg/ParamValue.msg
- msg/TimesyncStatus.msg
- msg/ESCTelemetryItem.msg
- msg/PositionTarget.msg
- msg/DebugValue.msg
- msg/GPSRTK.msg
- msg/GPSRAW.msg
- msg/State.msg
- msg/CellularStatus.msg
- msg/GPSINPUT.msg
- msg/FileEntry.msg
- msg/OverrideRCIn.msg
- msg/CommandCode.msg
- msg/StatusText.msg
- msg/ExtendedState.msg
- msg/RCIn.msg
- msg/Tunnel.msg
- msg/HilGPS.msg
- msg/AttitudeTarget.msg
- msg/ESCStatusItem.msg
- msg/RTCM.msg
- msg/Trajectory.msg
- msg/MagnetometerReporter.msg
- msg/HilStateQuaternion.msg
- msg/ActuatorControl.msg
- msg/ParamEvent.msg
- msg/LogData.msg
Services
- srv/CommandTriggerInterval.srv
- srv/CommandAck.srv
- srv/ParamSet.srv
- srv/LogRequestEnd.srv
- srv/CommandVtolTransition.srv
- srv/CommandBool.srv
- srv/CommandHome.srv
- srv/WaypointSetCurrent.srv
- srv/FileRemoveDir.srv
- srv/CommandInt.srv
- srv/CommandTOL.srv
- srv/FileList.srv
- srv/WaypointPush.srv
- srv/CommandLong.srv
- srv/FileTruncate.srv
- srv/ParamGet.srv
- srv/VehicleInfoGet.srv
- srv/FileRemove.srv
- srv/MessageInterval.srv
- srv/ParamSetV2.srv
- srv/FileClose.srv
- srv/WaypointPull.srv
- srv/CommandTriggerControl.srv
- srv/ParamPull.srv
- srv/StreamRate.srv
- srv/LogRequestList.srv
- srv/SetMode.srv
- srv/EndpointDel.srv
- srv/LogRequestData.srv
- srv/EndpointAdd.srv
- srv/SetMavFrame.srv
- srv/MountConfigure.srv
- srv/FileChecksum.srv
- srv/FileRename.srv
- srv/FileMakeDir.srv
- srv/WaypointClear.srv
- srv/FileWrite.srv
- srv/FileRead.srv
- srv/ParamPush.srv
- srv/FileOpen.srv
Plugins
Recent questions tagged mavros_msgs at answers.ros.org
![]() |
mavros_msgs package from mavros repolibmavconn mavros mavros_extras mavros_msgs |
|
Package Summary
Tags | No category tags. |
Version | 2.5.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 | 2023-05-05 |
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
Additional Links
Maintainers
- Vladimir Ermakov
Authors
- Vladimir Ermakov
Changelog for package mavros_msgs
2.5.0 (2023-05-05)
2.4.0 (2022-12-30)
- msgs: re-generate
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>
Contributors: Sverre Velten Rothmund, Vladimir Ermakov
2.3.0 (2022-09-24)
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
Contributors: Vladimir Ermakov
2.2.0 (2022-06-27)
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
msgs: support humble
2.1.1 (2022-03-02)
2.1.0 (2022-02-02)
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 #1690 from mavlink/fix-enum_sensor_orientation Fix enum sensor_orientation
re-generate all coglets
Merge pull request #1680 from AndersonRayner/new_mav_frames Add extra MAV_FRAMES to waypoint message
Merge pull request #1677 from AndersonRayner/add_terrain Add plugin for reporting terrain height estimate from the FCU
More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages
Add extra MAV_FRAMES to waypoint message as defined in https://mavlink.io/en/messages/common.html
Add plugin for reporting terrain height estimate from FCU
1.12.2
update changelog
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
Contributors: Vladimir Ermakov, matt
2.0.5 (2021-11-28)
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
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
msgs: use pragmas to ignore unaligned pointer warnings
msgs: fix convert const
msgs: try to hide \'unaligned pointer\' warning
Merge pull request #1651 from Jaeyoung-Lim/pr-image-capture-plugin Add camera plugin for interfacing with mavlink camera protocol
Address review comments
Add camera plugin for interfacing with mavlink camera protocol Add camera image captured message for handling camera trigger information
Merge branch \'master\' into ros2 * master: msgs: add yaw field to GPS_INPUT
msgs: add yaw field to GPS_INPUT
Contributors: Jaeyoung-Lim, Vladimir Ermakov
2.0.4 (2021-11-04)
Merge branch \'master\' into ros2 * master: 1.10.0 prepare release
1.10.0
prepare release
Merge branch \'master\' into ros2 * master: msgs: update gpsraw to have yaw field
msgs: update gpsraw to have yaw field
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.msg: Generate enum with cog
mavros_msgs: Add Tunnel message
Merge pull request #1623 from amilcarlucas/pr/more-typo-fixes More typo fixes
MountControl.msg: fix copy-paste
1.9.0
update changelog
Merge pull request #1616 from amilcarlucas/pr/RC_CHANNELS-mavlink2-extensions Mavlink v2.0 specs for RC_CHANNELS_OVERRIDE accepts upto 18 channels....
Changed OverrideRCIn to 18 channels
Merge pull request #1617 from amilcarlucas/pr/NAV_CONTROLLER_OUTPUT-plugin Added NAV_CONTROLLER_OUTPUT Plugin
Merge pull request #1618 from amilcarlucas/pr/GPS_INPUT-plugin Added GPS_INPUT plugin
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
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.
Remove Mount_Status plugin. Add Status data to Mount_Control plugin. Remove Mount_Status message.
msgs: re-generate file lists
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.
msgs: fix types for apm\'s esc telemetry
actually allocate memory for the telemetry information
added esc_telemetry plugin
Add Mount angles message for communications with ardupilotmega.
Remove extra message from CMakeLists.
Add message and service definition.
Contributors: Abhijith Thottumadayil Jagadeesh, Andr
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
1 | ament_cmake | |
2 | rosidl_default_generators | |
2 | rosidl_default_runtime | |
1 | ament_lint_auto | |
1 | ament_lint_common | |
1 | rcl_interfaces | |
1 | geographic_msgs | |
2 | geometry_msgs | |
2 | sensor_msgs |
System Dependencies
Launch files
Messages
- msg/RCOut.msg
- msg/OpticalFlowRad.msg
- msg/ESCStatus.msg
- msg/Thrust.msg
- msg/WheelOdomStamped.msg
- msg/Altitude.msg
- msg/OnboardComputerStatus.msg
- msg/RTKBaseline.msg
- msg/CameraImageCaptured.msg
- msg/LandingTarget.msg
- msg/LogEntry.msg
- msg/RadioStatus.msg
- msg/HilSensor.msg
- msg/PlayTuneV2.msg
- msg/Param.msg
- msg/CompanionProcessStatus.msg
- msg/Mavlink.msg
- msg/Waypoint.msg
- msg/ESCInfo.msg
- msg/MountControl.msg
- msg/NavControllerOutput.msg
- msg/ADSBVehicle.msg
- msg/TerrainReport.msg
- msg/EstimatorStatus.msg
- msg/ManualControl.msg
- msg/WaypointReached.msg
- msg/WaypointList.msg
- msg/GlobalPositionTarget.msg
- msg/ESCTelemetry.msg
- msg/VfrHud.msg
- msg/HomePosition.msg
- msg/CamIMUStamp.msg
- msg/VehicleInfo.msg
- msg/Vibration.msg
- msg/HilControls.msg
- msg/ESCInfoItem.msg
- msg/HilActuatorControls.msg
- msg/ParamValue.msg
- msg/TimesyncStatus.msg
- msg/ESCTelemetryItem.msg
- msg/PositionTarget.msg
- msg/DebugValue.msg
- msg/GPSRTK.msg
- msg/GPSRAW.msg
- msg/State.msg
- msg/CellularStatus.msg
- msg/GPSINPUT.msg
- msg/FileEntry.msg
- msg/OverrideRCIn.msg
- msg/CommandCode.msg
- msg/StatusText.msg
- msg/ExtendedState.msg
- msg/RCIn.msg
- msg/Tunnel.msg
- msg/HilGPS.msg
- msg/AttitudeTarget.msg
- msg/ESCStatusItem.msg
- msg/RTCM.msg
- msg/Trajectory.msg
- msg/MagnetometerReporter.msg
- msg/HilStateQuaternion.msg
- msg/ActuatorControl.msg
- msg/ParamEvent.msg
- msg/LogData.msg
Services
- srv/CommandTriggerInterval.srv
- srv/CommandAck.srv
- srv/ParamSet.srv
- srv/LogRequestEnd.srv
- srv/CommandVtolTransition.srv
- srv/CommandBool.srv
- srv/CommandHome.srv
- srv/WaypointSetCurrent.srv
- srv/FileRemoveDir.srv
- srv/CommandInt.srv
- srv/CommandTOL.srv
- srv/FileList.srv
- srv/WaypointPush.srv
- srv/CommandLong.srv
- srv/FileTruncate.srv
- srv/ParamGet.srv
- srv/VehicleInfoGet.srv
- srv/FileRemove.srv
- srv/MessageInterval.srv
- srv/ParamSetV2.srv
- srv/FileClose.srv
- srv/WaypointPull.srv
- srv/CommandTriggerControl.srv
- srv/ParamPull.srv
- srv/StreamRate.srv
- srv/LogRequestList.srv
- srv/SetMode.srv
- srv/EndpointDel.srv
- srv/LogRequestData.srv
- srv/EndpointAdd.srv
- srv/SetMavFrame.srv
- srv/MountConfigure.srv
- srv/FileChecksum.srv
- srv/FileRename.srv
- srv/FileMakeDir.srv
- srv/WaypointClear.srv
- srv/FileWrite.srv
- srv/FileRead.srv
- srv/ParamPush.srv
- srv/FileOpen.srv
Plugins
Recent questions tagged mavros_msgs at answers.ros.org
![]() |
mavros_msgs package from mavros repolibmavconn mavros mavros_extras mavros_msgs |
|
Package Summary
Tags | No category tags. |
Version | 2.5.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 | 2023-05-05 |
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
Additional Links
Maintainers
- Vladimir Ermakov
Authors
- Vladimir Ermakov
Changelog for package mavros_msgs
2.5.0 (2023-05-05)
2.4.0 (2022-12-30)
- msgs: re-generate
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>
Contributors: Sverre Velten Rothmund, Vladimir Ermakov
2.3.0 (2022-09-24)
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
Contributors: Vladimir Ermakov
2.2.0 (2022-06-27)
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
msgs: support humble
2.1.1 (2022-03-02)
2.1.0 (2022-02-02)
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 #1690 from mavlink/fix-enum_sensor_orientation Fix enum sensor_orientation
re-generate all coglets
Merge pull request #1680 from AndersonRayner/new_mav_frames Add extra MAV_FRAMES to waypoint message
Merge pull request #1677 from AndersonRayner/add_terrain Add plugin for reporting terrain height estimate from the FCU
More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages
Add extra MAV_FRAMES to waypoint message as defined in https://mavlink.io/en/messages/common.html
Add plugin for reporting terrain height estimate from FCU
1.12.2
update changelog
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
Contributors: Vladimir Ermakov, matt
2.0.5 (2021-11-28)
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
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
msgs: use pragmas to ignore unaligned pointer warnings
msgs: fix convert const
msgs: try to hide \'unaligned pointer\' warning
Merge pull request #1651 from Jaeyoung-Lim/pr-image-capture-plugin Add camera plugin for interfacing with mavlink camera protocol
Address review comments
Add camera plugin for interfacing with mavlink camera protocol Add camera image captured message for handling camera trigger information
Merge branch \'master\' into ros2 * master: msgs: add yaw field to GPS_INPUT
msgs: add yaw field to GPS_INPUT
Contributors: Jaeyoung-Lim, Vladimir Ermakov
2.0.4 (2021-11-04)
Merge branch \'master\' into ros2 * master: 1.10.0 prepare release
1.10.0
prepare release
Merge branch \'master\' into ros2 * master: msgs: update gpsraw to have yaw field
msgs: update gpsraw to have yaw field
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.msg: Generate enum with cog
mavros_msgs: Add Tunnel message
Merge pull request #1623 from amilcarlucas/pr/more-typo-fixes More typo fixes
MountControl.msg: fix copy-paste
1.9.0
update changelog
Merge pull request #1616 from amilcarlucas/pr/RC_CHANNELS-mavlink2-extensions Mavlink v2.0 specs for RC_CHANNELS_OVERRIDE accepts upto 18 channels....
Changed OverrideRCIn to 18 channels
Merge pull request #1617 from amilcarlucas/pr/NAV_CONTROLLER_OUTPUT-plugin Added NAV_CONTROLLER_OUTPUT Plugin
Merge pull request #1618 from amilcarlucas/pr/GPS_INPUT-plugin Added GPS_INPUT plugin
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
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.
Remove Mount_Status plugin. Add Status data to Mount_Control plugin. Remove Mount_Status message.
msgs: re-generate file lists
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.
msgs: fix types for apm\'s esc telemetry
actually allocate memory for the telemetry information
added esc_telemetry plugin
Add Mount angles message for communications with ardupilotmega.
Remove extra message from CMakeLists.
Add message and service definition.
Contributors: Abhijith Thottumadayil Jagadeesh, Andr
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
1 | ament_cmake | |
2 | rosidl_default_generators | |
2 | rosidl_default_runtime | |
1 | ament_lint_auto | |
1 | ament_lint_common | |
1 | rcl_interfaces | |
1 | geographic_msgs | |
2 | geometry_msgs | |
2 | sensor_msgs |
System Dependencies
Launch files
Messages
- msg/RCOut.msg
- msg/OpticalFlowRad.msg
- msg/ESCStatus.msg
- msg/Thrust.msg
- msg/WheelOdomStamped.msg
- msg/Altitude.msg
- msg/OnboardComputerStatus.msg
- msg/RTKBaseline.msg
- msg/CameraImageCaptured.msg
- msg/LandingTarget.msg
- msg/LogEntry.msg
- msg/RadioStatus.msg
- msg/HilSensor.msg
- msg/PlayTuneV2.msg
- msg/Param.msg
- msg/CompanionProcessStatus.msg
- msg/Mavlink.msg
- msg/Waypoint.msg
- msg/ESCInfo.msg
- msg/MountControl.msg
- msg/NavControllerOutput.msg
- msg/ADSBVehicle.msg
- msg/TerrainReport.msg
- msg/EstimatorStatus.msg
- msg/ManualControl.msg
- msg/WaypointReached.msg
- msg/WaypointList.msg
- msg/GlobalPositionTarget.msg
- msg/ESCTelemetry.msg
- msg/VfrHud.msg
- msg/HomePosition.msg
- msg/CamIMUStamp.msg
- msg/VehicleInfo.msg
- msg/Vibration.msg
- msg/HilControls.msg
- msg/ESCInfoItem.msg
- msg/HilActuatorControls.msg
- msg/ParamValue.msg
- msg/TimesyncStatus.msg
- msg/ESCTelemetryItem.msg
- msg/PositionTarget.msg
- msg/DebugValue.msg
- msg/GPSRTK.msg
- msg/GPSRAW.msg
- msg/State.msg
- msg/CellularStatus.msg
- msg/GPSINPUT.msg
- msg/FileEntry.msg
- msg/OverrideRCIn.msg
- msg/CommandCode.msg
- msg/StatusText.msg
- msg/ExtendedState.msg
- msg/RCIn.msg
- msg/Tunnel.msg
- msg/HilGPS.msg
- msg/AttitudeTarget.msg
- msg/ESCStatusItem.msg
- msg/RTCM.msg
- msg/Trajectory.msg
- msg/MagnetometerReporter.msg
- msg/HilStateQuaternion.msg
- msg/ActuatorControl.msg
- msg/ParamEvent.msg
- msg/LogData.msg
Services
- srv/CommandTriggerInterval.srv
- srv/CommandAck.srv
- srv/ParamSet.srv
- srv/LogRequestEnd.srv
- srv/CommandVtolTransition.srv
- srv/CommandBool.srv
- srv/CommandHome.srv
- srv/WaypointSetCurrent.srv
- srv/FileRemoveDir.srv
- srv/CommandInt.srv
- srv/CommandTOL.srv
- srv/FileList.srv
- srv/WaypointPush.srv
- srv/CommandLong.srv
- srv/FileTruncate.srv
- srv/ParamGet.srv
- srv/VehicleInfoGet.srv
- srv/FileRemove.srv
- srv/MessageInterval.srv
- srv/ParamSetV2.srv
- srv/FileClose.srv
- srv/WaypointPull.srv
- srv/CommandTriggerControl.srv
- srv/ParamPull.srv
- srv/StreamRate.srv
- srv/LogRequestList.srv
- srv/SetMode.srv
- srv/EndpointDel.srv
- srv/LogRequestData.srv
- srv/EndpointAdd.srv
- srv/SetMavFrame.srv
- srv/MountConfigure.srv
- srv/FileChecksum.srv
- srv/FileRename.srv
- srv/FileMakeDir.srv
- srv/WaypointClear.srv
- srv/FileWrite.srv
- srv/FileRead.srv
- srv/ParamPush.srv
- srv/FileOpen.srv
Plugins
Recent questions tagged mavros_msgs at answers.ros.org
![]() |
mavros_msgs package from mavros repolibmavconn mavros mavros_extras mavros_msgs test_mavros |
|
Package Summary
Tags | No category tags. |
Version | 1.16.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 | 2023-05-05 |
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
Additional Links
Maintainers
- Vladimir Ermakov
Authors
- Vladimir Ermakov
Changelog for package mavros_msgs
1.16.0 (2023-05-05)
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>
- Contributors: Sverre Velten Rothmund, Vladimir Ermakov
1.14.0 (2022-09-24)
- Merge pull request #1742 from amilcarlucas/correct_rpm_units ESCTelemetryItem.msg: correct RPM units
- ESCTelemetryItem.msg: correct RPM units
- Merge pull request #1727 from BV-OpenSource/pr-cellular-status Pr cellular status
- Add CellularStatus plugin and message
- Contributors: Dr.-Ing. Amilcar do Carmo Lucas, Rui Mendes, Vladimir Ermakov
1.13.0 (2022-01-13)
- Merge pull request #1690 from mavlink/fix-enum_sensor_orientation Fix enum sensor_orientation
- re-generate all coglets
- Merge pull request #1680 from AndersonRayner/new_mav_frames Add extra MAV_FRAMES to waypoint message
- Merge pull request #1677 from AndersonRayner/add_terrain Add plugin for reporting terrain height estimate from the FCU
- More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages
- Add extra MAV_FRAMES to waypoint message as defined in https://mavlink.io/en/messages/common.html
- Add plugin for reporting terrain height estimate from FCU
- Contributors: Vladimir Ermakov, matt
1.12.2 (2021-12-12)
1.12.1 (2021-11-29)
1.12.0 (2021-11-27)
1.11.1 (2021-11-24)
1.11.0 (2021-11-24)
- msgs: use pragmas to ignore unaligned pointer warnings
- msgs: fix convert const
- msgs: try to hide \'unaligned pointer\' warning
- Merge pull request #1651 from Jaeyoung-Lim/pr-image-capture-plugin Add camera plugin for interfacing with mavlink camera protocol
- Address review comments
- Add camera plugin for interfacing with mavlink camera protocol Add camera image captured message for handling camera trigger information
- msgs: add yaw field to GPS_INPUT
- Contributors: Jaeyoung-Lim, Vladimir Ermakov
1.10.0 (2021-11-04)
- msgs: update gpsraw to have yaw field
- Merge pull request #1625 from scoutdi/tunnel-plugin Plugin for TUNNEL messages
- Tunnel.msg: Generate enum with cog
- mavros_msgs: Add Tunnel message
- Merge pull request #1623 from amilcarlucas/pr/more-typo-fixes More typo fixes
- MountControl.msg: fix copy-paste
- Contributors: Dr.-Ing. Amilcar do Carmo Lucas, Morten Fyhn Amundsen, Vladimir Ermakov
1.9.0 (2021-09-09)
- Merge pull request #1616 from amilcarlucas/pr/RC_CHANNELS-mavlink2-extensions Mavlink v2.0 specs for RC_CHANNELS_OVERRIDE accepts upto 18 channels....
- Changed OverrideRCIn to 18 channels
- Merge pull request #1617 from amilcarlucas/pr/NAV_CONTROLLER_OUTPUT-plugin Added NAV_CONTROLLER_OUTPUT Plugin
- Merge pull request #1618 from amilcarlucas/pr/GPS_INPUT-plugin Added GPS_INPUT plugin
- 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
- 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.
- Remove Mount_Status plugin. Add Status data to Mount_Control plugin. Remove Mount_Status message.
- msgs: fix types for apm\'s esc telemetry
- actually allocate memory for the telemetry information
- added esc_telemetry plugin
- Add Mount angles message for communications with ardupilotmega.
- Remove extra message from CMakeLists.
- Add message and service definition.
- Contributors: Abhijith Thottumadayil Jagadeesh, Andr
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
1 | message_generation | |
1 | catkin | |
1 | message_runtime | |
2 | std_msgs | |
2 | geometry_msgs | |
2 | sensor_msgs | |
1 | geographic_msgs |
System Dependencies
Dependant Packages
Launch files
Messages
- msg/RCOut.msg
- msg/OpticalFlowRad.msg
- msg/ESCStatus.msg
- msg/Thrust.msg
- msg/WheelOdomStamped.msg
- msg/Altitude.msg
- msg/OnboardComputerStatus.msg
- msg/RTKBaseline.msg
- msg/CameraImageCaptured.msg
- msg/BatteryStatus.msg
- msg/LandingTarget.msg
- msg/LogEntry.msg
- msg/RadioStatus.msg
- msg/HilSensor.msg
- msg/PlayTuneV2.msg
- msg/Param.msg
- msg/CompanionProcessStatus.msg
- msg/Mavlink.msg
- msg/Waypoint.msg
- msg/ESCInfo.msg
- msg/VFR_HUD.msg
- msg/MountControl.msg
- msg/NavControllerOutput.msg
- msg/ADSBVehicle.msg
- msg/TerrainReport.msg
- msg/EstimatorStatus.msg
- msg/ManualControl.msg
- msg/WaypointReached.msg
- msg/WaypointList.msg
- msg/GlobalPositionTarget.msg
- msg/ESCTelemetry.msg
- msg/HomePosition.msg
- msg/CamIMUStamp.msg
- msg/VehicleInfo.msg
- msg/Vibration.msg
- msg/HilControls.msg
- msg/ESCInfoItem.msg
- msg/HilActuatorControls.msg
- msg/ParamValue.msg
- msg/TimesyncStatus.msg
- msg/ESCTelemetryItem.msg
- msg/PositionTarget.msg
- msg/DebugValue.msg
- msg/GPSRTK.msg
- msg/GPSRAW.msg
- msg/State.msg
- msg/CellularStatus.msg
- msg/GPSINPUT.msg
- msg/FileEntry.msg
- msg/OverrideRCIn.msg
- msg/CommandCode.msg
- msg/StatusText.msg
- msg/ExtendedState.msg
- msg/RCIn.msg
- msg/Tunnel.msg
- msg/HilGPS.msg
- msg/AttitudeTarget.msg
- msg/ESCStatusItem.msg
- msg/RTCM.msg
- msg/Trajectory.msg
- msg/MagnetometerReporter.msg
- msg/HilStateQuaternion.msg
- msg/ActuatorControl.msg
- msg/LogData.msg
Services
- srv/CommandTriggerInterval.srv
- srv/CommandAck.srv
- srv/ParamSet.srv
- srv/LogRequestEnd.srv
- srv/CommandVtolTransition.srv
- srv/CommandBool.srv
- srv/CommandHome.srv
- srv/WaypointSetCurrent.srv
- srv/FileRemoveDir.srv
- srv/CommandInt.srv
- srv/CommandTOL.srv
- srv/FileList.srv
- srv/WaypointPush.srv
- srv/CommandLong.srv
- srv/FileTruncate.srv
- srv/ParamGet.srv
- srv/VehicleInfoGet.srv
- srv/FileRemove.srv
- srv/MessageInterval.srv
- srv/FileClose.srv
- srv/WaypointPull.srv
- srv/CommandTriggerControl.srv
- srv/ParamPull.srv
- srv/StreamRate.srv
- srv/LogRequestList.srv
- srv/SetMode.srv
- srv/LogRequestData.srv
- srv/SetMavFrame.srv
- srv/MountConfigure.srv
- srv/FileChecksum.srv
- srv/FileRename.srv
- srv/FileMakeDir.srv
- srv/WaypointClear.srv
- srv/FileWrite.srv
- srv/FileRead.srv
- srv/ParamPush.srv
- srv/FileOpen.srv
Plugins
Recent questions tagged mavros_msgs at answers.ros.org
![]() |
mavros_msgs package from mavros repolibmavconn mavros mavros_extras mavros_msgs test_mavros |
|
Package Summary
Tags | No category tags. |
Version | 1.16.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 | 2023-05-05 |
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
Additional Links
Maintainers
- Vladimir Ermakov
Authors
- Vladimir Ermakov
Changelog for package mavros_msgs
1.16.0 (2023-05-05)
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>
- Contributors: Sverre Velten Rothmund, Vladimir Ermakov
1.14.0 (2022-09-24)
- Merge pull request #1742 from amilcarlucas/correct_rpm_units ESCTelemetryItem.msg: correct RPM units
- ESCTelemetryItem.msg: correct RPM units
- Merge pull request #1727 from BV-OpenSource/pr-cellular-status Pr cellular status
- Add CellularStatus plugin and message
- Contributors: Dr.-Ing. Amilcar do Carmo Lucas, Rui Mendes, Vladimir Ermakov
1.13.0 (2022-01-13)
- Merge pull request #1690 from mavlink/fix-enum_sensor_orientation Fix enum sensor_orientation
- re-generate all coglets
- Merge pull request #1680 from AndersonRayner/new_mav_frames Add extra MAV_FRAMES to waypoint message
- Merge pull request #1677 from AndersonRayner/add_terrain Add plugin for reporting terrain height estimate from the FCU
- More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages
- Add extra MAV_FRAMES to waypoint message as defined in https://mavlink.io/en/messages/common.html
- Add plugin for reporting terrain height estimate from FCU
- Contributors: Vladimir Ermakov, matt
1.12.2 (2021-12-12)
1.12.1 (2021-11-29)
1.12.0 (2021-11-27)
1.11.1 (2021-11-24)
1.11.0 (2021-11-24)
- msgs: use pragmas to ignore unaligned pointer warnings
- msgs: fix convert const
- msgs: try to hide \'unaligned pointer\' warning
- Merge pull request #1651 from Jaeyoung-Lim/pr-image-capture-plugin Add camera plugin for interfacing with mavlink camera protocol
- Address review comments
- Add camera plugin for interfacing with mavlink camera protocol Add camera image captured message for handling camera trigger information
- msgs: add yaw field to GPS_INPUT
- Contributors: Jaeyoung-Lim, Vladimir Ermakov
1.10.0 (2021-11-04)
- msgs: update gpsraw to have yaw field
- Merge pull request #1625 from scoutdi/tunnel-plugin Plugin for TUNNEL messages
- Tunnel.msg: Generate enum with cog
- mavros_msgs: Add Tunnel message
- Merge pull request #1623 from amilcarlucas/pr/more-typo-fixes More typo fixes
- MountControl.msg: fix copy-paste
- Contributors: Dr.-Ing. Amilcar do Carmo Lucas, Morten Fyhn Amundsen, Vladimir Ermakov
1.9.0 (2021-09-09)
- Merge pull request #1616 from amilcarlucas/pr/RC_CHANNELS-mavlink2-extensions Mavlink v2.0 specs for RC_CHANNELS_OVERRIDE accepts upto 18 channels....
- Changed OverrideRCIn to 18 channels
- Merge pull request #1617 from amilcarlucas/pr/NAV_CONTROLLER_OUTPUT-plugin Added NAV_CONTROLLER_OUTPUT Plugin
- Merge pull request #1618 from amilcarlucas/pr/GPS_INPUT-plugin Added GPS_INPUT plugin
- 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
- 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.
- Remove Mount_Status plugin. Add Status data to Mount_Control plugin. Remove Mount_Status message.
- msgs: fix types for apm\'s esc telemetry
- actually allocate memory for the telemetry information
- added esc_telemetry plugin
- Add Mount angles message for communications with ardupilotmega.
- Remove extra message from CMakeLists.
- Add message and service definition.
- Contributors: Abhijith Thottumadayil Jagadeesh, Andr
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
1 | message_generation | |
1 | catkin | |
1 | message_runtime | |
2 | std_msgs | |
2 | geometry_msgs | |
2 | sensor_msgs | |
1 | geographic_msgs |
System Dependencies
Dependant Packages
Launch files
Messages
- msg/RCOut.msg
- msg/OpticalFlowRad.msg
- msg/ESCStatus.msg
- msg/Thrust.msg
- msg/WheelOdomStamped.msg
- msg/Altitude.msg
- msg/OnboardComputerStatus.msg
- msg/RTKBaseline.msg
- msg/CameraImageCaptured.msg
- msg/BatteryStatus.msg
- msg/LandingTarget.msg
- msg/LogEntry.msg
- msg/RadioStatus.msg
- msg/HilSensor.msg
- msg/PlayTuneV2.msg
- msg/Param.msg
- msg/CompanionProcessStatus.msg
- msg/Mavlink.msg
- msg/Waypoint.msg
- msg/ESCInfo.msg
- msg/VFR_HUD.msg
- msg/MountControl.msg
- msg/NavControllerOutput.msg
- msg/ADSBVehicle.msg
- msg/TerrainReport.msg
- msg/EstimatorStatus.msg
- msg/ManualControl.msg
- msg/WaypointReached.msg
- msg/WaypointList.msg
- msg/GlobalPositionTarget.msg
- msg/ESCTelemetry.msg
- msg/HomePosition.msg
- msg/CamIMUStamp.msg
- msg/VehicleInfo.msg
- msg/Vibration.msg
- msg/HilControls.msg
- msg/ESCInfoItem.msg
- msg/HilActuatorControls.msg
- msg/ParamValue.msg
- msg/TimesyncStatus.msg
- msg/ESCTelemetryItem.msg
- msg/PositionTarget.msg
- msg/DebugValue.msg
- msg/GPSRTK.msg
- msg/GPSRAW.msg
- msg/State.msg
- msg/CellularStatus.msg
- msg/GPSINPUT.msg
- msg/FileEntry.msg
- msg/OverrideRCIn.msg
- msg/CommandCode.msg
- msg/StatusText.msg
- msg/ExtendedState.msg
- msg/RCIn.msg
- msg/Tunnel.msg
- msg/HilGPS.msg
- msg/AttitudeTarget.msg
- msg/ESCStatusItem.msg
- msg/RTCM.msg
- msg/Trajectory.msg
- msg/MagnetometerReporter.msg
- msg/HilStateQuaternion.msg
- msg/ActuatorControl.msg
- msg/LogData.msg
Services
- srv/CommandTriggerInterval.srv
- srv/CommandAck.srv
- srv/ParamSet.srv
- srv/LogRequestEnd.srv
- srv/CommandVtolTransition.srv
- srv/CommandBool.srv
- srv/CommandHome.srv
- srv/WaypointSetCurrent.srv
- srv/FileRemoveDir.srv
- srv/CommandInt.srv
- srv/CommandTOL.srv
- srv/FileList.srv
- srv/WaypointPush.srv
- srv/CommandLong.srv
- srv/FileTruncate.srv
- srv/ParamGet.srv
- srv/VehicleInfoGet.srv
- srv/FileRemove.srv
- srv/MessageInterval.srv
- srv/FileClose.srv
- srv/WaypointPull.srv
- srv/CommandTriggerControl.srv
- srv/ParamPull.srv
- srv/StreamRate.srv
- srv/LogRequestList.srv
- srv/SetMode.srv
- srv/LogRequestData.srv
- srv/SetMavFrame.srv
- srv/MountConfigure.srv
- srv/FileChecksum.srv
- srv/FileRename.srv
- srv/FileMakeDir.srv
- srv/WaypointClear.srv
- srv/FileWrite.srv
- srv/FileRead.srv
- srv/ParamPush.srv
- srv/FileOpen.srv
Plugins
Recent questions tagged mavros_msgs at answers.ros.org
![]() |
mavros_msgs package from mavros repolibmavconn mavros mavros_extras mavros_msgs |
|
Package Summary
Tags | No category tags. |
Version | 2.5.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 | 2023-05-05 |
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
Additional Links
Maintainers
- Vladimir Ermakov
Authors
- Vladimir Ermakov
Changelog for package mavros_msgs
2.5.0 (2023-05-05)
2.4.0 (2022-12-30)
- msgs: re-generate
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>
Contributors: Sverre Velten Rothmund, Vladimir Ermakov
2.3.0 (2022-09-24)
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
Contributors: Vladimir Ermakov
2.2.0 (2022-06-27)
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
msgs: support humble
2.1.1 (2022-03-02)
2.1.0 (2022-02-02)
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 #1690 from mavlink/fix-enum_sensor_orientation Fix enum sensor_orientation
re-generate all coglets
Merge pull request #1680 from AndersonRayner/new_mav_frames Add extra MAV_FRAMES to waypoint message
Merge pull request #1677 from AndersonRayner/add_terrain Add plugin for reporting terrain height estimate from the FCU
More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages
Add extra MAV_FRAMES to waypoint message as defined in https://mavlink.io/en/messages/common.html
Add plugin for reporting terrain height estimate from FCU
1.12.2
update changelog
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
Contributors: Vladimir Ermakov, matt
2.0.5 (2021-11-28)
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
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
msgs: use pragmas to ignore unaligned pointer warnings
msgs: fix convert const
msgs: try to hide \'unaligned pointer\' warning
Merge pull request #1651 from Jaeyoung-Lim/pr-image-capture-plugin Add camera plugin for interfacing with mavlink camera protocol
Address review comments
Add camera plugin for interfacing with mavlink camera protocol Add camera image captured message for handling camera trigger information
Merge branch \'master\' into ros2 * master: msgs: add yaw field to GPS_INPUT
msgs: add yaw field to GPS_INPUT
Contributors: Jaeyoung-Lim, Vladimir Ermakov
2.0.4 (2021-11-04)
Merge branch \'master\' into ros2 * master: 1.10.0 prepare release
1.10.0
prepare release
Merge branch \'master\' into ros2 * master: msgs: update gpsraw to have yaw field
msgs: update gpsraw to have yaw field
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.msg: Generate enum with cog
mavros_msgs: Add Tunnel message
Merge pull request #1623 from amilcarlucas/pr/more-typo-fixes More typo fixes
MountControl.msg: fix copy-paste
1.9.0
update changelog
Merge pull request #1616 from amilcarlucas/pr/RC_CHANNELS-mavlink2-extensions Mavlink v2.0 specs for RC_CHANNELS_OVERRIDE accepts upto 18 channels....
Changed OverrideRCIn to 18 channels
Merge pull request #1617 from amilcarlucas/pr/NAV_CONTROLLER_OUTPUT-plugin Added NAV_CONTROLLER_OUTPUT Plugin
Merge pull request #1618 from amilcarlucas/pr/GPS_INPUT-plugin Added GPS_INPUT plugin
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
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.
Remove Mount_Status plugin. Add Status data to Mount_Control plugin. Remove Mount_Status message.
msgs: re-generate file lists
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.
msgs: fix types for apm\'s esc telemetry
actually allocate memory for the telemetry information
added esc_telemetry plugin
Add Mount angles message for communications with ardupilotmega.
Remove extra message from CMakeLists.
Add message and service definition.
Contributors: Abhijith Thottumadayil Jagadeesh, Andr
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
1 | ament_cmake | |
2 | rosidl_default_generators | |
2 | rosidl_default_runtime | |
1 | ament_lint_auto | |
1 | ament_lint_common | |
1 | rcl_interfaces | |
1 | geographic_msgs | |
2 | geometry_msgs | |
2 | sensor_msgs |
System Dependencies
Launch files
Messages
- msg/RCOut.msg
- msg/OpticalFlowRad.msg
- msg/ESCStatus.msg
- msg/Thrust.msg
- msg/WheelOdomStamped.msg
- msg/Altitude.msg
- msg/OnboardComputerStatus.msg
- msg/RTKBaseline.msg
- msg/CameraImageCaptured.msg
- msg/LandingTarget.msg
- msg/LogEntry.msg
- msg/RadioStatus.msg
- msg/HilSensor.msg
- msg/PlayTuneV2.msg
- msg/Param.msg
- msg/CompanionProcessStatus.msg
- msg/Mavlink.msg
- msg/Waypoint.msg
- msg/ESCInfo.msg
- msg/MountControl.msg
- msg/NavControllerOutput.msg
- msg/ADSBVehicle.msg
- msg/TerrainReport.msg
- msg/EstimatorStatus.msg
- msg/ManualControl.msg
- msg/WaypointReached.msg
- msg/WaypointList.msg
- msg/GlobalPositionTarget.msg
- msg/ESCTelemetry.msg
- msg/VfrHud.msg
- msg/HomePosition.msg
- msg/CamIMUStamp.msg
- msg/VehicleInfo.msg
- msg/Vibration.msg
- msg/HilControls.msg
- msg/ESCInfoItem.msg
- msg/HilActuatorControls.msg
- msg/ParamValue.msg
- msg/TimesyncStatus.msg
- msg/ESCTelemetryItem.msg
- msg/PositionTarget.msg
- msg/DebugValue.msg
- msg/GPSRTK.msg
- msg/GPSRAW.msg
- msg/State.msg
- msg/CellularStatus.msg
- msg/GPSINPUT.msg
- msg/FileEntry.msg
- msg/OverrideRCIn.msg
- msg/CommandCode.msg
- msg/StatusText.msg
- msg/ExtendedState.msg
- msg/RCIn.msg
- msg/Tunnel.msg
- msg/HilGPS.msg
- msg/AttitudeTarget.msg
- msg/ESCStatusItem.msg
- msg/RTCM.msg
- msg/Trajectory.msg
- msg/MagnetometerReporter.msg
- msg/HilStateQuaternion.msg
- msg/ActuatorControl.msg
- msg/ParamEvent.msg
- msg/LogData.msg
Services
- srv/CommandTriggerInterval.srv
- srv/CommandAck.srv
- srv/ParamSet.srv
- srv/LogRequestEnd.srv
- srv/CommandVtolTransition.srv
- srv/CommandBool.srv
- srv/CommandHome.srv
- srv/WaypointSetCurrent.srv
- srv/FileRemoveDir.srv
- srv/CommandInt.srv
- srv/CommandTOL.srv
- srv/FileList.srv
- srv/WaypointPush.srv
- srv/CommandLong.srv
- srv/FileTruncate.srv
- srv/ParamGet.srv
- srv/VehicleInfoGet.srv
- srv/FileRemove.srv
- srv/MessageInterval.srv
- srv/ParamSetV2.srv
- srv/FileClose.srv
- srv/WaypointPull.srv
- srv/CommandTriggerControl.srv
- srv/ParamPull.srv
- srv/StreamRate.srv
- srv/LogRequestList.srv
- srv/SetMode.srv
- srv/EndpointDel.srv
- srv/LogRequestData.srv
- srv/EndpointAdd.srv
- srv/SetMavFrame.srv
- srv/MountConfigure.srv
- srv/FileChecksum.srv
- srv/FileRename.srv
- srv/FileMakeDir.srv
- srv/WaypointClear.srv
- srv/FileWrite.srv
- srv/FileRead.srv
- srv/ParamPush.srv
- srv/FileOpen.srv
Plugins
Recent questions tagged mavros_msgs at answers.ros.org
![]() |
mavros_msgs package from mavros repolibmavconn mavros mavros_extras mavros_msgs test_mavros |
|
Package Summary
Tags | No category tags. |
Version | 1.16.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 | 2023-05-05 |
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
Additional Links
Maintainers
- Vladimir Ermakov
Authors
- Vladimir Ermakov
Changelog for package mavros_msgs
1.16.0 (2023-05-05)
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>
- Contributors: Sverre Velten Rothmund, Vladimir Ermakov
1.14.0 (2022-09-24)
- Merge pull request #1742 from amilcarlucas/correct_rpm_units ESCTelemetryItem.msg: correct RPM units
- ESCTelemetryItem.msg: correct RPM units
- Merge pull request #1727 from BV-OpenSource/pr-cellular-status Pr cellular status
- Add CellularStatus plugin and message
- Contributors: Dr.-Ing. Amilcar do Carmo Lucas, Rui Mendes, Vladimir Ermakov
1.13.0 (2022-01-13)
- Merge pull request #1690 from mavlink/fix-enum_sensor_orientation Fix enum sensor_orientation
- re-generate all coglets
- Merge pull request #1680 from AndersonRayner/new_mav_frames Add extra MAV_FRAMES to waypoint message
- Merge pull request #1677 from AndersonRayner/add_terrain Add plugin for reporting terrain height estimate from the FCU
- More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages
- Add extra MAV_FRAMES to waypoint message as defined in https://mavlink.io/en/messages/common.html
- Add plugin for reporting terrain height estimate from FCU
- Contributors: Vladimir Ermakov, matt
1.12.2 (2021-12-12)
1.12.1 (2021-11-29)
1.12.0 (2021-11-27)
1.11.1 (2021-11-24)
1.11.0 (2021-11-24)
- msgs: use pragmas to ignore unaligned pointer warnings
- msgs: fix convert const
- msgs: try to hide \'unaligned pointer\' warning
- Merge pull request #1651 from Jaeyoung-Lim/pr-image-capture-plugin Add camera plugin for interfacing with mavlink camera protocol
- Address review comments
- Add camera plugin for interfacing with mavlink camera protocol Add camera image captured message for handling camera trigger information
- msgs: add yaw field to GPS_INPUT
- Contributors: Jaeyoung-Lim, Vladimir Ermakov
1.10.0 (2021-11-04)
- msgs: update gpsraw to have yaw field
- Merge pull request #1625 from scoutdi/tunnel-plugin Plugin for TUNNEL messages
- Tunnel.msg: Generate enum with cog
- mavros_msgs: Add Tunnel message
- Merge pull request #1623 from amilcarlucas/pr/more-typo-fixes More typo fixes
- MountControl.msg: fix copy-paste
- Contributors: Dr.-Ing. Amilcar do Carmo Lucas, Morten Fyhn Amundsen, Vladimir Ermakov
1.9.0 (2021-09-09)
- Merge pull request #1616 from amilcarlucas/pr/RC_CHANNELS-mavlink2-extensions Mavlink v2.0 specs for RC_CHANNELS_OVERRIDE accepts upto 18 channels....
- Changed OverrideRCIn to 18 channels
- Merge pull request #1617 from amilcarlucas/pr/NAV_CONTROLLER_OUTPUT-plugin Added NAV_CONTROLLER_OUTPUT Plugin
- Merge pull request #1618 from amilcarlucas/pr/GPS_INPUT-plugin Added GPS_INPUT plugin
- 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
- 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.
- Remove Mount_Status plugin. Add Status data to Mount_Control plugin. Remove Mount_Status message.
- msgs: fix types for apm\'s esc telemetry
- actually allocate memory for the telemetry information
- added esc_telemetry plugin
- Add Mount angles message for communications with ardupilotmega.
- Remove extra message from CMakeLists.
- Add message and service definition.
- Contributors: Abhijith Thottumadayil Jagadeesh, Andr
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
1 | message_generation | |
1 | catkin | |
1 | message_runtime | |
2 | std_msgs | |
2 | geometry_msgs | |
2 | sensor_msgs | |
1 | geographic_msgs |
System Dependencies
Dependant Packages
Name | Repo | Deps |
---|---|---|
mavros | github-mavlink-mavros | |
mavros_extras | github-mavlink-mavros |
Launch files
Messages
- msg/RCOut.msg
- msg/OpticalFlowRad.msg
- msg/ESCStatus.msg
- msg/Thrust.msg
- msg/WheelOdomStamped.msg
- msg/Altitude.msg
- msg/OnboardComputerStatus.msg
- msg/RTKBaseline.msg
- msg/CameraImageCaptured.msg
- msg/BatteryStatus.msg
- msg/LandingTarget.msg
- msg/LogEntry.msg
- msg/RadioStatus.msg
- msg/HilSensor.msg
- msg/PlayTuneV2.msg
- msg/Param.msg
- msg/CompanionProcessStatus.msg
- msg/Mavlink.msg
- msg/Waypoint.msg
- msg/ESCInfo.msg
- msg/VFR_HUD.msg
- msg/MountControl.msg
- msg/NavControllerOutput.msg
- msg/ADSBVehicle.msg
- msg/TerrainReport.msg
- msg/EstimatorStatus.msg
- msg/ManualControl.msg
- msg/WaypointReached.msg
- msg/WaypointList.msg
- msg/GlobalPositionTarget.msg
- msg/ESCTelemetry.msg
- msg/HomePosition.msg
- msg/CamIMUStamp.msg
- msg/VehicleInfo.msg
- msg/Vibration.msg
- msg/HilControls.msg
- msg/ESCInfoItem.msg
- msg/HilActuatorControls.msg
- msg/ParamValue.msg
- msg/TimesyncStatus.msg
- msg/ESCTelemetryItem.msg
- msg/PositionTarget.msg
- msg/DebugValue.msg
- msg/GPSRTK.msg
- msg/GPSRAW.msg
- msg/State.msg
- msg/CellularStatus.msg
- msg/GPSINPUT.msg
- msg/FileEntry.msg
- msg/OverrideRCIn.msg
- msg/CommandCode.msg
- msg/StatusText.msg
- msg/ExtendedState.msg
- msg/RCIn.msg
- msg/Tunnel.msg
- msg/HilGPS.msg
- msg/AttitudeTarget.msg
- msg/ESCStatusItem.msg
- msg/RTCM.msg
- msg/Trajectory.msg
- msg/MagnetometerReporter.msg
- msg/HilStateQuaternion.msg
- msg/ActuatorControl.msg
- msg/LogData.msg
Services
- srv/CommandTriggerInterval.srv
- srv/CommandAck.srv
- srv/ParamSet.srv
- srv/LogRequestEnd.srv
- srv/CommandVtolTransition.srv
- srv/CommandBool.srv
- srv/CommandHome.srv
- srv/WaypointSetCurrent.srv
- srv/FileRemoveDir.srv
- srv/CommandInt.srv
- srv/CommandTOL.srv
- srv/FileList.srv
- srv/WaypointPush.srv
- srv/CommandLong.srv
- srv/FileTruncate.srv
- srv/ParamGet.srv
- srv/VehicleInfoGet.srv
- srv/FileRemove.srv
- srv/MessageInterval.srv
- srv/FileClose.srv
- srv/WaypointPull.srv
- srv/CommandTriggerControl.srv
- srv/ParamPull.srv
- srv/StreamRate.srv
- srv/LogRequestList.srv
- srv/SetMode.srv
- srv/LogRequestData.srv
- srv/SetMavFrame.srv
- srv/MountConfigure.srv
- srv/FileChecksum.srv
- srv/FileRename.srv
- srv/FileMakeDir.srv
- srv/WaypointClear.srv
- srv/FileWrite.srv
- srv/FileRead.srv
- srv/ParamPush.srv
- srv/FileOpen.srv
Plugins
Recent questions tagged mavros_msgs at answers.ros.org
![]() |
mavros_msgs package from mavros repolibmavconn mavros mavros_extras mavros_msgs test_mavros |
|
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 | 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
Additional Links
Maintainers
- Vladimir Ermakov
Authors
- Vladimir Ermakov
Changelog for package mavros_msgs
0.17.5 (2017-02-07)
0.17.4 (2016-06-23)
- Adding anchor to the HIL_CONTROLS message reference link
- Utilizing synchronise_stamp and adding reference to MAVLINK msg documentation
- Added a plugin that publishes HIL_CONTROLS as ROS messages
- Contributors: Pavel
0.17.3 (2016-05-20)
0.17.2 (2016-04-29)
0.17.1 (2016-03-28)
0.17.0 (2016-02-09)
- rebased with master
- Contributors: francois
0.16.6 (2016-02-04)
0.16.5 (2016-01-11)
0.16.4 (2015-12-14)
- Update mavlink message documentation links
- remove \"altitude_\" prefix from members
- implemented altitude plugin
- Contributors: Andreas Antener, Vladimir Ermakov
0.16.3 (2015-11-19)
0.16.2 (2015-11-17)
0.16.1 (2015-11-13)
0.16.0 (2015-11-09)
- msgs #418: add message for attitude setpoints
- plugin: waypoint fix #414: remove GOTO service. It is replaced with more standard global setpoint messages.
- msgs #415: Add message for raw global setpoint
- msgs #402: PositionTarget message type
- setting constant values and reference docs
- pass new extended state to ros
- msgs #371: add missing message
- msgs #371: add HomePosition message
- Contributors: Andreas Antener, Vladimir Ermakov
0.15.0 (2015-09-17)
- msgs #286: fix bug with packet header.
- msgs #286: Add valid flag and checksum to Mavlink.msg
- plugin: manual_control: Use shared pointer message Fix alphabetic order of msgs.
- removed old commend in .msg file
- Add MANUAL_CONTROL handling with new plugin
- Contributors: Vladimir Ermakov, v01d
0.14.2 (2015-08-20)
0.14.1 (2015-08-19)
0.14.0 (2015-08-17)
- msgs: Add mixer group constants ActuatorControl
- msgs: Add notes to message headers.
- msgs: sort msgs in alphabetical order
- msgs: use std::move for mavlink->ros convert
- msgs: add note about convert function
- msgs: change description, make catkin lint happy
- msgs: move convert functions to msgs package.
- msgs: fix message generator and runtime depent tags
- msgs: remove never used Mavlink.fromlcm field.
- msgs: add package name for all non basic types
- msgs: fix msgs build
- msgs #354: move all messages to mavros_msgs package.
- Contributors: Vladimir Ermakov
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
1 | message_generation | |
1 | catkin | |
1 | message_runtime | |
2 | std_msgs | |
2 | geometry_msgs |
System Dependencies
Dependant Packages
Launch files
Messages
- msg/RCOut.msg
- msg/OpticalFlowRad.msg
- msg/Altitude.msg
- msg/BatteryStatus.msg
- msg/RadioStatus.msg
- msg/Mavlink.msg
- msg/Waypoint.msg
- msg/VFR_HUD.msg
- msg/ManualControl.msg
- msg/WaypointList.msg
- msg/GlobalPositionTarget.msg
- msg/HomePosition.msg
- msg/CamIMUStamp.msg
- msg/Vibration.msg
- msg/HilControls.msg
- msg/ParamValue.msg
- msg/PositionTarget.msg
- msg/State.msg
- msg/FileEntry.msg
- msg/OverrideRCIn.msg
- msg/CommandCode.msg
- msg/ExtendedState.msg
- msg/RCIn.msg
- msg/AttitudeTarget.msg
- msg/ActuatorControl.msg
Services
- srv/ParamSet.srv
- srv/CommandBool.srv
- srv/CommandHome.srv
- srv/WaypointSetCurrent.srv
- srv/FileRemoveDir.srv
- srv/CommandInt.srv
- srv/CommandTOL.srv
- srv/FileList.srv
- srv/WaypointPush.srv
- srv/CommandLong.srv
- srv/FileTruncate.srv
- srv/ParamGet.srv
- srv/FileRemove.srv
- srv/FileClose.srv
- srv/WaypointPull.srv
- srv/CommandTriggerControl.srv
- srv/ParamPull.srv
- srv/StreamRate.srv
- srv/SetMode.srv
- srv/FileChecksum.srv
- srv/FileRename.srv
- srv/FileMakeDir.srv
- srv/WaypointClear.srv
- srv/FileWrite.srv
- srv/FileRead.srv
- srv/ParamPush.srv
- srv/FileOpen.srv
Plugins
Recent questions tagged mavros_msgs at answers.ros.org
![]() |
mavros_msgs package from mavros repolibmavconn mavros mavros_extras mavros_msgs test_mavros |
|
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 | 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
Additional Links
Maintainers
- Vladimir Ermakov
Authors
- Vladimir Ermakov
Changelog for package mavros_msgs
0.17.5 (2017-02-07)
0.17.4 (2016-06-23)
- Adding anchor to the HIL_CONTROLS message reference link
- Utilizing synchronise_stamp and adding reference to MAVLINK msg documentation
- Added a plugin that publishes HIL_CONTROLS as ROS messages
- Contributors: Pavel
0.17.3 (2016-05-20)
0.17.2 (2016-04-29)
0.17.1 (2016-03-28)
0.17.0 (2016-02-09)
- rebased with master
- Contributors: francois
0.16.6 (2016-02-04)
0.16.5 (2016-01-11)
0.16.4 (2015-12-14)
- Update mavlink message documentation links
- remove \"altitude_\" prefix from members
- implemented altitude plugin
- Contributors: Andreas Antener, Vladimir Ermakov
0.16.3 (2015-11-19)
0.16.2 (2015-11-17)
0.16.1 (2015-11-13)
0.16.0 (2015-11-09)
- msgs #418: add message for attitude setpoints
- plugin: waypoint fix #414: remove GOTO service. It is replaced with more standard global setpoint messages.
- msgs #415: Add message for raw global setpoint
- msgs #402: PositionTarget message type
- setting constant values and reference docs
- pass new extended state to ros
- msgs #371: add missing message
- msgs #371: add HomePosition message
- Contributors: Andreas Antener, Vladimir Ermakov
0.15.0 (2015-09-17)
- msgs #286: fix bug with packet header.
- msgs #286: Add valid flag and checksum to Mavlink.msg
- plugin: manual_control: Use shared pointer message Fix alphabetic order of msgs.
- removed old commend in .msg file
- Add MANUAL_CONTROL handling with new plugin
- Contributors: Vladimir Ermakov, v01d
0.14.2 (2015-08-20)
0.14.1 (2015-08-19)
0.14.0 (2015-08-17)
- msgs: Add mixer group constants ActuatorControl
- msgs: Add notes to message headers.
- msgs: sort msgs in alphabetical order
- msgs: use std::move for mavlink->ros convert
- msgs: add note about convert function
- msgs: change description, make catkin lint happy
- msgs: move convert functions to msgs package.
- msgs: fix message generator and runtime depent tags
- msgs: remove never used Mavlink.fromlcm field.
- msgs: add package name for all non basic types
- msgs: fix msgs build
- msgs #354: move all messages to mavros_msgs package.
- Contributors: Vladimir Ermakov
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
1 | message_generation | |
1 | catkin | |
1 | message_runtime | |
2 | std_msgs | |
2 | geometry_msgs |
System Dependencies
Launch files
Messages
- msg/RCOut.msg
- msg/OpticalFlowRad.msg
- msg/Altitude.msg
- msg/BatteryStatus.msg
- msg/RadioStatus.msg
- msg/Mavlink.msg
- msg/Waypoint.msg
- msg/VFR_HUD.msg
- msg/ManualControl.msg
- msg/WaypointList.msg
- msg/GlobalPositionTarget.msg
- msg/HomePosition.msg
- msg/CamIMUStamp.msg
- msg/Vibration.msg
- msg/HilControls.msg
- msg/ParamValue.msg
- msg/PositionTarget.msg
- msg/State.msg
- msg/FileEntry.msg
- msg/OverrideRCIn.msg
- msg/CommandCode.msg
- msg/ExtendedState.msg
- msg/RCIn.msg
- msg/AttitudeTarget.msg
- msg/ActuatorControl.msg
Services
- srv/ParamSet.srv
- srv/CommandBool.srv
- srv/CommandHome.srv
- srv/WaypointSetCurrent.srv
- srv/FileRemoveDir.srv
- srv/CommandInt.srv
- srv/CommandTOL.srv
- srv/FileList.srv
- srv/WaypointPush.srv
- srv/CommandLong.srv
- srv/FileTruncate.srv
- srv/ParamGet.srv
- srv/FileRemove.srv
- srv/FileClose.srv
- srv/WaypointPull.srv
- srv/CommandTriggerControl.srv
- srv/ParamPull.srv
- srv/StreamRate.srv
- srv/SetMode.srv
- srv/FileChecksum.srv
- srv/FileRename.srv
- srv/FileMakeDir.srv
- srv/WaypointClear.srv
- srv/FileWrite.srv
- srv/FileRead.srv
- srv/ParamPush.srv
- srv/FileOpen.srv
Plugins
Recent questions tagged mavros_msgs at answers.ros.org
![]() |
mavros_msgs package from mavros repolibmavconn mavros mavros_extras mavros_msgs test_mavros |
|
Package Summary
Tags | No category tags. |
Version | 1.16.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 | 2023-05-05 |
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
Additional Links
Maintainers
- Vladimir Ermakov
Authors
- Vladimir Ermakov
Changelog for package mavros_msgs
1.16.0 (2023-05-05)
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>
- Contributors: Sverre Velten Rothmund, Vladimir Ermakov
1.14.0 (2022-09-24)
- Merge pull request #1742 from amilcarlucas/correct_rpm_units ESCTelemetryItem.msg: correct RPM units
- ESCTelemetryItem.msg: correct RPM units
- Merge pull request #1727 from BV-OpenSource/pr-cellular-status Pr cellular status
- Add CellularStatus plugin and message
- Contributors: Dr.-Ing. Amilcar do Carmo Lucas, Rui Mendes, Vladimir Ermakov
1.13.0 (2022-01-13)
- Merge pull request #1690 from mavlink/fix-enum_sensor_orientation Fix enum sensor_orientation
- re-generate all coglets
- Merge pull request #1680 from AndersonRayner/new_mav_frames Add extra MAV_FRAMES to waypoint message
- Merge pull request #1677 from AndersonRayner/add_terrain Add plugin for reporting terrain height estimate from the FCU
- More explicitly state \"TerrainReport\" to allow for future extension of the plugin to support other terrain messages
- Add extra MAV_FRAMES to waypoint message as defined in https://mavlink.io/en/messages/common.html
- Add plugin for reporting terrain height estimate from FCU
- Contributors: Vladimir Ermakov, matt
1.12.2 (2021-12-12)
1.12.1 (2021-11-29)
1.12.0 (2021-11-27)
1.11.1 (2021-11-24)
1.11.0 (2021-11-24)
- msgs: use pragmas to ignore unaligned pointer warnings
- msgs: fix convert const
- msgs: try to hide \'unaligned pointer\' warning
- Merge pull request #1651 from Jaeyoung-Lim/pr-image-capture-plugin Add camera plugin for interfacing with mavlink camera protocol
- Address review comments
- Add camera plugin for interfacing with mavlink camera protocol Add camera image captured message for handling camera trigger information
- msgs: add yaw field to GPS_INPUT
- Contributors: Jaeyoung-Lim, Vladimir Ermakov
1.10.0 (2021-11-04)
- msgs: update gpsraw to have yaw field
- Merge pull request #1625 from scoutdi/tunnel-plugin Plugin for TUNNEL messages
- Tunnel.msg: Generate enum with cog
- mavros_msgs: Add Tunnel message
- Merge pull request #1623 from amilcarlucas/pr/more-typo-fixes More typo fixes
- MountControl.msg: fix copy-paste
- Contributors: Dr.-Ing. Amilcar do Carmo Lucas, Morten Fyhn Amundsen, Vladimir Ermakov
1.9.0 (2021-09-09)
- Merge pull request #1616 from amilcarlucas/pr/RC_CHANNELS-mavlink2-extensions Mavlink v2.0 specs for RC_CHANNELS_OVERRIDE accepts upto 18 channels....
- Changed OverrideRCIn to 18 channels
- Merge pull request #1617 from amilcarlucas/pr/NAV_CONTROLLER_OUTPUT-plugin Added NAV_CONTROLLER_OUTPUT Plugin
- Merge pull request #1618 from amilcarlucas/pr/GPS_INPUT-plugin Added GPS_INPUT plugin
- 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
- 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.
- Remove Mount_Status plugin. Add Status data to Mount_Control plugin. Remove Mount_Status message.
- msgs: fix types for apm\'s esc telemetry
- actually allocate memory for the telemetry information
- added esc_telemetry plugin
- Add Mount angles message for communications with ardupilotmega.
- Remove extra message from CMakeLists.
- Add message and service definition.
- Contributors: Abhijith Thottumadayil Jagadeesh, Andr
Wiki Tutorials
Source Tutorials
Package Dependencies
Deps | Name | |
---|---|---|
1 | message_generation | |
1 | catkin | |
1 | message_runtime | |
2 | std_msgs | |
2 | geometry_msgs | |
2 | sensor_msgs | |
1 | geographic_msgs |
System Dependencies
Launch files
Messages
- msg/RCOut.msg
- msg/OpticalFlowRad.msg
- msg/ESCStatus.msg
- msg/Thrust.msg
- msg/WheelOdomStamped.msg
- msg/Altitude.msg
- msg/OnboardComputerStatus.msg
- msg/RTKBaseline.msg
- msg/CameraImageCaptured.msg
- msg/BatteryStatus.msg
- msg/LandingTarget.msg
- msg/LogEntry.msg
- msg/RadioStatus.msg
- msg/HilSensor.msg
- msg/PlayTuneV2.msg
- msg/Param.msg
- msg/CompanionProcessStatus.msg
- msg/Mavlink.msg
- msg/Waypoint.msg
- msg/ESCInfo.msg
- msg/VFR_HUD.msg
- msg/MountControl.msg
- msg/NavControllerOutput.msg
- msg/ADSBVehicle.msg
- msg/TerrainReport.msg
- msg/EstimatorStatus.msg
- msg/ManualControl.msg
- msg/WaypointReached.msg
- msg/WaypointList.msg
- msg/GlobalPositionTarget.msg
- msg/ESCTelemetry.msg
- msg/HomePosition.msg
- msg/CamIMUStamp.msg
- msg/VehicleInfo.msg
- msg/Vibration.msg
- msg/HilControls.msg
- msg/ESCInfoItem.msg
- msg/HilActuatorControls.msg
- msg/ParamValue.msg
- msg/TimesyncStatus.msg
- msg/ESCTelemetryItem.msg
- msg/PositionTarget.msg
- msg/DebugValue.msg
- msg/GPSRTK.msg
- msg/GPSRAW.msg
- msg/State.msg
- msg/CellularStatus.msg
- msg/GPSINPUT.msg
- msg/FileEntry.msg
- msg/OverrideRCIn.msg
- msg/CommandCode.msg
- msg/StatusText.msg
- msg/ExtendedState.msg
- msg/RCIn.msg
- msg/Tunnel.msg
- msg/HilGPS.msg
- msg/AttitudeTarget.msg
- msg/ESCStatusItem.msg
- msg/RTCM.msg
- msg/Trajectory.msg
- msg/MagnetometerReporter.msg
- msg/HilStateQuaternion.msg
- msg/ActuatorControl.msg
- msg/LogData.msg
Services
- srv/CommandTriggerInterval.srv
- srv/CommandAck.srv
- srv/ParamSet.srv
- srv/LogRequestEnd.srv
- srv/CommandVtolTransition.srv
- srv/CommandBool.srv
- srv/CommandHome.srv
- srv/WaypointSetCurrent.srv
- srv/FileRemoveDir.srv
- srv/CommandInt.srv
- srv/CommandTOL.srv
- srv/FileList.srv
- srv/WaypointPush.srv
- srv/CommandLong.srv
- srv/FileTruncate.srv
- srv/ParamGet.srv
- srv/VehicleInfoGet.srv
- srv/FileRemove.srv
- srv/MessageInterval.srv
- srv/FileClose.srv
- srv/WaypointPull.srv
- srv/CommandTriggerControl.srv
- srv/ParamPull.srv
- srv/StreamRate.srv
- srv/LogRequestList.srv
- srv/SetMode.srv
- srv/LogRequestData.srv
- srv/SetMavFrame.srv
- srv/MountConfigure.srv
- srv/FileChecksum.srv
- srv/FileRename.srv
- srv/FileMakeDir.srv
- srv/WaypointClear.srv
- srv/FileWrite.srv
- srv/FileRead.srv
- srv/ParamPush.srv
- srv/FileOpen.srv