차이
문서의 선택한 두 판 사이의 차이를 보여줍니다.
양쪽 이전 판 이전 판 다음 판 | 이전 판 | ||
activity:public:2020:ros:210216 [2021/02/17 16:56:07] – [1.3.] gakscoriora1 | activity:public:2020:ros:210216 [2021/02/17 19:58:32] (현재) – david | ||
---|---|---|---|
줄 6: | 줄 6: | ||
=====1. ===== | =====1. ===== | ||
+ | <sxh> | ||
+ | </ | ||
====1.1. ==== | ====1.1. ==== | ||
줄 14: | 줄 16: | ||
====1.2. ==== | ====1.2. ==== | ||
- | ====1.3. ==== | + | ====1.3. |
+ | === urdf 파일 만들기 === | ||
+ | <sxh bash> | ||
+ | cd ~/ | ||
+ | catkin_create_pkg testbot_description urdf | ||
+ | cd testbot_description | ||
+ | mkdir urdf | ||
+ | cd urdf | ||
+ | gedit testbot.urdf | ||
+ | </ | ||
+ | **urdf ** | ||
+ | <sxh xml title: | ||
+ | <?xml version=" | ||
+ | <robot name=" | ||
+ | < | ||
+ | <color rgba=" | ||
+ | </ | ||
+ | < | ||
+ | <color rgba=" | ||
+ | </ | ||
- | <sxh>sudo apt-get install ros-melodic-ros-controllers ros-melodic-gazebo* ros-melodic-moveit* ros-melodic-industrial-core< | + | |
- | <sxh> | + | <joint name=" |
+ | <parent link=" | ||
+ | <child link=" | ||
+ | </ | ||
+ | |||
+ | <link name=" | ||
+ | < | ||
+ | <origin xyz="0 0 0.25" rpy="0 0 0"/> | ||
+ | < | ||
+ | <box size=" | ||
+ | </ | ||
+ | </ | ||
+ | < | ||
+ | <origin xyz="0 0 0.25" rpy="0 0 0"/> | ||
+ | < | ||
+ | <box size=" | ||
+ | </ | ||
+ | < | ||
+ | </ | ||
+ | < | ||
+ | <origin xyz="0 0 0.25" rpy="0 0 0"/> | ||
+ | <mass value=" | ||
+ | <inertia ixx=" | ||
+ | </ | ||
+ | </ | ||
+ | |||
+ | <joint name=" | ||
+ | <parent link=" | ||
+ | <child link=" | ||
+ | <origin xyz="0 0 0.5" rpy="0 0 0"/> | ||
+ | <axis xyz="0 0 1"/> | ||
+ | <limit effort=" | ||
+ | </ | ||
+ | |||
+ | <link name=" | ||
+ | < | ||
+ | <origin xyz="0 0 0.25" rpy="0 0 0"/> | ||
+ | < | ||
+ | <box size=" | ||
+ | </ | ||
+ | </ | ||
+ | < | ||
+ | <origin xyz="0 0 0.25" rpy="0 0 0"/> | ||
+ | < | ||
+ | <box size=" | ||
+ | </ | ||
+ | < | ||
+ | </ | ||
+ | < | ||
+ | <origin xyz="0 0 0.25" rpy="0 0 0"/> | ||
+ | <mass value=" | ||
+ | <inertia ixx=" | ||
+ | </ | ||
+ | </ | ||
+ | |||
+ | <joint name=" | ||
+ | <parent link=" | ||
+ | <child link=" | ||
+ | <origin xyz="0 0 0.5" rpy="0 0 0"/> | ||
+ | <axis xyz="0 1 0"/> | ||
+ | <limit effort=" | ||
+ | </ | ||
+ | |||
+ | <link name=" | ||
+ | < | ||
+ | <origin xyz="0 0 0.5" rpy="0 0 0"/> | ||
+ | < | ||
+ | <box size=" | ||
+ | </ | ||
+ | </ | ||
+ | < | ||
+ | <origin xyz="0 0 0.5" rpy="0 0 0"/> | ||
+ | < | ||
+ | <box size=" | ||
+ | </ | ||
+ | < | ||
+ | </ | ||
+ | < | ||
+ | <origin xyz="0 0 0.5" rpy="0 0 0"/> | ||
+ | <mass value=" | ||
+ | <inertia ixx=" | ||
+ | </ | ||
+ | </ | ||
+ | |||
+ | <joint name=" | ||
+ | <parent link=" | ||
+ | <child link=" | ||
+ | <origin xyz="0 0 1.0" rpy="0 0 0"/> | ||
+ | <axis xyz="0 1 0"/> | ||
+ | <limit effort=" | ||
+ | </ | ||
+ | |||
+ | <link name=" | ||
+ | < | ||
+ | <origin xyz="0 0 0.25" rpy="0 0 0"/> | ||
+ | < | ||
+ | <box size=" | ||
+ | </ | ||
+ | </ | ||
+ | < | ||
+ | <origin xyz="0 0 0.25" rpy="0 0 0"/> | ||
+ | < | ||
+ | <box size=" | ||
+ | </ | ||
+ | < | ||
+ | </ | ||
+ | < | ||
+ | <origin xyz="0 0 0.25" rpy="0 0 0"/> | ||
+ | <mass value=" | ||
+ | <inertia ixx=" | ||
+ | </ | ||
+ | </ | ||
+ | |||
+ | </ | ||
+ | |||
+ | |||
+ | </ | ||
+ | ==========================================================================================================================\\ | ||
+ | 문법검사 | ||
+ | <sxh bash title: | ||
+ | check_urdf testbot.urdf | ||
+ | </ | ||
+ | |||
+ | 그래프 표시 | ||
+ | <sxh bash title: | ||
+ | urdf_to_graphiz testbot.urdf | ||
+ | </ | ||
+ | |||
+ | ==========================================================================================================================\\ | ||
+ | |||
+ | \\ | ||
+ | \\ | ||
+ | \\ | ||
+ | \\ | ||
+ | |||
+ | \\ | ||
+ | \\ | ||
+ | \\ | ||
+ | 런치파일 생성 | ||
+ | <sxh bash title 런치파일 생성> | ||
+ | cd ~/ | ||
+ | mkdir launch | ||
+ | cd launch | ||
+ | gedit testbot.launch | ||
+ | </ | ||
+ | |||
+ | |||
+ | |||
+ | |||
+ | |||
+ | |||
+ | launch | ||
+ | <sxh xml title: | ||
+ | < | ||
+ | <arg name=" | ||
+ | <arg name=" | ||
+ | <param name=" | ||
+ | <param name=" | ||
+ | <node name=" | ||
+ | <node name=" | ||
+ | </ | ||
+ | </ | ||
+ | |||
+ | |||
+ | |||
+ | <sxh bash> | ||
+ | roslaunch testbot_description testbot.launch | ||
+ | rviz | ||
+ | </ | ||
+ | |||
+ | |||
+ | |||
+ | <sxh bash title: | ||
+ | sudo apt-get install ros-melodic-ros-controllers ros-melodic-gazebo* ros-melodic-moveit* ros-melodic-industrial-core | ||
+ | </ | ||
+ | |||
+ | < | ||
cd ~/ | cd ~/ | ||
git clone https:// | git clone https:// | ||
git clone https:// | git clone https:// | ||
- | git clone https:// | + | git clone https:// |
git clone https:// | git clone https:// | ||
git clone https:// | git clone https:// | ||
줄 39: | 줄 236: | ||
- | <sxh> | + | |
+ | < | ||
roslaunch open_manipulator_description open_manipulator_rviz.launch | roslaunch open_manipulator_description open_manipulator_rviz.launch | ||
roslaunch open_manipulator_gazebo open_manipulator_gazebo.launch | roslaunch open_manipulator_gazebo open_manipulator_gazebo.launch | ||
</ | </ | ||
+ | 조인트 2번째 포지션 변경 | ||
+ | rostopic pub / | ||
- | <sxh> | + | < |
roslaunch open_manipulator_description open_manipulator_rviz.launch | roslaunch open_manipulator_description open_manipulator_rviz.launch | ||
roslaunch open_manipulator_control_gui open_manipulator_control_gui.launch | roslaunch open_manipulator_control_gui open_manipulator_control_gui.launch | ||
</ | </ | ||
+ | |||
+ | |||
+ | |||
+ |