Show EOL distros:
Package Summary
This package provides automatic collision avoidance and is intended to be used for safer teleoperation of a robot base.
- Author: Charles DuHadway (maintained by Benjamin Pitzer)
- License: BSD
- Source: svn http://svn.code.sf.net/p/bosch-ros-pkg/code/branches/electric/stacks/shared_autonomy
Package Summary
This package provides automatic collision avoidance and is intended to be used for safer teleoperation of a robot base.
- Maintainer status: unmaintained
- Maintainer: Charles DuHadway (maintained by Benjamin Pitzer) <foo AT foo DOT com>, ROS Orphaned Package Maintainers <ros-orphaned-packages AT googlegroups DOT com>
- Author:
- License: BSD
- Source: git https://github.com/SharedAutonomyToolkit/shared_autonomy_manipulation.git (branch: hydro-devel)
Package Summary
This package provides automatic collision avoidance and is intended to be used for safer teleoperation of a robot base.
- Maintainer status: unmaintained
- Maintainer: Charles DuHadway (maintained by Benjamin Pitzer) <foo AT foo DOT com>, ROS Orphaned Package Maintainers <ros-orphaned-packages AT googlegroups DOT com>
- Author:
- License: BSD
- Source: git https://github.com/SharedAutonomyToolkit/shared_autonomy_manipulation.git (branch: hydro-devel)
Package Summary
This package provides automatic collision avoidance and is intended to be used for safer teleoperation of a robot base.
- Maintainer status: unmaintained
- Maintainer: Charles DuHadway (maintained by Benjamin Pitzer) <foo AT foo DOT com>, ROS Orphaned Package Maintainers <ros-orphaned-packages AT googlegroups DOT com>
- Author:
- License: BSD
- Source: git https://github.com/SharedAutonomyToolkit/shared_autonomy_manipulation.git (branch: hydro-devel)
Nodes
safe_trajectory_node
This node takes as input commands for a robot base and outputs the nearest safe commands. The core functionality has some similarities to base_local_planner.
Published Topics
~<name>/safe_vel (geometry_msgs/Twist)- Safe base commands
- The trajectory corresponding to the incoming base commands
- The trajectory corresponding to the outgoing (safe) base commands
Subscribed Topics
/base_velocity (geometry_msgs/Twist)- Desired base commands
- Base odometry
Services
~<name>/clear_costmaps (std_srvs/Empty)- Clear marked cells in the current costmap layers. (available on 0.0.3 and later)
Parameters
Many of the parameters are identical to those of the base_local_planner package.
~<name>/acc_lim_x (double, default: 2.5)
- Maximum forward acceleration (in m/s/s)
- Maximum lateral acceleration (in m/s/s)
- Maximum rotational acceleration (in radians/s/s)
- Length, in seconds, of trajectories to simulate forward
- Resolution at which to sample trajectories
- Number of x velocities to consider
- Number of y velocities to consider
- Number of rotational velocities to consider
- Weight given to incoming base commands, used in trajectory scoring
- Weight given to distance to nearest occupied grid cell, used in trajectory scoring
- Maximum forward velocity in m/s
- Minimum forward velocity in m/s
- Maximum lateral velocity in m/s
- Minimum lateral velocity in m/s
- Minimum lateral velocity in m/s7.name= ~<name>/max_rotational_vel
- Maximum rotational velocity rad/s
- World model type
- True to indicate robot can move laterally
- True to indicate dynamic window
- True to use safe trajectory for moving backward (available on 0.0.3 and later)