🤖
Introduction to ROS2 and Robotics
  • Introduction
  • ROS2
    • Index
    • IDE and CMake Setup
      • How to add additional include search path
    • ROS2 Building Blocks
      • ROS Workspace and Package Layout
      • Launch File
      • tf2
      • Quality of Service
      • Configurations
        • Rviz Configuration
      • Built-in Types
        • Built-in Message Type
    • ROS Architecture
      • Intra-process Communication
    • Navigation and Planning
      • Navigation Stack and Concepts
      • Navigation2 Implementation Overview
        • 🏗️Cost Map
        • Obstacle Avoidance and DWB Controller
      • DWB Controller
      • Page 5
    • How to launch the Nav2 stack
    • ROS2 Control
      • Online Resources
      • Overview of Codebase
    • 🍳Cookbook
      • Useful Commands
      • How to specify parameters
      • How to build the workspace
      • 🏗️How to publish message to a topic from command line?
      • How to inspect service and make a service call
      • How to properly terminate ROS and Gazebo
      • How to add and remove models in Gazebo simulation dynamically
      • 🚧How to spin nodes
    • 🛒Tutorials
      • Services and Communication between ROS2 and Gazebo
      • Subscription and Message Filters Demo
      • Executor and Spin Explained
      • Lifecycle Node Demo
      • Robotic Arm Demo
      • ⚒️Multiple Robotic Arms Simulation Demo
      • 🚧Introduction to xacro
    • Page
    • 🍺Tech Blog
      • Difference between URDF and SDF and how to convert
  • Gazebo
    • Index
    • Terminology
    • GUI
    • World Frame and Axis
    • Cookbook
    • Page 1
  • Programming in Robotics
    • C++
      • CMake
    • Python
    • Rust
  • Mathematics in Robotics
    • Linear Algebra
    • Matrix Properties
    • Probability
      • Expectation-Maximization Algorithm
    • Multivariable Function and Derivatives
  • Physics in Robotics
  • Control of Dynamic Systems
    • Dynamic Response and Transfer Function
    • Block Diagram
    • PID Controller
  • Robot Modeling and Control
    • Rotation and Homogeneous Transformation
  • Probabilistic Robotics
    • Bayes Filter
    • Kalman Filter
    • Particle Filter
    • Discrete Bayes Filter
    • Motion Model
    • Perception Model
    • Localization
    • SLAM
  • Miscellany
  • Concept Index
    • Quaternions
Powered by GitBook
On this page
  1. ROS2
  2. Navigation and Planning

Navigation Stack and Concepts

PreviousNavigation and PlanningNextNavigation2 Implementation Overview

Last updated 1 year ago

Source:

Section
Description

2D Nav Goal

  • Topic: move_base_simple/goal

  • Type:

  • Description: Allows the user to send a goal to the by setting a desired pose for the robot to achieve.

2D Pose Estimate

  • Topic: initialpose

  • Type:

  • Description: Allows the user to initialize the used by the stack by setting the pose of the robot in the world.

Static Map

  • Topic: map

  • Type:

  • Type:

  • Description: Displays the static map that is being served by the if one exists.

Particle Cloud

  • Topic: particlecloud

  • Type:

  • Description: Displays the particle cloud used by the robot's system. The spread of the cloud represents the system's uncertainty about the robot's pose. A cloud that is very spread out reflects high uncertainty, while a condensed cloud represents low uncertainty.

Robot Footprint

  • Topic: local_costmap/robot_footprint

  • Type:

  • Description: Displays the footprint of the robot

Obstacles

  • Topic: local_costmap/obstacles

  • Type:

  • Desctiption: Displays the obstacles that the navigation stack sees in its . For the robot to avoid collision, the robot footprint should never intersect with a cell that contains an obstacle.

Inflated Obstacles

  • Topic: local_costmap/inflated_obstacles

  • Type:

  • Description: Displays obstacles in the navigation stack's inflated by the inscribed radius of the robot. For the robot to avoid collision, the center point of the robot should never overlap with a cell that contains an inflated obstacle.

Unknown Space

  • Topic: local_costmap/unknown_space

  • Type:

  • Description: Displays any unknown space contained in the navigation stack's .

Global Plan

  • Topic: TrajectoryPlannerROS/global_plan

  • Type:

  • Description: Displays the portion of the global plan that the is currently pursuing.

Local Plan

  • Topic: TrajectoryPlannerROS/local_plan

  • Type:

  • Description: Displays the trajectory associated with the velocity commands currently being commanded to the base by the .

Planner Plan

  • Topic: TrajectoryPlannerROS/local_plan

  • Type:

  • Description: Displays the trajectory associated with the velocity commands currently being commanded to the base by the .

Current Goal

  • Topic: current_goal

  • Type:

  • Description: Displays the goal pose that the navigation stack is attempting to achieve.

http://wiki.ros.org/navigation/Tutorials/Using%20rviz%20with%20the%20Navigation%20Stack
geometry_msgs/PoseStamped
navigation
geometry_msgs/PoseWithCovarianceStamped
localization system
navigation
nav_msgs/GetMap
nav_msgs/OccupancyGrid
map_server
geometry_msgs/PoseArray
localization
localization
geometry_msgs/PolygonStamped
nav_msgs/GridCells
costmap
nav_msgs/GridCells
costmap
nav_msgs/GridCells
costmap_2d
nav_msgs/Path
local planner
nav_msgs/Path
local planner
nav_msgs/Path
local planner
geometry_msgs/PoseStamped