Show EOL distros:
open_manipulator: open_manipulator_control_gui | open_manipulator_controller | open_manipulator_description | open_manipulator_libs | open_manipulator_moveit | open_manipulator_teleop
Package Summary
Released
Documented
OpenManipulator GUI control package based on QT
- Maintainer status: developed
- Maintainer: Pyo <pyo AT robotis DOT com>, Hye-Jong KIM <hjkim AT robotis DOT com>
- Author: Darby Lim <thlim AT robotis DOT com>, Hye-Jong KIM <hjkim AT robotis DOT com>, Ryan Shim <jhshim AT robotis DOT com>, Yong-Ho Na <yhna AT robotis DOT com>
- License: Apache 2.0
- Bug / feature tracker: https://github.com/ROBOTIS-GIT/open_manipulator/issues
- Source: git https://github.com/ROBOTIS-GIT/open_manipulator.git (branch: kinetic-devel)
open_manipulator: open_manipulator_control_gui | open_manipulator_controller | open_manipulator_description | open_manipulator_libs | open_manipulator_teleop
Package Summary
Released
Documented
OpenManipulator GUI control package based on QT
- Maintainer status: developed
- Maintainer: Will Son <willson AT robotis DOT com>
- Author: Darby Lim <thlim AT robotis DOT com>, Hye-Jong KIM <hjkim AT robotis DOT com>, Ryan Shim <jhshim AT robotis DOT com>, Yong-Ho Na <yhna AT robotis DOT com>
- License: Apache 2.0
- Bug / feature tracker: https://github.com/ROBOTIS-GIT/open_manipulator/issues
- Source: git https://github.com/ROBOTIS-GIT/open_manipulator.git (branch: melodic-devel)
Contents
ROS Software Maintainer: ROBOTIS
ROBOTIS e-Manual
ROS API
open_manipulator_control_gui
This node provides graphical user interface based on QT.Subscribed Topics
states (open_manimulator_msgs/OpenManipulatorState)- Subscribe whether the manipulator is moving or not, and whether the actuators are enabled or disabled.
- Subscribe robot joint states such as joint position.
- Subscribe kinematic pose of manipulator end-effector.
Published Topics
option (std_msgs/String)- Publish options to the manipulator in std::string format.
Services Called
goal_joint_space_path (open_manipulator_msgs/SetJointPosition)- This service is used when requesting movement of the manipulator to the target position in the joint space.
- This service is used when requesting movement of the manipulator to the target position in the task space.
- This service is used when requesting goal position of the tool of the manipulator.
- This service is used to request the status change of enable or disable of the actuators.
- This service is used to request manipulator movement to follow a preset target drawing trajectory set at open_manipulator_libs.
Parameters
robot_name (string, default: open_manipulator)- Set robot name as namespace.
- Set the end-effector name of the manipulator set in open_manipulator node of open_manipulator_libs package.