-
 

Package Summary

Tags No category tags.
Version 0.25.8
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/geometry2.git
VCS Type git
VCS Version humble
Last Updated 2024-08-30
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

tf2_geometry_msgs

Additional Links

Maintainers

  • Chris Lalancette
  • Alejandro Hernandez Cordero

Authors

  • Tully Foote
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_geometry_msgs

0.25.8 (2024-08-29)

  • Enable Twist interpolator (backport #646) (#684) * Enable Twist interpolator (#646) Co-authored-by: Tully Foote <<tullyfoote@intrinsic.ai>> (cherry picked from commit 62322b8fa74c90d144dfe32294f6670bf6cfe786) # Conflicts: # tf2/include/tf2/buffer_core.h # tf2_ros/test/test_buffer.cpp Co-authored-by: Alejandro Hernández Cordero <<ahcorde@gmail.com>>

  • Contributors: mergify[bot]

0.25.7 (2024-05-29)

0.25.6 (2024-02-16)

  • When finding Python3, use python3 executable as a hint (#650)
  • Contributors: Scott K Logan

0.25.5 (2023-11-13)

  • add torque due to force offset (#538) (#633)
  • Contributors: mergify[bot]

0.25.4 (2023-09-19)

  • Fixed Windows warnings (#623)
  • Add doTransform support for Point32, Polygon and PolygonStamped (#616)
  • Contributors: Alejandro Hernández Cordero, Guillaume Doisy

0.25.3 (2023-07-17)

  • Add do_transform_polygon_stamped (#582) (#590)
  • Contributors: mergify[bot]

0.25.2 (2023-01-10)

0.25.1 (2022-08-05)

  • Use orocos_kdl_vendor and orocos-kdl target (#548)
  • Contributors: Scott K Logan

0.25.0 (2022-04-05)

  • Make sure to find the right Python executable. (#514)
  • Depend on orocos_kdl_vendor (#473)
  • Install includes to include/${PROJECT_NAME} and use modern CMake (#493)
  • Contributors: Chris Lalancette, Jacob Perron, Shane Loretz

0.24.0 (2022-03-31)

0.23.0 (2022-03-28)

  • Drop PyKDL dependency in tf2_geometry_msgs (#509)
  • Contributors: Florian Vahl

0.22.0 (2022-03-01)

0.21.0 (2022-01-14)

  • Fix cpplint errors (#497)
  • Export a tf2_geometry_msgs::tf2_geometry_msgs target (#496)
  • Feature: Add doTransform for Wrench messages (#476)
  • Contributors: Denis Štogl, Jacob Perron, Shane Loretz

0.20.0 (2021-12-17)

0.19.0 (2021-10-15)

  • Remove some references to the ROS 1 wiki.
  • Style fixes in tf2_geometry_msgs. (#464)
  • Fix for issue #431 - Covariance is not transformed in do_transform_pose_with_covariance_stamped (#453)
  • doTransform non stamped msgs (#452)
  • `tf2_geometry_msgs`: Fixing covariance transformation in [doTransform<PoseWithCovarianceStamped, TransformStamped>]{.title-ref} (#430)
  • Contributors: Abrar Rahman Protyasha, Chris Lalancette, Khasreto, vineet131

0.18.0 (2021-06-01)

  • Geometry nitpicks (#426)
  • Conversion tests for toMsg() (#423)
  • Deprecate tf2_geometry_msgs.h (#418)
  • Contributors: Bjar Ne, Chris Lalancette

0.17.1 (2021-04-06)

0.17.0 (2021-03-19)

  • Fix doTransform with Eigen Quaternion (#369)
  • Contributors: Bjar Ne

0.16.0 (2021-01-25)

0.15.1 (2020-12-08)

0.15.0 (2020-11-02)

  • Update maintainers of the ros2/geometry2 fork. (#328)
  • Contributors: Chris Lalancette

0.14.1 (2020-09-21)

  • Activate usual compiler warnings and fix errors (#270)
  • Add PoseWithCovarianceStamped transform support (#312)
  • Contributors: Ivan Santiago Paunovic, Joshua Whitley

0.14.0 (2020-08-14)

  • Don't install python tf2_geometry_msgs (#299) It hasn't been ported yet. Closes https://github.com/ros2/geometry2/issues/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

0.13.4 (2020-06-03)

  • export targets in addition to include directories / libraries (#271)
  • Contributors: Dirk Thomas

0.13.3 (2020-05-26)

0.13.2 (2020-05-18)

0.13.1 (2020-05-08)

0.13.0 (2020-04-30)

  • 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

0.12.4 (2019-11-19)

0.12.3 (2019-11-18)

  • Remove unused setup.py files (#190)
  • Contributors: Vasilii Artemev

0.12.2 (2019-11-18)

0.12.1 (2019-10-23)

  • 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

0.12.0 (2019-09-26)

0.11.3 (2019-05-24)

0.11.2 (2019-05-20)

0.11.1 (2019-05-09)

0.11.0 (2019-04-14)

  • Updated to use ament_target_dependencies where possible. (#98)

0.10.1 (2018-12-06)

0.10.0 (2018-11-22)

  • Use ros2 time (#67)
    • Buffer constructor accepts a clock
    • Use rclcpp::Time::seconds()
  • revert now unnecessary message initializations (#64)
  • Contributors: Mikael Arguedas, Shane Loretz

0.5.15 (2017-01-24)

0.5.14 (2017-01-16)

  • Add doxygen documentation for tf2_geometry_msgs
  • Contributors: Jackie Kay

0.5.13 (2016-03-04)

  • Add missing python_orocos_kdl dependency
  • make example into unit test
  • vector3 not affected by translation
  • Contributors: Daniel Claes, chapulina

0.5.12 (2015-08-05)

  • Merge pull request #112 from vrabaud/getYaw Get yaw
  • add toMsg and fromMsg for QuaternionStamped
  • Contributors: Tully Foote, Vincent Rabaud

0.5.11 (2015-04-22)

0.5.10 (2015-04-21)

0.5.9 (2015-03-25)

0.5.8 (2015-03-17)

  • remove useless Makefile files
  • tf2 optimizations
  • add conversions of type between tf2 and geometry_msgs
  • fix ODR violations
  • Contributors: Vincent Rabaud

0.5.7 (2014-12-23)

  • fixing transitive dependency for kdl. Fixes #53
  • Contributors: Tully Foote

0.5.6 (2014-09-18)

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

0.5.0 (2014-02-14)

0.4.10 (2013-12-26)

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

0.4.0 (2013-06-27)

  • 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.6 (2013-03-03)

0.3.5 (2013-02-15 14:46)

  • 0.3.4 -> 0.3.5

0.3.4 (2013-02-15 13:14)

  • 0.3.3 -> 0.3.4

0.3.3 (2013-02-15 11:30)

  • 0.3.2 -> 0.3.3

0.3.2 (2013-02-15 00:42)

  • 0.3.1 -> 0.3.2

0.3.1 (2013-02-14)

  • 0.3.0 -> 0.3.1

0.3.0 (2013-02-13)

  • 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

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Dependant Packages

Name Deps
aruco_ros
create_driver
depthai_bridge
find_object_2d
gazebo_plugins
geometry2
test_tf2
turtle_tf2_cpp
grid_map_costmap_2d
image_rotate
imu_transformer
imu_filter_madgwick
interactive_markers
laser_filters
mapviz
swri_route_util
swri_transform_util
microstrain_inertial_driver
moveit_core
pilz_industrial_motion_planner
moveit_resources_prbt_ikfast_manipulator_plugin
moveit_ros_move_group
moveit_ros_perception
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_robot_interaction
mrpt_map_server
mrpt_pf_localization
mrpt_pointcloud_pipeline
mrpt_rawlog
mrpt_reactivenav2d
mrpt_tps_astar_planner
mrpt_generic_sensor
mrpt_sensorlib
mvsim
naoqi_driver
novatel_gps_driver
novatel_oem7_driver
octomap_server
pcl_ros
robot_calibration
robot_controllers
robot_localization
rtabmap_conversions
rtabmap_util
rviz_common
rviz_default_plugins
rviz_visual_tools
sbg_driver
septentrio_gnss_driver
slam_toolbox
spatio_temporal_voxel_layer
ur_robot_driver
warehouse_ros
aruco_opencv
crane_plus_examples
bosch_locator_bridge
nav2_amcl
nav2_behavior_tree
nav2_behaviors
nav2_collision_monitor
nav2_costmap_2d
nav_2d_utils
nav2_graceful_controller
nav2_lifecycle_manager
nav2_mppi_controller
nav2_regulated_pure_pursuit_controller
nav2_rviz_plugins
nav2_system_tests
nav2_util
odom_to_tf_ros2
admittance_controller
steering_controllers_library
ros2_ouster
moveit2z_client
nav2z_planners_common
pure_spinning_local_planner
undo_path_global_planner
nav2z_client
nitrosz_client
webots_ros2_driver
irobot_create_nodes
irobot_create_gz_toolbox
ign_rviz
ign_rviz_common
adi_3dtof_image_stitching
beluga_ros
etsi_its_msgs_utils
etsi_its_rviz_plugins
message_tf_frame_transformer
mrpt_apps
mrpt_libapps
mrpt_libbase
mrpt_libgui
mrpt_libhwdrivers
mrpt_libmaps
mrpt_libmath
mrpt_libnav
mrpt_libobs
mrpt_libopengl
mrpt_libposes
mrpt_libros_bridge
mrpt_libslam
mrpt_libtclap
python_mrpt
autoware_lanelet2_extension
mola_bridge_ros2
mola_input_rosbag2
pick_ik
create3_coverage
as2_core
as2_map_server
as2_platform_mavlink
as2_platform_pixhawk
clearpath_mecanum_drive_controller
gazebo_planar_move_plugin
mocap4r2_robot_gt
off_highway_premium_radar_sample
pal_gazebo_plugins
robotont_driver
vector_pursuit_controller

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.31.8
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/geometry2.git
VCS Type git
VCS Version iron
Last Updated 2024-08-30
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

tf2_geometry_msgs

Additional Links

Maintainers

  • Alejandro Hernandez Cordero
  • Chris Lalancette

Authors

  • Tully Foote
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_geometry_msgs

0.31.8 (2024-08-29)

  • Enable Twist interpolator (backport #646) (#685)
  • Contributors: mergify[bot]

0.31.7 (2024-05-29)

0.31.6 (2024-04-19)

0.31.5 (2023-09-08)

  • Add doTransform support for Point32, Polygon and PolygonStamped (#618)
  • Contributors: Alejandro Hernández Cordero

0.31.4 (2023-07-14)

0.31.3 (2023-05-11)

0.31.2 (2023-04-13)

0.31.1 (2023-04-12)

0.31.0 (2023-04-11)

  • Add do_transform_polygon_stamped (#582)
  • Contributors: Tony Najjar

0.30.0 (2023-02-14)

  • Update the demos to C++17. (#578)
  • Contributors: Chris Lalancette

0.29.0 (2022-11-21)

  • Update maintainers (#560)
  • Add torque due to force offset (#538)
  • Contributors: Audrow Nash, Paul Gesel

0.28.0 (2022-11-02)

0.27.0 (2022-09-13)

0.26.2 (2022-08-15)

0.26.1 (2022-06-24)

  • Use orocos_kdl_vendor and orocos-kdl target (#534)
  • Contributors: Scott K Logan

0.26.0 (2022-04-29)

0.25.0 (2022-04-05)

  • Make sure to find the right Python executable. (#514)
  • Depend on orocos_kdl_vendor (#473)
  • Install includes to include/${PROJECT_NAME} and use modern CMake (#493)
  • Contributors: Chris Lalancette, Jacob Perron, Shane Loretz

0.24.0 (2022-03-31)

0.23.0 (2022-03-28)

  • Drop PyKDL dependency in tf2_geometry_msgs (#509)
  • Contributors: Florian Vahl

0.22.0 (2022-03-01)

0.21.0 (2022-01-14)

  • Fix cpplint errors (#497)
  • Export a tf2_geometry_msgs::tf2_geometry_msgs target (#496)
  • Feature: Add doTransform for Wrench messages (#476)
  • Contributors: Denis Štogl, Jacob Perron, Shane Loretz

0.20.0 (2021-12-17)

0.19.0 (2021-10-15)

  • Remove some references to the ROS 1 wiki.
  • Style fixes in tf2_geometry_msgs. (#464)
  • Fix for issue #431 - Covariance is not transformed in do_transform_pose_with_covariance_stamped (#453)
  • doTransform non stamped msgs (#452)
  • `tf2_geometry_msgs`: Fixing covariance transformation in [doTransform<PoseWithCovarianceStamped, TransformStamped>]{.title-ref} (#430)
  • Contributors: Abrar Rahman Protyasha, Chris Lalancette, Khasreto, vineet131

0.18.0 (2021-06-01)

  • Geometry nitpicks (#426)
  • Conversion tests for toMsg() (#423)
  • Deprecate tf2_geometry_msgs.h (#418)
  • Contributors: Bjar Ne, Chris Lalancette

0.17.1 (2021-04-06)

0.17.0 (2021-03-19)

  • Fix doTransform with Eigen Quaternion (#369)
  • Contributors: Bjar Ne

0.16.0 (2021-01-25)

0.15.1 (2020-12-08)

0.15.0 (2020-11-02)

  • Update maintainers of the ros2/geometry2 fork. (#328)
  • Contributors: Chris Lalancette

0.14.1 (2020-09-21)

  • Activate usual compiler warnings and fix errors (#270)
  • Add PoseWithCovarianceStamped transform support (#312)
  • Contributors: Ivan Santiago Paunovic, Joshua Whitley

0.14.0 (2020-08-14)

  • Don't install python tf2_geometry_msgs (#299) It hasn't been ported yet. Closes https://github.com/ros2/geometry2/issues/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

0.13.4 (2020-06-03)

  • export targets in addition to include directories / libraries (#271)
  • Contributors: Dirk Thomas

0.13.3 (2020-05-26)

0.13.2 (2020-05-18)

0.13.1 (2020-05-08)

0.13.0 (2020-04-30)

  • 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

0.12.4 (2019-11-19)

0.12.3 (2019-11-18)

  • Remove unused setup.py files (#190)
  • Contributors: Vasilii Artemev

0.12.2 (2019-11-18)

0.12.1 (2019-10-23)

  • 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

0.12.0 (2019-09-26)

0.11.3 (2019-05-24)

0.11.2 (2019-05-20)

0.11.1 (2019-05-09)

0.11.0 (2019-04-14)

  • Updated to use ament_target_dependencies where possible. (#98)

0.10.1 (2018-12-06)

0.10.0 (2018-11-22)

  • Use ros2 time (#67)
    • Buffer constructor accepts a clock
    • Use rclcpp::Time::seconds()
  • revert now unnecessary message initializations (#64)
  • Contributors: Mikael Arguedas, Shane Loretz

0.5.15 (2017-01-24)

0.5.14 (2017-01-16)

  • Add doxygen documentation for tf2_geometry_msgs
  • Contributors: Jackie Kay

0.5.13 (2016-03-04)

  • Add missing python_orocos_kdl dependency
  • make example into unit test
  • vector3 not affected by translation
  • Contributors: Daniel Claes, chapulina

0.5.12 (2015-08-05)

  • Merge pull request #112 from vrabaud/getYaw Get yaw
  • add toMsg and fromMsg for QuaternionStamped
  • Contributors: Tully Foote, Vincent Rabaud

0.5.11 (2015-04-22)

0.5.10 (2015-04-21)

0.5.9 (2015-03-25)

0.5.8 (2015-03-17)

  • remove useless Makefile files
  • tf2 optimizations
  • add conversions of type between tf2 and geometry_msgs
  • fix ODR violations
  • Contributors: Vincent Rabaud

0.5.7 (2014-12-23)

  • fixing transitive dependency for kdl. Fixes #53
  • Contributors: Tully Foote

0.5.6 (2014-09-18)

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

0.5.0 (2014-02-14)

0.4.10 (2013-12-26)

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

0.4.0 (2013-06-27)

  • 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.6 (2013-03-03)

0.3.5 (2013-02-15 14:46)

  • 0.3.4 -> 0.3.5

0.3.4 (2013-02-15 13:14)

  • 0.3.3 -> 0.3.4

0.3.3 (2013-02-15 11:30)

  • 0.3.2 -> 0.3.3

0.3.2 (2013-02-15 00:42)

  • 0.3.1 -> 0.3.2

0.3.1 (2013-02-14)

  • 0.3.0 -> 0.3.1

0.3.0 (2013-02-13)

  • 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

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Dependant Packages

Name Deps
aruco_ros
depthai_bridge
find_object_2d
fuse_models
fuse_publishers
fuse_viz
gazebo_plugins
geometry2
test_tf2
turtle_tf2_cpp
grid_map_costmap_2d
image_rotate
imu_transformer
imu_filter_madgwick
interactive_markers
laser_filters
mapviz
swri_route_util
swri_transform_util
microstrain_inertial_driver
moveit_core
pilz_industrial_motion_planner
moveit_resources_prbt_ikfast_manipulator_plugin
moveit_ros_move_group
moveit_ros_perception
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_robot_interaction
mrpt_map_server
mrpt_pf_localization
mrpt_pointcloud_pipeline
mrpt_rawlog
mrpt_reactivenav2d
mrpt_tps_astar_planner
mrpt_generic_sensor
mrpt_sensorlib
mvsim
naoqi_driver
novatel_gps_driver
octomap_server
pcl_ros
robot_calibration
robot_localization
rtabmap_conversions
rtabmap_util
rviz_common
rviz_default_plugins
rviz_visual_tools
sbg_driver
septentrio_gnss_driver
slam_toolbox
spatio_temporal_voxel_layer
tf2_2d
ur_robot_driver
warehouse_ros
aruco_opencv
bosch_locator_bridge
nav2_amcl
nav2_behavior_tree
nav2_behaviors
nav2_collision_monitor
nav2_costmap_2d
nav_2d_utils
nav2_lifecycle_manager
nav2_mppi_controller
nav2_regulated_pure_pursuit_controller
nav2_rviz_plugins
nav2_system_tests
nav2_util
odom_to_tf_ros2
admittance_controller
steering_controllers_library
move_group_interface_client
nav2z_planners_common
pure_spinning_local_planner
undo_path_global_planner
nav2z_client
sm_autoware_avp
webots_ros2_driver
ign_rviz
ign_rviz_common
beluga_ros
etsi_its_msgs_utils
etsi_its_rviz_plugins
message_tf_frame_transformer
mrpt_apps
mrpt_libapps
mrpt_libbase
mrpt_libgui
mrpt_libhwdrivers
mrpt_libmaps
mrpt_libmath
mrpt_libnav
mrpt_libobs
mrpt_libopengl
mrpt_libposes
mrpt_libros_bridge
mrpt_libslam
mrpt_libtclap
python_mrpt
mola_bridge_ros2
mola_input_rosbag2
pick_ik

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.36.4
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/geometry2.git
VCS Type git
VCS Version jazzy
Last Updated 2024-10-04
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

tf2_geometry_msgs

Additional Links

Maintainers

  • Alejandro Hernandez Cordero
  • Chris Lalancette

Authors

  • Tully Foote
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_geometry_msgs

0.36.4 (2024-05-29)

0.36.3 (2024-05-13)

0.36.2 (2024-04-10)

  • Enable Twist interpolator (#646) Co-authored-by: Tully Foote <<tullyfoote@intrinsic.ai>>
  • Contributors: Alejandro Hernández Cordero

0.36.1 (2024-03-28)

0.36.0 (2024-02-07)

  • Removed obsolete headers (#645)
  • Contributors: Alejandro Hernández Cordero

0.35.1 (2024-01-24)

0.35.0 (2023-12-26)

0.34.0 (2023-11-06)

0.33.2 (2023-10-04)

0.33.1 (2023-09-07)

0.33.0 (2023-08-21)

  • Add doTransform support for Point32, Polygon and PolygonStamped (backport #616) (#619)
  • Contributors: mergify[bot]

0.32.2 (2023-07-11)

0.32.1 (2023-05-11)

0.32.0 (2023-04-27)

0.31.2 (2023-04-13)

0.31.1 (2023-04-12)

0.31.0 (2023-04-11)

  • Add do_transform_polygon_stamped (#582)
  • Contributors: Tony Najjar

0.30.0 (2023-02-14)

  • Update the demos to C++17. (#578)
  • Contributors: Chris Lalancette

0.29.0 (2022-11-21)

  • Update maintainers (#560)
  • Add torque due to force offset (#538)
  • Contributors: Audrow Nash, Paul Gesel

0.28.0 (2022-11-02)

0.27.0 (2022-09-13)

0.26.2 (2022-08-15)

0.26.1 (2022-06-24)

  • Use orocos_kdl_vendor and orocos-kdl target (#534)
  • Contributors: Scott K Logan

0.26.0 (2022-04-29)

0.25.0 (2022-04-05)

  • Make sure to find the right Python executable. (#514)
  • Depend on orocos_kdl_vendor (#473)
  • Install includes to include/${PROJECT_NAME} and use modern CMake (#493)
  • Contributors: Chris Lalancette, Jacob Perron, Shane Loretz

0.24.0 (2022-03-31)

0.23.0 (2022-03-28)

  • Drop PyKDL dependency in tf2_geometry_msgs (#509)
  • Contributors: Florian Vahl

0.22.0 (2022-03-01)

0.21.0 (2022-01-14)

  • Fix cpplint errors (#497)
  • Export a tf2_geometry_msgs::tf2_geometry_msgs target (#496)
  • Feature: Add doTransform for Wrench messages (#476)
  • Contributors: Denis Štogl, Jacob Perron, Shane Loretz

0.20.0 (2021-12-17)

0.19.0 (2021-10-15)

  • Remove some references to the ROS 1 wiki.
  • Style fixes in tf2_geometry_msgs. (#464)
  • Fix for issue #431 - Covariance is not transformed in do_transform_pose_with_covariance_stamped (#453)
  • doTransform non stamped msgs (#452)
  • `tf2_geometry_msgs`: Fixing covariance transformation in [doTransform<PoseWithCovarianceStamped, TransformStamped>]{.title-ref} (#430)
  • Contributors: Abrar Rahman Protyasha, Chris Lalancette, Khasreto, vineet131

0.18.0 (2021-06-01)

  • Geometry nitpicks (#426)
  • Conversion tests for toMsg() (#423)
  • Deprecate tf2_geometry_msgs.h (#418)
  • Contributors: Bjar Ne, Chris Lalancette

0.17.1 (2021-04-06)

0.17.0 (2021-03-19)

  • Fix doTransform with Eigen Quaternion (#369)
  • Contributors: Bjar Ne

0.16.0 (2021-01-25)

0.15.1 (2020-12-08)

0.15.0 (2020-11-02)

  • Update maintainers of the ros2/geometry2 fork. (#328)
  • Contributors: Chris Lalancette

0.14.1 (2020-09-21)

  • Activate usual compiler warnings and fix errors (#270)
  • Add PoseWithCovarianceStamped transform support (#312)
  • Contributors: Ivan Santiago Paunovic, Joshua Whitley

0.14.0 (2020-08-14)

  • Don't install python tf2_geometry_msgs (#299) It hasn't been ported yet. Closes https://github.com/ros2/geometry2/issues/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

0.13.4 (2020-06-03)

  • export targets in addition to include directories / libraries (#271)
  • Contributors: Dirk Thomas

0.13.3 (2020-05-26)

0.13.2 (2020-05-18)

0.13.1 (2020-05-08)

0.13.0 (2020-04-30)

  • 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

0.12.4 (2019-11-19)

0.12.3 (2019-11-18)

  • Remove unused setup.py files (#190)
  • Contributors: Vasilii Artemev

0.12.2 (2019-11-18)

0.12.1 (2019-10-23)

  • 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

0.12.0 (2019-09-26)

0.11.3 (2019-05-24)

0.11.2 (2019-05-20)

0.11.1 (2019-05-09)

0.11.0 (2019-04-14)

  • Updated to use ament_target_dependencies where possible. (#98)

0.10.1 (2018-12-06)

0.10.0 (2018-11-22)

  • Use ros2 time (#67)
    • Buffer constructor accepts a clock
    • Use rclcpp::Time::seconds()
  • revert now unnecessary message initializations (#64)
  • Contributors: Mikael Arguedas, Shane Loretz

0.5.15 (2017-01-24)

0.5.14 (2017-01-16)

  • Add doxygen documentation for tf2_geometry_msgs
  • Contributors: Jackie Kay

0.5.13 (2016-03-04)

  • Add missing python_orocos_kdl dependency
  • make example into unit test
  • vector3 not affected by translation
  • Contributors: Daniel Claes, chapulina

0.5.12 (2015-08-05)

  • Merge pull request #112 from vrabaud/getYaw Get yaw
  • add toMsg and fromMsg for QuaternionStamped
  • Contributors: Tully Foote, Vincent Rabaud

0.5.11 (2015-04-22)

0.5.10 (2015-04-21)

0.5.9 (2015-03-25)

0.5.8 (2015-03-17)

  • remove useless Makefile files
  • tf2 optimizations
  • add conversions of type between tf2 and geometry_msgs
  • fix ODR violations
  • Contributors: Vincent Rabaud

0.5.7 (2014-12-23)

  • fixing transitive dependency for kdl. Fixes #53
  • Contributors: Tully Foote

0.5.6 (2014-09-18)

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

0.5.0 (2014-02-14)

0.4.10 (2013-12-26)

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

0.4.0 (2013-06-27)

  • 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.6 (2013-03-03)

0.3.5 (2013-02-15 14:46)

  • 0.3.4 -> 0.3.5

0.3.4 (2013-02-15 13:14)

  • 0.3.3 -> 0.3.4

0.3.3 (2013-02-15 11:30)

  • 0.3.2 -> 0.3.3

0.3.2 (2013-02-15 00:42)

  • 0.3.1 -> 0.3.2

0.3.1 (2013-02-14)

  • 0.3.0 -> 0.3.1

0.3.0 (2013-02-13)

  • 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

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Dependant Packages

Name Deps
aruco_ros
depthai_bridge
find_object_2d
fuse_models
fuse_publishers
fuse_viz
gazebo_plugins
geometry2
test_tf2
turtle_tf2_cpp
grid_map_costmap_2d
image_proc
image_rotate
imu_transformer
imu_filter_madgwick
interactive_markers
laser_filters
mapviz
swri_route_util
swri_transform_util
microstrain_inertial_driver
moveit_core
pilz_industrial_motion_planner
moveit_resources_prbt_ikfast_manipulator_plugin
moveit_ros_move_group
moveit_ros_perception
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_robot_interaction
mrpt_map_server
mrpt_pf_localization
mrpt_pointcloud_pipeline
mrpt_rawlog
mrpt_reactivenav2d
mrpt_tps_astar_planner
mrpt_generic_sensor
mrpt_sensorlib
mvsim
novatel_gps_driver
octomap_server
pcl_ros
robot_calibration
robot_localization
rtabmap_conversions
rtabmap_util
rviz_default_plugins
rviz_visual_tools
sbg_driver
septentrio_gnss_driver
slam_toolbox
spatio_temporal_voxel_layer
tf2_2d
ur_robot_driver
warehouse_ros
aruco_opencv
nav2_amcl
nav2_behavior_tree
nav2_behaviors
nav2_collision_monitor
nav2_costmap_2d
nav_2d_utils
nav2_graceful_controller
nav2_lifecycle_manager
nav2_mppi_controller
nav2_regulated_pure_pursuit_controller
nav2_rviz_plugins
nav2_system_tests
nav2_util
odom_to_tf_ros2
admittance_controller
steering_controllers_library
ros2_ouster
move_group_interface_client
nav2z_planners_common
pure_spinning_local_planner
undo_path_global_planner
nav2z_client
sm_autoware_avp
webots_ros2_driver
irobot_create_nodes
irobot_create_gz_toolbox
ign_rviz
ign_rviz_common
beluga_ros
etsi_its_msgs_utils
etsi_its_rviz_plugins
message_tf_frame_transformer
mrpt_apps
mrpt_libapps
mrpt_libbase
mrpt_libgui
mrpt_libhwdrivers
mrpt_libmaps
mrpt_libmath
mrpt_libnav
mrpt_libobs
mrpt_libopengl
mrpt_libposes
mrpt_libros_bridge
mrpt_libslam
mrpt_libtclap
python_mrpt
autoware_lanelet2_extension
mola_bridge_ros2
mola_input_rosbag2
pick_ik
create3_coverage

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.39.1
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/geometry2.git
VCS Type git
VCS Version rolling
Last Updated 2024-11-07
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

tf2_geometry_msgs

Additional Links

Maintainers

  • Alejandro Hernandez Cordero
  • Chris Lalancette

Authors

  • Tully Foote
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_geometry_msgs

0.39.1 (2024-10-15)

  • Remove use of python_cmake_module (#651)
  • Contributors: Chris Lalancette

0.39.0 (2024-10-03)

0.38.2 (2024-07-19)

0.38.1 (2024-07-09)

0.38.0 (2024-06-17)

0.37.1 (2024-05-29)

0.37.0 (2024-04-26)

0.36.2 (2024-04-10)

  • Enable Twist interpolator (#646) Co-authored-by: Tully Foote <<tullyfoote@intrinsic.ai>>
  • Contributors: Alejandro Hernández Cordero

0.36.1 (2024-03-28)

0.36.0 (2024-02-07)

  • Removed obsolete headers (#645)
  • Contributors: Alejandro Hernández Cordero

0.35.1 (2024-01-24)

0.35.0 (2023-12-26)

0.34.0 (2023-11-06)

0.33.2 (2023-10-04)

0.33.1 (2023-09-07)

0.33.0 (2023-08-21)

  • Add doTransform support for Point32, Polygon and PolygonStamped (backport #616) (#619)
  • Contributors: mergify[bot]

0.32.2 (2023-07-11)

0.32.1 (2023-05-11)

0.32.0 (2023-04-27)

0.31.2 (2023-04-13)

0.31.1 (2023-04-12)

0.31.0 (2023-04-11)

  • Add do_transform_polygon_stamped (#582)
  • Contributors: Tony Najjar

0.30.0 (2023-02-14)

  • Update the demos to C++17. (#578)
  • Contributors: Chris Lalancette

0.29.0 (2022-11-21)

  • Update maintainers (#560)
  • Add torque due to force offset (#538)
  • Contributors: Audrow Nash, Paul Gesel

0.28.0 (2022-11-02)

0.27.0 (2022-09-13)

0.26.2 (2022-08-15)

0.26.1 (2022-06-24)

  • Use orocos_kdl_vendor and orocos-kdl target (#534)
  • Contributors: Scott K Logan

0.26.0 (2022-04-29)

0.25.0 (2022-04-05)

  • Make sure to find the right Python executable. (#514)
  • Depend on orocos_kdl_vendor (#473)
  • Install includes to include/${PROJECT_NAME} and use modern CMake (#493)
  • Contributors: Chris Lalancette, Jacob Perron, Shane Loretz

0.24.0 (2022-03-31)

0.23.0 (2022-03-28)

  • Drop PyKDL dependency in tf2_geometry_msgs (#509)
  • Contributors: Florian Vahl

0.22.0 (2022-03-01)

0.21.0 (2022-01-14)

  • Fix cpplint errors (#497)
  • Export a tf2_geometry_msgs::tf2_geometry_msgs target (#496)
  • Feature: Add doTransform for Wrench messages (#476)
  • Contributors: Denis Štogl, Jacob Perron, Shane Loretz

0.20.0 (2021-12-17)

0.19.0 (2021-10-15)

  • Remove some references to the ROS 1 wiki.
  • Style fixes in tf2_geometry_msgs. (#464)
  • Fix for issue #431 - Covariance is not transformed in do_transform_pose_with_covariance_stamped (#453)
  • doTransform non stamped msgs (#452)
  • `tf2_geometry_msgs`: Fixing covariance transformation in [doTransform<PoseWithCovarianceStamped, TransformStamped>]{.title-ref} (#430)
  • Contributors: Abrar Rahman Protyasha, Chris Lalancette, Khasreto, vineet131

0.18.0 (2021-06-01)

  • Geometry nitpicks (#426)
  • Conversion tests for toMsg() (#423)
  • Deprecate tf2_geometry_msgs.h (#418)
  • Contributors: Bjar Ne, Chris Lalancette

0.17.1 (2021-04-06)

0.17.0 (2021-03-19)

  • Fix doTransform with Eigen Quaternion (#369)
  • Contributors: Bjar Ne

0.16.0 (2021-01-25)

0.15.1 (2020-12-08)

0.15.0 (2020-11-02)

  • Update maintainers of the ros2/geometry2 fork. (#328)
  • Contributors: Chris Lalancette

0.14.1 (2020-09-21)

  • Activate usual compiler warnings and fix errors (#270)
  • Add PoseWithCovarianceStamped transform support (#312)
  • Contributors: Ivan Santiago Paunovic, Joshua Whitley

0.14.0 (2020-08-14)

  • Don't install python tf2_geometry_msgs (#299) It hasn't been ported yet. Closes https://github.com/ros2/geometry2/issues/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

0.13.4 (2020-06-03)

  • export targets in addition to include directories / libraries (#271)
  • Contributors: Dirk Thomas

0.13.3 (2020-05-26)

0.13.2 (2020-05-18)

0.13.1 (2020-05-08)

0.13.0 (2020-04-30)

  • 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

0.12.4 (2019-11-19)

0.12.3 (2019-11-18)

  • Remove unused setup.py files (#190)
  • Contributors: Vasilii Artemev

0.12.2 (2019-11-18)

0.12.1 (2019-10-23)

  • 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

0.12.0 (2019-09-26)

0.11.3 (2019-05-24)

0.11.2 (2019-05-20)

0.11.1 (2019-05-09)

0.11.0 (2019-04-14)

  • Updated to use ament_target_dependencies where possible. (#98)

0.10.1 (2018-12-06)

0.10.0 (2018-11-22)

  • Use ros2 time (#67)
    • Buffer constructor accepts a clock
    • Use rclcpp::Time::seconds()
  • revert now unnecessary message initializations (#64)
  • Contributors: Mikael Arguedas, Shane Loretz

0.5.15 (2017-01-24)

0.5.14 (2017-01-16)

  • Add doxygen documentation for tf2_geometry_msgs
  • Contributors: Jackie Kay

0.5.13 (2016-03-04)

  • Add missing python_orocos_kdl dependency
  • make example into unit test
  • vector3 not affected by translation
  • Contributors: Daniel Claes, chapulina

0.5.12 (2015-08-05)

  • Merge pull request #112 from vrabaud/getYaw Get yaw
  • add toMsg and fromMsg for QuaternionStamped
  • Contributors: Tully Foote, Vincent Rabaud

0.5.11 (2015-04-22)

0.5.10 (2015-04-21)

0.5.9 (2015-03-25)

0.5.8 (2015-03-17)

  • remove useless Makefile files
  • tf2 optimizations
  • add conversions of type between tf2 and geometry_msgs
  • fix ODR violations
  • Contributors: Vincent Rabaud

0.5.7 (2014-12-23)

  • fixing transitive dependency for kdl. Fixes #53
  • Contributors: Tully Foote

0.5.6 (2014-09-18)

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

0.5.0 (2014-02-14)

0.4.10 (2013-12-26)

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

0.4.0 (2013-06-27)

  • 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.6 (2013-03-03)

0.3.5 (2013-02-15 14:46)

  • 0.3.4 -> 0.3.5

0.3.4 (2013-02-15 13:14)

  • 0.3.3 -> 0.3.4

0.3.3 (2013-02-15 11:30)

  • 0.3.2 -> 0.3.3

0.3.2 (2013-02-15 00:42)

  • 0.3.1 -> 0.3.2

0.3.1 (2013-02-14)

  • 0.3.0 -> 0.3.1

0.3.0 (2013-02-13)

  • 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

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.7.7
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/geometry2.git
VCS Type git
VCS Version noetic-devel
Last Updated 2024-02-02
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

tf2_geometry_msgs

Additional Links

Maintainers

  • Tully Foote

Authors

  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_geometry_msgs

0.7.7 (2023-10-13)

0.7.6 (2022-10-11)

  • remove method with misleading doc (#534)
  • Contributors: Wellington Castro

0.7.5 (2020-09-01)

0.7.4 (2020-09-01)

0.7.3 (2020-08-25)

  • Use list instead of set to make build reproducible (#473)
  • Contributors: Jochen Sprickerhof

0.7.2 (2020-06-08)

0.7.1 (2020-05-13)

  • import setup from setuptools instead of distutils-core (#449)
  • Contributors: Alejandro Hernández Cordero

0.7.0 (2020-03-09)

  • Replace kdl packages with rosdep keys (#447)
  • Bump CMake version to avoid CMP0048 warning (#445)
  • Make kdl headers available (#419)
  • FIx python3 compatibility for noetic (#416)
  • add <array> from STL (#366)
  • use ROS_DEPRECATED macro for portability (#362)
    • use ROS_DEPRECATED for better portability
    • change ROS_DEPRECATED position (#5)
  • Contributors: James Xu, Shane Loretz, Tully Foote

0.6.5 (2018-11-16)

  • Fix python3 import error
  • Contributors: Timon Engelke

0.6.4 (2018-11-06)

0.6.3 (2018-07-09)

  • Changed access to Vector to prevent memory leak (#305)
  • Added WrenchStamped transformation (#302)
  • Contributors: Denis Štogl, Markus Grimm

0.6.2 (2018-05-02)

0.6.1 (2018-03-21)

0.6.0 (2018-03-21)

  • Boilerplate for Sphinx (#284) Fixes #264
  • tf2_geometry_msgs added doTransform implementations for not stamped types (#262)
    • tf2_geometry_msgs added doTransform implementations for not stamped Point, Quaterion, Pose and Vector3 message types
  • New functionality to transform PoseWithCovarianceStamped messages. (#282)
    • New functionality to transform PoseWithCovarianceStamped messages.
  • Contributors: Blake Anderson, Tully Foote, cwecht

0.5.17 (2018-01-01)

0.5.16 (2017-07-14)

  • remove explicit templating to standardize on overloading. But provide backwards compatibility with deprecation.
  • adding unit tests for conversions
  • Copy transform before altering it in do_transform_vector3 [issue 233] (#235)
  • store gtest return value as int (#229)
  • Document the lifetime of the returned reference for getFrameId and getTimestamp
  • tf2_geometry_msgs: using tf2::Transform in doTransform-functions, marked gmTransformToKDL as deprecated
  • Switch tf2_geometry_msgs to use package.xml format 2 (#217)
  • tf2_geometry_msgs: added missing conversion functions
  • Contributors: Christopher Wecht, Sebastian Wagner, Tully Foote, dhood, pAIgn10

0.5.15 (2017-01-24)

0.5.14 (2017-01-16)

  • Add doxygen documentation for tf2_geometry_msgs
  • Contributors: Jackie Kay

0.5.13 (2016-03-04)

  • Add missing python_orocos_kdl dependency
  • make example into unit test
  • vector3 not affected by translation
  • Contributors: Daniel Claes, chapulina

0.5.12 (2015-08-05)

  • Merge pull request #112 from vrabaud/getYaw Get yaw
  • add toMsg and fromMsg for QuaternionStamped
  • Contributors: Tully Foote, Vincent Rabaud

0.5.11 (2015-04-22)

0.5.10 (2015-04-21)

0.5.9 (2015-03-25)

0.5.8 (2015-03-17)

  • remove useless Makefile files
  • tf2 optimizations
  • add conversions of type between tf2 and geometry_msgs
  • fix ODR violations
  • Contributors: Vincent Rabaud

0.5.7 (2014-12-23)

  • fixing transitive dependency for kdl. Fixes #53
  • Contributors: Tully Foote

0.5.6 (2014-09-18)

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

0.5.0 (2014-02-14)

0.4.10 (2013-12-26)

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

0.4.0 (2013-06-27)

  • 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.6 (2013-03-03)

0.3.5 (2013-02-15 14:46)

  • 0.3.4 -> 0.3.5

0.3.4 (2013-02-15 13:14)

  • 0.3.3 -> 0.3.4

0.3.3 (2013-02-15 11:30)

  • 0.3.2 -> 0.3.3

0.3.2 (2013-02-15 00:42)

  • 0.3.1 -> 0.3.2

0.3.1 (2013-02-14)

  • 0.3.0 -> 0.3.1

0.3.0 (2013-02-13)

  • 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

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Dependant Packages

Name Deps
agni_tf_tools
dock
perch
handrail_detect
planner_trapezoidal
ff_util
astrobee_gazebo
interactive_marker_teleop
audibot_gazebo
cras_cpp_common
create_driver
depthai_bridge
ensenso_camera
aruco_detect
fiducial_slam
stag_detect
find_object_2d
floam
fuse_models
fuse_publishers
fuse_viz
geometry2
test_tf2
turtle_tf2
graceful_controller_ros
hfl_driver
image_rotate
imu_transformer
imu_filter_madgwick
interactive_markers
jsk_perception
laser_geometry
multirobot_map_merge
mcl_3dl
microstrain_inertial_driver
move_base_swp
move_basic
moveit_core
pilz_industrial_motion_planner
moveit_ros_move_group
moveit_ros_perception
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_robot_interaction
mpc_local_planner
mrpt_local_obstacles
mrpt_localization
mrpt_rawlog
mrpt_reactivenav2d
mrpt_ekf_slam_2d
mrpt_ekf_slam_3d
mrpt_graphslam_2d
mrpt_icp_slam_2d
mrpt_rbpf_slam
multisense_ros
mvsim
naoqi_driver
amcl
base_local_planner
carrot_planner
costmap_2d
dwa_local_planner
fake_localization
global_planner
move_base
rotate_recovery
pose_base_controller
pose_follower
twist_recovery
neo_local_planner
costmap_cspace
map_organizer
planner_cspace
safety_limiter
track_odometry
trajectory_tracker
novatel_oem7_driver
ov_msckf
outsight_alb_driver
pilz_robot_programming
pilz_control
prbt_hardware_support
pincher_arm_moveit_demos
qb_chain_controllers
qb_move_hardware_interface
rc_hand_eye_calibration_client
rc_pick_client
rc_silhouettematch_client
rc_tagdetect_client
robot_calibration
robot_localization
nav_2d_utils
rviz
rviz_satellite
rviz_visual_tools
sbg_driver
septentrio_gnss_driver
slam_toolbox
spatio_temporal_voxel_layer
teb_local_planner
tf2_2d
ur_robot_driver
witmotion_ros
ypspur_ros
aruco_opencv
bosch_locator_bridge
adi_3dtof_image_stitching
beluga_ros
magnetometer_compass
etsi_its_msgs_utils
etsi_its_rviz_plugins
flatland_server
gmcl
message_tf_frame_transformer
moveit_calibration_plugins
mrpt_apps
mrpt_libapps
mrpt_libbase
mrpt_libgui
mrpt_libhwdrivers
mrpt_libmaps
mrpt_libmath
mrpt_libnav
mrpt_libobs
mrpt_libopengl
mrpt_libposes
mrpt_libros_bridge
mrpt_libslam
mrpt_libtclap
python_mrpt
rm_referee
rm_chassis_controllers
rm_gimbal_controllers
rm_orientation_controller

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.8.0
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/geometry2.git
VCS Type git
VCS Version ardent
Last Updated 2017-12-09
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

tf2_geometry_msgs

Additional Links

Maintainers

  • Tully Foote

Authors

  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_geometry_msgs

0.5.15 (2017-01-24)

0.5.14 (2017-01-16)

  • Add doxygen documentation for tf2_geometry_msgs
  • Contributors: Jackie Kay

0.5.13 (2016-03-04)

  • Add missing python_orocos_kdl dependency
  • make example into unit test
  • vector3 not affected by translation
  • Contributors: Daniel Claes, chapulina

0.5.12 (2015-08-05)

  • Merge pull request #112 from vrabaud/getYaw Get yaw
  • add toMsg and fromMsg for QuaternionStamped
  • Contributors: Tully Foote, Vincent Rabaud

0.5.11 (2015-04-22)

0.5.10 (2015-04-21)

0.5.9 (2015-03-25)

0.5.8 (2015-03-17)

  • remove useless Makefile files
  • tf2 optimizations
  • add conversions of type between tf2 and geometry_msgs
  • fix ODR violations
  • Contributors: Vincent Rabaud

0.5.7 (2014-12-23)

  • fixing transitive dependency for kdl. Fixes #53
  • Contributors: Tully Foote

0.5.6 (2014-09-18)

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

0.5.0 (2014-02-14)

0.4.10 (2013-12-26)

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

0.4.0 (2013-06-27)

  • 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.6 (2013-03-03)

0.3.5 (2013-02-15 14:46)

  • 0.3.4 -> 0.3.5

0.3.4 (2013-02-15 13:14)

  • 0.3.3 -> 0.3.4

0.3.3 (2013-02-15 11:30)

  • 0.3.2 -> 0.3.3

0.3.2 (2013-02-15 00:42)

  • 0.3.1 -> 0.3.2

0.3.1 (2013-02-14)

  • 0.3.0 -> 0.3.1

0.3.0 (2013-02-13)

  • 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

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.9.1
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/geometry2.git
VCS Type git
VCS Version bouncy
Last Updated 2018-12-06
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

tf2_geometry_msgs

Additional Links

Maintainers

  • Tully Foote

Authors

  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_geometry_msgs

0.5.15 (2017-01-24)

0.5.14 (2017-01-16)

  • Add doxygen documentation for tf2_geometry_msgs
  • Contributors: Jackie Kay

0.5.13 (2016-03-04)

  • Add missing python_orocos_kdl dependency
  • make example into unit test
  • vector3 not affected by translation
  • Contributors: Daniel Claes, chapulina

0.5.12 (2015-08-05)

  • Merge pull request #112 from vrabaud/getYaw Get yaw
  • add toMsg and fromMsg for QuaternionStamped
  • Contributors: Tully Foote, Vincent Rabaud

0.5.11 (2015-04-22)

0.5.10 (2015-04-21)

0.5.9 (2015-03-25)

0.5.8 (2015-03-17)

  • remove useless Makefile files
  • tf2 optimizations
  • add conversions of type between tf2 and geometry_msgs
  • fix ODR violations
  • Contributors: Vincent Rabaud

0.5.7 (2014-12-23)

  • fixing transitive dependency for kdl. Fixes #53
  • Contributors: Tully Foote

0.5.6 (2014-09-18)

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

0.5.0 (2014-02-14)

0.4.10 (2013-12-26)

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

0.4.0 (2013-06-27)

  • 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.6 (2013-03-03)

0.3.5 (2013-02-15 14:46)

  • 0.3.4 -> 0.3.5

0.3.4 (2013-02-15 13:14)

  • 0.3.3 -> 0.3.4

0.3.3 (2013-02-15 11:30)

  • 0.3.2 -> 0.3.3

0.3.2 (2013-02-15 00:42)

  • 0.3.1 -> 0.3.2

0.3.1 (2013-02-14)

  • 0.3.0 -> 0.3.1

0.3.0 (2013-02-13)

  • 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

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.10.1
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/geometry2.git
VCS Type git
VCS Version crystal
Last Updated 2018-12-07
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

tf2_geometry_msgs

Additional Links

Maintainers

  • Tully Foote

Authors

  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_geometry_msgs

0.10.1 (2018-12-06)

0.10.0 (2018-11-22)

  • Use ros2 time (#67)
    • Buffer constructor accepts a clock
    • Use rclcpp::Time::seconds()
  • revert now unnecessary message initializations (#64)
  • Contributors: Mikael Arguedas, Shane Loretz

0.5.15 (2017-01-24)

0.5.14 (2017-01-16)

  • Add doxygen documentation for tf2_geometry_msgs
  • Contributors: Jackie Kay

0.5.13 (2016-03-04)

  • Add missing python_orocos_kdl dependency
  • make example into unit test
  • vector3 not affected by translation
  • Contributors: Daniel Claes, chapulina

0.5.12 (2015-08-05)

  • Merge pull request #112 from vrabaud/getYaw Get yaw
  • add toMsg and fromMsg for QuaternionStamped
  • Contributors: Tully Foote, Vincent Rabaud

0.5.11 (2015-04-22)

0.5.10 (2015-04-21)

0.5.9 (2015-03-25)

0.5.8 (2015-03-17)

  • remove useless Makefile files
  • tf2 optimizations
  • add conversions of type between tf2 and geometry_msgs
  • fix ODR violations
  • Contributors: Vincent Rabaud

0.5.7 (2014-12-23)

  • fixing transitive dependency for kdl. Fixes #53
  • Contributors: Tully Foote

0.5.6 (2014-09-18)

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

0.5.0 (2014-02-14)

0.4.10 (2013-12-26)

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

0.4.0 (2013-06-27)

  • 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.6 (2013-03-03)

0.3.5 (2013-02-15 14:46)

  • 0.3.4 -> 0.3.5

0.3.4 (2013-02-15 13:14)

  • 0.3.3 -> 0.3.4

0.3.3 (2013-02-15 11:30)

  • 0.3.2 -> 0.3.3

0.3.2 (2013-02-15 00:42)

  • 0.3.1 -> 0.3.2

0.3.1 (2013-02-14)

  • 0.3.0 -> 0.3.1

0.3.0 (2013-02-13)

  • 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

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.12.6
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/geometry2.git
VCS Type git
VCS Version eloquent
Last Updated 2020-12-04
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

tf2_geometry_msgs

Additional Links

Maintainers

  • Chris Lalancette
  • Alejandro Hernandez Cordero

Authors

  • Tully Foote
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_geometry_msgs

0.12.6 (2020-12-04)

  • Update maintainers of the ros2/geometry2 fork. (#328) (#331)
  • installed python tf2_geometry_msgs (#207) (#223)
  • Contributors: Alejandro Hernández Cordero

0.12.5 (2020-01-17)

0.12.4 (2019-11-19)

0.12.3 (2019-11-18)

  • Remove unused setup.py files (#190)
  • Contributors: Vasilii Artemev

0.12.2 (2019-11-18)

0.12.1 (2019-10-23)

  • 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

0.12.0 (2019-09-26)

0.11.3 (2019-05-24)

0.11.2 (2019-05-20)

0.11.1 (2019-05-09)

0.11.0 (2019-04-14)

  • Updated to use ament_target_dependencies where possible. (#98)

0.10.1 (2018-12-06)

0.10.0 (2018-11-22)

  • Use ros2 time (#67)
    • Buffer constructor accepts a clock
    • Use rclcpp::Time::seconds()
  • revert now unnecessary message initializations (#64)
  • Contributors: Mikael Arguedas, Shane Loretz

0.5.15 (2017-01-24)

0.5.14 (2017-01-16)

  • Add doxygen documentation for tf2_geometry_msgs
  • Contributors: Jackie Kay

0.5.13 (2016-03-04)

  • Add missing python_orocos_kdl dependency
  • make example into unit test
  • vector3 not affected by translation
  • Contributors: Daniel Claes, chapulina

0.5.12 (2015-08-05)

  • Merge pull request #112 from vrabaud/getYaw Get yaw
  • add toMsg and fromMsg for QuaternionStamped
  • Contributors: Tully Foote, Vincent Rabaud

0.5.11 (2015-04-22)

0.5.10 (2015-04-21)

0.5.9 (2015-03-25)

0.5.8 (2015-03-17)

  • remove useless Makefile files
  • tf2 optimizations
  • add conversions of type between tf2 and geometry_msgs
  • fix ODR violations
  • Contributors: Vincent Rabaud

0.5.7 (2014-12-23)

  • fixing transitive dependency for kdl. Fixes #53
  • Contributors: Tully Foote

0.5.6 (2014-09-18)

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

0.5.0 (2014-02-14)

0.4.10 (2013-12-26)

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

0.4.0 (2013-06-27)

  • 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.6 (2013-03-03)

0.3.5 (2013-02-15 14:46)

  • 0.3.4 -> 0.3.5

0.3.4 (2013-02-15 13:14)

  • 0.3.3 -> 0.3.4

0.3.3 (2013-02-15 11:30)

  • 0.3.2 -> 0.3.3

0.3.2 (2013-02-15 00:42)

  • 0.3.1 -> 0.3.2

0.3.1 (2013-02-14)

  • 0.3.0 -> 0.3.1

0.3.0 (2013-02-13)

  • 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

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.11.6
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/geometry2.git
VCS Type git
VCS Version dashing
Last Updated 2019-12-10
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

tf2_geometry_msgs

Additional Links

Maintainers

  • Tully Foote

Authors

  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_geometry_msgs

0.11.6 (2019-12-10)

0.11.5 (2019-09-06)

0.11.4 (2019-07-31)

0.11.3 (2019-05-24)

0.11.2 (2019-05-20)

0.11.1 (2019-05-09)

0.11.0 (2019-04-14)

  • Updated to use ament_target_dependencies where possible. (#98)

0.10.1 (2018-12-06)

0.10.0 (2018-11-22)

  • Use ros2 time (#67)
    • Buffer constructor accepts a clock
    • Use rclcpp::Time::seconds()
  • revert now unnecessary message initializations (#64)
  • Contributors: Mikael Arguedas, Shane Loretz

0.5.15 (2017-01-24)

0.5.14 (2017-01-16)

  • Add doxygen documentation for tf2_geometry_msgs
  • Contributors: Jackie Kay

0.5.13 (2016-03-04)

  • Add missing python_orocos_kdl dependency
  • make example into unit test
  • vector3 not affected by translation
  • Contributors: Daniel Claes, chapulina

0.5.12 (2015-08-05)

  • Merge pull request #112 from vrabaud/getYaw Get yaw
  • add toMsg and fromMsg for QuaternionStamped
  • Contributors: Tully Foote, Vincent Rabaud

0.5.11 (2015-04-22)

0.5.10 (2015-04-21)

0.5.9 (2015-03-25)

0.5.8 (2015-03-17)

  • remove useless Makefile files
  • tf2 optimizations
  • add conversions of type between tf2 and geometry_msgs
  • fix ODR violations
  • Contributors: Vincent Rabaud

0.5.7 (2014-12-23)

  • fixing transitive dependency for kdl. Fixes #53
  • Contributors: Tully Foote

0.5.6 (2014-09-18)

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

0.5.0 (2014-02-14)

0.4.10 (2013-12-26)

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

0.4.0 (2013-06-27)

  • 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.6 (2013-03-03)

0.3.5 (2013-02-15 14:46)

  • 0.3.4 -> 0.3.5

0.3.4 (2013-02-15 13:14)

  • 0.3.3 -> 0.3.4

0.3.3 (2013-02-15 11:30)

  • 0.3.2 -> 0.3.3

0.3.2 (2013-02-15 00:42)

  • 0.3.1 -> 0.3.2

0.3.1 (2013-02-14)

  • 0.3.0 -> 0.3.1

0.3.0 (2013-02-13)

  • 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

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.17.5
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/geometry2.git
VCS Type git
VCS Version galactic
Last Updated 2022-12-03
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

tf2_geometry_msgs

Additional Links

Maintainers

  • Chris Lalancette
  • Alejandro Hernandez Cordero

Authors

  • Tully Foote
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_geometry_msgs

0.17.5 (2022-12-02)

  • Drop PyKDL dependency in tf2_geometry_msgs (#533)
  • Contributors: Charles Dawson, Florian Vahl

0.17.4 (2022-06-30)

0.17.3 (2022-04-28)

  • `tf2_geometry_msgs`: Fixing covariance transformation in [doTransform<PoseWithCovarianceStamped, TransformStamped>]{.title-ref} (#430) (#488)
  • Contributors: mergify[bot]

0.17.2 (2021-05-10)

0.17.1 (2021-04-06)

0.17.0 (2021-03-19)

  • Fix doTransform with Eigen Quaternion (#369)
  • Contributors: Bjar Ne

0.16.0 (2021-01-25)

0.15.1 (2020-12-08)

0.15.0 (2020-11-02)

  • Update maintainers of the ros2/geometry2 fork. (#328)
  • Contributors: Chris Lalancette

0.14.1 (2020-09-21)

  • Activate usual compiler warnings and fix errors (#270)
  • Add PoseWithCovarianceStamped transform support (#312)
  • Contributors: Ivan Santiago Paunovic, Joshua Whitley

0.14.0 (2020-08-14)

  • Don't install python tf2_geometry_msgs (#299) It hasn't been ported yet. Closes https://github.com/ros2/geometry2/issues/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

0.13.4 (2020-06-03)

  • export targets in addition to include directories / libraries (#271)
  • Contributors: Dirk Thomas

0.13.3 (2020-05-26)

0.13.2 (2020-05-18)

0.13.1 (2020-05-08)

0.13.0 (2020-04-30)

  • 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

0.12.4 (2019-11-19)

0.12.3 (2019-11-18)

  • Remove unused setup.py files (#190)
  • Contributors: Vasilii Artemev

0.12.2 (2019-11-18)

0.12.1 (2019-10-23)

  • 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

0.12.0 (2019-09-26)

0.11.3 (2019-05-24)

0.11.2 (2019-05-20)

0.11.1 (2019-05-09)

0.11.0 (2019-04-14)

  • Updated to use ament_target_dependencies where possible. (#98)

0.10.1 (2018-12-06)

0.10.0 (2018-11-22)

  • Use ros2 time (#67)
    • Buffer constructor accepts a clock
    • Use rclcpp::Time::seconds()
  • revert now unnecessary message initializations (#64)
  • Contributors: Mikael Arguedas, Shane Loretz

0.5.15 (2017-01-24)

0.5.14 (2017-01-16)

  • Add doxygen documentation for tf2_geometry_msgs
  • Contributors: Jackie Kay

0.5.13 (2016-03-04)

  • Add missing python_orocos_kdl dependency
  • make example into unit test
  • vector3 not affected by translation
  • Contributors: Daniel Claes, chapulina

0.5.12 (2015-08-05)

  • Merge pull request #112 from vrabaud/getYaw Get yaw
  • add toMsg and fromMsg for QuaternionStamped
  • Contributors: Tully Foote, Vincent Rabaud

0.5.11 (2015-04-22)

0.5.10 (2015-04-21)

0.5.9 (2015-03-25)

0.5.8 (2015-03-17)

  • remove useless Makefile files
  • tf2 optimizations
  • add conversions of type between tf2 and geometry_msgs
  • fix ODR violations
  • Contributors: Vincent Rabaud

0.5.7 (2014-12-23)

  • fixing transitive dependency for kdl. Fixes #53
  • Contributors: Tully Foote

0.5.6 (2014-09-18)

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

0.5.0 (2014-02-14)

0.4.10 (2013-12-26)

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

0.4.0 (2013-06-27)

  • 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.6 (2013-03-03)

0.3.5 (2013-02-15 14:46)

  • 0.3.4 -> 0.3.5

0.3.4 (2013-02-15 13:14)

  • 0.3.3 -> 0.3.4

0.3.3 (2013-02-15 11:30)

  • 0.3.2 -> 0.3.3

0.3.2 (2013-02-15 00:42)

  • 0.3.1 -> 0.3.2

0.3.1 (2013-02-14)

  • 0.3.0 -> 0.3.1

0.3.0 (2013-02-13)

  • 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

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.13.14
License BSD
Build type AMENT_CMAKE
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros2/geometry2.git
VCS Type git
VCS Version foxy
Last Updated 2023-03-16
Dev Status MAINTAINED
CI status No Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

tf2_geometry_msgs

Additional Links

Maintainers

  • Chris Lalancette
  • Alejandro Hernandez Cordero

Authors

  • Tully Foote
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_geometry_msgs

0.13.14 (2023-03-16)

  • Drop PyKDL dependency in tf2_geometry_msgs (backport #509 to foxy) (#532)
  • Contributors: Charles Dawson, Florian Vahl

0.13.13 (2022-01-31)

  • Fix covariance transformation in doTransform<PoseWithCovarianceStamped, TransformStamped> (#430) (#489)
  • Contributors: Abrar Rahman Protyasha

0.13.12 (2021-10-05)

0.13.11 (2021-08-31)

0.13.10 (2021-04-14)

0.13.9 (2020-12-09)

0.13.8 (2020-12-08)

0.13.7 (2020-11-18)

0.13.6 (2020-10-28)

  • [Foxy backport] Add PoseWithCovarianceStamped transform support (#336)
  • Update maintainers of the ros2/geometry2 fork. (#328) (#332)
  • Don't install python tf2_geometry_msgs (#299) (#302)
  • Contributors: Alejandro Hernández Cordero, Nikolai Morin, Shane Loretz

0.13.5 (2020-08-05)

0.13.4 (2020-06-03)

  • export targets in addition to include directories / libraries (#271)
  • Contributors: Dirk Thomas

0.13.3 (2020-05-26)

0.13.2 (2020-05-18)

0.13.1 (2020-05-08)

0.13.0 (2020-04-30)

  • 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

0.12.4 (2019-11-19)

0.12.3 (2019-11-18)

  • Remove unused setup.py files (#190)
  • Contributors: Vasilii Artemev

0.12.2 (2019-11-18)

0.12.1 (2019-10-23)

  • 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

0.12.0 (2019-09-26)

0.11.3 (2019-05-24)

0.11.2 (2019-05-20)

0.11.1 (2019-05-09)

0.11.0 (2019-04-14)

  • Updated to use ament_target_dependencies where possible. (#98)

0.10.1 (2018-12-06)

0.10.0 (2018-11-22)

  • Use ros2 time (#67)
    • Buffer constructor accepts a clock
    • Use rclcpp::Time::seconds()
  • revert now unnecessary message initializations (#64)
  • Contributors: Mikael Arguedas, Shane Loretz

0.5.15 (2017-01-24)

0.5.14 (2017-01-16)

  • Add doxygen documentation for tf2_geometry_msgs
  • Contributors: Jackie Kay

0.5.13 (2016-03-04)

  • Add missing python_orocos_kdl dependency
  • make example into unit test
  • vector3 not affected by translation
  • Contributors: Daniel Claes, chapulina

0.5.12 (2015-08-05)

  • Merge pull request #112 from vrabaud/getYaw Get yaw
  • add toMsg and fromMsg for QuaternionStamped
  • Contributors: Tully Foote, Vincent Rabaud

0.5.11 (2015-04-22)

0.5.10 (2015-04-21)

0.5.9 (2015-03-25)

0.5.8 (2015-03-17)

  • remove useless Makefile files
  • tf2 optimizations
  • add conversions of type between tf2 and geometry_msgs
  • fix ODR violations
  • Contributors: Vincent Rabaud

0.5.7 (2014-12-23)

  • fixing transitive dependency for kdl. Fixes #53
  • Contributors: Tully Foote

0.5.6 (2014-09-18)

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

0.5.0 (2014-02-14)

0.4.10 (2013-12-26)

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

0.4.0 (2013-06-27)

  • 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.6 (2013-03-03)

0.3.5 (2013-02-15 14:46)

  • 0.3.4 -> 0.3.5

0.3.4 (2013-02-15 13:14)

  • 0.3.3 -> 0.3.4

0.3.3 (2013-02-15 11:30)

  • 0.3.2 -> 0.3.3

0.3.2 (2013-02-15 00:42)

  • 0.3.1 -> 0.3.2

0.3.1 (2013-02-14)

  • 0.3.0 -> 0.3.1

0.3.0 (2013-02-13)

  • 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

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.5.20
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/geometry2.git
VCS Type git
VCS Version indigo-devel
Last Updated 2018-11-16
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

tf2_geometry_msgs

Additional Links

Maintainers

  • Tully Foote

Authors

  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_geometry_msgs

0.5.20 (2018-11-16)

0.5.19 (2018-11-06)

  • Use boost::array insted of std:array ... for older C++ version
  • Added WrenchStamped transformation (#302)
    • Added doTransformation for geometry_msgs/Wrench
    • Added python implementation of Wrench transform
  • Contributors: Denis Štogl

0.5.18 (2018-07-10)

  • Changed access to Vector to prevent memory leak (#305)
  • Boilerplate for Sphinx (#284)
  • tf2_geometry_msgs added doTransform implementations for not stamped P… (#262)
  • New functionality to transform PoseWithCovarianceStamped messages. (#282)
  • Contributors: Blake Anderson, Markus Grimm, Tully Foote, cwecht

0.5.17 (2018-01-01)

0.5.16 (2017-07-14)

  • remove explicit templating to standardize on overloading. But provide backwards compatibility with deprecation.
  • adding unit tests for conversions
  • Copy transform before altering it in do_transform_vector3 [issue 233] (#235)
  • store gtest return value as int (#229)
  • Document the lifetime of the returned reference for getFrameId and getTimestamp
  • tf2_geometry_msgs: using tf2::Transform in doTransform-functions, marked gmTransformToKDL as deprecated
  • Switch tf2_geometry_msgs to use package.xml format 2 (#217)
  • tf2_geometry_msgs: added missing conversion functions
  • Contributors: Christopher Wecht, Sebastian Wagner, Tully Foote, dhood, pAIgn10

0.5.15 (2017-01-24)

0.5.14 (2017-01-16)

  • Add doxygen documentation for tf2_geometry_msgs
  • Contributors: Jackie Kay

0.5.13 (2016-03-04)

  • Add missing python_orocos_kdl dependency
  • make example into unit test
  • vector3 not affected by translation
  • Contributors: Daniel Claes, chapulina

0.5.12 (2015-08-05)

  • Merge pull request #112 from vrabaud/getYaw Get yaw
  • add toMsg and fromMsg for QuaternionStamped
  • Contributors: Tully Foote, Vincent Rabaud

0.5.11 (2015-04-22)

0.5.10 (2015-04-21)

0.5.9 (2015-03-25)

0.5.8 (2015-03-17)

  • remove useless Makefile files
  • tf2 optimizations
  • add conversions of type between tf2 and geometry_msgs
  • fix ODR violations
  • Contributors: Vincent Rabaud

0.5.7 (2014-12-23)

  • fixing transitive dependency for kdl. Fixes #53
  • Contributors: Tully Foote

0.5.6 (2014-09-18)

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

0.5.0 (2014-02-14)

0.4.10 (2013-12-26)

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

0.4.0 (2013-06-27)

  • 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.6 (2013-03-03)

0.3.5 (2013-02-15 14:46)

  • 0.3.4 -> 0.3.5

0.3.4 (2013-02-15 13:14)

  • 0.3.3 -> 0.3.4

0.3.3 (2013-02-15 11:30)

  • 0.3.2 -> 0.3.3

0.3.2 (2013-02-15 00:42)

  • 0.3.1 -> 0.3.2

0.3.1 (2013-02-14)

  • 0.3.0 -> 0.3.1

0.3.0 (2013-02-13)

  • 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

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.5.20
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/geometry2.git
VCS Type git
VCS Version indigo-devel
Last Updated 2018-11-16
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

tf2_geometry_msgs

Additional Links

Maintainers

  • Tully Foote

Authors

  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_geometry_msgs

0.5.20 (2018-11-16)

0.5.19 (2018-11-06)

  • Use boost::array insted of std:array ... for older C++ version
  • Added WrenchStamped transformation (#302)
    • Added doTransformation for geometry_msgs/Wrench
    • Added python implementation of Wrench transform
  • Contributors: Denis Štogl

0.5.18 (2018-07-10)

  • Changed access to Vector to prevent memory leak (#305)
  • Boilerplate for Sphinx (#284)
  • tf2_geometry_msgs added doTransform implementations for not stamped P… (#262)
  • New functionality to transform PoseWithCovarianceStamped messages. (#282)
  • Contributors: Blake Anderson, Markus Grimm, Tully Foote, cwecht

0.5.17 (2018-01-01)

0.5.16 (2017-07-14)

  • remove explicit templating to standardize on overloading. But provide backwards compatibility with deprecation.
  • adding unit tests for conversions
  • Copy transform before altering it in do_transform_vector3 [issue 233] (#235)
  • store gtest return value as int (#229)
  • Document the lifetime of the returned reference for getFrameId and getTimestamp
  • tf2_geometry_msgs: using tf2::Transform in doTransform-functions, marked gmTransformToKDL as deprecated
  • Switch tf2_geometry_msgs to use package.xml format 2 (#217)
  • tf2_geometry_msgs: added missing conversion functions
  • Contributors: Christopher Wecht, Sebastian Wagner, Tully Foote, dhood, pAIgn10

0.5.15 (2017-01-24)

0.5.14 (2017-01-16)

  • Add doxygen documentation for tf2_geometry_msgs
  • Contributors: Jackie Kay

0.5.13 (2016-03-04)

  • Add missing python_orocos_kdl dependency
  • make example into unit test
  • vector3 not affected by translation
  • Contributors: Daniel Claes, chapulina

0.5.12 (2015-08-05)

  • Merge pull request #112 from vrabaud/getYaw Get yaw
  • add toMsg and fromMsg for QuaternionStamped
  • Contributors: Tully Foote, Vincent Rabaud

0.5.11 (2015-04-22)

0.5.10 (2015-04-21)

0.5.9 (2015-03-25)

0.5.8 (2015-03-17)

  • remove useless Makefile files
  • tf2 optimizations
  • add conversions of type between tf2 and geometry_msgs
  • fix ODR violations
  • Contributors: Vincent Rabaud

0.5.7 (2014-12-23)

  • fixing transitive dependency for kdl. Fixes #53
  • Contributors: Tully Foote

0.5.6 (2014-09-18)

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

0.5.0 (2014-02-14)

0.4.10 (2013-12-26)

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

0.4.0 (2013-06-27)

  • 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.6 (2013-03-03)

0.3.5 (2013-02-15 14:46)

  • 0.3.4 -> 0.3.5

0.3.4 (2013-02-15 13:14)

  • 0.3.3 -> 0.3.4

0.3.3 (2013-02-15 11:30)

  • 0.3.2 -> 0.3.3

0.3.2 (2013-02-15 00:42)

  • 0.3.1 -> 0.3.2

0.3.1 (2013-02-14)

  • 0.3.0 -> 0.3.1

0.3.0 (2013-02-13)

  • 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

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.5.20
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/geometry2.git
VCS Type git
VCS Version indigo-devel
Last Updated 2018-11-16
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

tf2_geometry_msgs

Additional Links

Maintainers

  • Tully Foote

Authors

  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_geometry_msgs

0.5.20 (2018-11-16)

0.5.19 (2018-11-06)

  • Use boost::array insted of std:array ... for older C++ version
  • Added WrenchStamped transformation (#302)
    • Added doTransformation for geometry_msgs/Wrench
    • Added python implementation of Wrench transform
  • Contributors: Denis Štogl

0.5.18 (2018-07-10)

  • Changed access to Vector to prevent memory leak (#305)
  • Boilerplate for Sphinx (#284)
  • tf2_geometry_msgs added doTransform implementations for not stamped P… (#262)
  • New functionality to transform PoseWithCovarianceStamped messages. (#282)
  • Contributors: Blake Anderson, Markus Grimm, Tully Foote, cwecht

0.5.17 (2018-01-01)

0.5.16 (2017-07-14)

  • remove explicit templating to standardize on overloading. But provide backwards compatibility with deprecation.
  • adding unit tests for conversions
  • Copy transform before altering it in do_transform_vector3 [issue 233] (#235)
  • store gtest return value as int (#229)
  • Document the lifetime of the returned reference for getFrameId and getTimestamp
  • tf2_geometry_msgs: using tf2::Transform in doTransform-functions, marked gmTransformToKDL as deprecated
  • Switch tf2_geometry_msgs to use package.xml format 2 (#217)
  • tf2_geometry_msgs: added missing conversion functions
  • Contributors: Christopher Wecht, Sebastian Wagner, Tully Foote, dhood, pAIgn10

0.5.15 (2017-01-24)

0.5.14 (2017-01-16)

  • Add doxygen documentation for tf2_geometry_msgs
  • Contributors: Jackie Kay

0.5.13 (2016-03-04)

  • Add missing python_orocos_kdl dependency
  • make example into unit test
  • vector3 not affected by translation
  • Contributors: Daniel Claes, chapulina

0.5.12 (2015-08-05)

  • Merge pull request #112 from vrabaud/getYaw Get yaw
  • add toMsg and fromMsg for QuaternionStamped
  • Contributors: Tully Foote, Vincent Rabaud

0.5.11 (2015-04-22)

0.5.10 (2015-04-21)

0.5.9 (2015-03-25)

0.5.8 (2015-03-17)

  • remove useless Makefile files
  • tf2 optimizations
  • add conversions of type between tf2 and geometry_msgs
  • fix ODR violations
  • Contributors: Vincent Rabaud

0.5.7 (2014-12-23)

  • fixing transitive dependency for kdl. Fixes #53
  • Contributors: Tully Foote

0.5.6 (2014-09-18)

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

0.5.0 (2014-02-14)

0.4.10 (2013-12-26)

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

0.4.0 (2013-06-27)

  • 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.6 (2013-03-03)

0.3.5 (2013-02-15 14:46)

  • 0.3.4 -> 0.3.5

0.3.4 (2013-02-15 13:14)

  • 0.3.3 -> 0.3.4

0.3.3 (2013-02-15 11:30)

  • 0.3.2 -> 0.3.3

0.3.2 (2013-02-15 00:42)

  • 0.3.1 -> 0.3.2

0.3.1 (2013-02-14)

  • 0.3.0 -> 0.3.1

0.3.0 (2013-02-13)

  • 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

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.4.12
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/geometry2.git
VCS Type git
VCS Version hydro-devel
Last Updated 2014-12-16
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

tf2_geometry_msgs

Additional Links

Maintainers

  • Tully Foote

Authors

  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_geometry_msgs

0.4.12 (2014-09-18)

0.4.11 (2014-06-04)

0.4.10 (2013-12-26)

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

0.4.0 (2013-06-27)

  • 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.6 (2013-03-03)

0.3.5 (2013-02-15 14:46)

  • 0.3.4 -> 0.3.5

0.3.4 (2013-02-15 13:14)

  • 0.3.3 -> 0.3.4

0.3.3 (2013-02-15 11:30)

  • 0.3.2 -> 0.3.3

0.3.2 (2013-02-15 00:42)

  • 0.3.1 -> 0.3.2

0.3.1 (2013-02-14)

  • 0.3.0 -> 0.3.1

0.3.0 (2013-02-13)

  • 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

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Launch files

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.5.20
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/geometry2.git
VCS Type git
VCS Version indigo-devel
Last Updated 2018-11-16
Dev Status MAINTAINED
CI status Continuous Integration
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

tf2_geometry_msgs

Additional Links

Maintainers

  • Tully Foote

Authors

  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_geometry_msgs

0.5.20 (2018-11-16)

0.5.19 (2018-11-06)

  • Use boost::array insted of std:array ... for older C++ version
  • Added WrenchStamped transformation (#302)
    • Added doTransformation for geometry_msgs/Wrench
    • Added python implementation of Wrench transform
  • Contributors: Denis Štogl

0.5.18 (2018-07-10)

  • Changed access to Vector to prevent memory leak (#305)
  • Boilerplate for Sphinx (#284)
  • tf2_geometry_msgs added doTransform implementations for not stamped P… (#262)
  • New functionality to transform PoseWithCovarianceStamped messages. (#282)
  • Contributors: Blake Anderson, Markus Grimm, Tully Foote, cwecht

0.5.17 (2018-01-01)

0.5.16 (2017-07-14)

  • remove explicit templating to standardize on overloading. But provide backwards compatibility with deprecation.
  • adding unit tests for conversions
  • Copy transform before altering it in do_transform_vector3 [issue 233] (#235)
  • store gtest return value as int (#229)
  • Document the lifetime of the returned reference for getFrameId and getTimestamp
  • tf2_geometry_msgs: using tf2::Transform in doTransform-functions, marked gmTransformToKDL as deprecated
  • Switch tf2_geometry_msgs to use package.xml format 2 (#217)
  • tf2_geometry_msgs: added missing conversion functions
  • Contributors: Christopher Wecht, Sebastian Wagner, Tully Foote, dhood, pAIgn10

0.5.15 (2017-01-24)

0.5.14 (2017-01-16)

  • Add doxygen documentation for tf2_geometry_msgs
  • Contributors: Jackie Kay

0.5.13 (2016-03-04)

  • Add missing python_orocos_kdl dependency
  • make example into unit test
  • vector3 not affected by translation
  • Contributors: Daniel Claes, chapulina

0.5.12 (2015-08-05)

  • Merge pull request #112 from vrabaud/getYaw Get yaw
  • add toMsg and fromMsg for QuaternionStamped
  • Contributors: Tully Foote, Vincent Rabaud

0.5.11 (2015-04-22)

0.5.10 (2015-04-21)

0.5.9 (2015-03-25)

0.5.8 (2015-03-17)

  • remove useless Makefile files
  • tf2 optimizations
  • add conversions of type between tf2 and geometry_msgs
  • fix ODR violations
  • Contributors: Vincent Rabaud

0.5.7 (2014-12-23)

  • fixing transitive dependency for kdl. Fixes #53
  • Contributors: Tully Foote

0.5.6 (2014-09-18)

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

0.5.0 (2014-02-14)

0.4.10 (2013-12-26)

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

0.4.0 (2013-06-27)

  • 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.6 (2013-03-03)

0.3.5 (2013-02-15 14:46)

  • 0.3.4 -> 0.3.5

0.3.4 (2013-02-15 13:14)

  • 0.3.3 -> 0.3.4

0.3.3 (2013-02-15 11:30)

  • 0.3.2 -> 0.3.3

0.3.2 (2013-02-15 00:42)

  • 0.3.1 -> 0.3.2

0.3.1 (2013-02-14)

  • 0.3.0 -> 0.3.1

0.3.0 (2013-02-13)

  • 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

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_geometry_msgs at Robotics Stack Exchange

Package Summary

Tags No category tags.
Version 0.6.7
License BSD
Build type CATKIN
Use RECOMMENDED

Repository Summary

Checkout URI https://github.com/ros/geometry2.git
VCS Type git
VCS Version melodic-devel
Last Updated 2020-08-24
Dev Status MAINTAINED
CI status
Released RELEASED
Tags No category tags.
Contributing Help Wanted (0)
Good First Issues (0)
Pull Requests to Review (0)

Package Description

tf2_geometry_msgs

Additional Links

Maintainers

  • Tully Foote

Authors

  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_geometry_msgs

0.6.7 (2020-03-09)

0.6.6 (2020-01-09)

  • Make kdl headers available (#419)
  • Fix python3 compatibility for noetic (#416)
  • add <array> from STL (#366)
  • use ROS_DEPRECATED macro for portability (#362)
  • Contributors: James Xu, Shane Loretz, Tully Foote

0.6.5 (2018-11-16)

  • Fix python3 import error
  • Contributors: Timon Engelke

0.6.4 (2018-11-06)

0.6.3 (2018-07-09)

  • Changed access to Vector to prevent memory leak (#305)
  • Added WrenchStamped transformation (#302)
  • Contributors: Denis Štogl, Markus Grimm

0.6.2 (2018-05-02)

0.6.1 (2018-03-21)

0.6.0 (2018-03-21)

  • Boilerplate for Sphinx (#284) Fixes #264
  • tf2_geometry_msgs added doTransform implementations for not stamped types (#262)
    • tf2_geometry_msgs added doTransform implementations for not stamped Point, Quaterion, Pose and Vector3 message types
  • New functionality to transform PoseWithCovarianceStamped messages. (#282)
    • New functionality to transform PoseWithCovarianceStamped messages.
  • Contributors: Blake Anderson, Tully Foote, cwecht

0.5.17 (2018-01-01)

0.5.16 (2017-07-14)

  • remove explicit templating to standardize on overloading. But provide backwards compatibility with deprecation.
  • adding unit tests for conversions
  • Copy transform before altering it in do_transform_vector3 [issue 233] (#235)
  • store gtest return value as int (#229)
  • Document the lifetime of the returned reference for getFrameId and getTimestamp
  • tf2_geometry_msgs: using tf2::Transform in doTransform-functions, marked gmTransformToKDL as deprecated
  • Switch tf2_geometry_msgs to use package.xml format 2 (#217)
  • tf2_geometry_msgs: added missing conversion functions
  • Contributors: Christopher Wecht, Sebastian Wagner, Tully Foote, dhood, pAIgn10

0.5.15 (2017-01-24)

0.5.14 (2017-01-16)

  • Add doxygen documentation for tf2_geometry_msgs
  • Contributors: Jackie Kay

0.5.13 (2016-03-04)

  • Add missing python_orocos_kdl dependency
  • make example into unit test
  • vector3 not affected by translation
  • Contributors: Daniel Claes, chapulina

0.5.12 (2015-08-05)

  • Merge pull request #112 from vrabaud/getYaw Get yaw
  • add toMsg and fromMsg for QuaternionStamped
  • Contributors: Tully Foote, Vincent Rabaud

0.5.11 (2015-04-22)

0.5.10 (2015-04-21)

0.5.9 (2015-03-25)

0.5.8 (2015-03-17)

  • remove useless Makefile files
  • tf2 optimizations
  • add conversions of type between tf2 and geometry_msgs
  • fix ODR violations
  • Contributors: Vincent Rabaud

0.5.7 (2014-12-23)

  • fixing transitive dependency for kdl. Fixes #53
  • Contributors: Tully Foote

0.5.6 (2014-09-18)

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

0.5.0 (2014-02-14)

0.4.10 (2013-12-26)

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

0.4.0 (2013-06-27)

  • 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.6 (2013-03-03)

0.3.5 (2013-02-15 14:46)

  • 0.3.4 -> 0.3.5

0.3.4 (2013-02-15 13:14)

  • 0.3.3 -> 0.3.4

0.3.3 (2013-02-15 11:30)

  • 0.3.2 -> 0.3.3

0.3.2 (2013-02-15 00:42)

  • 0.3.1 -> 0.3.2

0.3.1 (2013-02-14)

  • 0.3.0 -> 0.3.1

0.3.0 (2013-02-13)

  • 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

Wiki Tutorials

This package does not provide any links to tutorials in it's rosindex metadata. You can check on the ROS Wiki Tutorials page for the package.

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

Name Deps
agni_tf_tools
dock
perch
handrail_detect
planner_trapezoidal
ff_util
astrobee_gazebo
interactive_marker_teleop
ati_force_torque
audibot_gazebo
aruco_pose
clover
costmap_tf_layer
cras_cpp_common
create_driver
datmo
distance_map_core
eband_local_planner
ensenso_camera
fetch_simple_linear_controller
aruco_detect
fiducial_slam
find_object_2d
floam
force_torque_sensor
fuse_models
fuse_publishers
fuse_viz
geometry2
test_tf2
turtle_tf2
graceful_controller_ros
hfl_driver
iirob_filters
image_rotate
imu_transformer
imu_filter_madgwick
jsk_perception
laser_geometry
multirobot_map_merge
moveback_recovery
mcl_3dl
microstrain_inertial_driver
move_base_swp
move_basic
moveit_core
pilz_industrial_motion_planner
moveit_ros_move_group
moveit_ros_perception
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_robot_interaction
moveit_tutorials
mpc_local_planner
mrpt_local_obstacles
mrpt_localization
mrpt_rawlog
mrpt_reactivenav2d
mrpt_ekf_slam_2d
mrpt_ekf_slam_3d
mrpt_icp_slam_2d
mrpt_rbpf_slam
multisense_ros
mvsim
naoqi_driver
amcl
base_local_planner
carrot_planner
costmap_2d
dwa_local_planner
fake_localization
global_planner
move_base
rotate_recovery
pose_base_controller
pose_follower
twist_recovery
range_sensor_layer
neo_local_planner
costmap_cspace
map_organizer
planner_cspace
safety_limiter
track_odometry
trajectory_tracker
novatel_oem7_driver
ov_msckf
orb_slam2_ros
outsight_alb_driver
pilz_robot_programming
pilz_trajectory_generation
pilz_control
prbt_hardware_support
pincher_arm_moveit_demos
qb_chain_controllers
qb_move_hardware_interface
rc_hand_eye_calibration_client
rc_pick_client
rc_silhouettematch_client
rc_tagdetect_client
robot_calibration
robot_localization
nav_2d_utils
rr_openrover_driver
rviz_satellite
sbg_driver
septentrio_gnss_driver
slam_toolbox
spatio_temporal_voxel_layer
teb_local_planner
tf2_2d
tf2_urdf
ur_robot_driver
witmotion_ros
ypspur_ros

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_geometry_msgs at Robotics Stack Exchange