ROS1を使ってみる その6(MoveItのパッケージ作成、Open Manipulator)
はじめに
今回はOpen Manipulatorを練習の題材として、MoveItのパッケージを作成してみました。
ジョイントやリンクの親子関係などを記述したURDFファイルについては以前作成したので、MoveItで運動学の計算を行えるようにします。
手順が分かれば、自作のロボットアームの制御にも利用できそうです。
▼以前の記事はこちら
環境を構築する
▼WSL2でのUbuntu 20.04、ROS Noeticの環境構築についてはこちら
▼PCを買い替えたので、Windows 11で環境を再構築しました。Ubuntu 20.04が入っています。
data:image/s3,"s3://crabby-images/60715/607154ff9ea7f93593f66859f1149c3865386e08" alt=""
Open ManipulatorのURDFファイルを作成したときの手順を改めて掲載しておきます。
▼こちらの記事で作成しました。
以下のコマンドでurdf_testという名前のパッケージを作成し、Open Manipulatorのxmlファイルを作成します。
cd ~/catkin_ws/src
catkin_create_pkg urdf_test std_msgs rospy roscpp tf
cd urdf_test
mkdir urdf
cd urdf
sudo nano open_manipulator.xml
xmlファイルの中身は以下です。
<robot name="test_robot">
<link name="base_link"/>
<link name="link1">
<visual>
<geometry>
<mesh filename="package://urdf_test/urdf/chain_link1.stl" scale="0.001 0.001 0.001"/>
</geometry>
<origin xyz="0 -0.01 0" rpy="0 0 1.5708"/>
</visual>
</link>
<link name="link2">
<visual>
<geometry>
<mesh filename="package://urdf_test/urdf/chain_link2.stl" scale="0.001 0.001 0.001"/>
</geometry>
<origin xyz="0 0 0.035" rpy="0 0 1.5708"/>
</visual>
</link>
<link name="link3">
<visual>
<geometry>
<mesh filename="package://urdf_test/urdf/chain_link3.stl" scale="0.001 0.001 0.001"/>
</geometry>
<origin xyz="0 0 0" rpy="0 0 1.5708"/>
</visual>
</link>
<link name="link4">
<visual>
<geometry>
<mesh filename="package://urdf_test/urdf/chain_link4.stl" scale="0.001 0.001 0.001"/>
</geometry>
<origin xyz="0 0 0" rpy="0 0 1.5708"/>
</visual>
</link>
<link name="link5">
<visual>
<geometry>
<mesh filename="package://urdf_test/urdf/chain_link5.stl" scale="0.001 0.001 0.001"/>
</geometry>
<origin xyz="0 0 0" rpy="0 0 1.5708"/>
</visual>
</link>
<link name="grip_r">
<visual>
<geometry>
<mesh filename="package://urdf_test/urdf/chain_link_grip_r.stl" scale="0.001 0.001 0.001"/>
</geometry>
<origin xyz="0 0 0" rpy="0 0 1.5708"/>
</visual>
</link>
<link name="grip_l">
<visual>
<geometry>
<mesh filename="package://urdf_test/urdf/chain_link_grip_l.stl" scale="0.001 0.001 0.001"/>
</geometry>
<origin xyz="0 0 0" rpy="0 0 1.5708"/>
</visual>
</link>
<joint name="base" type="fixed">
<parent link="base_link"/>
<child link="link1"/>
</joint>
<joint name="joint1" type="revolute">
<parent link="link1"/>
<child link="link2"/>
<origin xyz="0 0 0" rpy="0 0 0"/>
<axis xyz="0 0 1"/>
<limit lower="-1.5" upper="1.5" effort="0" velocity="0"/>
</joint>
<joint name="joint2" type="revolute">
<parent link="link2"/>
<child link="link3"/>
<origin xyz="0 0 0.077" rpy="0 0 0"/>
<limit lower="-1.5" upper="1.5" effort="0" velocity="0"/>
</joint>
<joint name="joint3" type="revolute">
<parent link="link3"/>
<child link="link4"/>
<origin xyz="0 0.024 0.128" rpy="0 0 0"/>
<limit lower="-1.5" upper="1.5" effort="0" velocity="0"/>
</joint>
<joint name="joint4" type="revolute">
<parent link="link4"/>
<child link="link5"/>
<origin xyz="0 0.124 0" rpy="0 0 0"/>
<limit lower="-1.5" upper="1.5" effort="0" velocity="0"/>
</joint>
<joint name="joint_r" type="prismatic">
<parent link="link5"/>
<child link="grip_r"/>
<origin xyz="0 0.0875 0" rpy="0 0 0"/>
<limit lower="0.02" upper="0.038" effort="0" velocity="0.5"/>
</joint>
<joint name="joint_l" type="prismatic">
<parent link="link5"/>
<child link="grip_l"/>
<origin xyz="0 0.0875 0" rpy="0 0 0"/>
<limit lower="-0.038" upper="-0.02" effort="0" velocity="0.5"/>
</joint>
</robot>
▼CADのデータは以下からダウンロードしました。リポジトリが更新されたようで、場所と名前が少し変わっていました。
https://github.com/ROBOTIS-GIT/open_manipulator/tree/main/open_manipulator_x_description/meshes
▼xmlファイルと同じディレクトリに、部品のstlファイルを入れています。
data:image/s3,"s3://crabby-images/68785/687854aaeb55cc0f98e13ab1f44112245dc47152" alt=""
作成したxmlファイルをRVizで表示するのですが、WSLの場合は注意点があります。以前の記事にも書いていたことですが、export LIBGL_ALWAYS_SOFTWARE=trueを実行して環境変数を設定しておかないと、3Dモデルが表示されません。
以下のコマンドを実行して、RVizで表示してみました。
export LIBGL_ALWAYS_SOFTWARE=true
roslaunch urdf_tutorial display.launch model:=open_manipulator.xml
▼以下のように表示されたらOKです。
data:image/s3,"s3://crabby-images/8ea07/8ea071a8d41c3b18dff46e296f61b539509411f3" alt=""
Open Manipulatorのモデルが表示されたので、このモデルに対してMoveItのパッケージを作成します。
MoveItのパッケージを作成する
MoveIt Setup Assistantを起動する
MoveIt Setup Assistantでパッケージを生成しました。
▼こちらのページの手順が参考になりました。
以下のコマンドでMoveIt Setup Assistantを起動しました。
roslaunch moveit_setup_assistant setup_assistant.launch
▼以下のように起動しました。
data:image/s3,"s3://crabby-images/58aca/58acaa80ec01076b203b31398d39b13cac7c11ab" alt=""
▼Create New MoveIt Configuration Packageを選択すると、以下の画面が表示されました。
data:image/s3,"s3://crabby-images/8f422/8f4229e88a70c9ebba77ee93fa548499c7916316" alt=""
▼Browseを選択して、先程RVizで表示したxmlファイルを選択しました。
data:image/s3,"s3://crabby-images/0560f/0560f07b34436245c1ee6db3f19d22f62f613e40" alt=""
▼その後Load Filesを選択すると、Success!と表示されました。
data:image/s3,"s3://crabby-images/dda62/dda623338aae1fb30272ed5b5f5980e2e69fc62f" alt=""
▼なお、export LIBGL_ALWAYS_SOFTWARE=trueを設定していない場合は、3Dモデルが表示されていませんでした。
data:image/s3,"s3://crabby-images/3515c/3515c85cd6c7f6b1cec0464c95205dfafbde2b46" alt=""
左の欄から各項目を設定できるようになっています。今回はすべて設定するわけではありません。運動学の計算を行うのに必要な部分を設定していきます。
▼Self-Collision Checkingは特に何も起きませんでした。
data:image/s3,"s3://crabby-images/454a8/454a89d10ee828a910defa95e79e8091e2cc1bad" alt=""
▼Virtual Joints、End Effectors、Passive Jointsは設定していません。
data:image/s3,"s3://crabby-images/db04e/db04efa9b8f2d586fc799e25ceb51d084d0604d0" alt=""
data:image/s3,"s3://crabby-images/b6e0c/b6e0c7ea549f1fb6a226068528033eb2380c28a9" alt=""
data:image/s3,"s3://crabby-images/74adc/74adcc5da5fbff75b618233b7732d4bc7ccf9c23" alt=""
▼Simulationの欄でもURDFファイルの編集ができるようです。
data:image/s3,"s3://crabby-images/ae537/ae537ff6858326a59a61d2e4f70c7313b1692a14" alt=""
▼センサーの設定もできるようですね。
data:image/s3,"s3://crabby-images/8fa99/8fa99031074e6e48a963171b77f392e1a5208da0" alt=""
Planning Groups
Planning Groupsの欄で、ジョイントやリンクを設定しました。
▼Plannning Groupsを選択しました。
data:image/s3,"s3://crabby-images/f20f5/f20f51811cd233ce645d0a90d97d23986132e374" alt=""
▼Add Groupを選択すると、以下のように表示されました。
data:image/s3,"s3://crabby-images/96f95/96f95b4cb939d0f3cf192dc23d4dd6745bd34237" alt=""
▼以下のように設定後、Add Jointsを選択しました。
data:image/s3,"s3://crabby-images/df435/df4356ea3a9054e3779b36cc28304ac3363503be" alt=""
▼なおGroup Nameにスペースが含まれていた場合、Exception caught while processing action 'loadRobotModel'
というエラーが出ていました。
data:image/s3,"s3://crabby-images/149d5/149d5a8e862dbac987bc797f1fe1b34415b779da" alt=""
data:image/s3,"s3://crabby-images/42ee8/42ee8db6a46e97ad7c6d3a8b3def097348f8dcb0" alt=""
Add Linksを選択しました。
▼リンクを選択し、右側の欄に追加してから保存しました。
data:image/s3,"s3://crabby-images/03bac/03bac5a7d7dc4ed8d7818b6f931f0756d794391f" alt=""
Jointsを選択し、Edit Selectedを選択しました。
▼以下のように設定し、保存しました。
data:image/s3,"s3://crabby-images/9d682/9d68237774161d83646c087395eb9dbf8dac039b" alt=""
Chainを選択し、Edit Selectedを選択しました。
▼以下のように設定し、保存しました。
data:image/s3,"s3://crabby-images/eaf96/eaf963e6af08004e2d9722e9a1a09990d4716465" alt=""
▼最終的に以下のようになりました。
data:image/s3,"s3://crabby-images/bdb4f/bdb4f278b79bd85280dee3087d956d83c0e9c8d4" alt=""
Robot Poses
Robot Posesの欄で、ロボットの初期姿勢を設定しておきました。
▼Robot Posesを選択しました。
data:image/s3,"s3://crabby-images/b3a3e/b3a3e45702d9f77b9fec0fd611244f40e41593fd" alt=""
▼initとして姿勢を設定しておきました。
data:image/s3,"s3://crabby-images/43b6c/43b6cb5a4fbbc0a939b03e816e97be709ecd490e" alt=""
▼以下のように追加されました。
data:image/s3,"s3://crabby-images/8431a/8431a438c2e109b8b265815dcec21f09704d993b" alt=""
Controllers
Controllersの欄も設定しました。
▼Controllersを開きました。
data:image/s3,"s3://crabby-images/2e64f/2e64f486da3df4b312765f4a44057ffb06170f79" alt=""
▼Auto Add FollowjointsTrajectory Controllers For Each Planning Groupを選択すると、Jointsが追加されました。
data:image/s3,"s3://crabby-images/f038b/f038bfc832f282a439e0a5bb7e9d6d645aad7f6f" alt=""
data:image/s3,"s3://crabby-images/d6880/d6880f68b4819629b9e8dab568cdbb73b8ec1384" alt=""
Author Information
名前とメールアドレスを設定しておきました。
data:image/s3,"s3://crabby-images/99b02/99b02e1e0f1ce87f5adec3f906e91200ebfbfd25" alt=""
Configuration Files
最後に、Configuration Filesで設定します。
▼Configuration Filesの欄を開きました。
data:image/s3,"s3://crabby-images/4a7ea/4a7ea062a967770db210c9caf7cb047ab12294a7" alt=""
▼保存先を設定しました。catkin_ws/srcのフォルダに、open_manipulator_configという名前で保存されるようにしました。
data:image/s3,"s3://crabby-images/bfb00/bfb00ab9c9e13ef3b8ac8811a1d7291a3941d4b3" alt=""
なお、既存のパッケージの中にパッケージを作成するようなパスを指定すると、パッケージの作成に失敗したのでご注意ください。
Generate Packageでパッケージを作成します。
▼不足しているところがあるようですが、OKを選択して進めました。
data:image/s3,"s3://crabby-images/553c4/553c48182418c54cd52b19f878a887ead634bf17" alt=""
▼正常に作成できました!
data:image/s3,"s3://crabby-images/e1953/e1953f56e1bbe3db40c4341782b93d228ec733df" alt=""
再び編集するときは、Moveit Setup Assistantを起動して、Edit Existing MoveIt Configuration Packageを選択すると編集できます。
▼読み込むパッケージの場所は、先程作成したパッケージのパスです。
data:image/s3,"s3://crabby-images/03f2c/03f2c67f38f636cba709c7be3e5285160fef6bb8" alt=""
▼読み込み後、編集できるようになります。
data:image/s3,"s3://crabby-images/5da59/5da59c46831387848a88e5b6ffccbb512e9daf5d" alt=""
RVizで動かしてみる
パッケージは作成できたので、以下のコマンドでRViz上に表示してみました。
cd ~/catkin_ws
catkin_make
export LIBGL_ALWAYS_SOFTWARE=true
roslaunch open_manipulator_config demo.launch
▼なお、ここでもexport LIBGL_ALWAYS_SOFTWARE=trueを実行していない状態だと、3Dモデルが表示されませんでした。
data:image/s3,"s3://crabby-images/4482d/4482d4ece7a78e2b8449ace8a7453938c4c38974" alt=""
▼RVizで表示されました!
data:image/s3,"s3://crabby-images/ef26f/ef26fec5f374fc4afbe57a62d8f91847d9ba2ed0" alt=""
実際にRViz上で動かしてみました。
▼こんな感じで動きました。
▼エンドエフェクタを動かして、姿勢を変更することができました。
data:image/s3,"s3://crabby-images/27ed1/27ed10398fae3b499b862021d70e3b2c376aed9e" alt=""
最後に
MoveItのパッケージを作成できるようになったので、自分で設計したロボットアームや、パッケージが用意されていないロボットアームの制御に利用できそうです。
今回はRViz上で動かしましたが、トピック通信かサービス通信でエンドエフェクタの位置を送信して、他のジョイントの角度を計算できるようにしたいなと思っています。
▼Amazonで購入したロボットアームをMQTT通信で制御できるようにしたので、これをROSと連携させたいところです。