- Geometry nitpicks (#426)
- Conversion tests for toMsg() (#423)
- Deprecate tf2_geometry_msgs.h (#418)
- Contributors: Bjar Ne, Chris Lalancette
- Fix doTransform with Eigen Quaternion (#369)
- Contributors: Bjar Ne
- Update maintainers of the ros2/geometry2 fork. (#328)
- Contributors: Chris Lalancette
- Activate usual compiler warnings and fix errors (#270)
- Add PoseWithCovarianceStamped transform support (#312)
- Contributors: Ivan Santiago Paunovic, Joshua Whitley
- Don't install python tf2_geometry_msgs (#299) It hasn't been ported yet. Closes ros2#285
- Split tf2_ros in tf2_ros and tf2_ros_py (#210) * Split tf2_ros in tf2_ros and tf2_ros_py
- Contributors: Alejandro Hernández Cordero, Shane Loretz
- export targets in addition to include directories / libraries (#271)
- Contributors: Dirk Thomas
- Added doxyfiles and sphinx Makefiles (#257)
- add missing test dependency (#256)
- use target_include_directories (#231)
- installed python tf2_geometry_msgs (#207)
- Contributors: Alejandro Hernández Cordero, Dirk Thomas, Karsten Knese
- Remove unused setup.py files (#190)
- Contributors: Vasilii Artemev
- Remove template specialization for toMsg functions (#179)
- Use smart pointers for global buffer variables in tests
- Don't assume quaternions init to all zeros
- Contributors: Jacob Perron, Josh Langsfeld
- Updated to use ament_target_dependencies where possible. (#98)
- Use ros2 time (#67) * Buffer constructor accepts a clock * Use rclcpp::Time::seconds()
- revert now unnecessary message initializations (#64)
- Contributors: Mikael Arguedas, Shane Loretz
- Add doxygen documentation for tf2_geometry_msgs
- Contributors: Jackie Kay
- Add missing python_orocos_kdl dependency
- make example into unit test
- vector3 not affected by translation
- Contributors: Daniel Claes, chapulina
- Merge pull request #112 from vrabaud/getYaw Get yaw
- add toMsg and fromMsg for QuaternionStamped
- Contributors: Tully Foote, Vincent Rabaud
- remove useless Makefile files
- tf2 optimizations
- add conversions of type between tf2 and geometry_msgs
- fix ODR violations
- Contributors: Vincent Rabaud
- fixing transitive dependency for kdl. Fixes #53
- Contributors: Tully Foote
- making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.
- moving convert methods back into tf2 because it does not have any ros dependencies beyond ros::Time which is already a dependency of tf2
- Cleaning up unnecessary dependency on roscpp
- converting contents of tf2_ros to be properly namespaced in the tf2_ros namespace
- Cleaning up packaging of tf2 including: removing unused nodehandle cleaning up a few dependencies and linking removing old backup of package.xml making diff minimally different from tf version of library
- Restoring test packages and bullet packages. reverting 3570e8c42f9b394ecbfd9db076b920b41300ad55 to get back more of the packages previously implemented reverting 04cf29d1b58c660fdc999ab83563a5d4b76ab331 to fix #7
- 0.3.4 -> 0.3.5
- 0.3.3 -> 0.3.4
- 0.3.2 -> 0.3.3
- 0.3.1 -> 0.3.2
- 0.3.0 -> 0.3.1
- switching to version 0.3.0
- add setup.py
- added setup.py etc to tf2_geometry_msgs
- adding tf2 dependency to tf2_geometry_msgs
- adding tf2_geometry_msgs to groovy-devel (unit tests disabled)
- fixing groovy-devel
- removing bullet and kdl related packages
- disabling tf2_geometry_msgs due to missing kdl dependency
- catkinizing geometry-experimental
- catkinizing tf2_geometry_msgs
- add twist, wrench and pose conversion to kdl, fix message to message conversion by adding specific conversion functions
- merge tf2_cpp and tf2_py into tf2_ros
- Got transform with types working in python
- A working first version of transforming and converting between different types
- Moving from camelCase to undescores to be in line with python style guides
- Fixing tests now that Buffer creates a NodeHandle
- add posestamped
- import vector3stamped
- add support for Vector3Stamped and PoseStamped
- add support for PointStamped geometry_msgs
- add regression tests for geometry_msgs point, vector and pose
- Fixing missing export, compiling version of buffer_client test
- add bullet transforms, and create tests for bullet and kdl
- working transformations of messages
- add support for PoseStamped message
- test for pointstamped
- add PointStamped message transform methods
- transform for vector3stamped message