geometry2 icon indicating copy to clipboard operation
geometry2 copied to clipboard

A set of ROS packages for keeping track of coordinate transforms.

Results 116 geometry2 issues
Sort by recently updated
recently updated
newest added

In https://github.com/RoboStack/ros-noetic/issues/86 we discovered that `import tf2_py` results in a segmentation fault on OSX. We previously observed similar issues with cv_bridge: https://github.com/ros-perception/vision_opencv/pull/331 which also contains links to why the proposed...

noetic

Solves #387 and adds more functionality that might come handy to people who also use other 3D-data channels in pointclouds.

It is possible to want to represent that position of a robot with respect to several "parent" reference frames such as different maps, geocordinates, or odometry. Right now this is...

Closes: #275 This breaks the cycle between tf2 and tf2_geometry_msgs. I didn't add deprecated attributes for functions having tf2_geometry_msgs in the method signature, as they would need to have the...

noetic

Setting up your robot with tf2 [Setting up your robot using tf](http://wiki.ros.org/navigation/Tutorials/RobotSetup/TF) This tutorial provides a guide to set up your robot to start using tf. [Using the robot state...

It is redundant to have both [Transform](https://github.com/ros/geometry2/blob/noetic-devel/tf2/include/tf2/LinearMath/Transform.h) and [Pose](https://github.com/ros/common_msgs/blob/noetic-devel/geometry_msgs/msg/Pose.msg) since they have the same fundamental semantic. tf2 should stop using `Transform` and start using exclusively `Pose`. Related to [this issue](https://github.com/ros/common_msgs/issues/175).

### Problem [http://docs.ros.org/en/melodic/api/tf2_ros/html/python/](url) currently only contains information about exceptions, but is lacking class-member variables, functions, and function parameters. E.g. in `TransformListener()`, I currently cannot find out from this page what...

enhancement
documentation

Is there any documentation on the convert/transform registration in Python?

I have a nodelet which periodically calls `canTransform()` with timeout in a separate thread on a TF2 ROS buffer. When I'm replaying a bag file and pause it, the `canTransform()`...

bug

At any time except startup where the tf buffer is unpopulated (where tf lookups are likely to fail anyhow) there's no reason to expect that an `into the past` extrapolation...

enhancement