Robotics and AI manuals
  • Overview
  • Useful Links

Software

  • Linux
  • Git
  • Gazebo Simulator
  • AI/ML and Data Science
  • ROS2
    • Nodes
    • Services
    • Actions
    • ROS 2 commands
    • ROS graph
    • Parameters
    • Computer Vision in ROS
    • Logging, monitoring and debugging
    • MoveIt
    • Navigation
      • Nav2
        • Behavior Tree
        • Costmap
        • Instructions for running the SLAM and navigation
        • Localization
        • Mapping
        • Nav2 architecture
        • Odometry
        • Path planning
        • Point Cloud
        • SLAM
    • Perception in ROS 2
    • Robot Web Tools
    • ros2_control
    • ROS Transforms
    • URDF
    • Tips and troubleshooting
    • Other Helpful Information
  • Docker
  • Kubernetes
  • Nx
  • Coding
  • Django
  • Databases
  • Networking
  • Node.js
  • Node-RED
  • NVIDIA Software Ecosystem
  • Other

Electronics

  • Motors and actuators
  • Sensors
  • Cameras
  • Embedded Systems
  • Microcontrollers
  • Relays

Mechanics

  • Forces

Projects

  • Robotics Projects

Building a product

  • Building a product

Learning By Doing

  • Learning By Doing
Robotics and AI manuals
  • ROS2
  • Navigation
  • Nav2 architecture
  • View page source

Nav2 architecture

Nav2 architecture

Source

Nav2 architecture
  • BT Navigator Server - behavioral tree determining the execution of the appropriate step of the algorithm (e.g. first determine the optimal path and then run the controller).

  • Controller Server - creates a local costmap and implements the server for handling the controller requests.

  • Planner Server - creates a global costmap and determines the optimal trajectories based on the global costmap.

  • Behavior Server - determines the actions that should be performed when the robot gets stuck.

  • Smoother Server - creates smoother path plans to be more continuous and feasible.

Previous Next

© Copyright 2023, Jevgeni Kalbin.

Built with Sphinx using a theme provided by Read the Docs.