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

Without the additional char messages were coming out like this: ``` Lookup would require extrapolation at time 1628007756.300918579, but only time 1628007759.293766737 is in the buffe, when looking up transform...

@tfoote, I'm wondering why the release 0.6.7 didn't actually make it into the Melodic distro? Did you just forget to bloom? I remember that we had issues with 0.6.6, finally...

Should there be an else here? https://github.com/ros/geometry2/blob/noetic-devel/tf2_tools/scripts/view_frames.py#L71-L72 I ran into an issue with this on a buggy config I had running just now. There are problems with this config, but...

bug

The TF_REPEATED_DATA error, while important, can be overly verbose, sometimes flooding the terminal scrollback buffer such that no other output can be found. Throttle the error to 10 seconds. Implement...

noetic

It seems like generating an Eigen::Vector3f and transforming it for each iteration is very inefficient. In our case, this mod took transform-time of a point-cloud from 90-100ms to 1-2ms. Verified...

noetic

If you look closely, you can see that tf2/include/tf2/impl/utils.h includes and tf2_geometry_msgs/include/tf2_geometry_msgs/tf2_geometry_msgs.h includes So there is a cycle there. I am forced to compile these packages via a different build...

bug

tf2/utils.h depends on tf2_geometry_msgs https://github.com/ros/geometry2/blob/noetic-devel/tf2/include/tf2/impl/utils.h#L18 So it should be added as a package dependency.

With tf2, there's no possibility to remove already published static TF frames. I think it'd make sense to have such possibility. There's a relevant ARO question: https://answers.ros.org/question/311864/is-it-possible-to-delete-a-static-tfs/ . My use-case:...

Hi, I'm using Ubuntu 18.04 and ROS melodic. I first got this error when I tried to import tf2_ros, and I followed this [instruction](https://answers.ros.org/question/326226/importerror-dynamic-module-does-not-define-module-export-function-pyinit__tf2/) to install the tf2_ros. Since the...