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

When compiling against tf2_ros with `-Wnon-virtual-dtor` we get the following warning: ``` In file included from /opt/ros/indigo/include/tf2_ros/buffer.h:35:0, from ... < snipped private file names > ... /opt/ros/indigo/include/tf2_ros/buffer_interface.h:47:7: warning: ‘class tf2_ros::BufferInterface’...

ready

See the code https://github.com/ros/geometry2/blob/7ea64d25a0631fe91bd277e0d9195f18cc437151/tf2/include/tf2/time_cache.h#L56 https://github.com/ros/geometry2/blob/7ea64d25a0631fe91bd277e0d9195f18cc437151/tf2/include/tf2/time_cache.h#L88 https://github.com/ros/geometry2/blob/7ea64d25a0631fe91bd277e0d9195f18cc437151/tf2/include/tf2/time_cache.h#L94 https://github.com/ros/geometry2/blob/7ea64d25a0631fe91bd277e0d9195f18cc437151/tf2/src/buffer_core.cpp#L290-L294

Affine transforms are a superset of ROS transforms (which are isometries). So should there really be the conversion function from Affine3d to Transform? Shouldn't the user be required to convert...

enhancement

Was looking for the python API of tf2_ros, and while the source has many nice comments (Thanks!) they don't seem to have made it to http://docs.ros.org/latest/api/tf2_ros/html/python/tf2_ros.html

I am using a `tf2_ros.Buffer` to collect transformations via `set_transform` to later synchronize the export of messages into other formats (images, csv, ...). By default, the Buffer has a cache...

From https://github.com/ros/geometry/issues/159 @tfoote > I would suggest that reimplementing this in python might make sense. Obviously this would be a big change, but it would be a good reason to...

I have an application, where I might have some initial lookups that would require extrapolation to the past. These lookups could just be ignored and the program should move on...

enhancement

Class `tf2_ros::BufferInterface` did not define a virtual destructor, but has virtual methods. This is dangerous because it may lead to memory leaks if instances are deleted using a pointer to...

I migrated some of my code to tf2 and it crashes from time to time. I am running the latest version from source. Here is the backtrace: ``` #0 0x00007ffff4852cc9...

ready