Only released in EOL distros:  

cob_substitute: cob_lbr | frida_description | frida_driver | prace_gripper_description | prace_gripper_driver | ur_description | ur_driver

Package Summary

Driver for the UR5/10 arm based on the Polyscope control scheme.

universal_robot: ur10_moveit_config | ur5_moveit_config | ur_bringup | ur_description | ur_driver | ur_gazebo | ur_kinematics | ur_msgs

Package Summary

Driver for the UR5/10 arm based on the Polyscope control scheme.

  • Maintainer status: developed
  • Maintainer: Alexander Bubeck <aub AT ipa.fhg DOT de>
  • Author: Stuart Glaser, Shaun Edwards <sedwards AT swri DOT org>, Felix Messmer <fxm AT ipa.fhg DOT de>
  • License: BSD
  • Source: git https://github.com/ros-industrial/universal_robot.git (branch: hydro)
universal_robot: ur10_moveit_config | ur3_moveit_config | ur5_moveit_config | ur_bringup | ur_description | ur_driver | ur_gazebo | ur_kinematics | ur_msgs

Package Summary

Driver for the UR5/10 arm based on the Polyscope control scheme.

  • Maintainer status: developed
  • Maintainer: Felix Messmer <fxm AT ipa.fhg DOT de>, G.A. vd. Hoorn <g.a.vanderhoorn AT tudelft DOT nl>
  • Author: Stuart Glaser, Shaun Edwards <sedwards AT swri DOT org>, Felix Messmer <fxm AT ipa.fhg DOT de>
  • License: BSD
  • Source: git https://github.com/ros-industrial/universal_robot.git (branch: indigo)
universal_robots: ur10_e_moveit_config | ur10_moveit_config | ur3_e_moveit_config | ur3_moveit_config | ur5_e_moveit_config | ur5_moveit_config | ur_bringup | ur_description | ur_driver | ur_e_description | ur_e_gazebo | ur_gazebo | ur_kinematics | ur_msgs

Package Summary

Driver for the UR5/10 arm based on the Polyscope control scheme.

  • Maintainer status: developed
  • Maintainer: G.A. vd. Hoorn <g.a.vanderhoorn AT tudelft DOT nl>, Miguel Prada Sarasola <miguel.prada AT tecnalia DOT com>, Nadia Hammoudeh Garcia <nhg AT ipa.fhg DOT de>
  • Author: Stuart Glaser, Shaun Edwards, Felix Messmer
  • License: BSD
  • Source: git https://github.com/ros-industrial/universal_robot.git (branch: kinetic)

Deprecation

This package has been deprecated and should no longer be used.

Please see ur_robot_driver for a replacement.

Refer to Deprecation of ur_modern_driver on ROS Discourse for more information.

Overview

This package is part of the ROS-Industrial program.

Compatibility

Please see the universal_robot page for information on compatible (Polyscope) system versions.

Network configuration

Standard TCP/IP connections are used to communicate with the Universal Robot controller. A working network configuration is therefore required.

For simple setups, a single, direct cable connection is probably sufficient. In the absence of a DHCP server on the ROS PC, configure both controller and PC with static IPs.

For more complex network setups (multiple subnets, NAT, VPN) be sure to allow traffic to pass unrestricted between the controller and your ROS PC. At a minimum: TCP port 30002 (PC to controller) and TCP port 50001 (controller to PC) should be usable.

In all cases, make sure to check that you can ping the controller from your ROS PC.

Nodes

ur_driver

Responsible for communication with the UR controller. Opens a custom socket connection and deserialises packets coming from the driver for trajectory relay and joint states.

Published Topics

joint_states (sensor_msgs/JointState)
  • Joint State for all joints of the connected robot.

Parameters

~max_velocity (double, default: 2.0)
  • Maximum joint velocity that may occur in a JointTrajectory. Submitting trajectories with velocities larger than this will result in an error being reported and the trajectory will not be executed. Units: rad/s.
~prefix (str, default: none)
  • Prefix to prepend to joint names (used in JointState publications, trajectory processing).
~prevent_programming (boolean, default: False)
  • May be used to prevent uploading of the URScript control program.
~robot_description (str, default: none)
  • The urdf robot description.

Overview

This package is part of the ROS-Industrial program.

Compatibility

Please see the universal_robot page for information on compatible (Polyscope) system versions.

Network configuration

Standard TCP/IP connections are used to communicate with the Universal Robot controller. A working network configuration is therefore required.

For simple setups, a single, direct cable connection is probably sufficient. In the absence of a DHCP server on the ROS PC, configure both controller and PC with static IPs.

For more complex network setups (multiple subnets, NAT, VPN) be sure to allow traffic to pass unrestricted between the controller and your ROS PC. At a minimum: ports used are 30002 & 30003 (from PC to controller), and port 50001 (controller to PC, configurable) (all TCP). For multi-controller setups, additional ports are opened on the ROS PC.

In all cases, make sure to check that you can ping the controller from your ROS PC.

Nodes

ur_driver

Responsible for communication with the UR controller. Connects to and deserialises packets from the secondary client interface and the Matlab interface, as well as a custom socket connection for trajectory relay and IO services.

Published Topics

io_states (ur_msgs/IOStates)
  • State of the digital and analogue inputs and outputs of the connected robot (10 Hz).
joint_states (sensor_msgs/JointState)
  • Joint State for all joints of the connected robot (125 Hz).
wrench (geometry_msgs/WrenchStamped)
  • The wrench (Force/Torque vector) at the TCP (125 Hz).

Parameters

~max_velocity (double, default: 10.0)
  • Maximum joint velocity that may occur in a JointTrajectory. Submitting trajectories with velocities larger than this will result in an error being reported and the trajectory will not be executed. Units: rad/s.
~min_payload (double, default: 0.0)
  • Minimum payload value accepted by SetPayload service. Units: Kg.
~max_payload (double, default: 1.0)
  • Maximum payload value accepted by SetPayload service. Units: Kg.
~prefix (str, default: none)
  • Prefix to prepend to joint names (used in JointState publications, trajectory processing).
~prevent_programming (boolean, default: False)
  • May be used to prevent uploading of the URScript control program.
~robot_description (str, default: none)
  • The urdf robot description.

Wiki: ur_driver (last edited 2019-11-23 13:05:48 by GvdHoorn)