// it's for Latex

pages

[SLAM] #07. gazebo erle-copter teleoperation (원격조종) / solving yaw rotation problem

이제 우리가 사용하기 위한 기본적인 Drone with Depth Camera Model은 준비되었다.
그렇다면 다음은 이 Drone을 조작하는 방법을 숙지해야 한다.


SLAM 작업환경
OS : Ubuntu 16.06 LTS
ROS version : Kinetic
Compiler : catkin
Depth Camera : Intel realsene D435

Simulation 작업환경
OS: Ubuntu 14.04 LTS
ROS version : Indigo
Compiler : catkin
Depth Camera : Kinect Sensor


1. Making mavlink_bridge.launch
(Ref. http://docs.erlerobotics.com/simulation/vehicles/erle_copter/tutorial_2)

2. ros_erle_teleoperation package compile
(Ref. http://docs.erlerobotics.com/simulation/vehicles/erle_copter/tutorial_4)

$ cd ~/simulation/ros_catkin_ws/src
$ git clone https://github.com/erlerobot/ros_erle_teleoperation
$ cd ..
$ catkin_make --pkg ros_erle_teleoperation
 
3. Launch ArduCopter
(Ref. http://docs.erlerobotics.com/simulation/vehicles/erle_copter/tutorial_1)
 
$ source ~/simulation/ros_catkin_ws/devel/setup.bash
$ cd ~/simulation/ardupilot/ArduCopter
$ ../Tools/autotest/sim_vehicle.sh -j 4 -f Gazebo 

4. Launch Spawn
(Ref. http://docs.erlerobotics.com/simulation/vehicles/erle_copter/tutorial_1)
 
$ source ~/simulation/ros_catkin_ws/devel/setup.bash
$ roslaunch ardupilot_sitl_gazebo_plugin erlecopter_spawn.launch 
 
5. Launch mavlink_bridge.launch

$ source ~/simulation/ros_catkin_ws/devel/setup.bash
$ roslaunch mavros mavlink_bridge.launch 
 
6. Run Teleoperation


$ source ~/simulation/ros_catkin_ws/devel/setup.bash
$ rosrun ros_erle_teleoperation ros_erle_teleoperation
 
Controler 조작법은 다음 영상에서 참고한다.
https://youtu.be/OWQlLTyxA7E 
 
처음에 STABLIZE MODE에서 Calibration을 해주고 난 뒤
LOITER모드에서 오른쪽 아래로 커서를 당겼다가 올려주면 drone이 뜬다. 
 
Flight Mode 들에 대한 자세한 설명은 다음 사이트들을 참고하자.
https://www.internetmap.kr/entry/APMCompter-Flight-Mode
https://blog.naver.com/zhl22hot/220724525503 
 

!!Error!!

 
원격조종 도중 drone이 회전을 시도할 때 마다 제대로 조작이 안되는 현상이 발견되었다.
처음에는 APM Planner 설정이 잘못되었나 하고 다양한 시도들을 해보았지만 해결되지 않았다.
더 조사해본 결과, simulation간에 사용하는 rotors_simulation의 소스 중 문제가 있는 부분이 있는 것을 알았고
다음 사이트를 참고하여 해당 code를 수정해주면 된다.

https://github.com/ethz-asl/rotors_simulator/commit/71c1ddef1ff42345090a2dd8e112683ecf7ac46f

해당 문제에 대해 다룬 forum
http://forum.erlerobotics.com/t/yaw-rotation-with-mavros/2418/36


 
 

댓글 없음:

댓글 쓰기