Parts Arrangement Robot
Parts Arrangement Robot Demo Video - [YouTube]
Environment
- Ubuntu 18.04
- ROS Melodic
- python 2.7
Installing
-
Install ROS
Follow these ROS Melodic installation instructions. You can select any of the default configurations in step 1.4; even the ROS-Base (Bare Bones) package (
ros-melodic-ros-base
) is enough. -
Download the code
$ cd ~/catkin_ws/src $ git clone https://github.com/Kminseo/Parts-Arrangement-Robot.git
-
Install python dependencies
$ cd ~/catkin_ws/src/Parts-Arrangement-Robot $ pip install -r requirements.txt
-
Install ROS dependencies
$ cd ~/catkin_ws $ rosdep install --from-paths src -i --rosdistro melodic $ sudo apt-get install ros-melodic-rosbash ros-melodic-ros-comm
-
Build
$ cd ~/catkin_ws $ catkin_make
Quick Start
$ roslaunch gripper_ur5 gazebo_env_setting.launch
$ roslaunch gripper_ur5_moveit_config moveit_planning_execution.launch
$ roslaunch yolov3_pytorch_ros detector.launch
$ rosrun gripper_ur5 robot_sorting_yolo.py
Node info - Launch 파일 설명
-
To simulate the robot environment launch the following:
$ roslaunch gripper_ur5 gazebo_env_setting.launch
gripper_ur5
패키지의gazebo_env_setting.launch
는 Gazebo Simulation환경 구성에 필요한 로봇, 테이블, 주변환경 등 불러오기 위한 launch파일. -
For setting up the MoveIt! nodes to allow motion planning run:
$ roslaunch gripper_ur5_moveit_config moveit_planning_execution.launch`
UR5 제어를 위해 Moveit을 사용하는데, UR5에 맞게 설정된 Moveit 패키지를 불러오기 위해 사용하는 Launch 파일
-
Start screw grasp detection node:
$ roslaunch yolov3_pytorch_ros detector.launch
Gazebo 환경에 설치된 카메라를 사용해 yolov3로 Obejct Detection을 하기위한 구성된 패키지이며,rqt
,rvize
를 사용해서 환경에 배치된screw
3종을 검출 및 분류 하는 것이 가능하다. -
Start screw sorting robot node:
$ rosrun gripper_ur5 robot_sorting_yolo.py
Moveit을 사용해로 로봇을 제어, 환경상의 3가지 종류의 스크류를 생성, yolov3를 포함하며 전체적인 Pick & Place에 대한 동작 코드를 포함합니다.