Only released in EOL distros:
Package Summary
An interactive markers package for Husky.
- Author: Ryan Gariepy
- License: BSD
- Source: git https://github.com/clearpathrobotics/clearpath_husky.git (branch: master)
Package Summary
An interactive markers package for Husky.
- Author: Ryan Gariepy
- License: BSD
- Source: git https://github.com/clearpathrobotics/clearpath_husky.git (branch: master)
Package Summary
An interactive markers package for Husky.
- Author: Ryan Gariepy
- License: BSD
- Source: git https://github.com/clearpathrobotics/clearpath_husky.git (branch: groovy)
Package Summary
Interactive markers for controlling Husky from inside rviz.
- Maintainer: Mike Purvis <mpurvis AT clearpathrobotics DOT com>
- Author:
- License: BSD
- Source: git https://github.com/husky/husky_interactive_markers.git (branch: hydro-devel)
Contents
Usage
When connected to a ROS network running Husky, launch rviz and the marker server together:
roslaunch husky_viz view_robot.launch
If you want to launch only the markers without an rviz instance:
roslaunch husky_interactive_markers interactive_markers.launch
Markers should appear around Husky in running rviz instances. Click and drag them to send velocity command messages.
Nodes
marker_server
Creates an interactive marker server to allow the user to control the Husky base through rvizPublished Topics
cmd_vel (geometry_msgs/Twist)- Husky commanded velocity topic.
Parameters
~link_name (string, default: /base_link)- tf frame to center the interactive markers around
- Value to scale translation input by to convert to velocity
- Value to scale rotational input by to convert to angular velocity
Nodes
husky_marker_server
Creates an interactive marker server to allow the user to control the Husky base through rvizPublished Topics
cmd_vel (geometry_msgs/Twist)- Husky commanded velocity topic.
Parameters
~link_name (string, default: /base_link)- tf frame to center the interactive markers around
- Value to scale translation input by to convert to velocity
- Value to scale rotational input by to convert to angular velocity