actions: [] api_documentation: http://docs.ros.org/lunar/api/move_base/html authors: Eitan Marder-Eppstein, contradict@gmail.com brief: '' bugtracker: '' depends: - actionlib - base_local_planner - catkin - clear_costmap_recovery - cmake_modules - costmap_2d - dynamic_reconfigure - geometry_msgs - message_generation - message_runtime - move_base_msgs - nav_core - nav_msgs - navfn - pluginlib - roscpp - rospy - rotate_recovery - std_srvs - tf - visualization_msgs depends_on: - mbf_costmap_nav - mir_navigation - navigation - teb_local_planner_tutorials description: The move_base package provides an implementation of an action (see the actionlib package) that, given a goal in the world, will attempt to reach it with a mobile base. The move_base node links together a global and local planner to accomplish its global navigation task. It supports any global planner adhering to the nav_core::BaseGlobalPlanner interface specified in the nav_core package and any local planner adhering to the nav_core::BaseLocalPlanner interface specified in the nav_core package. The move_base node also maintains two costmaps, one for the global planner, and one for a local planner (see the costmap_2d package) that are used to accomplish navigation tasks. devel_jobs: - http://build.ros.org/view/Ldev/job/Ldev__navigation__ubuntu_xenial_amd64 doc_job: http://build.ros.org/view/Ldoc/job/Ldoc__navigation__ubuntu_xenial_amd64 has_changelog_rst: true license: BSD maintainer_status: maintained maintainers: David V. Lu!! , Michael Ferguson , Aaron Hoy metapackages: - navigation msgs: [] package_type: package release_jobs: - http://build.ros.org/view/Lsrc_uX/job/Lsrc_uX__move_base__ubuntu_xenial__source - http://build.ros.org/view/Lsrc_dS/job/Lsrc_dS__move_base__debian_stretch__source - http://build.ros.org/view/Lbin_uX64/job/Lbin_uX64__move_base__ubuntu_xenial_amd64__binary - http://build.ros.org/view/Lbin_ds_dS64/job/Lbin_ds_dS64__move_base__debian_stretch_amd64__binary - http://build.ros.org/view/Lbin_dsv8_dSv8/job/Lbin_dsv8_dSv8__move_base__debian_stretch_arm64__binary - http://build.ros.org/view/Lbin_uxhf_uXhf/job/Lbin_uxhf_uXhf__move_base__ubuntu_xenial_armhf__binary - http://build.ros.org/view/Lbin_uxv8_uXv8/job/Lbin_uxv8_uXv8__move_base__ubuntu_xenial_arm64__binary repo_name: navigation repo_url: '' srvs: [] timestamp: 1551612534.467868 url: http://wiki.ros.org/move_base vcs: git vcs_uri: https://github.com/ros-planning/navigation.git vcs_version: lunar