DRC vehicle tele operation with Atlas - modulabs/gazebo-tutorial GitHub Wiki
๊ฐ์
vrcํ๋ก๊ทธ์ธ์ ์ด์ฉํด์ ์ํ๋ผ์ค ๋ก๋ด์ ์๋์ผ๋ก ์๋์ฐจ ์ํธ๊น์ง ์ด๋์ํค๋ ๋ฐฉ๋ฒ์ ๋๋ค. ํ ์คํธ ์ฉ์ ๋๋ค. ์๋์ผ๋ก ์๋์ฐจ์์ ๋๊ฐ๊ณ ๋ค์ด๊ฐ๊ฒ๋๋ค.
Install DRC Simulator
DRC simulator ์ associated utilities.๋ฅผ ์ค์นํ์ธ์
Launch the DRC Simulator
the atlas_drc_vehicle_fire_hose.launch ๋ฅผ ์ด์ฉํด์ ์คํํ๋ผ
VRC_CHEATS_ENABLED=1 roslaunch drcsim_gazebo atlas_drc_vehicle_fire_hose.launch
์ํ๋ผ์ค ๋ก๋ด์ ์๋์ฐจ ๊ทผ์ฒ์ ์์น์ํค์ธ์
The VRC plugin์ ์๋์ ๋ค์ด๊ฐ๊ณ ๋๊ฐ๋ ROS topics์ ๋ณด์ฌ์ค๋๋ค. ์ด ํ ํฝ๋ค์ ์๋์ ์ด๋๊ณณ์ผ๋ก ๋ถํฐ๋ผ๋ ํธ์ถ๋ ์ ์์ต๋๋ค
/drc_world/robot_enter_car
/drc_world/robot_exit_car
์ด ํ ํฝ์ ์์น๋ฉ์ธ์ง๋ฅผ ์ทจํฉ๋๋ค, ๋ํดํธ์์น๋ก ๋ถํฐ ์ต์ ๋งํผ ์๋ฌผ๋ ์ดํฐ ์คํํ 10์ด๋ฅผ ๊ธฐ๋ค๋ฆฌ์ธ์, ์ํธ๋ผ์ค๊ฐ ์ค๋น๋ ์ ์๋๋ก ์ํ๋ผ์ค๋ฅผ ์ด์ ์์ ์ฌ์ด๋ ๋์ด๋ฐ์ ์์น์ํค๊ธฐ์ํด์, robotexitcar topic์ ์ด์ฉํ์ธ์~
rostopic pub --once /drc_world/robot_exit_car geometry_msgs/Pose '{ position: {x: -0.58, y: -0.2}}'
์น๊ฐ์ชฝ ์๋ฆฌ๋ก ๋ก๋ด์ ์์น์ํค์ธ์
rostopic pub --once /drc_world/robot_exit_car geometry_msgs/Pose \
'{ position: {x: -0.5, y: -3.5}, orientation: {w: 0.707, z: 0.707}}'
๋ช์ด๋ฅผ ๊ธฐ๋ค๋ฆฌ์ธ์. robotexitcar messages๋ฅผ ๋ณด๋ด๊ฑฐ๋ ์๋ฌผ๋ ์ดํฐ๊ฐ ์ค๋น๋๊ธฐ ์ํด์ ๊ธฐ๋ค๋ฆฌ์ธ์
the Atlas robot๋ฅผ vehicle์ ์์น์์ผ์ฃผ์ธ์~
์ด์ ์ ์ํธ์์ ์ํ๋ผ์ค๋ฅผ ๋ฃ์ด์ฃผ์ธ์. robotentercar topic ๊ณผ identity pose๋ฅผ ์ด์ฉํด์ ์ด๋์ํต๋๋ค.
rostopic pub --once /drc_world/robot_enter_car geometry_msgs/Pose '{}'
์ํ๋ผ์ค๋ฅผ ์์น์ต์ ์ ํน์ง์ง์ด์ ์ด์ ์ ์ํธ์ ์์น์ํค์ธ์
rostopic pub --once /drc_world/robot_enter_car geometry_msgs/Pose '{position: {y: -0.6, z: 0.01}}'
VRC plugin์ ์๋์ฐจ์์ ์ํ๋ผ์ค ์ํค๊ธฐ ์ํด ๊ณ ์ ๋ ์กฐ์ธํธ๋ฅผ ์ด์ฉํฉ๋๋ค.
์๋์ฐจ ์์ ์ํ๋ผ์ค๋ก perception์ ํ ์คํธ
์ํ๋ผ์ค๋ฅผ ์๋์ฐจ์ ํ์ฐ๊ณ , ๋น์ ์ ๋ค๋ฅธ ์ง์นจ์์ ์๋ ๋ฐฉ๋ฒ์ ์ด์ฉํ ์์์ต๋๋ค. ์๋์ฐจ๊ฐ ์ด๋์ค์ perception systems ์ ํ ์คํธ ํ ์์์ต๋๋ค.
๋ธ๋ ์ดํฌ๋ฅผ ํธ์ธ์
rostopic pub --once /drc_vehicle_xp900/hand_brake/cmd std_msgs/Float64 '{ data : 0 }'
์กฐํฅํ ๋๋ฆฌ๊ธฐ
rostopic pub --once /drc_vehicle_xp900/hand_wheel/cmd std_msgs/Float64 '{ data : 3.14 }'
gas pedal ๋๋ฅด๊ธฐ
rostopic pub --once /drc_vehicle_xp900/gas_pedal/cmd std_msgs/Float64 '{ data : 1 }'
์ด์ ์๋์ฐจ๋ ์น๊ฐ์ํธ์์ ์ํ๋ผ์ค์ ๋๋ผ์ด๋น ํด์ผํฉ๋๋ค. rviz ๋ฅผ ์ด์ฉํ ์ง์นจ์๋ฅผ ๋ฌ์ฌํฉ๋๋ค. ๋น์ ์ rviz๋ฅผ ์ด์ฉํ ์ ์์ต๋๋ค.
Atlas robot's foot๋ฅผ ์ด์ฉํ์ธ์, ๊ฐ์ค ํจ๋ฌ์ ์ด์ฉํ๊ธฐ์ํด