반응형

Robot Operating System 57

[Melodic][TF Tutorial] 6. Time travel with tf (Python)

1. Time travel $ roscd learning_tf $ nano ./nodes/turtle_tf_listener.py #!/usr/bin/env python import roslib roslib.load_manifest('learning_tf') import rospy import math import tf import geometry_msgs.msg import turtlesim.srv if __name__ == '__main__': rospy.init_node('turtle_tf_listener') listener = tf.TransformListener() rospy.wait_for_service('spawn') spawner = rospy.ServiceProxy('spawn', turt..

[Melodic][TF Tutorial] 5. Learning about tf and time (Python)

1. tf and Time In the previous tutorials we learned about how tf keeps track of a tree of coordinate frames. This tree changes over time, and tf stores a time snapshot for every transform (for up to 10 seconds by default). Until now we used the lookupTransform() function to get access to the latest available transforms in that tf tree, without knowing at what time that transform was recorded. Th..

[Melodic][TF Tutorial] 4. Adding a frame (Python)

Env. VMware workstation(Ubuntu 18.04 amd64, ROS Melodic) 1.Why adding frames 많은 경우, local frame을 사용하여 생각하는 것이 쉽다. 예를 들어, laser scan에 대해 추론하는 경우, laser scanner의 중심에 있는 프레임을 사용하는게 쉽다. tf는 각각의 sensor, link에 대해 local frame을 정의할 수 있게 하며, tf는 모든 프레임에 대한 transform을 관리해준다. 2. Where to add frames tf는 tree구조를 사용한다. 그리고 closed loop를 허용하지 않는다. 이 의미는 오직 하나의 parent만을 허용하고, 다수의 children을 가질 수 있다. 위의 그림에서는 3 fr..

[Melodic][TF Tutorial] 3. Writing a tf listener (Python)

Env. VMware workstation(Ubuntu 18.04 amd64, ROS Melodic) 1. How to create a tf listener $ roscd learning_tf $ nano ./nodes/turtle_tf_listener.py #!/usr/bin/env python import roslib roslib.load_manifest('learning_tf') import rospy import math import tf import geometry_msgs.msg import turtlesim.srv if __name__ == '__main__': rospy.init_node('turtle_tf_listener') listener = tf.TransformListener() r..

[Melodic][TF Tutorial] 2. Writing a tf broadcaster (Python)

Env. VMware workstation(Ubuntu 18.04 amd64, ROS Melodic) 0. Create package $ mkdir -p ~/catkin_ws/src $ cd ~/catkin_ws/src $ catkin_create_pkg learning_tf tf roscpp rospy turtlesim $ cd .. $ catkin_make $ source ./devel/setup.bash 1. How to broadcast transforms $ roscd learning_tf $ mkdir nodes $ nano ./nodes/turtle_tf_broadcaster.py #!/usr/bin/env python import roslib roslib.load_manifest('lear..

[Melodic][TF Tutorial] 1. Introduction to tf

Env. VMware workstation(Ubuntu 18.04 amd64, ROS Melodic) 1. Set Up the Demo $ sudo apt-get install ros-melodic-ros-tutorials ros-melodic-geometry-tutorials ros-melodic-rviz ros-melodic-rosbash ros-melodic-rqt-tf-tree 2. Running the Demo # 1st termial $ roslaunch turtle_tf turtle_tf_demo.launch 두 거북이가 나타난다. turtle1(가운데 있는 거북이)를 화살표로 조정할 수 있으며(roslaunch를 실행한 terminal에 화살표 입력), turtle2(다른 거북이)가 따라간..

[ROS Melodic] CMake Error at /opt/ros/melodic/share/image_geometry/cmake/image_geometryConfig.cmake:113 (message):

Env. Nvidia Jetson Xavier NX (Jetpack 4.5.1, Ubuntu 18.04) ROS Melodic 에러 현상 CMake Error at /opt/ros/melodic/share/image_geometry/cmake/image_geometryConfig.cmake:113 (message): Project 'image_geometry' specifies '/usr/include/opencv' as an include dir, which is not found. It does neither exist as an absolute directory nor in '${{prefix}}//usr/include/opencv'. Check the website 'http://www.ros.o..

[Foxy] 표윤석 박사님, 임태훈님 ROS 강좌 with 책, 네이버 카페

https://cafe.naver.com/openrt/24070 000 로봇 운영체제 ROS 강좌 목차 로봇 운영체제 ROS 강좌 목차 - ROS 1 / 2 강좌 목차 - Created Date: 2020.07.13 Modified Date: 2021.07.30 revision... cafe.naver.com 위 링크에서 내용을 확인하세요!! [ROS 2 (2021)] 2020년 8월부터 2021년 5월까지 약 10개월간 ROS 2 온라인 세미나를 진행하며 준비한 강의 자료와 세미나 참가자분들의 피드백을 담은 책이 출간되어 기쁜 마음에 공유합니다. 전문 편집자와 디자이너가 함께 만드니 더욱 완성도가 더욱 높아졌어요. 많은 관심 부탁드려요. - [YES24] http://www.yes24.com/Produ..

[Kinetic] ROS 로봇 프로그래밍 강의 with 책, 네이버 카페, Youtube, PDF

[ROS 1 (2013~2018)] (종료) > 로봇 운영체제 ROS 1 강좌 목차 (총 76개) 로봇 운영체제 ROS 1 강좌 목차 로봇 운영체제 강좌 - ROS 1 강좌 목차 - Created Date: 2013.09.05Modified Date: 2015.03.02revision 45 키워드 : ROS... cafe.naver.com * 참고: 2018년 1월 이후 ROS 1 연재 강좌는 종료하고 위의 ROS 2 강좌를 연재하고 있습니다. ​ > 로봇 운영체제 ROS 1 온라인 강의 모음 (유튜브 강의 동영상 14개) - https://www.youtube.com/playlist?list=PLRG6WP3c31_VIFtFAxSke2NG_DumVZPgw ROS Courses (한국어) https://g..

반응형