geometry2
                                
                                 geometry2 copied to clipboard
                                
                                    geometry2 copied to clipboard
                            
                            
                            
                        A set of ROS packages for keeping track of coordinate transforms.
I found this very useful to debug/fix TF_REPEATED_DATA warnings.
This converts the time into floating point in order to translate from python rostime to C++ rostime, and nanosecond precision is lost: https://github.com/ros/geometry2/blob/noetic-devel/tf2_py/src/tf2_py.cpp#L150-L161 I ran into this doing exact time...
For ROS Noetic on Ubuntu 20.04 and Python 3.8.10. When loading a `tf.py.BufferCore` with transforms, it seems it does not respect the `cache_time` argument when setting it as a named...
the code do not process child_frame_id transform. look below: tf2_geometry_msgs/tf2_geometry_msgs.h ``` template inline void doTransform(const geometry_msgs::TransformStamped& t_in, geometry_msgs::TransformStamped& t_out, const geometry_msgs::TransformStamped& transform) { tf2::Transform input; fromMsg(t_in.transform, input); tf2::Transform t; fromMsg(transform.transform,...
Wrong warning TF_REPEATED_DATA if 2 different transforms (with different frames) but same timestamp
Let's say I publish 2 transformations between `a` and `b` and `a` and `c`, with the same timestamp. The following warning comes up ``` Warning: TF_REPEATED_DATA ignoring data with a...
As ROS latches only the last message from a given node and topic, when using multiple static broadcasters, only the last message is actually kept. To correctly handle multiple static...
A bug reported in https://github.com/ros-visualization/rviz/issues/1753 pointed to race condition(s) in `tf2_ros::MessageFilter`. I implemented a stress test to analyze the problem in detail. There were two issues: 1. A race condition...
I'm using Ubuntu 18.04 Melodic I can import tf, but not PyKDL I built with virtualenv -p /usr/bin/python3 venv source venv/bin/activate catkin_make --cmake-args \ -DPYTHON_EXECUTABLE=/venv/bin/python3.6 \ >>> import PyKDL Traceback...