======ROS 스터디 #11: 매니퓰레이터====== 2021년 02월 17일 수요일 19:00\\ ZOOM 화상회의 =====1. ===== ====1.1. ==== ====1.2. ==== ====1.3. urdf 파일 만들기 및 실행 ==== === urdf 파일 만들기 === cd ~/catkin_ws/src catkin_create_pkg testbot_description urdf cd testbot_description mkdir urdf cd urdf gedit testbot.urdf **urdf ** ==========================================================================================================================\\ 문법검사 check_urdf testbot.urdf 그래프 표시 urdf_to_graphiz testbot.urdf ==========================================================================================================================\\ \\ \\ \\ \\ \\ \\ \\ 런치파일 생성 cd ~/catkin_ws/src/testbot_description mkdir launch cd launch gedit testbot.launch launch roslaunch testbot_description testbot.launch rviz sudo apt-get install ros-melodic-ros-controllers ros-melodic-gazebo* ros-melodic-moveit* ros-melodic-industrial-core cd ~/catkin_ws/src git clone https://github.com/ROBOTIS-GIT/DynamixelSDK.git git clone https://github.com/ROBOTIS-GIT/dynamixel-workbench.git git clone https://github.com/ROBOTIS-GIT/dynamixel-workbench-msgs.git git clone https://github.com/ROBOTIS-GIT/open_manipulator.git git clone https://github.com/ROBOTIS-GIT/open_manipulator_msgs.git git clone https://github.com/ROBOTIS-GIT/open_manipulator_simulations.git git clone https://github.com/ROBOTIS-GIT/robotis_manipulator.git cd ~/catkin_ws&&catkin_make roslaunch open_manipulator_description open_manipulator_rviz.launch roslaunch open_manipulator_gazebo open_manipulator_gazebo.launch 조인트 2번째 포지션 변경 rostopic pub /open_manipulator_chain/joint2_position/command std_msgs/Float64 "data: 1.0" --once roslaunch open_manipulator_description open_manipulator_rviz.launch roslaunch open_manipulator_control_gui open_manipulator_control_gui.launch