반응형

분류 전체보기 308

[Docker] Docker를 이용하여 ROS 실행 및 GUI 보는 방법

https://jstar0525.tistory.com/202 [Docker] Deep Learning 및 ROS 연구 개발 환경 setting 내가 사용하는 딥러닝 개발 환경에 대하여 서술하고자 한다. Deep Learning과 관련하여 우리 연구실에서 다수의 연구원들이 개별 PC에서 서버로 ssh를 통하여 접속하고 GPU들을 사용을 한다. 지금까지 jstar0525.tistory.com 위에서 언급한 Docker 설정 후, ROS를 실행하고 GUI를 보는 방법은 아래와 같다. 여기에서는 아래의 두가지 방법으로 GUI를 띄우는 방법을 알아본다. ※주의 : Windows11에서는 GUI가 실행되지 않거나 문제가 있을 수 있음 (2023년 1월 21일 기준) Docker에서 GUI 띄우는 방법 Ubuntu ..

Development/Docker 2022.09.01

[Docker] Docker 사용법

https://jstar0525.tistory.com/202 [Docker] Deep Learning 및 ROS 연구 개발 환경 setting 내가 사용하는 딥러닝 개발 환경에 대하여 서술하고자 한다. Deep Learning과 관련하여 우리 연구실에서 다수의 연구원들이 개별 PC에서 서버로 ssh를 통하여 접속하고 GPU들을 사용을 한다. 지금까지 jstar0525.tistory.com 위와 같이 Docker 환경 설정 후 docker의 사용방법을 정리하면 아래와 같다. Docker 사용법 PC에서 mobaxterm을 이용하여 서버로 ssh 접속하여 아래와 같은 설정을 진행한다. 도커 권한 부여 $ sudo usermod -aG docker [username] $ sudo service docker r..

Development/Docker 2022.09.01

[VScode] VScode로 windows 환경에서 Docker 접속하기 위한 환경 설정

0. VScode 설치 https://code.visualstudio.com/download Download Visual Studio Code - Mac, Linux, Windows Visual Studio Code is free and available on your favorite platform - Linux, macOS, and Windows. Download Visual Studio Code to experience a redefined code editor, optimized for building and debugging modern web and cloud applications. code.visualstudio.com 1. VScode Extensions에 Docker install 2...

Development/VScode 2022.09.01

[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..

반응형