UR5LegoVision icon indicating copy to clipboard operation
UR5LegoVision copied to clipboard

Vision-Based Lego Detection, Localization, and Assembly Using UR5 Robot Arm

Results 32 UR5LegoVision issues
Sort by recently updated
recently updated
newest added

The object on table seems have a tiny movement, caused by the less friction amount between them. This can lead to inaccuracy when assemblying objects.

bug
enhancement

ee pose will be published to this topic: ```python self.pub_ee_pose = ros.Publisher("/ur5/ee_pose", geometry_msgs.msg.Pose, queue_size=1, tcp_nodelay=True) ```

bug
kinematics
motion planning

Table mesh (tavolo) has been added to the robot description to help moveit generate collision detection. This effects: - params.py: ``` 'spawn_x' : 0.5, 'spawn_y' : 0.35, 'spawn_z' : 1.75,...

documentation
enhancement
dataset

Set limit area for placing lego blocks to avoid singularity.

enhancement
kinematics

When launching `main` and `moveit`, both of them publish the same TF. ![Image](https://github.com/anhtuduong/UR5BlokVision/assets/76017474/a97c63d1-bb4f-474f-b068-a9910bd056de)

bug

3 fingers gripper is currently controlled by a ROS service: ```python ros.Service('move_gripper', generic_float, self.move_gripper_callback) ``` But it seems to move parallelly with robot joint, which is a bug.

kinematics

## Inverse Kinematics The inverse kinematics problem involves finding the joint angles that correspond to a desired end-effector position and orientation. The UR5 robot arm has six revolute joints, and...

kinematics

enhancement
motion planning
object detection
object localization
point cloud

### Transformation Point cloud taken from ZED camera is based on the camera's frame. We need to transform every point cloud to world's frame as it is the base frame....

enhancement
object detection
object localization
point cloud