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 to prepend to joint names (used in JointState publications, trajectory processing).
- May be used to prevent uploading of the URScript control program.
- The urdf robot description.