Wiki

  Show EOL distros: 

Package Summary

Simple navigation package

  • Maintainer status: developed
  • Maintainer: Jim Vaughan <jimv AT mrjim DOT com>, Rohan Agrawal <send2arohan AT gmail DOT com>, Teodor Janez Podobnik <tp AT ubiquityrobotics DOT com>
  • Author: Jim Vaughan <jimv AT mrjim DOT com>
  • License: BSD
  • Source: git https://github.com/UbiquityRobotics/move_basic.git (branch: kinetic-devel)

Package Summary

Simple navigation package

  • Maintainer status: maintained
  • Maintainer: Jim Vaughan <jimv AT mrjim DOT com>, Rohan Agrawal <send2arohan AT gmail DOT com>, Teodor Janez Podobnik <tp AT ubiquityrobotics DOT com>
  • Author: Jim Vaughan <jimv AT mrjim DOT com>
  • License: BSD
  • Source: git https://github.com/UbiquityRobotics/move_basic.git (branch: kinetic-devel)

Package Summary

Simple navigation package

  • Maintainer: Jim Vaughan <jimv AT mrjim DOT com>, Rohan Agrawal <send2arohan AT gmail DOT com>, Teodor Janez Podobnik <tp AT ubiquityrobotics DOT com>
  • Author: Jim Vaughan <jimv AT mrjim DOT com>
  • License: BSD

Nodes

This package provides the move_basic ROS Node a very basic navigation node.

move_basic

The move_basic node performs basic navigation tasks. Path planning consists of rotating in place to face the goal and then driving straight towards it. It is designed to provide the same software interfaces as move_base, that is, it implements a QueuedActionServer (similar to SimpleActionServer, see actionlib documentation), that queues up to two goals containing geometry_msgs/PoseStamped messages.

It is assumed that we are dealing with imperfect localization data: map->base_link is accurate but may be delayed and is at a slow rate and odom->base_link is more frequent, but drifts, particularly after rotating. To counter these issues, move_basic plans in the map frame, and waits a short time after each step, and executes movement in the odom frame. If goals in the base_link frame are received, they are interpreted as relative to the robot's current position. This behavior is different to that of move_base, which will not accept goals in the base_link frame.

Collision Avoidance

If data from a laser scanner or sonars is available, collision avoidance can be performed. If an obstacle is detected, it will slow or stop in an attempt to avoid a collision.

Visualization

Some of the data produced by move_basic can be visualized with rviz. In the screen shot below, the portion of the laser scan data (in white) which is currently in the path of the robot is depicted as a red line. The light purple line shows the path planned by the robot. A navigation goal can be sent to move_basic by rviz by pressing the 2D nav goal button and clicking on the map.

move_basic.png

During rotation, the footprint of the robot is shown as a blue rectangle. The red box, if shown shows the rotation that can be performed without collision. If no obstacles are detected that obstruct a rotation, the red box is not shown.

rotation.png

Subscribed Topics

/move_base/goal (move_base_msgs/MoveBaseActionGoal) /move_base/cancel (actionlib_msgs/GoalID) /move_base_simple/goal (geometry_msgs/PoseStamped) /scan (sensor_msgs/LaserScan) /sonars (sensor_msgs/Range) /tf (tf2_msgs/TFMessage)

Published Topics

/move_base/feedback (move_base_msgs/MoveBaseActionFeedback) /move_base/status (actionlib_msgs/GoalStatusArray) /move_base/result (move_base_msgs/MoveBaseActionResult) /cmd_vel (geometry_msgs/Twist) /plan (nav_msgs/Path) /obstacle_distance (std_msgs/Float32) /obstacle_viz (visualization_msgs/Marker) /lateral_error (geometry_msgs/Vector3)

Services

~stop (std_msgs/Bool)

Parameters

~min_turning_velocity (double, default: 0.18) ~max_turning_velocity (double, default: 1.0) ~max_lateral_velocity (double, default: 0.5) ~turning_acceleration (double, default: 0.3) ~max_linear_velocity (double, default: 0.5) ~linear_acceleration (double, default: 0.1) ~angular_tolerance (double, default: 0.01) ~linear_tolerance (double, default: 0.1) ~localization_latency (double, default: 0.5) ~lateral_kp (double, default: 2.0) ~lateral_ki (double, default: 0.0) ~lateral_kd (double, default: 20.0) ~velocity_threshold (double, default: 0.01) ~linear_gain (double, default: 1.0) ~rotational_gain (double, default: 2.5) ~abort_timeout (double, default: 5.0) ~obstacle_wait_threshold (double, default: 10.0) ~forward_obstacle_threshold (double, default: 1.0) ~reverse_without_turning_threshold (double, default: 0.5) ~map_frame (string, default: map) ~robot_width (double, default: 0.35) ~robot_front_length (double, default: 0.11) ~robot_back_length (double, default: 0.21)

Installation

sudo apt install ros-kinetic-move-basic

Example

To move forward one meter using rostopic (note that bash completion will provide an empty message that can be filled out):

rostopic pub /move_base_simple/goal geometry_msgs/PoseStamped "header:
  seq: 0
  stamp:
    secs: 0
    nsecs: 0
  frame_id: 'base_link'
pose:
  position:
    x: 1.0
    y: 0.0
    z: 0.0
  orientation:
    x: 0.0
    y: 0.0
    z: 0.0
    w: 1.0" 

This is an example of a relative goal, since the frame_id is set to base_link. The position of the target pose is set to 1 meter in the forward direction, and the orientation is the identity quaternion.

Wiki: move_basic (last edited 2021-03-24 09:09:07 by Teodor)