공부 썸네일형 리스트형 kinematics와 dynamics 차이 https://taeyoung96.github.io/research/Kinematics_and_dynamics/ Kinematics 와 Dynamics 차이점 Kinematics와 Dynamics 그리고 Kinetic에 대해서 알아보자! taeyoung96.github.io 더보기 EasyInstallDeprecationWarning: easy_install command is deprecated.!! 더보기 ModuleNotFoundError: No module named 'ament_package' 빌드를 하려는데 ament package가 없다는 에러를 만났다. ament package 가 문제가 생겼나 구글링 해봤는데 그게 아니었다... ros2를 실행 안하고 colcon build를 해서 그런거였다..;;ㅋㅋㅋ,, rosfoxy 후 colcon build 하니까 이 에러는 해결ㅎㅎ 더보기 python3.8 설치 후 빌드 경고 빌드하면 노란색으로 뜬다 setuptools 버전 확인후 58.2보다 높으면 낮춰줘야 한다. 해결됐당 참고 https://answers.ros.org/question/396439/setuptoolsdeprecationwarning-setuppy-install-is-deprecated-use-build-and-pip-and-other-standards-based-tools/ SetuptoolsDeprecationWarning: setup.py install is deprecated. Use build and pip and other standards-based tools. - ROS Answers: SetuptoolsDeprecationWarning: setup.py install is deprecated.. 더보기 두개 서브스크라이버 받기 import rclpy from rclpy.node import Node from std_msgs.msg import Float32 class MinimalSubscriber(Node): def __init__(self): super().__init__('minimal_subscriber') self.id1_subscription = self.create_subscription( Float32, 'id1_curr_ang_rad', self.id1_listener_callback, 10) self.id1_subscription # prevent unused variable warning self.id1_subscription = self.create_subscription( Float32, 'id2_cur.. 더보기 gazebo의 model pose를 tf로 게시하기 gazebo를 실행하기 위해 world 파일을 생성한다. gazebo에서 model을 나타내는 방법은 robot spawn, world안에 model 생성 등이 있다. 아래 내용은 world로 생성한 model의 포즈를 구하고 tf로 게시 하는 방법이다. 1. world 파일에 plugin 추가 /gazebo 1.0 이 plugin을 world 파일에 넣는다. 매생이는 맨 위의 world name 밑에 넣었다. 2. model의 tf 게시 노드 tf게시하는 방법은 ros2 doc을 찾아보면 된다. https://docs.ros.org/en/rolling/Tutorials/Intermediate/Tf2/Writing-A-Tf2-Broadcaster-Py.html Writing a broadcaster (P.. 더보기 [ROS 2] marker 추적하는 2dof 로봇 오늘은 2축 로봇이 마커를 추적하여 상하좌우 움직이는 코드를 완성했다. https://www.youtube.com/watch?v=7Lscj_yttNk 코드 합치기 전에 1. marker_link의 tf 생성 노드 2. marker_link 와 fixed_link1의 lookuptransform 생성 노드 3. marker_link 와 fixed_link2의 lookuptransform 생성 노드 4. 2번째 노드의 값을 받아서 좌우 joint 동작 노드 5. 3번째 노드의 값을 받아서 상하 joint 동작 노드 이렇게 5개를 실행해야했다. 나는 그냥 런치파일에 넣고 싶었는데 교수님께서 노드를 한개로 합치라고 하셨다. 합치는 중에 tf2 브로드캐스트, tf2 리스너가 안 합쳐져서 1. marker_link.. 더보기 [ROS 2 Simulation] tf_broadcaste 사용해서 링크 좌표 게시하기 trajectory_marker_tf2_broadcaster.py 이 노드를 사용하면 aruco_poses로 받은 Pose 토픽을 받아서 tf로 rviz에 좌표를 게시 할 수 있다. quaternion_from_euler는 로테이션 값을 rpy로 바꿔 주는 것이다(자세한 설명 구글 참고) 사진이 좀 흐리긴 하지만 카메라에서 본 마커의 좌표를 게시 했다. 근데 좌표가 생성되는 위치가 gazebo 환경이랑 맞지 않아서 수정해야한다. 더보기 이전 1 2 3 다음