![]() |
moveit_ur5_interface package from ros2_pick_and_place_ur5 repomoveit_ur5_interface moveit_ur5_msgs pnp_actionlib pnp_msgs robotiq_description ur5_gripper_description ur5_gripper_moveit_config |
Package Summary
Tags | No category tags. |
Version | 0.0.0 |
License | TODO: License declaration |
Build type | AMENT_CMAKE |
Use | RECOMMENDED |
Repository Summary
Checkout URI | https://github.com/juotungchen/ros2_pick_and_place_ur5.git |
VCS Type | git |
VCS Version | master |
Last Updated | 2025-01-09 |
Dev Status | UNMAINTAINED |
CI status | No Continuous Integration |
Released | UNRELEASED |
Tags | No category tags. |
Contributing |
Help Wanted (0)
Good First Issues (0) Pull Requests to Review (0) |
Package Description
Additional Links
Maintainers
- justin
Authors
Moveit UR5 Interface
This package provides a service/client interface between the official Universal Robots ROS2 Driver and the Moveit2 API. The package takes position commands in the form of geometry_msgs/msg/Pose via ROS2 service and generates a trajectory. It then uses the UR5 ROS2 driver to control the robot and follow the trajectory.
</br>
Launch Files
The package provides the following launch file:
- moveit_ur5_interface.launch
This launch file starts the UR5 driver and the Moveit2 server with custom settings. It launches the UR5 Moveit configuration with the UR type selected as UR5e and opens Rviz. The fake controller for UR5e with ROS2 control is also launched.
</br>
Executables
The package provides the following executables:
- moveit_server_node.cpp
This node initiates a server that communicates with the move group node when receiving a planning request.
- moveit_client_node.cpp
This is an example client node that sends a planning request to the moveit_server_node.cpp. It constructs and sends a request to the server by calling the following function (overloaded with two variants):
call(const double &x, const double &y, const double &z, const double &q_x, const double &q_y, const double &q_z, const double &q_w);
call(const geometry_msgs::msg::Pose &target_pose);
- moveit_interface.cpp
This is an example of using the Moveit C++ API to control the UR5. It uses the move group to plan and execute a path for the UR5. It does the same thing as moveit_server but without the ability to initiate a planning request from the client.
</br>
Usage
- To send a planning request from the command line, use the following commands:
ros2 launch moveit_ur5_interface moveit_ur5_interface.launch
ros2 service call /moveit_ur5/target_pose moveit_ur5_msgs/srv/PlanRequest "{target:{position: {x: -0.3, y: -0.4, z: 0.6}, orientation: {x: -1.0, y: 0.0, z: 0.0, w: 0.0}}}"
- To send a plan request from the client node, modify the target within the moveit_client_node.cpp file and use the following commands:
ros2 launch moveit_ur5_interface moveit_ur5_interface.launch
ros2 run moveit_ur5_interface moveit_cli_node
Wiki Tutorials
Package Dependencies
System Dependencies
Dependant Packages
Name | Deps |
---|---|
pnp_actionlib |