geometry_tutorials icon indicating copy to clipboard operation
geometry_tutorials copied to clipboard

ROS geometry_tutorials stack migrated from https://kforge.ros.org/geometry/tutorials/branches

Results 6 geometry_tutorials issues
Sort by recently updated
recently updated
newest added

Hello all! I am not sure if this is the right place but I was not able to locate the sources for *turtle_tf* for *ros-noeitc*. Otherwise I would have forked...

ros1

Hi, I just followed [introduction to tf2](http://wiki.ros.org/tf2/Tutorials/Introduction%20to%20tf2) and on`turtle_tf2_demo.launch` I got this traceback: ``` Traceback (most recent call last): File "/opt/ros/noetic/lib/turtle_tf2/turtle_tf2_broadcaster.py", line 35, in import rospy File "/opt/ros/noetic/lib/python3/dist-packages/rospy/__init__.py", line 47,...

ros1

Hi, I am trying to learn how to use tf2 with the tutorial but I have some problems with one. I am working with Ubuntu 18.04 LTS with ROS Melodic....

As discussed [here](https://answers.ros.org/question/374986/how-to-use-transformpose-in-python-with-time0-most-recent-common-time/?comment=375052#post-id-375052), these tutorials were missing the most convenient interface. I tried adding them in this PR, but I can't get the [TF2 API](http://docs.ros.org/en/api/tf2_ros/html/c++/classtf2__ros_1_1BufferInterface.html#a9406dc8d32c3a50e026859b587587769) to work. Also, I don't...

Eliminated use of nested if/else blocks to improve code readability

### Description I am a ROS 2 learner on Windows and following the [Managing large projects](https://docs.ros.org/en/iron/Tutorials/Intermediate/Launch/Using-ROS2-Launch-For-Large-Projects.html), which uses the `turtle_tf2_py` package. I couldn't find any information regarding its compatibility with...

ros2