Packages
Packages
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2018-05-30 | marker_msgs |
The marker_msgs package contains messages usable to setup a marker/fiducial system.
The package distinguishes between two types of messages.
First messages to describe the properties of a marker/fiducial detection system and the detected markers.
Secondly messages used to represent a map of markers/features with covariances as it would be produced by a SLAM system or published by a map server for self-localization.
The marker_msgs package contains messages usable to setup a marker/fiducial system.
The package distinguishes between two types of messages.
First messages to describe the properties of a marker/fiducial detection system and the detected markers.
Secondly messages used to represent a map of markers/features with covariances as it would be produced by a SLAM system or published by a map server for self-localization.
|
||
| 1 | 2016-11-06 | marker_rviz_plugin |
The marker_rviz_plugin package contains RViz plugins to visualize messages of the marker_msgs package using RViz.
The marker_rviz_plugin package contains RViz plugins to visualize messages of the marker_msgs package using RViz.
|
||
| 1 | markov_decision_making | ||||
| 1 | marshmallow | ||||
| 1 | 2018-10-19 | marti_can_msgs |
marti_can_msgs
marti_can_msgs
|
||
| 1 | 2018-10-19 | marti_common_msgs |
marti_common_msgs
marti_common_msgs
|
||
| 1 | 2019-05-23 | marti_data_structures |
marti_data_structures
marti_data_structures
|
||
| 1 | 2018-10-19 | marti_nav_msgs |
marti_nav_msgs
marti_nav_msgs
|
||
| 1 | 2018-10-19 | marti_perception_msgs |
marti_perception_msgs
marti_perception_msgs
|
||
| 1 | 2018-10-19 | marti_sensor_msgs |
marti_sensor_msgs
marti_sensor_msgs
|
||
| 1 | 2018-10-19 | marti_status_msgs |
marti_status_msgs
marti_status_msgs
|
||
| 1 | 2018-10-19 | marti_visualization_msgs |
marti_visualization_msgs
marti_visualization_msgs
|
||
| 1 | marvelmind_nav | ||||
| 1 | 2019-04-30 | master_discovery_fkie |
Discover the running ROS Masters in local network. The
discovering is done by sending an echo heartbeat messages to a defined
multicast group.
The alternative is to use a zeroconf/avahi daemon to register the ROS
master as service and discover other ROS masters.
Discover the running ROS Masters in local network. The
discovering is done by sending an echo heartbeat messages to a defined
multicast group.
The alternative is to use a zeroconf/avahi daemon to register the ROS
master as service and discover other ROS masters.
|
||
| 1 | 2019-04-30 | master_sync_fkie |
Synchronize the local ROS master to the remote masters
discovered by master_discovery_fkie node. The registration
of topics and services is only perform by local ROS master.
Synchronize the local ROS master to the remote masters
discovered by master_discovery_fkie node. The registration
of topics and services is only perform by local ROS master.
|
||
| 1 | 2018-08-24 | mav_comm |
Contains messages and services for MAV communication
Contains messages and services for MAV communication
|
||
| 1 | 2018-08-24 | mav_msgs |
Package containing messages for communicating with rotary wing MAVs
Package containing messages for communicating with rotary wing MAVs
|
||
| 1 | 2018-08-24 | mav_planning_msgs |
Messages specific to MAV planning, especially polynomial planning.
Messages specific to MAV planning, especially polynomial planning.
|
||
| 1 | 2019-05-20 | mavlink |
MAVLink message marshaling library.
This package provides C-headers and C++11 library
for both 1.0 and 2.0 versions of protocol.
For pymavlink use separate install via rosdep (python-pymavlink).
MAVLink message marshaling library.
This package provides C-headers and C++11 library
for both 1.0 and 2.0 versions of protocol.
For pymavlink use separate install via rosdep (python-pymavlink).
|
||
| 1 | 2019-05-22 | mavros |
MAVROS -- MAVLink extendable communication node for ROS
with proxy for Ground Control Station.
MAVROS -- MAVLink extendable communication node for ROS
with proxy for Ground Control Station.
|
||
| 1 | 2019-05-22 | mavros_extras |
Extra nodes and plugins for
Extra nodes and plugins for
|
||
| 1 | 2019-05-22 | mavros_msgs |
mavros_msgs defines messages for
mavros_msgs defines messages for
|
||
| 1 | maxwell | ||||
| 1 | maxwell_calibration | ||||
| 1 | maxwell_defs | ||||
| 1 | maxwell_moveit_config | ||||
| 1 | maxwell_navigation | ||||
| 1 | 2018-11-13 | mbf_abstract_core |
This package provides common interfaces for navigation specific robot actions. It contains the AbstractPlanner, AbstractController and AbstractRecovery plugin interfaces. This interfaces have to be implemented by the plugins to make the plugin available for Move Base Flex. The abstract classes provides a meaningful interface enabling the planners, controllers and recovery behaviors to return information, e.g. why something went wrong. Derivided interfaces can, for example, provide methods to initialize the planner, controller or recovery with map representations like costmap_2d, grid_map or other representations.
This package provides common interfaces for navigation specific robot actions. It contains the AbstractPlanner, AbstractController and AbstractRecovery plugin interfaces. This interfaces have to be implemented by the plugins to make the plugin available for Move Base Flex. The abstract classes provides a meaningful interface enabling the planners, controllers and recovery behaviors to return information, e.g. why something went wrong. Derivided interfaces can, for example, provide methods to initialize the planner, controller or recovery with map representations like costmap_2d, grid_map or other representations.
|
||
| 1 | 2018-11-13 | mbf_abstract_nav |
The mbf_abstract_nav package contains the abstract navigation server implementation of Move Base Flex (MBF). The abstract navigation server is not bound to any map representation. It provides the actions for planning, controlling and recovering. MBF loads all defined plugins at the program start. Therefor, it loads all plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions.
The mbf_abstract_nav package contains the abstract navigation server implementation of Move Base Flex (MBF). The abstract navigation server is not bound to any map representation. It provides the actions for planning, controlling and recovering. MBF loads all defined plugins at the program start. Therefor, it loads all plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions.
|
||
| 1 | 2018-11-13 | mbf_costmap_core |
This package provides common interfaces for navigation specific robot actions. It contains the CostmapPlanner, CostmapController and CostmapRecovery interfaces. The interfaces have to be implemented by the plugins to make them available for Move Base Flex using the mbf_costmap_nav navigation implementation. That implementation inherits the mbf_abstract_nav implementation and binds the system to a local and a global costmap.
This package provides common interfaces for navigation specific robot actions. It contains the CostmapPlanner, CostmapController and CostmapRecovery interfaces. The interfaces have to be implemented by the plugins to make them available for Move Base Flex using the mbf_costmap_nav navigation implementation. That implementation inherits the mbf_abstract_nav implementation and binds the system to a local and a global costmap.
|
||
| 1 | 2018-11-13 | mbf_costmap_nav |
The mbf_costmap_nav package contains the costmap navigation server implementation of Move Base Flex (MBF). The costmap navigation server is bound to the
The mbf_costmap_nav package contains the costmap navigation server implementation of Move Base Flex (MBF). The costmap navigation server is bound to the
|
||
| 1 | 2018-11-13 | mbf_msgs |
The move_base_flex messages package providing the action definition files for the action GetPath, ExePath, Recovery and MoveBase. The action servers providing these action are implemented in
The move_base_flex messages package providing the action definition files for the action GetPath, ExePath, Recovery and MoveBase. The action servers providing these action are implemented in
|
||
| 1 | 2018-11-13 | mbf_simple_nav |
The mbf_simple_nav package contains a simple navigation server implementation of Move Base Flex (MBF). The simple navigation server is bound to no map representation. It provides actions for planning, controlling and recovering. MBF loads all defined plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions.
It tries to load the defined plugins which implements the defined interfaces in
The mbf_simple_nav package contains a simple navigation server implementation of Move Base Flex (MBF). The simple navigation server is bound to no map representation. It provides actions for planning, controlling and recovering. MBF loads all defined plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions.
It tries to load the defined plugins which implements the defined interfaces in
|
||
| 1 | 2018-11-13 | mbf_utility |
The mbf_utility package
The mbf_utility package
|
||
| 1 | 2019-05-23 | mcl_3dl |
3-D/6-DOF localization for mobile robots with 3-D LIDAR(s)
3-D/6-DOF localization for mobile robots with 3-D LIDAR(s)
|
||
| 1 | 2019-05-23 | mcl_3dl_msgs |
The mcl_3dl message definition package
The mcl_3dl message definition package
|
||
| 1 | 2019-05-14 | mcmillan_airfield |
The mcmillan_airfield package
The mcmillan_airfield package
|
||
| 1 | 2015-12-26 | md49_base_controller |
The md49_base_controller package
The md49_base_controller package
|
||
| 1 | 2015-12-26 | md49_messages |
The md49_messages package
The md49_messages package
|
||
| 1 | 2015-12-26 | md49_serialport |
The md49_serialport package
The md49_serialport package
|
||
| 1 | mdm_example | ||||
| 1 | mdm_library | ||||
| 1 | mdm_topological_tools | ||||
| 1 | 2019-03-23 | mecanum_gazebo_plugin |
Plugin which uses directional friction to simulate mecanum wheels.
Plugin which uses directional friction to simulate mecanum wheels.
|
||
| 1 | 2014-03-24 | media_export |
Placeholder package enabling generic export of media paths.
Placeholder package enabling generic export of media paths.
|
||
| 1 | melfa_description | ||||
| 1 | melfa_driver | ||||
| 1 | melfa_robot | ||||
| 3 | 2019-04-23 | message_filters |
A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.
A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.
|
||
| 1 | 2016-04-28 | message_generation |
Package modeling the build-time dependencies for generating language bindings of messages.
Package modeling the build-time dependencies for generating language bindings of messages.
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | marker_msgs | ||||
| 1 | marker_rviz_plugin | ||||
| 1 | markov_decision_making | ||||
| 1 | marshmallow | ||||
| 1 | 2018-10-19 | marti_can_msgs |
marti_can_msgs
marti_can_msgs
|
||
| 1 | 2018-10-19 | marti_common_msgs |
marti_common_msgs
marti_common_msgs
|
||
| 1 | 2019-05-23 | marti_data_structures |
marti_data_structures
marti_data_structures
|
||
| 1 | 2018-10-19 | marti_nav_msgs |
marti_nav_msgs
marti_nav_msgs
|
||
| 1 | 2018-10-19 | marti_perception_msgs |
marti_perception_msgs
marti_perception_msgs
|
||
| 1 | 2018-10-19 | marti_sensor_msgs |
marti_sensor_msgs
marti_sensor_msgs
|
||
| 1 | 2018-10-19 | marti_status_msgs |
marti_status_msgs
marti_status_msgs
|
||
| 1 | 2018-10-19 | marti_visualization_msgs |
marti_visualization_msgs
marti_visualization_msgs
|
||
| 1 | marvelmind_nav | ||||
| 1 | master_discovery_fkie | ||||
| 1 | master_sync_fkie | ||||
| 1 | 2018-08-24 | mav_comm |
Contains messages and services for MAV communication
Contains messages and services for MAV communication
|
||
| 1 | 2018-08-24 | mav_msgs |
Package containing messages for communicating with rotary wing MAVs
Package containing messages for communicating with rotary wing MAVs
|
||
| 1 | 2018-08-24 | mav_planning_msgs |
Messages specific to MAV planning, especially polynomial planning.
Messages specific to MAV planning, especially polynomial planning.
|
||
| 1 | 2019-04-04 | mavlink |
MAVLink message marshaling library.
This package provides C-headers and C++11 library
for both 1.0 and 2.0 versions of protocol.
For pymavlink use separate install via rosdep (python-pymavlink).
MAVLink message marshaling library.
This package provides C-headers and C++11 library
for both 1.0 and 2.0 versions of protocol.
For pymavlink use separate install via rosdep (python-pymavlink).
|
||
| 1 | 2019-05-22 | mavros |
MAVROS -- MAVLink extendable communication node for ROS
with proxy for Ground Control Station.
MAVROS -- MAVLink extendable communication node for ROS
with proxy for Ground Control Station.
|
||
| 1 | 2019-05-22 | mavros_extras |
Extra nodes and plugins for
Extra nodes and plugins for
|
||
| 1 | 2019-05-22 | mavros_msgs |
mavros_msgs defines messages for
mavros_msgs defines messages for
|
||
| 1 | maxwell | ||||
| 1 | maxwell_calibration | ||||
| 1 | maxwell_defs | ||||
| 1 | maxwell_moveit_config | ||||
| 1 | maxwell_navigation | ||||
| 1 | 2018-11-13 | mbf_abstract_core |
This package provides common interfaces for navigation specific robot actions. It contains the AbstractPlanner, AbstractController and AbstractRecovery plugin interfaces. This interfaces have to be implemented by the plugins to make the plugin available for Move Base Flex. The abstract classes provides a meaningful interface enabling the planners, controllers and recovery behaviors to return information, e.g. why something went wrong. Derivided interfaces can, for example, provide methods to initialize the planner, controller or recovery with map representations like costmap_2d, grid_map or other representations.
This package provides common interfaces for navigation specific robot actions. It contains the AbstractPlanner, AbstractController and AbstractRecovery plugin interfaces. This interfaces have to be implemented by the plugins to make the plugin available for Move Base Flex. The abstract classes provides a meaningful interface enabling the planners, controllers and recovery behaviors to return information, e.g. why something went wrong. Derivided interfaces can, for example, provide methods to initialize the planner, controller or recovery with map representations like costmap_2d, grid_map or other representations.
|
||
| 1 | 2018-11-13 | mbf_abstract_nav |
The mbf_abstract_nav package contains the abstract navigation server implementation of Move Base Flex (MBF). The abstract navigation server is not bound to any map representation. It provides the actions for planning, controlling and recovering. MBF loads all defined plugins at the program start. Therefor, it loads all plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions.
The mbf_abstract_nav package contains the abstract navigation server implementation of Move Base Flex (MBF). The abstract navigation server is not bound to any map representation. It provides the actions for planning, controlling and recovering. MBF loads all defined plugins at the program start. Therefor, it loads all plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions.
|
||
| 1 | 2018-11-13 | mbf_costmap_core |
This package provides common interfaces for navigation specific robot actions. It contains the CostmapPlanner, CostmapController and CostmapRecovery interfaces. The interfaces have to be implemented by the plugins to make them available for Move Base Flex using the mbf_costmap_nav navigation implementation. That implementation inherits the mbf_abstract_nav implementation and binds the system to a local and a global costmap.
This package provides common interfaces for navigation specific robot actions. It contains the CostmapPlanner, CostmapController and CostmapRecovery interfaces. The interfaces have to be implemented by the plugins to make them available for Move Base Flex using the mbf_costmap_nav navigation implementation. That implementation inherits the mbf_abstract_nav implementation and binds the system to a local and a global costmap.
|
||
| 1 | 2018-11-13 | mbf_costmap_nav |
The mbf_costmap_nav package contains the costmap navigation server implementation of Move Base Flex (MBF). The costmap navigation server is bound to the
The mbf_costmap_nav package contains the costmap navigation server implementation of Move Base Flex (MBF). The costmap navigation server is bound to the
|
||
| 1 | 2018-11-13 | mbf_msgs |
The move_base_flex messages package providing the action definition files for the action GetPath, ExePath, Recovery and MoveBase. The action servers providing these action are implemented in
The move_base_flex messages package providing the action definition files for the action GetPath, ExePath, Recovery and MoveBase. The action servers providing these action are implemented in
|
||
| 1 | 2018-11-13 | mbf_simple_nav |
The mbf_simple_nav package contains a simple navigation server implementation of Move Base Flex (MBF). The simple navigation server is bound to no map representation. It provides actions for planning, controlling and recovering. MBF loads all defined plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions.
It tries to load the defined plugins which implements the defined interfaces in
The mbf_simple_nav package contains a simple navigation server implementation of Move Base Flex (MBF). The simple navigation server is bound to no map representation. It provides actions for planning, controlling and recovering. MBF loads all defined plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions.
It tries to load the defined plugins which implements the defined interfaces in
|
||
| 1 | 2018-11-13 | mbf_utility |
The mbf_utility package
The mbf_utility package
|
||
| 1 | 2019-05-23 | mcl_3dl |
3-D/6-DOF localization for mobile robots with 3-D LIDAR(s)
3-D/6-DOF localization for mobile robots with 3-D LIDAR(s)
|
||
| 1 | 2019-05-23 | mcl_3dl_msgs |
The mcl_3dl message definition package
The mcl_3dl message definition package
|
||
| 1 | mcmillan_airfield | ||||
| 1 | md49_base_controller | ||||
| 1 | md49_messages | ||||
| 1 | md49_serialport | ||||
| 1 | mdm_example | ||||
| 1 | mdm_library | ||||
| 1 | mdm_topological_tools | ||||
| 1 | mecanum_gazebo_plugin | ||||
| 1 | 2014-03-24 | media_export |
Placeholder package enabling generic export of media paths.
Placeholder package enabling generic export of media paths.
|
||
| 1 | melfa_description | ||||
| 1 | melfa_driver | ||||
| 1 | melfa_robot | ||||
| 3 | 2019-02-01 | message_filters |
A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.
A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.
|
||
| 1 | 2016-04-28 | message_generation |
Package modeling the build-time dependencies for generating language bindings of messages.
Package modeling the build-time dependencies for generating language bindings of messages.
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2018-05-30 | marker_msgs |
The marker_msgs package contains messages usable to setup a marker/fiducial system.
The package distinguishes between two types of messages.
First messages to describe the properties of a marker/fiducial detection system and the detected markers.
Secondly messages used to represent a map of markers/features with covariances as it would be produced by a SLAM system or published by a map server for self-localization.
The marker_msgs package contains messages usable to setup a marker/fiducial system.
The package distinguishes between two types of messages.
First messages to describe the properties of a marker/fiducial detection system and the detected markers.
Secondly messages used to represent a map of markers/features with covariances as it would be produced by a SLAM system or published by a map server for self-localization.
|
||
| 1 | 2016-11-06 | marker_rviz_plugin |
The marker_rviz_plugin package contains RViz plugins to visualize messages of the marker_msgs package using RViz.
The marker_rviz_plugin package contains RViz plugins to visualize messages of the marker_msgs package using RViz.
|
||
| 1 | markov_decision_making | ||||
| 1 | 2016-07-21 | marshmallow |
A lightweight library for converting complex objects to and from simple Python datatypes.
A lightweight library for converting complex objects to and from simple Python datatypes.
|
||
| 1 | 2018-10-19 | marti_can_msgs |
marti_can_msgs
marti_can_msgs
|
||
| 1 | 2018-10-19 | marti_common_msgs |
marti_common_msgs
marti_common_msgs
|
||
| 1 | 2019-05-23 | marti_data_structures |
marti_data_structures
marti_data_structures
|
||
| 1 | 2018-10-19 | marti_nav_msgs |
marti_nav_msgs
marti_nav_msgs
|
||
| 1 | 2018-10-19 | marti_perception_msgs |
marti_perception_msgs
marti_perception_msgs
|
||
| 1 | 2018-10-19 | marti_sensor_msgs |
marti_sensor_msgs
marti_sensor_msgs
|
||
| 1 | 2018-10-19 | marti_status_msgs |
marti_status_msgs
marti_status_msgs
|
||
| 1 | 2018-10-19 | marti_visualization_msgs |
marti_visualization_msgs
marti_visualization_msgs
|
||
| 1 | 2018-03-15 | marvelmind_nav |
Marvelmind local navigation system
Marvelmind local navigation system
|
||
| 1 | 2019-04-30 | master_discovery_fkie |
Discover the running ROS Masters in local network. The
discovering is done by sending an echo heartbeat messages to a defined
multicast group.
The alternative is to use a zeroconf/avahi daemon to register the ROS
master as service and discover other ROS masters.
Discover the running ROS Masters in local network. The
discovering is done by sending an echo heartbeat messages to a defined
multicast group.
The alternative is to use a zeroconf/avahi daemon to register the ROS
master as service and discover other ROS masters.
|
||
| 1 | 2019-04-30 | master_sync_fkie |
Synchronize the local ROS master to the remote masters
discovered by master_discovery_fkie node. The registration
of topics and services is only perform by local ROS master.
Synchronize the local ROS master to the remote masters
discovered by master_discovery_fkie node. The registration
of topics and services is only perform by local ROS master.
|
||
| 1 | 2018-08-24 | mav_comm |
Contains messages and services for MAV communication
Contains messages and services for MAV communication
|
||
| 1 | 2018-08-24 | mav_msgs |
Package containing messages for communicating with rotary wing MAVs
Package containing messages for communicating with rotary wing MAVs
|
||
| 1 | 2018-08-24 | mav_planning_msgs |
Messages specific to MAV planning, especially polynomial planning.
Messages specific to MAV planning, especially polynomial planning.
|
||
| 1 | 2019-05-20 | mavlink |
MAVLink message marshaling library.
This package provides C-headers and C++11 library
for both 1.0 and 2.0 versions of protocol.
For pymavlink use separate install via rosdep (python-pymavlink).
MAVLink message marshaling library.
This package provides C-headers and C++11 library
for both 1.0 and 2.0 versions of protocol.
For pymavlink use separate install via rosdep (python-pymavlink).
|
||
| 1 | 2019-05-22 | mavros |
MAVROS -- MAVLink extendable communication node for ROS
with proxy for Ground Control Station.
MAVROS -- MAVLink extendable communication node for ROS
with proxy for Ground Control Station.
|
||
| 1 | 2019-05-22 | mavros_extras |
Extra nodes and plugins for
Extra nodes and plugins for
|
||
| 1 | 2019-05-22 | mavros_msgs |
mavros_msgs defines messages for
mavros_msgs defines messages for
|
||
| 1 | maxwell | ||||
| 1 | maxwell_calibration | ||||
| 1 | maxwell_defs | ||||
| 1 | maxwell_moveit_config | ||||
| 1 | maxwell_navigation | ||||
| 1 | 2018-11-13 | mbf_abstract_core |
This package provides common interfaces for navigation specific robot actions. It contains the AbstractPlanner, AbstractController and AbstractRecovery plugin interfaces. This interfaces have to be implemented by the plugins to make the plugin available for Move Base Flex. The abstract classes provides a meaningful interface enabling the planners, controllers and recovery behaviors to return information, e.g. why something went wrong. Derivided interfaces can, for example, provide methods to initialize the planner, controller or recovery with map representations like costmap_2d, grid_map or other representations.
This package provides common interfaces for navigation specific robot actions. It contains the AbstractPlanner, AbstractController and AbstractRecovery plugin interfaces. This interfaces have to be implemented by the plugins to make the plugin available for Move Base Flex. The abstract classes provides a meaningful interface enabling the planners, controllers and recovery behaviors to return information, e.g. why something went wrong. Derivided interfaces can, for example, provide methods to initialize the planner, controller or recovery with map representations like costmap_2d, grid_map or other representations.
|
||
| 1 | 2018-11-13 | mbf_abstract_nav |
The mbf_abstract_nav package contains the abstract navigation server implementation of Move Base Flex (MBF). The abstract navigation server is not bound to any map representation. It provides the actions for planning, controlling and recovering. MBF loads all defined plugins at the program start. Therefor, it loads all plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions.
The mbf_abstract_nav package contains the abstract navigation server implementation of Move Base Flex (MBF). The abstract navigation server is not bound to any map representation. It provides the actions for planning, controlling and recovering. MBF loads all defined plugins at the program start. Therefor, it loads all plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions.
|
||
| 1 | 2018-11-13 | mbf_costmap_core |
This package provides common interfaces for navigation specific robot actions. It contains the CostmapPlanner, CostmapController and CostmapRecovery interfaces. The interfaces have to be implemented by the plugins to make them available for Move Base Flex using the mbf_costmap_nav navigation implementation. That implementation inherits the mbf_abstract_nav implementation and binds the system to a local and a global costmap.
This package provides common interfaces for navigation specific robot actions. It contains the CostmapPlanner, CostmapController and CostmapRecovery interfaces. The interfaces have to be implemented by the plugins to make them available for Move Base Flex using the mbf_costmap_nav navigation implementation. That implementation inherits the mbf_abstract_nav implementation and binds the system to a local and a global costmap.
|
||
| 1 | 2018-11-13 | mbf_costmap_nav |
The mbf_costmap_nav package contains the costmap navigation server implementation of Move Base Flex (MBF). The costmap navigation server is bound to the
The mbf_costmap_nav package contains the costmap navigation server implementation of Move Base Flex (MBF). The costmap navigation server is bound to the
|
||
| 1 | 2018-11-13 | mbf_msgs |
The move_base_flex messages package providing the action definition files for the action GetPath, ExePath, Recovery and MoveBase. The action servers providing these action are implemented in
The move_base_flex messages package providing the action definition files for the action GetPath, ExePath, Recovery and MoveBase. The action servers providing these action are implemented in
|
||
| 1 | 2018-11-13 | mbf_simple_nav |
The mbf_simple_nav package contains a simple navigation server implementation of Move Base Flex (MBF). The simple navigation server is bound to no map representation. It provides actions for planning, controlling and recovering. MBF loads all defined plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions.
It tries to load the defined plugins which implements the defined interfaces in
The mbf_simple_nav package contains a simple navigation server implementation of Move Base Flex (MBF). The simple navigation server is bound to no map representation. It provides actions for planning, controlling and recovering. MBF loads all defined plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions.
It tries to load the defined plugins which implements the defined interfaces in
|
||
| 1 | 2018-11-13 | mbf_utility |
The mbf_utility package
The mbf_utility package
|
||
| 1 | 2019-05-23 | mcl_3dl |
3-D/6-DOF localization for mobile robots with 3-D LIDAR(s)
3-D/6-DOF localization for mobile robots with 3-D LIDAR(s)
|
||
| 1 | 2019-05-23 | mcl_3dl_msgs |
The mcl_3dl message definition package
The mcl_3dl message definition package
|
||
| 1 | 2019-05-14 | mcmillan_airfield |
The mcmillan_airfield package
The mcmillan_airfield package
|
||
| 1 | 2015-12-26 | md49_base_controller |
The md49_base_controller package
The md49_base_controller package
|
||
| 1 | 2015-12-26 | md49_messages |
The md49_messages package
The md49_messages package
|
||
| 1 | 2015-12-26 | md49_serialport |
The md49_serialport package
The md49_serialport package
|
||
| 1 | mdm_example | ||||
| 1 | mdm_library | ||||
| 1 | mdm_topological_tools | ||||
| 1 | 2018-04-25 | mecanum_gazebo_plugin |
Plugin which uses directional friction to simulate mecanum wheels.
Plugin which uses directional friction to simulate mecanum wheels.
|
||
| 1 | 2014-03-24 | media_export |
Placeholder package enabling generic export of media paths.
Placeholder package enabling generic export of media paths.
|
||
| 1 | 2019-02-25 | melfa_description |
The melfa_description package
The melfa_description package
|
||
| 1 | 2019-02-25 | melfa_driver |
The melfa_driver package
The melfa_driver package
|
||
| 1 | 2019-02-25 | melfa_robot |
The melfa_robot meta package
The melfa_robot meta package
|
||
| 3 | 2019-02-01 | message_filters |
A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.
A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.
|
||
| 1 | 2016-04-28 | message_generation |
Package modeling the build-time dependencies for generating language bindings of messages.
Package modeling the build-time dependencies for generating language bindings of messages.
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2018-05-30 | marker_msgs |
The marker_msgs package contains messages usable to setup a marker/fiducial system.
The package distinguishes between two types of messages.
First messages to describe the properties of a marker/fiducial detection system and the detected markers.
Secondly messages used to represent a map of markers/features with covariances as it would be produced by a SLAM system or published by a map server for self-localization.
The marker_msgs package contains messages usable to setup a marker/fiducial system.
The package distinguishes between two types of messages.
First messages to describe the properties of a marker/fiducial detection system and the detected markers.
Secondly messages used to represent a map of markers/features with covariances as it would be produced by a SLAM system or published by a map server for self-localization.
|
||
| 1 | marker_rviz_plugin | ||||
| 1 | markov_decision_making | ||||
| 1 | 2016-07-21 | marshmallow |
A lightweight library for converting complex objects to and from simple Python datatypes.
A lightweight library for converting complex objects to and from simple Python datatypes.
|
||
| 1 | 2018-10-19 | marti_can_msgs |
marti_can_msgs
marti_can_msgs
|
||
| 1 | 2018-10-19 | marti_common_msgs |
marti_common_msgs
marti_common_msgs
|
||
| 1 | 2019-05-23 | marti_data_structures |
marti_data_structures
marti_data_structures
|
||
| 1 | 2018-10-19 | marti_nav_msgs |
marti_nav_msgs
marti_nav_msgs
|
||
| 1 | 2018-10-19 | marti_perception_msgs |
marti_perception_msgs
marti_perception_msgs
|
||
| 1 | 2018-10-19 | marti_sensor_msgs |
marti_sensor_msgs
marti_sensor_msgs
|
||
| 1 | 2018-10-19 | marti_status_msgs |
marti_status_msgs
marti_status_msgs
|
||
| 1 | 2018-10-19 | marti_visualization_msgs |
marti_visualization_msgs
marti_visualization_msgs
|
||
| 1 | 2018-03-15 | marvelmind_nav |
Marvelmind local navigation system
Marvelmind local navigation system
|
||
| 1 | 2019-04-30 | master_discovery_fkie |
Discover the running ROS Masters in local network. The
discovering is done by sending an echo heartbeat messages to a defined
multicast group.
The alternative is to use a zeroconf/avahi daemon to register the ROS
master as service and discover other ROS masters.
Discover the running ROS Masters in local network. The
discovering is done by sending an echo heartbeat messages to a defined
multicast group.
The alternative is to use a zeroconf/avahi daemon to register the ROS
master as service and discover other ROS masters.
|
||
| 1 | 2019-04-30 | master_sync_fkie |
Synchronize the local ROS master to the remote masters
discovered by master_discovery_fkie node. The registration
of topics and services is only perform by local ROS master.
Synchronize the local ROS master to the remote masters
discovered by master_discovery_fkie node. The registration
of topics and services is only perform by local ROS master.
|
||
| 1 | 2018-08-24 | mav_comm |
Contains messages and services for MAV communication
Contains messages and services for MAV communication
|
||
| 1 | 2018-08-24 | mav_msgs |
Package containing messages for communicating with rotary wing MAVs
Package containing messages for communicating with rotary wing MAVs
|
||
| 1 | 2018-08-24 | mav_planning_msgs |
Messages specific to MAV planning, especially polynomial planning.
Messages specific to MAV planning, especially polynomial planning.
|
||
| 1 | 2016-05-20 | mavlink |
MAVLink message marshaling library.
This package provides C-headers and pymavlink library
for both 1.0 and 2.0 versions of protocol.
MAVLink message marshaling library.
This package provides C-headers and pymavlink library
for both 1.0 and 2.0 versions of protocol.
|
||
| 1 | 2017-02-07 | mavros |
MAVROS -- MAVLink extendable communication node for ROS
with proxy for Ground Control Station.
MAVROS -- MAVLink extendable communication node for ROS
with proxy for Ground Control Station.
|
||
| 1 | 2017-02-07 | mavros_extras |
Extra nodes and plugins for
Extra nodes and plugins for
|
||
| 1 | 2017-02-07 | mavros_msgs |
mavros_msgs defines messages for
mavros_msgs defines messages for
|
||
| 1 | 2018-06-13 | maxwell |
Maxwell is a custom mobile manipulator. The Maxwell stack contains configuration, launch, and demo applications for the Maxwell robot.
Maxwell is a custom mobile manipulator. The Maxwell stack contains configuration, launch, and demo applications for the Maxwell robot.
|
||
| 1 | 2018-06-13 | maxwell_calibration |
Launch and configuration files for calibrating Maxwell using the 'robot_calibration' package.
Launch and configuration files for calibrating Maxwell using the 'robot_calibration' package.
|
||
| 1 | 2018-06-13 | maxwell_defs |
Maxwell is a custom mobile manipulator, this package contains his configuration and launch files.
Maxwell is a custom mobile manipulator, this package contains his configuration and launch files.
|
||
| 1 | 2018-06-13 | maxwell_moveit_config |
An automatically generated package with all the configuration and launch files for using the maxwell with the MoveIt Motion Planning Framework
An automatically generated package with all the configuration and launch files for using the maxwell with the MoveIt Motion Planning Framework
|
||
| 1 | 2018-06-13 | maxwell_navigation |
Navigation configuration for Maxwell.
Navigation configuration for Maxwell.
|
||
| 1 | 2018-11-13 | mbf_abstract_core |
This package provides common interfaces for navigation specific robot actions. It contains the AbstractPlanner, AbstractController and AbstractRecovery plugin interfaces. This interfaces have to be implemented by the plugins to make the plugin available for Move Base Flex. The abstract classes provides a meaningful interface enabling the planners, controllers and recovery behaviors to return information, e.g. why something went wrong. Derivided interfaces can, for example, provide methods to initialize the planner, controller or recovery with map representations like costmap_2d, grid_map or other representations.
This package provides common interfaces for navigation specific robot actions. It contains the AbstractPlanner, AbstractController and AbstractRecovery plugin interfaces. This interfaces have to be implemented by the plugins to make the plugin available for Move Base Flex. The abstract classes provides a meaningful interface enabling the planners, controllers and recovery behaviors to return information, e.g. why something went wrong. Derivided interfaces can, for example, provide methods to initialize the planner, controller or recovery with map representations like costmap_2d, grid_map or other representations.
|
||
| 1 | 2018-11-13 | mbf_abstract_nav |
The mbf_abstract_nav package contains the abstract navigation server implementation of Move Base Flex (MBF). The abstract navigation server is not bound to any map representation. It provides the actions for planning, controlling and recovering. MBF loads all defined plugins at the program start. Therefor, it loads all plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions.
The mbf_abstract_nav package contains the abstract navigation server implementation of Move Base Flex (MBF). The abstract navigation server is not bound to any map representation. It provides the actions for planning, controlling and recovering. MBF loads all defined plugins at the program start. Therefor, it loads all plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions.
|
||
| 1 | 2018-11-13 | mbf_costmap_core |
This package provides common interfaces for navigation specific robot actions. It contains the CostmapPlanner, CostmapController and CostmapRecovery interfaces. The interfaces have to be implemented by the plugins to make them available for Move Base Flex using the mbf_costmap_nav navigation implementation. That implementation inherits the mbf_abstract_nav implementation and binds the system to a local and a global costmap.
This package provides common interfaces for navigation specific robot actions. It contains the CostmapPlanner, CostmapController and CostmapRecovery interfaces. The interfaces have to be implemented by the plugins to make them available for Move Base Flex using the mbf_costmap_nav navigation implementation. That implementation inherits the mbf_abstract_nav implementation and binds the system to a local and a global costmap.
|
||
| 1 | 2018-11-13 | mbf_costmap_nav |
The mbf_costmap_nav package contains the costmap navigation server implementation of Move Base Flex (MBF). The costmap navigation server is bound to the
The mbf_costmap_nav package contains the costmap navigation server implementation of Move Base Flex (MBF). The costmap navigation server is bound to the
|
||
| 1 | 2018-11-13 | mbf_msgs |
The move_base_flex messages package providing the action definition files for the action GetPath, ExePath, Recovery and MoveBase. The action servers providing these action are implemented in
The move_base_flex messages package providing the action definition files for the action GetPath, ExePath, Recovery and MoveBase. The action servers providing these action are implemented in
|
||
| 1 | 2018-11-13 | mbf_simple_nav |
The mbf_simple_nav package contains a simple navigation server implementation of Move Base Flex (MBF). The simple navigation server is bound to no map representation. It provides actions for planning, controlling and recovering. MBF loads all defined plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions.
It tries to load the defined plugins which implements the defined interfaces in
The mbf_simple_nav package contains a simple navigation server implementation of Move Base Flex (MBF). The simple navigation server is bound to no map representation. It provides actions for planning, controlling and recovering. MBF loads all defined plugins which are defined in the lists *planners*, *controllers* and *recovery_behaviors*. Each list holds a pair of a *name* and a *type*. The *type* defines which kind of plugin to load. The *name* defines under which name the plugin should be callable by the actions.
It tries to load the defined plugins which implements the defined interfaces in
|
||
| 1 | 2018-11-13 | mbf_utility |
The mbf_utility package
The mbf_utility package
|
||
| 1 | 2019-05-23 | mcl_3dl |
3-D/6-DOF localization for mobile robots with 3-D LIDAR(s)
3-D/6-DOF localization for mobile robots with 3-D LIDAR(s)
|
||
| 1 | 2019-05-23 | mcl_3dl_msgs |
The mcl_3dl message definition package
The mcl_3dl message definition package
|
||
| 1 | mcmillan_airfield | ||||
| 1 | 2015-12-26 | md49_base_controller |
The md49_base_controller package
The md49_base_controller package
|
||
| 1 | 2015-12-26 | md49_messages |
The md49_messages package
The md49_messages package
|
||
| 1 | 2015-12-26 | md49_serialport |
The md49_serialport package
The md49_serialport package
|
||
| 1 | mdm_example | ||||
| 1 | mdm_library | ||||
| 1 | mdm_topological_tools | ||||
| 1 | 2017-05-08 | mecanum_gazebo_plugin |
Plugin which uses directional friction to simulate mecanum wheels.
Plugin which uses directional friction to simulate mecanum wheels.
|
||
| 1 | 2014-03-24 | media_export |
Placeholder package enabling generic export of media paths.
Placeholder package enabling generic export of media paths.
|
||
| 1 | melfa_description | ||||
| 1 | melfa_driver | ||||
| 1 | melfa_robot | ||||
| 3 | 2017-03-06 | message_filters |
A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.
A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.
|
||
| 1 | 2013-08-21 | message_generation |
Package modeling the build-time dependencies for generating language bindings of messages.
Package modeling the build-time dependencies for generating language bindings of messages.
|
Packages
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | 2018-05-30 | marker_msgs |
The marker_msgs package contains messages usable to setup a marker/fiducial system.
The package distinguishes between two types of messages.
First messages to describe the properties of a marker/fiducial detection system and the detected markers.
Secondly messages used to represent a map of markers/features with covariances as it would be produced by a SLAM system or published by a map server for self-localization.
The marker_msgs package contains messages usable to setup a marker/fiducial system.
The package distinguishes between two types of messages.
First messages to describe the properties of a marker/fiducial detection system and the detected markers.
Secondly messages used to represent a map of markers/features with covariances as it would be produced by a SLAM system or published by a map server for self-localization.
|
||
| 1 | 2016-11-06 | marker_rviz_plugin |
The marker_rviz_plugin package contains RViz plugins to visualize messages of the marker_msgs package using RViz.
The marker_rviz_plugin package contains RViz plugins to visualize messages of the marker_msgs package using RViz.
|
||
| 1 | markov_decision_making | ||||
| 1 | 2016-07-21 | marshmallow |
A lightweight library for converting complex objects to and from simple Python datatypes.
A lightweight library for converting complex objects to and from simple Python datatypes.
|
||
| 1 | 2018-10-19 | marti_can_msgs |
marti_can_msgs
marti_can_msgs
|
||
| 1 | 2018-10-19 | marti_common_msgs |
marti_common_msgs
marti_common_msgs
|
||
| 1 | 2019-05-23 | marti_data_structures |
marti_data_structures
marti_data_structures
|
||
| 1 | 2018-10-19 | marti_nav_msgs |
marti_nav_msgs
marti_nav_msgs
|
||
| 1 | 2018-10-19 | marti_perception_msgs |
marti_perception_msgs
marti_perception_msgs
|
||
| 1 | 2018-10-19 | marti_sensor_msgs |
marti_sensor_msgs
marti_sensor_msgs
|
||
| 1 | 2018-10-19 | marti_status_msgs |
marti_status_msgs
marti_status_msgs
|
||
| 1 | 2018-10-19 | marti_visualization_msgs |
marti_visualization_msgs
marti_visualization_msgs
|
||
| 1 | marvelmind_nav | ||||
| 1 | 2017-04-24 | master_discovery_fkie |
Discover the running ROS Masters in local network. The
discovering is done by sending an echo heartbeat messages to a defined
multicast group.
The alternative is to use a zeroconf/avahi daemon to register the ROS
master as service and discover other ROS masters.
Discover the running ROS Masters in local network. The
discovering is done by sending an echo heartbeat messages to a defined
multicast group.
The alternative is to use a zeroconf/avahi daemon to register the ROS
master as service and discover other ROS masters.
|
||
| 1 | 2017-04-24 | master_sync_fkie |
Synchronize the local ROS master to the remote masters
discovered by master_discovery_fkie node. The registration
of topics and services is only perform by local ROS master.
Synchronize the local ROS master to the remote masters
discovered by master_discovery_fkie node. The registration
of topics and services is only perform by local ROS master.
|
||
| 1 | 2018-08-24 | mav_comm |
Contains messages and services for MAV communication
Contains messages and services for MAV communication
|
||
| 1 | 2018-08-24 | mav_msgs |
Package containing messages for communicating with rotary wing MAVs
Package containing messages for communicating with rotary wing MAVs
|
||
| 1 | 2018-08-24 | mav_planning_msgs |
Messages specific to MAV planning, especially polynomial planning.
Messages specific to MAV planning, especially polynomial planning.
|
||
| 1 | 2016-05-20 | mavlink |
MAVLink message marshaling library.
This package provides C-headers and pymavlink library
for both 1.0 and 2.0 versions of protocol.
MAVLink message marshaling library.
This package provides C-headers and pymavlink library
for both 1.0 and 2.0 versions of protocol.
|
||
| 1 | 2017-02-07 | mavros |
MAVROS -- MAVLink extendable communication node for ROS
with proxy for Ground Control Station.
MAVROS -- MAVLink extendable communication node for ROS
with proxy for Ground Control Station.
|
||
| 1 | 2017-02-07 | mavros_extras |
Extra nodes and plugins for
Extra nodes and plugins for
|
||
| 1 | 2017-02-07 | mavros_msgs |
mavros_msgs defines messages for
mavros_msgs defines messages for
|
||
| 1 | maxwell | ||||
| 1 | maxwell_calibration | ||||
| 1 | maxwell_defs | ||||
| 1 | maxwell_moveit_config | ||||
| 1 | maxwell_navigation | ||||
| 1 | mbf_abstract_core | ||||
| 1 | mbf_abstract_nav | ||||
| 1 | mbf_costmap_core | ||||
| 1 | mbf_costmap_nav | ||||
| 1 | mbf_msgs | ||||
| 1 | mbf_simple_nav | ||||
| 1 | mbf_utility | ||||
| 1 | mcl_3dl | ||||
| 1 | mcl_3dl_msgs | ||||
| 1 | mcmillan_airfield | ||||
| 1 | 2015-12-26 | md49_base_controller |
The md49_base_controller package
The md49_base_controller package
|
||
| 1 | 2015-12-26 | md49_messages |
The md49_messages package
The md49_messages package
|
||
| 1 | 2015-12-26 | md49_serialport |
The md49_serialport package
The md49_serialport package
|
||
| 1 | mdm_example | ||||
| 1 | mdm_library | ||||
| 1 | mdm_topological_tools | ||||
| 1 | mecanum_gazebo_plugin | ||||
| 1 | 2014-03-24 | media_export |
Placeholder package enabling generic export of media paths.
Placeholder package enabling generic export of media paths.
|
||
| 1 | melfa_description | ||||
| 1 | melfa_driver | ||||
| 1 | melfa_robot | ||||
| 3 | 2017-03-06 | message_filters |
A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.
A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.
|
||
| 1 | 2015-04-22 | message_generation |
Package modeling the build-time dependencies for generating language bindings of messages.
Package modeling the build-time dependencies for generating language bindings of messages.
|
Packages
| Name | Description | ||||
|---|---|---|---|---|---|
| 1 | marker_msgs | ||||
| 1 | marker_rviz_plugin | ||||
| 1 | 2016-08-15 | markov_decision_making |
Markov Decision Making (MDM) is a ROS library for robot decision-making based on MDPs.
This metapackage contains: the Markov Decision Making Library itself (mdm_library),
the auxiliary packages Predicate Manager (predicate_manager) and Topological Tools (topological_tools),
and an example application of MDM (mdm_example)
Markov Decision Making (MDM) is a ROS library for robot decision-making based on MDPs.
This metapackage contains: the Markov Decision Making Library itself (mdm_library),
the auxiliary packages Predicate Manager (predicate_manager) and Topological Tools (topological_tools),
and an example application of MDM (mdm_example)
|
||
| 1 | marshmallow | ||||
| 1 | marti_can_msgs | ||||
| 1 | marti_common_msgs | ||||
| 1 | 2016-10-14 | marti_data_structures |
marti_data_structures
marti_data_structures
|
||
| 1 | marti_nav_msgs | ||||
| 1 | marti_perception_msgs | ||||
| 1 | marti_sensor_msgs | ||||
| 1 | marti_status_msgs | ||||
| 1 | marti_visualization_msgs | ||||
| 1 | marvelmind_nav | ||||
| 1 | 2015-04-27 | master_discovery_fkie |
Discover the running ROS Masters in local network. The
discovering is done by sending an echo heartbeat messages to a defined
multicast group.
The alternative is to use a zeroconf/avahi daemon to register the ROS
master as service and discover other ROS masters.
Discover the running ROS Masters in local network. The
discovering is done by sending an echo heartbeat messages to a defined
multicast group.
The alternative is to use a zeroconf/avahi daemon to register the ROS
master as service and discover other ROS masters.
|
||
| 1 | 2015-04-27 | master_sync_fkie |
Synchronize the local ROS master to the remote masters
discovered by master_discovery_fkie node. The registration
of topics and services is only perform by local ROS master.
Synchronize the local ROS master to the remote masters
discovered by master_discovery_fkie node. The registration
of topics and services is only perform by local ROS master.
|
||
| 1 | mav_comm | ||||
| 1 | mav_msgs | ||||
| 1 | mav_planning_msgs | ||||
| 1 | 2015-10-09 | mavlink |
MAVLink message marshaling library.
This package provides C-headers and pymavlink library.
MAVLink message marshaling library.
This package provides C-headers and pymavlink library.
|
||
| 1 | 2015-03-04 | mavros |
MAVROS -- MAVLink extendable communication node for ROS
with UDP proxy for Ground Control Station.
MAVROS -- MAVLink extendable communication node for ROS
with UDP proxy for Ground Control Station.
|
||
| 1 | 2015-03-04 | mavros_extras |
Extra nodes and plugins for mavros
Extra nodes and plugins for mavros
|
||
| 1 | mavros_msgs | ||||
| 1 | maxwell | ||||
| 1 | maxwell_calibration | ||||
| 1 | maxwell_defs | ||||
| 1 | maxwell_moveit_config | ||||
| 1 | maxwell_navigation | ||||
| 1 | mbf_abstract_core | ||||
| 1 | mbf_abstract_nav | ||||
| 1 | mbf_costmap_core | ||||
| 1 | mbf_costmap_nav | ||||
| 1 | mbf_msgs | ||||
| 1 | mbf_simple_nav | ||||
| 1 | mbf_utility | ||||
| 1 | mcl_3dl | ||||
| 1 | mcl_3dl_msgs | ||||
| 1 | mcmillan_airfield | ||||
| 1 | md49_base_controller | ||||
| 1 | md49_messages | ||||
| 1 | md49_serialport | ||||
| 1 | 2016-08-15 | mdm_example |
An example application of the MDM bundle
An example application of the MDM bundle
|
||
| 1 | 2016-08-15 | mdm_library |
This is the core package of the Markov Decision Making Library.
This is the core package of the Markov Decision Making Library.
|
||
| 1 | 2016-08-15 | mdm_topological_tools |
The mdm_topological_tools package contains utilities to ease the deployment
of the MDM Library in topological navigation problems.
The mdm_topological_tools package contains utilities to ease the deployment
of the MDM Library in topological navigation problems.
|
||
| 1 | mecanum_gazebo_plugin | ||||
| 1 | 2013-08-15 | media_export |
Placeholder package enabling generic export of media paths.
Placeholder package enabling generic export of media paths.
|
||
| 1 | melfa_description | ||||
| 1 | melfa_driver | ||||
| 1 | melfa_robot | ||||
| 3 | 2014-12-22 | message_filters |
A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.
A set of message filters which take in messages and may output those messages at a later time, based on the conditions that filter needs met.
|
||
| 1 | 2013-08-21 | message_generation |
Package modeling the build-time dependencies for generating language bindings of messages.
Package modeling the build-time dependencies for generating language bindings of messages.
|