Show EOL distros: 

Package Summary

The move_base_sequence package

Package Summary

The move_base_sequence package

Use GitHub to report bugs or submit feature requests. [View active issues]

Overview

This is a ROS package that uses a ROS Action server to manage sending multiple goals to the navigation stack (move base action server) on a robot in order to achieve them one after another. The package handles everything regarding the goals: receiving, storing, sending, error handling... etc.

A demo showing the package while running on turtlebot3:

Check: Readme file on GitHub

Nodes

move_base_sequence

The main and only node in the package.This is where the action server runs.

Subscribed Topics

wayposes (geometry_msgs/PoseArray)
  • a visualization topic that shows the registered goals. It can also be sued to pass precalculated set of goals all at once by publishing on it..
corner_pose (geometry_msgs/Pose)
  • the topic that is used to append new goals to the goals sequence.

Published Topics

wayposes (geometry_msgs/PoseArray)
  • a visualization topic that shows the registered goals. It can also be sued to pass precalculated set of goals all at once by publishing on it..
path (nav_msgs/Path)
  • visualization topic that draws the path that connects goals together.

note:

  • A robot using move base sequence can have two states: paused: paused state stops the move base server and stops the sequence server so the robot stays at its place. operating: operating state means that the sequence server will be sending goals and waiting for move base response. In other words, the system will be fully functioning until something causes state to change to paused (e.g. a goal cancellation or abortion).

Parameters

move_base_sequence/abortion_behaviour (Str, default: 'stop')

  • determines the behaviour of the robot should the move base server face any problems that cause goal abortion. Default is 'stop' but it can be set to 'continue' which will make the system ignore this goal and take the next one in the sequence. It takes 'continue' and 'stop' as strings.
move_base_sequence/is_repeating (Bool, default: True)
  • determines whether the robot should be looping on the goals in an infinite loop which is the default value and set to be True, or it should only achieve them once, delete them, and wait for new goals, which is set by False.

ROS Service Types

ROS Service Types
get_state
reset
set_state
toggle_state

Wiki: move-base-sequence (last edited 2021-03-01 13:54:08 by MarkNaeem)