Packages

Name Description
1 2019-03-13 nav2_navfn_planner
TODO
TODO
 
1 nav2_navigation
1 nav2_platform
1 2019-03-13 nav2_robot
TODO
TODO
 
1 2019-03-13 nav2_simple_navigator
TODO
TODO
 
1 2019-03-13 nav2_system_tests
TODO
TODO
 
1 2019-03-13 nav2_tasks
TODO
TODO
 
1 2019-03-13 nav2_turtlebot3_rl
This package enables Reinfocement Learning with Gazebo and Turtlebot3
This package enables Reinfocement Learning with Gazebo and Turtlebot3
 
1 2019-03-13 nav2_util
TODO
TODO
 
1 2019-03-13 nav2_voxel_grid
voxel_grid provides an implementation of an efficient 3D voxel grid. The occupancy grid can support 3 different representations for the state of a cell: marked, free, or unknown. Due to the underlying implementation relying on bitwise and and or integer operations, the voxel grid only supports 16 different levels per voxel column. However, this limitation yields raytracing and cell marking performance in the grid comparable to standard 2D structures making it quite fast compared to most 3D structures.
voxel_grid provides an implementation of an efficient 3D voxel grid. The occupancy grid can support 3 different representations for the state of a cell: marked, free, or unknown. Due to the underlying implementation relying on bitwise and and or integer operations, the voxel grid only supports 16 different levels per voxel column. However, this limitation yields raytracing and cell marking performance in the grid comparable to standard 2D structures making it quite fast compared to most 3D structures.
 
1 2019-03-13 nav2_world_model
TODO
TODO
 
1 nav2d
1 nav2d_exploration
1 nav2d_karto
1 nav2d_localizer
1 nav2d_msgs
1 nav2d_navigator
1 nav2d_operator
1 nav2d_remote
1 nav2d_tutorials
2 2019-03-13 nav_2d_msgs
Basic message types for two dimensional navigation, extending from geometry_msgs::Pose2D.
Basic message types for two dimensional navigation, extending from geometry_msgs::Pose2D.
 
2 2019-03-13 nav_2d_utils
A handful of useful utility functions for nav_2d packages.
A handful of useful utility functions for nav_2d packages.
 
2 nav_core
1 nav_core2
1 nav_core_adapter
1 nav_grid
1 nav_grid_iterators
1 nav_grid_pub_sub
1 nav_layer_from_points
2 2018-12-06 nav_msgs
A package containing some navigation related message and service definitions.
A package containing some navigation related message and service definitions.
 
1 nav_pcontroller
2 navfn
2 navigation
1 2019-03-13 navigation2
ROS2 Navigation Stack
ROS2 Navigation Stack
 
1 navigation_experimental
1 navigation_layers
1 navigation_stage
1 navigation_tutorials
1 ncd_parser
0 ndds-tools
1 ndt_costmap
1 ndt_feature_reg
1 ndt_fuser
1 ndt_map
1 ndt_map_builder
1 ndt_mcl
1 ndt_registration
1 ndt_rviz_visualisation
1 ndt_visualisation
1 neato_2dnav

Packages

Name Description
1 nav2_navfn_planner
1 nav2_navigation
1 nav2_platform
1 nav2_robot
1 nav2_simple_navigator
1 nav2_system_tests
1 nav2_tasks
1 nav2_turtlebot3_rl
1 nav2_util
1 nav2_voxel_grid
1 nav2_world_model
1 2019-03-28 nav2d
Meta-Package containing modules for 2D-Navigation
Meta-Package containing modules for 2D-Navigation
 
1 2019-03-28 nav2d_exploration
This package holds a collection of plugins for the RobotNavigator, that provide different cooperative exploration strategies for a team of mobile robots.
This package holds a collection of plugins for the RobotNavigator, that provide different cooperative exploration strategies for a team of mobile robots.
 
1 2019-03-28 nav2d_karto
Graph-based Simultaneous Localization and Mapping module. Includes OpenKarto GraphSLAM library by "SRI International".
Graph-based Simultaneous Localization and Mapping module. Includes OpenKarto GraphSLAM library by "SRI International".
 
1 2019-03-28 nav2d_localizer
Wrapper around Particle Filter implementation. The SelfLocalizer can be used as library or as a ros-node.
Wrapper around Particle Filter implementation. The SelfLocalizer can be used as library or as a ros-node.
 
1 2019-03-28 nav2d_msgs
Messages used for 2D-Navigation.
Messages used for 2D-Navigation.
 
1 2019-03-28 nav2d_navigator
This package provides a node for higher level navigation of a mobile robot in a planar environment. It needs a map and the robot's position within this map to create a plan for navigation. When used together with a SLAM module it can also be used to perform autonomous exploration of the robot's workspace.
This package provides a node for higher level navigation of a mobile robot in a planar environment. It needs a map and the robot's position within this map to create a plan for navigation. When used together with a SLAM module it can also be used to perform autonomous exploration of the robot's workspace.
 
1 2019-03-28 nav2d_operator
The operator is a lightweight, purely reactive obstacle-avoidance module for mobile robots moving in a planar environment. The operator node works by evaluating a set of predefined motion primitives based on a local costmap and a desired direction. The best evaluated motion command will be send to the mobile base.
The operator is a lightweight, purely reactive obstacle-avoidance module for mobile robots moving in a planar environment. The operator node works by evaluating a set of predefined motion primitives based on a local costmap and a desired direction. The best evaluated motion command will be send to the mobile base.
 
1 2019-03-28 nav2d_remote
This package is used to manually control a robot that uses the operator and navigator node from navigation_2d. Currently there is one node to control one robot with a joystick and one to control multiple robots in simulation. It can send commands directly to the operator or start and stop navigator actions.
This package is used to manually control a robot that uses the operator and navigator node from navigation_2d. Currently there is one node to control one robot with a joystick and one to control multiple robots in simulation. It can send commands directly to the operator or start and stop navigator actions.
 
1 2019-03-28 nav2d_tutorials
Contains a set of tutorials that run 2D-Navigation within Stage-Simulator.
Contains a set of tutorials that run 2D-Navigation within Stage-Simulator.
 
2 2019-02-12 nav_2d_msgs
Basic message types for two dimensional navigation, extending from geometry_msgs::Pose2D.
Basic message types for two dimensional navigation, extending from geometry_msgs::Pose2D.
 
2 2019-02-12 nav_2d_utils
A handful of useful utility functions for nav_core2 packages.
A handful of useful utility functions for nav_core2 packages.
 
2 2019-04-28 nav_core
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
 
1 2019-02-12 nav_core2
Interfaces for Costmap, LocalPlanner and GlobalPlanner. Replaces nav_core.
Interfaces for Costmap, LocalPlanner and GlobalPlanner. Replaces nav_core.
 
1 2019-02-12 nav_core_adapter
This package contains adapters for using `nav_core` plugins as `nav_core2` plugins and vice versa (more or less). See README.md for more information.
This package contains adapters for using `nav_core` plugins as `nav_core2` plugins and vice versa (more or less). See README.md for more information.
 
1 2019-02-12 nav_grid
A templatized interface for overlaying a two dimensional grid on the world.
A templatized interface for overlaying a two dimensional grid on the world.
 
1 2019-02-12 nav_grid_iterators
Iterator implementations for moving around the cells of a nav_grid in a number of common patterns.
Iterator implementations for moving around the cells of a nav_grid in a number of common patterns.
 
1 2019-02-12 nav_grid_pub_sub
Publishers and Subscribers for nav_grid data.
Publishers and Subscribers for nav_grid data.
 
1 nav_layer_from_points
2 2018-11-08 nav_msgs
nav_msgs defines the common messages used to interact with the
nav_msgs defines the common messages used to interact with the
 
1 nav_pcontroller
2 2019-04-28 navfn
navfn provides a fast interpolated navigation function that can be used to create plans for a mobile base. The planner assumes a circular robot and operates on a costmap to find a minimum cost plan from a start point to an end point in a grid. The navigation function is computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the nav_core::BaseGlobalPlanner interface specified in
navfn provides a fast interpolated navigation function that can be used to create plans for a mobile base. The planner assumes a circular robot and operates on a costmap to find a minimum cost plan from a start point to an end point in a grid. The navigation function is computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the nav_core::BaseGlobalPlanner interface specified in
 
2 2019-04-28 navigation
A 2D navigation stack that takes in information from odometry, sensor streams, and a goal pose and outputs safe velocity commands that are sent to a mobile base.
A 2D navigation stack that takes in information from odometry, sensor streams, and a goal pose and outputs safe velocity commands that are sent to a mobile base.
 
1 navigation2
1 2019-03-26 navigation_experimental
A collection of navigation plugins and tools: Various recovery behaviors, local and global planner plugins for move_base, a teleop filter for obstacle avoidance, a simple control-based move_base replacement etc.
A collection of navigation plugins and tools: Various recovery behaviors, local and global planner plugins for move_base, a teleop filter for obstacle avoidance, a simple control-based move_base replacement etc.
 
1 2018-08-31 navigation_layers
Extra navigation layers.
Extra navigation layers.
 
1 navigation_stage
1 navigation_tutorials
1 ncd_parser
0 ndds-tools
1 ndt_costmap
1 ndt_feature_reg
1 ndt_fuser
1 ndt_map
1 ndt_map_builder
1 ndt_mcl
1 ndt_registration
1 ndt_rviz_visualisation
1 ndt_visualisation
1 neato_2dnav

Packages

Name Description
1 nav2_navfn_planner
1 nav2_navigation
1 nav2_platform
1 nav2_robot
1 nav2_simple_navigator
1 nav2_system_tests
1 nav2_tasks
1 nav2_turtlebot3_rl
1 nav2_util
1 nav2_voxel_grid
1 nav2_world_model
1 2018-09-07 nav2d
Meta-Package containing modules for 2D-Navigation
Meta-Package containing modules for 2D-Navigation
 
1 2018-09-07 nav2d_exploration
This package holds a collection of plugins for the RobotNavigator, that provide different cooperative exploration strategies for a team of mobile robots.
This package holds a collection of plugins for the RobotNavigator, that provide different cooperative exploration strategies for a team of mobile robots.
 
1 2018-09-07 nav2d_karto
Graph-based Simultaneous Localization and Mapping module. Includes OpenKarto GraphSLAM library by "SRI International".
Graph-based Simultaneous Localization and Mapping module. Includes OpenKarto GraphSLAM library by "SRI International".
 
1 2018-09-07 nav2d_localizer
Wrapper around Particle Filter implementation. The SelfLocalizer can be used as library or as a ros-node.
Wrapper around Particle Filter implementation. The SelfLocalizer can be used as library or as a ros-node.
 
1 2018-09-07 nav2d_msgs
Messages used for 2D-Navigation.
Messages used for 2D-Navigation.
 
1 2018-09-07 nav2d_navigator
This package provides a node for higher level navigation of a mobile robot in a planar environment. It needs a map and the robot's position within this map to create a plan for navigation. When used together with a SLAM module it can also be used to perform autonomous exploration of the robot's workspace.
This package provides a node for higher level navigation of a mobile robot in a planar environment. It needs a map and the robot's position within this map to create a plan for navigation. When used together with a SLAM module it can also be used to perform autonomous exploration of the robot's workspace.
 
1 2018-09-07 nav2d_operator
The operator is a lightweight, purely reactive obstacle-avoidance module for mobile robots moving in a planar environment. The operator node works by evaluating a set of predefined motion primitives based on a local costmap and a desired direction. The best evaluated motion command will be send to the mobile base.
The operator is a lightweight, purely reactive obstacle-avoidance module for mobile robots moving in a planar environment. The operator node works by evaluating a set of predefined motion primitives based on a local costmap and a desired direction. The best evaluated motion command will be send to the mobile base.
 
1 2018-09-07 nav2d_remote
This package is used to manually control a robot that uses the operator and navigator node from navigation_2d. Currently there is one node to control one robot with a joystick and one to control multiple robots in simulation. It can send commands directly to the operator or start and stop navigator actions.
This package is used to manually control a robot that uses the operator and navigator node from navigation_2d. Currently there is one node to control one robot with a joystick and one to control multiple robots in simulation. It can send commands directly to the operator or start and stop navigator actions.
 
1 2018-09-07 nav2d_tutorials
Contains a set of tutorials that run 2D-Navigation within Stage-Simulator.
Contains a set of tutorials that run 2D-Navigation within Stage-Simulator.
 
2 2019-05-24 nav_2d_msgs
Basic message types for two dimensional navigation, extending from geometry_msgs::Pose2D.
Basic message types for two dimensional navigation, extending from geometry_msgs::Pose2D.
 
2 2019-05-24 nav_2d_utils
A handful of useful utility functions for nav_core2 packages.
A handful of useful utility functions for nav_core2 packages.
 
2 2019-02-28 nav_core
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
 
1 2019-05-24 nav_core2
Interfaces for Costmap, LocalPlanner and GlobalPlanner. Replaces nav_core.
Interfaces for Costmap, LocalPlanner and GlobalPlanner. Replaces nav_core.
 
1 2019-05-24 nav_core_adapter
This package contains adapters for using `nav_core` plugins as `nav_core2` plugins and vice versa (more or less). See README.md for more information.
This package contains adapters for using `nav_core` plugins as `nav_core2` plugins and vice versa (more or less). See README.md for more information.
 
1 2019-05-24 nav_grid
A templatized interface for overlaying a two dimensional grid on the world.
A templatized interface for overlaying a two dimensional grid on the world.
 
1 2019-05-24 nav_grid_iterators
Iterator implementations for moving around the cells of a nav_grid in a number of common patterns.
Iterator implementations for moving around the cells of a nav_grid in a number of common patterns.
 
1 2019-05-24 nav_grid_pub_sub
Publishers and Subscribers for nav_grid data.
Publishers and Subscribers for nav_grid data.
 
1 nav_layer_from_points
2 2018-11-08 nav_msgs
nav_msgs defines the common messages used to interact with the
nav_msgs defines the common messages used to interact with the
 
1 2018-07-02 nav_pcontroller
Simple P-Controller for a holonomic robot base
Simple P-Controller for a holonomic robot base
 
2 2019-02-28 navfn
navfn provides a fast interpolated navigation function that can be used to create plans for a mobile base. The planner assumes a circular robot and operates on a costmap to find a minimum cost plan from a start point to an end point in a grid. The navigation function is computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the nav_core::BaseGlobalPlanner interface specified in
navfn provides a fast interpolated navigation function that can be used to create plans for a mobile base. The planner assumes a circular robot and operates on a costmap to find a minimum cost plan from a start point to an end point in a grid. The navigation function is computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the nav_core::BaseGlobalPlanner interface specified in
 
2 2019-02-28 navigation
A 2D navigation stack that takes in information from odometry, sensor streams, and a goal pose and outputs safe velocity commands that are sent to a mobile base.
A 2D navigation stack that takes in information from odometry, sensor streams, and a goal pose and outputs safe velocity commands that are sent to a mobile base.
 
1 navigation2
1 2019-03-26 navigation_experimental
A collection of navigation plugins and tools: Various recovery behaviors, local and global planner plugins for move_base, a teleop filter for obstacle avoidance, a simple control-based move_base replacement etc.
A collection of navigation plugins and tools: Various recovery behaviors, local and global planner plugins for move_base, a teleop filter for obstacle avoidance, a simple control-based move_base replacement etc.
 
1 navigation_layers
1 navigation_stage
1 navigation_tutorials
1 ncd_parser
0 ndds-tools
1 ndt_costmap
1 ndt_feature_reg
1 ndt_fuser
1 ndt_map
1 ndt_map_builder
1 ndt_mcl
1 ndt_registration
1 ndt_rviz_visualisation
1 ndt_visualisation
1 neato_2dnav

Packages

Name Description
1 nav2_navfn_planner
1 nav2_navigation
1 nav2_platform
1 nav2_robot
1 nav2_simple_navigator
1 nav2_system_tests
1 nav2_tasks
1 nav2_turtlebot3_rl
1 nav2_util
1 nav2_voxel_grid
1 nav2_world_model
1 2017-11-01 nav2d
Meta-Package containing modules for 2D-Navigation
Meta-Package containing modules for 2D-Navigation
 
1 2017-11-01 nav2d_exploration
This package holds a collection of plugins for the RobotNavigator, that provide different cooperative exploration strategies for a team of mobile robots.
This package holds a collection of plugins for the RobotNavigator, that provide different cooperative exploration strategies for a team of mobile robots.
 
1 2017-11-01 nav2d_karto
Graph-based Simultaneous Localization and Mapping module. Includes OpenKarto GraphSLAM library by "SRI International".
Graph-based Simultaneous Localization and Mapping module. Includes OpenKarto GraphSLAM library by "SRI International".
 
1 2017-11-01 nav2d_localizer
Wrapper around Particle Filter implementation. The SelfLocalizer can be used as library or as a ros-node.
Wrapper around Particle Filter implementation. The SelfLocalizer can be used as library or as a ros-node.
 
1 2017-11-01 nav2d_msgs
Messages used for 2D-Navigation.
Messages used for 2D-Navigation.
 
1 2017-11-01 nav2d_navigator
This package provides a node for higher level navigation of a mobile robot in a planar environment. It needs a map and the robot's position within this map to create a plan for navigation. When used together with a SLAM module it can also be used to perform autonomous exploration of the robot's workspace.
This package provides a node for higher level navigation of a mobile robot in a planar environment. It needs a map and the robot's position within this map to create a plan for navigation. When used together with a SLAM module it can also be used to perform autonomous exploration of the robot's workspace.
 
1 2017-11-01 nav2d_operator
The operator is a lightweight, purely reactive obstacle-avoidance module for mobile robots moving in a planar environment. The operator node works by evaluating a set of predefined motion primitives based on a local costmap and a desired direction. The best evaluated motion command will be send to the mobile base.
The operator is a lightweight, purely reactive obstacle-avoidance module for mobile robots moving in a planar environment. The operator node works by evaluating a set of predefined motion primitives based on a local costmap and a desired direction. The best evaluated motion command will be send to the mobile base.
 
1 2017-11-01 nav2d_remote
This package is used to manually control a robot that uses the operator and navigator node from navigation_2d. Currently there is one node to control one robot with a joystick and one to control multiple robots in simulation. It can send commands directly to the operator or start and stop navigator actions.
This package is used to manually control a robot that uses the operator and navigator node from navigation_2d. Currently there is one node to control one robot with a joystick and one to control multiple robots in simulation. It can send commands directly to the operator or start and stop navigator actions.
 
1 2017-11-01 nav2d_tutorials
Contains a set of tutorials that run 2D-Navigation within Stage-Simulator.
Contains a set of tutorials that run 2D-Navigation within Stage-Simulator.
 
2 2019-05-24 nav_2d_msgs
Basic message types for two dimensional navigation, extending from geometry_msgs::Pose2D.
Basic message types for two dimensional navigation, extending from geometry_msgs::Pose2D.
 
2 2019-05-24 nav_2d_utils
A handful of useful utility functions for nav_core2 packages.
A handful of useful utility functions for nav_core2 packages.
 
2 2016-12-06 nav_core
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
 
1 2019-05-24 nav_core2
Interfaces for Costmap, LocalPlanner and GlobalPlanner. Replaces nav_core.
Interfaces for Costmap, LocalPlanner and GlobalPlanner. Replaces nav_core.
 
1 2019-05-24 nav_core_adapter
This package contains adapters for using `nav_core` plugins as `nav_core2` plugins and vice versa (more or less). See README.md for more information.
This package contains adapters for using `nav_core` plugins as `nav_core2` plugins and vice versa (more or less). See README.md for more information.
 
1 2019-05-24 nav_grid
A templatized interface for overlaying a two dimensional grid on the world.
A templatized interface for overlaying a two dimensional grid on the world.
 
1 2019-05-24 nav_grid_iterators
Iterator implementations for moving around the cells of a nav_grid in a number of common patterns.
Iterator implementations for moving around the cells of a nav_grid in a number of common patterns.
 
1 2019-05-24 nav_grid_pub_sub
Publishers and Subscribers for nav_grid data.
Publishers and Subscribers for nav_grid data.
 
1 2019-03-21 nav_layer_from_points
Plugin-based layers for the navigation software.
Plugin-based layers for the navigation software.
 
2 2018-11-08 nav_msgs
nav_msgs defines the common messages used to interact with the
nav_msgs defines the common messages used to interact with the
 
1 2018-07-02 nav_pcontroller
Simple P-Controller for a holonomic robot base
Simple P-Controller for a holonomic robot base
 
2 2016-12-06 navfn
navfn provides a fast interpolated navigation function that can be used to create plans for a mobile base. The planner assumes a circular robot and operates on a costmap to find a minimum cost plan from a start point to an end point in a grid. The navigation function is computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the nav_core::BaseGlobalPlanner interface specified in
navfn provides a fast interpolated navigation function that can be used to create plans for a mobile base. The planner assumes a circular robot and operates on a costmap to find a minimum cost plan from a start point to an end point in a grid. The navigation function is computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the nav_core::BaseGlobalPlanner interface specified in
 
2 2016-12-06 navigation
A 2D navigation stack that takes in information from odometry, sensor streams, and a goal pose and outputs safe velocity commands that are sent to a mobile base.
A 2D navigation stack that takes in information from odometry, sensor streams, and a goal pose and outputs safe velocity commands that are sent to a mobile base.
 
1 navigation2
1 2019-03-26 navigation_experimental
A collection of navigation plugins and tools: Various recovery behaviors, local and global planner plugins for move_base, a teleop filter for obstacle avoidance, a simple control-based move_base replacement etc.
A collection of navigation plugins and tools: Various recovery behaviors, local and global planner plugins for move_base, a teleop filter for obstacle avoidance, a simple control-based move_base replacement etc.
 
1 2018-08-31 navigation_layers
Extra navigation layers.
Extra navigation layers.
 
1 2016-03-24 navigation_stage
This package holds example launch files for running the ROS navigation stack in stage.
This package holds example launch files for running the ROS navigation stack in stage.
 
1 2016-03-24 navigation_tutorials
Navigation related tutorials.
Navigation related tutorials.
 
1 2018-06-03 ncd_parser
The ncd_parser package reads in .alog data files from the New College Dataset and broadcasts scan and odometry messages to ROS.
The ncd_parser package reads in .alog data files from the New College Dataset and broadcasts scan and odometry messages to ROS.
 
0 ndds-tools
1 ndt_costmap
1 ndt_feature_reg
1 ndt_fuser
1 ndt_map
1 ndt_map_builder
1 ndt_mcl
1 ndt_registration
1 ndt_rviz_visualisation
1 ndt_visualisation
1 neato_2dnav

Packages

Name Description
1 nav2_navfn_planner
1 2014-09-13 nav2_navigation
ROS navigation config and launch files for Nav2 Robot Platform
ROS navigation config and launch files for Nav2 Robot Platform
 
1 2014-09-13 nav2_platform
ROS stack containing all nodes, config, and launch files for Nav2 mobile robotics platform.
ROS stack containing all nodes, config, and launch files for Nav2 mobile robotics platform.
 
1 nav2_robot
1 nav2_simple_navigator
1 nav2_system_tests
1 nav2_tasks
1 nav2_turtlebot3_rl
1 nav2_util
1 nav2_voxel_grid
1 nav2_world_model
1 2017-03-28 nav2d
Meta-Package containing modules for 2D-Navigation
Meta-Package containing modules for 2D-Navigation
 
1 2017-03-28 nav2d_exploration
This package holds a collection of plugins for the RobotNavigator, that provide different cooperative exploration strategies for a team of mobile robots.
This package holds a collection of plugins for the RobotNavigator, that provide different cooperative exploration strategies for a team of mobile robots.
 
1 2017-03-28 nav2d_karto
Graph-based Simultaneous Localization and Mapping module. Includes OpenKarto GraphSLAM library by "SRI International".
Graph-based Simultaneous Localization and Mapping module. Includes OpenKarto GraphSLAM library by "SRI International".
 
1 2017-03-28 nav2d_localizer
Wrapper around Particle Filter implementation. The SelfLocalizer can be used as library or as a ros-node.
Wrapper around Particle Filter implementation. The SelfLocalizer can be used as library or as a ros-node.
 
1 2017-03-28 nav2d_msgs
Messages used for 2D-Navigation.
Messages used for 2D-Navigation.
 
1 2017-03-28 nav2d_navigator
This package provides a node for higher level navigation of a mobile robot in a planar environment. It needs a map and the robot's position within this map to create a plan for navigation. When used together with a SLAM module it can also be used to perform autonomous exploration of the robot's workspace.
This package provides a node for higher level navigation of a mobile robot in a planar environment. It needs a map and the robot's position within this map to create a plan for navigation. When used together with a SLAM module it can also be used to perform autonomous exploration of the robot's workspace.
 
1 2017-03-28 nav2d_operator
The operator is a lightweight, purely reactive obstacle-avoidance module for mobile robots moving in a planar environment. The operator node works by evaluating a set of predefined motion primitives based on a local costmap and a desired direction. The best evaluated motion command will be send to the mobile base.
The operator is a lightweight, purely reactive obstacle-avoidance module for mobile robots moving in a planar environment. The operator node works by evaluating a set of predefined motion primitives based on a local costmap and a desired direction. The best evaluated motion command will be send to the mobile base.
 
1 2017-03-28 nav2d_remote
This package is used to manually control a robot that uses the operator and navigator node from navigation_2d. Currently there is one node to control one robot with a joystick and one to control multiple robots in simulation. It can send commands directly to the operator or start and stop navigator actions.
This package is used to manually control a robot that uses the operator and navigator node from navigation_2d. Currently there is one node to control one robot with a joystick and one to control multiple robots in simulation. It can send commands directly to the operator or start and stop navigator actions.
 
1 2017-03-28 nav2d_tutorials
Contains a set of tutorials that run 2D-Navigation within Stage-Simulator.
Contains a set of tutorials that run 2D-Navigation within Stage-Simulator.
 
2 2019-05-24 nav_2d_msgs
Basic message types for two dimensional navigation, extending from geometry_msgs::Pose2D.
Basic message types for two dimensional navigation, extending from geometry_msgs::Pose2D.
 
2 2019-05-24 nav_2d_utils
A handful of useful utility functions for nav_core2 packages.
A handful of useful utility functions for nav_core2 packages.
 
2 2017-01-22 nav_core
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
 
1 2019-05-24 nav_core2
Interfaces for Costmap, LocalPlanner and GlobalPlanner. Replaces nav_core.
Interfaces for Costmap, LocalPlanner and GlobalPlanner. Replaces nav_core.
 
1 2019-05-24 nav_core_adapter
This package contains adapters for using `nav_core` plugins as `nav_core2` plugins and vice versa (more or less). See README.md for more information.
This package contains adapters for using `nav_core` plugins as `nav_core2` plugins and vice versa (more or less). See README.md for more information.
 
1 2019-05-24 nav_grid
A templatized interface for overlaying a two dimensional grid on the world.
A templatized interface for overlaying a two dimensional grid on the world.
 
1 2019-05-24 nav_grid_iterators
Iterator implementations for moving around the cells of a nav_grid in a number of common patterns.
Iterator implementations for moving around the cells of a nav_grid in a number of common patterns.
 
1 2019-05-24 nav_grid_pub_sub
Publishers and Subscribers for nav_grid data.
Publishers and Subscribers for nav_grid data.
 
1 2017-02-11 nav_layer_from_points
Plugin-based layers for the navigation software.
Plugin-based layers for the navigation software.
 
2 2018-05-03 nav_msgs
nav_msgs defines the common messages used to interact with the
nav_msgs defines the common messages used to interact with the
 
1 2018-07-02 nav_pcontroller
Simple P-Controller for a holonomic robot base
Simple P-Controller for a holonomic robot base
 
2 2017-01-22 navfn
navfn provides a fast interpolated navigation function that can be used to create plans for a mobile base. The planner assumes a circular robot and operates on a costmap to find a minimum cost plan from a start point to an end point in a grid. The navigation function is computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the nav_core::BaseGlobalPlanner interface specified in
navfn provides a fast interpolated navigation function that can be used to create plans for a mobile base. The planner assumes a circular robot and operates on a costmap to find a minimum cost plan from a start point to an end point in a grid. The navigation function is computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the nav_core::BaseGlobalPlanner interface specified in
 
2 2017-01-22 navigation
A 2D navigation stack that takes in information from odometry, sensor streams, and a goal pose and outputs safe velocity commands that are sent to a mobile base.
A 2D navigation stack that takes in information from odometry, sensor streams, and a goal pose and outputs safe velocity commands that are sent to a mobile base.
 
1 navigation2
1 2019-03-26 navigation_experimental
A collection of navigation plugins and tools: Various recovery behaviors, local and global planner plugins for move_base, a teleop filter for obstacle avoidance, a simple control-based move_base replacement etc.
A collection of navigation plugins and tools: Various recovery behaviors, local and global planner plugins for move_base, a teleop filter for obstacle avoidance, a simple control-based move_base replacement etc.
 
1 2018-08-31 navigation_layers
Extra navigation layers.
Extra navigation layers.
 
1 2013-08-16 navigation_stage
This package holds example launch files for running the ROS navigation stack in stage.
This package holds example launch files for running the ROS navigation stack in stage.
 
1 2013-08-16 navigation_tutorials
Navigation related tutorials.
Navigation related tutorials.
 
1 2018-06-03 ncd_parser
The ncd_parser package reads in .alog data files from the New College Dataset and broadcasts scan and odometry messages to ROS.
The ncd_parser package reads in .alog data files from the New College Dataset and broadcasts scan and odometry messages to ROS.
 
0 ndds-tools
1 2015-10-08 ndt_costmap
The ndt_costmap package
The ndt_costmap package
 
1 ndt_feature_reg
1 ndt_fuser
1 ndt_map
1 ndt_map_builder
1 ndt_mcl
1 ndt_registration
1 ndt_rviz_visualisation
1 ndt_visualisation
1 neato_2dnav

Packages

Name Description
1 nav2_navfn_planner
1 nav2_navigation
1 nav2_platform
1 nav2_robot
1 nav2_simple_navigator
1 nav2_system_tests
1 nav2_tasks
1 nav2_turtlebot3_rl
1 nav2_util
1 nav2_voxel_grid
1 nav2_world_model
1 2017-03-28 nav2d
Meta-Package containing modules for 2D-Navigation
Meta-Package containing modules for 2D-Navigation
 
1 2017-03-28 nav2d_exploration
This package holds a collection of plugins for the RobotNavigator, that provide different cooperative exploration strategies for a team of mobile robots.
This package holds a collection of plugins for the RobotNavigator, that provide different cooperative exploration strategies for a team of mobile robots.
 
1 2017-03-28 nav2d_karto
Graph-based Simultaneous Localization and Mapping module. Includes OpenKarto GraphSLAM library by "SRI International".
Graph-based Simultaneous Localization and Mapping module. Includes OpenKarto GraphSLAM library by "SRI International".
 
1 2017-03-28 nav2d_localizer
Wrapper around Particle Filter implementation. The SelfLocalizer can be used as library or as a ros-node.
Wrapper around Particle Filter implementation. The SelfLocalizer can be used as library or as a ros-node.
 
1 2017-03-28 nav2d_msgs
Messages used for 2D-Navigation.
Messages used for 2D-Navigation.
 
1 2017-03-28 nav2d_navigator
This package provides a node for higher level navigation of a mobile robot in a planar environment. It needs a map and the robot's position within this map to create a plan for navigation. When used together with a SLAM module it can also be used to perform autonomous exploration of the robot's workspace.
This package provides a node for higher level navigation of a mobile robot in a planar environment. It needs a map and the robot's position within this map to create a plan for navigation. When used together with a SLAM module it can also be used to perform autonomous exploration of the robot's workspace.
 
1 2017-03-28 nav2d_operator
The operator is a lightweight, purely reactive obstacle-avoidance module for mobile robots moving in a planar environment. The operator node works by evaluating a set of predefined motion primitives based on a local costmap and a desired direction. The best evaluated motion command will be send to the mobile base.
The operator is a lightweight, purely reactive obstacle-avoidance module for mobile robots moving in a planar environment. The operator node works by evaluating a set of predefined motion primitives based on a local costmap and a desired direction. The best evaluated motion command will be send to the mobile base.
 
1 2017-03-28 nav2d_remote
This package is used to manually control a robot that uses the operator and navigator node from navigation_2d. Currently there is one node to control one robot with a joystick and one to control multiple robots in simulation. It can send commands directly to the operator or start and stop navigator actions.
This package is used to manually control a robot that uses the operator and navigator node from navigation_2d. Currently there is one node to control one robot with a joystick and one to control multiple robots in simulation. It can send commands directly to the operator or start and stop navigator actions.
 
1 2017-03-28 nav2d_tutorials
Contains a set of tutorials that run 2D-Navigation within Stage-Simulator.
Contains a set of tutorials that run 2D-Navigation within Stage-Simulator.
 
2 nav_2d_msgs
2 nav_2d_utils
2 2016-11-13 nav_core
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
 
1 nav_core2
1 nav_core_adapter
1 nav_grid
1 nav_grid_iterators
1 nav_grid_pub_sub
1 nav_layer_from_points
2 2018-11-08 nav_msgs
nav_msgs defines the common messages used to interact with the
nav_msgs defines the common messages used to interact with the
 
1 2018-07-02 nav_pcontroller
Simple P-Controller for a holonomic robot base
Simple P-Controller for a holonomic robot base
 
2 2016-11-13 navfn
navfn provides a fast interpolated navigation function that can be used to create plans for a mobile base. The planner assumes a circular robot and operates on a costmap to find a minimum cost plan from a start point to an end point in a grid. The navigation function is computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the nav_core::BaseGlobalPlanner interface specified in
navfn provides a fast interpolated navigation function that can be used to create plans for a mobile base. The planner assumes a circular robot and operates on a costmap to find a minimum cost plan from a start point to an end point in a grid. The navigation function is computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the nav_core::BaseGlobalPlanner interface specified in
 
2 2016-11-13 navigation
A 2D navigation stack that takes in information from odometry, sensor streams, and a goal pose and outputs safe velocity commands that are sent to a mobile base.
A 2D navigation stack that takes in information from odometry, sensor streams, and a goal pose and outputs safe velocity commands that are sent to a mobile base.
 
1 navigation2
1 navigation_experimental
1 2018-08-31 navigation_layers
Extra navigation layers.
Extra navigation layers.
 
1 2016-03-24 navigation_stage
This package holds example launch files for running the ROS navigation stack in stage.
This package holds example launch files for running the ROS navigation stack in stage.
 
1 2016-03-24 navigation_tutorials
Navigation related tutorials.
Navigation related tutorials.
 
1 2018-06-03 ncd_parser
The ncd_parser package reads in .alog data files from the New College Dataset and broadcasts scan and odometry messages to ROS.
The ncd_parser package reads in .alog data files from the New College Dataset and broadcasts scan and odometry messages to ROS.
 
0 ndds-tools
1 ndt_costmap
1 ndt_feature_reg
1 ndt_fuser
1 ndt_map
1 ndt_map_builder
1 ndt_mcl
1 ndt_registration
1 ndt_rviz_visualisation
1 ndt_visualisation
1 neato_2dnav

Packages

Name Description
1 nav2_navfn_planner
1 2014-09-13 nav2_navigation
ROS navigation config and launch files for Nav2 Robot Platform
ROS navigation config and launch files for Nav2 Robot Platform
 
1 2014-09-13 nav2_platform
ROS stack containing all nodes, config, and launch files for Nav2 mobile robotics platform.
ROS stack containing all nodes, config, and launch files for Nav2 mobile robotics platform.
 
1 nav2_robot
1 nav2_simple_navigator
1 nav2_system_tests
1 nav2_tasks
1 nav2_turtlebot3_rl
1 nav2_util
1 nav2_voxel_grid
1 nav2_world_model
1 2014-09-10 nav2d
Meta-Package containing modules for 2D-Navigation
Meta-Package containing modules for 2D-Navigation
 
1 2014-09-10 nav2d_exploration
This package holds a collection of plugins for the RobotNavigator, that provide different cooperative exploration strategies for a team of mobile robots.
This package holds a collection of plugins for the RobotNavigator, that provide different cooperative exploration strategies for a team of mobile robots.
 
1 2014-09-10 nav2d_karto
Graph-based Simultaneous Localization and Mapping module. Includes OpenKarto GraphSLAM library by "SRI International".
Graph-based Simultaneous Localization and Mapping module. Includes OpenKarto GraphSLAM library by "SRI International".
 
1 2014-09-10 nav2d_localizer
Wrapper around Particle Filter implementation. The SelfLocalizer can be used as library or as a ros-node.
Wrapper around Particle Filter implementation. The SelfLocalizer can be used as library or as a ros-node.
 
1 2014-09-10 nav2d_msgs
Messages used for 2D-Navigation.
Messages used for 2D-Navigation.
 
1 2014-09-10 nav2d_navigator
This package provides a node for higher level navigation of a mobile robot in a planar environment. It needs a map and the robot's position within this map to create a plan for navigation. When used together with a SLAM module it can also be used to perform autonomous exploration of the robot's workspace.
This package provides a node for higher level navigation of a mobile robot in a planar environment. It needs a map and the robot's position within this map to create a plan for navigation. When used together with a SLAM module it can also be used to perform autonomous exploration of the robot's workspace.
 
1 2014-09-10 nav2d_operator
The operator is a lightweight, purely reactive obstacle-avoidance module for mobile robots moving in a planar environment. The operator node works by evaluating a set of predefined motion primitives based on a local costmap and a desired direction. The best evaluated motion command will be send to the mobile base.
The operator is a lightweight, purely reactive obstacle-avoidance module for mobile robots moving in a planar environment. The operator node works by evaluating a set of predefined motion primitives based on a local costmap and a desired direction. The best evaluated motion command will be send to the mobile base.
 
1 2014-09-10 nav2d_remote
This package is used to manually control a robot that uses the operator and navigator node from navigation_2d. Currently there is one node to control one robot with a joystick and one to control multiple robots in simulation. It can send commands directly to the operator or start and stop navigator actions.
This package is used to manually control a robot that uses the operator and navigator node from navigation_2d. Currently there is one node to control one robot with a joystick and one to control multiple robots in simulation. It can send commands directly to the operator or start and stop navigator actions.
 
1 2014-09-10 nav2d_tutorials
Contains a set of tutorials that run 2D-Navigation within Stage-Simulator.
Contains a set of tutorials that run 2D-Navigation within Stage-Simulator.
 
2 nav_2d_msgs
2 nav_2d_utils
2 2015-04-30 nav_core
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
This package provides common interfaces for navigation specific robot actions. Currently, this package provides the BaseGlobalPlanner, BaseLocalPlanner, and RecoveryBehavior interfaces, which can be used to build actions that can easily swap their planner, local controller, or recovery behavior for new versions adhering to the same interface.
 
1 nav_core2
1 nav_core_adapter
1 nav_grid
1 nav_grid_iterators
1 nav_grid_pub_sub
1 nav_layer_from_points
2 2015-05-11 nav_msgs
nav_msgs defines the common messages used to interact with the
nav_msgs defines the common messages used to interact with the
 
1 nav_pcontroller
2 2015-04-30 navfn
navfn provides a fast interpolated navigation function that can be used to create plans for a mobile base. The planner assumes a circular robot and operates on a costmap to find a minimum cost plan from a start point to an end point in a grid. The navigation function is computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the nav_core::BaseGlobalPlanner interface specified in
navfn provides a fast interpolated navigation function that can be used to create plans for a mobile base. The planner assumes a circular robot and operates on a costmap to find a minimum cost plan from a start point to an end point in a grid. The navigation function is computed with Dijkstra's algorithm, but support for an A* heuristic may also be added in the near future. navfn also provides a ROS wrapper for the navfn planner that adheres to the nav_core::BaseGlobalPlanner interface specified in
 
2 2015-04-30 navigation
A 2D navigation stack that takes in information from odometry, sensor streams, and a goal pose and outputs safe velocity commands that are sent to a mobile base.
A 2D navigation stack that takes in information from odometry, sensor streams, and a goal pose and outputs safe velocity commands that are sent to a mobile base.
 
1 navigation2
1 2014-07-29 navigation_experimental
The navigation_experimental meta-package
The navigation_experimental meta-package
 
1 2015-06-15 navigation_layers
Extra navigation layers.
Extra navigation layers.
 
1 2013-08-16 navigation_stage
This package holds example launch files for running the ROS navigation stack in stage.
This package holds example launch files for running the ROS navigation stack in stage.
 
1 2013-08-16 navigation_tutorials
Navigation related tutorials.
Navigation related tutorials.
 
1 2015-10-14 ncd_parser
The ncd_parser package reads in .alog data files from the New College Dataset and broadcasts scan and odometry messages to ROS.
The ncd_parser package reads in .alog data files from the New College Dataset and broadcasts scan and odometry messages to ROS.
 
0 ndds-tools
1 2015-01-13 ndt_costmap
The ndt_costmap package
The ndt_costmap package
 
1 2015-01-13 ndt_feature_reg
ndt_feature_reg
ndt_feature_reg
 
1 2015-01-13 ndt_fuser
ndt_fuser
ndt_fuser
 
1 2015-01-13 ndt_map
Contains the definitions of the 3D Normal Distributions Transform data structures, used for mapping, registration, etc.
Contains the definitions of the 3D Normal Distributions Transform data structures, used for mapping, registration, etc.
 
1 2015-01-13 ndt_map_builder
ndt_map_builder
ndt_map_builder
 
1 2015-01-13 ndt_mcl
ndt_mcl
ndt_mcl
 
1 2015-01-13 ndt_registration
Contains a new implementation of 3D NDT registration. Used to find the relative positions of two point clouds.
Contains a new implementation of 3D NDT registration. Used to find the relative positions of two point clouds.
 
1 2015-01-13 ndt_rviz_visualisation
The ndt_rviz_visualisation package
The ndt_rviz_visualisation package
 
1 2015-01-13 ndt_visualisation
Contains classes for creating an ndt visualization window. Initial implementation on top of mrpt.
Contains classes for creating an ndt visualization window. Initial implementation on top of mrpt.
 
1 2014-10-08 neato_2dnav
This package contains configuration and launch files for using the navigation stack with the Neato XV-11 robot.
This package contains configuration and launch files for using the navigation stack with the Neato XV-11 robot.