[Documentation] [TitleIndex] [WordIndex

Only released in EOL distros:  

actuator_array: actuator_array_driver | actuator_array_example | actuator_array_gazebo_plugin | actuator_array_gui

Package Summary

This package provides a simple GUI for viewing and controlling the state of an actuator array. The joint names to be controlled are read from the parameter server. Joint limits are extracted from the "robot_description."

Overview

This package provides a simple GUI for viewing and controlling the state of a node compliant with the actuator_array_driver. The joint names to be controlled are read from the parameter server. The same yaml formats used by the Actuator Array Driver are also acceptable here, so the same configuration file may be used for both nodes. If available, this node also parses the robot description urdf for joint limits and other information.

The GUI provides the user with two sets of information for each joint: (1) the command and (2) the current state of each joint. The user may adjust the command position slider and change the values of the velocity and effort fields. Clicking on the Send button causes the GUI to publish a single sensor_msgs/JointState message on the command topic. Toggling the Auto Send button causes the GUI to continuously send command messages at a rate of 10Hz. The Home and Stop buttons produce the corresponding service calls.

actuator_array_gui.png

ROS Nodes

actuator_array_gui

Subscribed Topics

joint_states (sensor_msgs/JointState)

Published Topics

command (sensor_msgs/JointState)

Called Services

stop (std_srvs/Empty)

home (std_srvs/Empty)

Parameters

robot_description_parameter (string, default: robot_description)

joints (string)


2024-02-24 12:24