-
 

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

This package contains the C++ ROS bindings for the tf2 library

Additional Links

Maintainers

  • Chris Lalancette
  • Alejandro Hernandez Cordero

Authors

  • Eitan Marder-Eppstein
  • Wim Meeussen
  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_ros

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)

0.25.5 (2023-11-13)

0.25.4 (2023-09-19)

  • Suppress spam from calling canTransform (#529) (#615)
  • Fix invalid timer handle exception (#474) (#614)
  • Contributors: mergify[bot]

0.25.3 (2023-07-17)

  • Enable StaticTransformBroadcaster in Intra-process enabled components (backport #607) (#612)
  • Contributors: mergify[bot]

0.25.2 (2023-01-10)

0.25.1 (2022-08-05)

0.25.0 (2022-04-05)

  • Install includes to include/${PROJECT_NAME} and use modern CMake (#493)
  • Contributors: Shane Loretz

0.24.0 (2022-03-31)

0.23.0 (2022-03-28)

  • use dedicated callback group and executor to isolate timer (#447)
  • Adding shared pointer definition to tf2 buffer (#508)
  • fix for a basic logic (#510)
  • Fix precision loss from using rclcpp::Time::seconds() (#511)
  • Contributors: Chen Lihui, Kenji Brameld, Steve Macenski, Zhenpeng Ge

0.22.0 (2022-03-01)

  • clear relative callback of Buffer if MessageFilter is destroyed (#490)
  • More info in tf2_echo output (#468)
  • Contributors: Chen Lihui, simulacrus

0.21.0 (2022-01-14)

  • Fix cpplint errors (#497)
  • Contributors: Jacob Perron

0.20.0 (2021-12-17)

  • Fixes for uncrustify 0.72 (#486)
  • Contributors: Chris Lalancette

0.19.0 (2021-10-15)

  • More Intuitive CLI for Static Transform Publisher (#392)
  • Reduce transform listener nodes (#442)
  • `tf2_ros`: Fix deprecated subscriber callbacks (#448)
  • Contributors: Abrar Rahman Protyasha, Hunter L. Allen, gezp

0.18.0 (2021-06-01)

  • Fix tf2_echo does not work with ros-args (#407) (#408)
  • Contributors: PGotzmann

0.17.1 (2021-04-06)

0.17.0 (2021-03-19)

  • Guard against access to null node pointer (#393)
  • Allow to reconfigure durability for /tf topic broadcaster/listener (#383)
  • Fix the rcl type used in the time jump. (#391)
  • Fix linter errors (#385)
  • fix accessing freed resources (#386)
  • Allow reconfiguring qos of tf and tf_static topics through parameters (#381)
  • Replace ROS_* logging macros and use RCLCPP_* instead (#380)
  • Contributors: Audrow Nash, Chris Lalancette, Ivan Santiago Paunovic, Jacob Perron, Kazunari Tanaka

0.16.0 (2021-01-25)

  • Improve message filters error messages (#364)
  • Contributors: Ivan Santiago Paunovic

0.15.1 (2020-12-08)

  • Clarify the role of child_frame_id and header.frame_id in the documentation. (#345)
  • Contributors: Vikas Dhiman

0.15.0 (2020-11-02)

  • Remove usage of deprecated rclcpp::Duration constructor (#340)
  • Remove messages_count member from tf2_ros::MessageFilter. (#335)
  • Style fixup in tf2_ros. (#325)
  • Update maintainers of the ros2/geometry2 fork. (#328)
  • Contributors: Chris Lalancette, Ivan Santiago Paunovic

0.14.1 (2020-09-21)

  • Update goal response callback signature (#323)
  • Activate usual compiler warnings and fix errors (#270)
  • Contributors: Ivan Santiago Paunovic, Jacob Perron

0.14.0 (2020-08-14)

  • Fixed memory leak in Buffer::waitForTransform (#281)
  • fix time-reset test with Connext (#306)
  • reenable FrameGraph server (#198)
  • Use the usual style of parameters for static_transform_program (#300)
  • Make static_transform_broadcaster consistent with its command line description (#294)
  • Avoid using invalid std::list iterators (#293)
  • Generate callbacks after updating message_ (#274)
  • Moved unique_lock of messages_mutex_ to guarantee pointer (#279)
  • Fix dependencies in tf2_ros. (#269)
  • Split tf2_ros in tf2_ros and tf2_ros_py (#210)
  • Contributors: Alejandro Hernández Cordero, Chris Lalancette, Dirk Thomas, Hunter L. Allen, Martin Ganeff, Michael Carroll, ymd-stella

0.13.4 (2020-06-03)

  • export targets in addition to include directories / libraries (#271)
  • Add missing virtual destructors (#272)
  • Contributors: Dirk Thomas, Ivan Santiago Paunovic

0.13.3 (2020-05-26)

  • Fixed in Exception constructor tf2_ros (#267)
  • Contributors: Alejandro Hernández Cordero

0.13.2 (2020-05-18)

0.13.1 (2020-05-08)

0.13.0 (2020-04-30)

  • Added doxyfiles and sphinx Makefiles (#257)
  • avoid more deprecations (#255)
  • create_timer takes shared pointers (#251)
  • Improve tf2_echo and tf2_monitor messages while waiting for data (#254)
  • Add missing visibility header include (#246)
  • Fix [-Wrange-loop-construct]{.title-ref} (#245) ` --- stderr: tf2_ros /opt/ros/master/src/ros2/geometry2/tf2_ros/test/test_buffer.cpp:84:21: warning: loop variable 'elem' creates a copy from type 'const std::pair<const unsigned long, std::function<void (const unsigned long &)> >' [-Wrange-loop-construct] for (const auto elem : timer_to_callback_map\_) { ^ /opt/ros/master/src/ros2/geometry2/tf2_ros/test/test_buffer.cpp:84:10: note: use reference type 'const std::pair<const unsigned long, std::function<void (const unsigned long &)> > &' to prevent copying for (const auto elem : timer_to_callback_map\_) { ^~~~~~~~~~~~~~~~~ & 1 warning generated. ---`
  • Remove TODO (#234) The TODO is done; The publisher is using QoS durability setting 'transient local' which is the closest thing to the 'latched' concept in ROS 1. Signed-off-by: Jacob Perron <<jacob@openrobotics.org>>
  • Remove virtual keyword from overridden functions (#214) Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>>
  • message filter fix (#216)
    • Fixed meesage_filter add method
    • removed using builtin_interfaces::msg::Time in tf2_ros
  • Porting more tests to tf2_ros (#202)
    • Added more tests to tf2_ros
    • improving tf2_ros time_reset_test
    • tf2_ros fixed failed test_buffer_client.cpp
    • added some EXPECT to listener unittest
    • reviews
    • Update listener_unittest.cpp
    • fixed tf2_ros time_reset_test
    • tf2_ros removed ROS launch files
    • Added TODO to fix test_buffer_client in CI
    • tf2_ros added feedback
  • Add static transform component (#182) * Create a static transform component for composition Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>> * Suffix node name with randomly generated alpha-numeric string Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>> * Fix windows build Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>> * Switch to much more readable and more performant implementation by \@clalancette Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>>

  • Adding support for view_frame (#192)
    • Adding tf2_tools support for view_frames
    • Changelog
    • tf2_tools 0.12.1 package version
    • tf2_tools common linters
    • tf2_tools changelog Forthcoming
    • tf2_tools log error and destroy client and node when a exception raised
    • tf2_tools 0.12.4 package version
    • tf2_tools revert some changes
    • tf2_tools - reduce changes
    • tf2_tools: finally block and passing the time instead of the node
    • tf2_tools: buffer with less arguments
    • tf2_tools: Fix condition
  • Contributors: Alejandro Hernández Cordero, Dan Rose, Hunter L. Allen, Jacob Perron, Karsten Knese, Shane Loretz, William Woodall

0.12.4 (2019-11-19)

0.12.3 (2019-11-18)

  • Remove unused setup.py files (#190)
  • Print out the name of the signalFailure reason instead of just its enum value (#186)
  • Contributors: Emerson Knapp, Vasilii Artemev

0.12.2 (2019-11-18)

  • Fix tf2_monitor subscriptions QoS settings. (#196)
  • Contributors: Michel Hidalgo

0.12.1 (2019-10-23)

  • Add convenience methods using rclcpp time types (#180)
  • Don't assume quaternions init to all zeros
  • Make BufferClient destructor virtual
  • Contributors: Josh Langsfeld, Shane Loretz, Thomas Moulard

0.12.0 (2019-09-26)

  • Simulate work in the acceptedCallback.
  • Make Windows Debug to run the correct python executable.
  • Make BufferInterface destructor virtual.
  • Remove unnecessary and blacklisted actionlib_msgs dependency.
  • More test fixes for tf2_ros python.
  • class Clock is in clock not timer.
  • tf2_ros is not built for Python (#99)
  • Migrate buffer action server to ROS 2
  • Add conversion functions for durations
  • Make /tf_static use transient_local durability (#160)
  • Force explicit --ros-args in NodeOptions::arguments(). (#162)
  • Use of -r/--remap flags where appropriate. (#159)
  • Include tf2 headers in message_filter.h (#157)
  • Use ament_target_dependencies to ensure correct dependency order (#156)
  • Make sure that TransformListener's node gets a unique name (#129)
  • Fix compiler warning (#148)
  • Do not timeout when waiting for transforms (#146)
  • Fix race between timeout and transform ready callback (#143)
  • Fix high CPU - Use executor to spin and stop node in tf_listener thread (#119)
  • Catch polymorphic exceptions by reference (#138)
  • Add missing export build dependencies (#135)
  • avoid delete-non-virtual-dtor warning (#134)
  • Template tf2_ros::MessageFilter on the buffer type
  • Add pure virtual interface tf2_ros::AsyncBufferInterface
  • Add pure virtual interface tf2_ros::CreateTimerInterface
  • Allow tf2_monitor to be run with ROS command line args (#122)
  • Drop misleading ROS_* logging macros from tf2_monitor (#123)
  • Fix the MessageFilter init order. (#120)
  • Contributors: Chris Lalancette, Dan Rose, Jacob Perron, Karsten Knese, Michel Hidalgo, Scott K Logan, Shane Loretz, Vinnam Kim, bpwilcox, evshary

0.11.3 (2019-05-24)

  • stop spinning TransformListener thread node in destructor (#114)
  • Store dedicated transform listener thread as a std::unique_ptr (#111)
  • enable pedantic for tf2_ros (#115)
  • Contributors: Hunter L. Allen, Karsten Knese, bpwilcox

0.11.2 (2019-05-20)

  • Remove stray semicolon which causes compiler error when using -Werror=pedantic (#112)
  • Contributors: Michael Jeronimo

0.11.1 (2019-05-09)

  • use node interfaces throughout tf2_ros (#108)
  • changes to avoid deprecated API's (#107)
  • Fix call to create_publisher after API changed (#105)
  • Use node interfaces for static transform broadcaster (#104)
  • Contributors: Emerson Knapp, Karsten Knese, William Woodall

0.11.0 (2019-04-14)

  • Updated to use node inteface pointers in the MessageFilter class. (#96)
  • Updated message_filter.h. (#91)
  • Contributors: Michael Jeronimo, Sagnik Basu

0.10.1 (2018-12-06)

  • Allow static_transform_publisher to be run with ros arguments ros2#80 (#82)
  • Contributors: Lucas Walter

0.10.0 (2018-11-22)

  • Port tf2 ros message filter with ros2 tf2 and message filters (#81)
    • Port tf2 message filter to ros2

    - remove APIs to node callback queue due to no callback queue in ros2 now - Change failure callback register with failure prompting due to no corresponding boost signal2 in C++11 and later

    • Fix expected transform count in case of time tolerance
    • Upgrade all message counts to 64 bitThis should resolve C4267 warnings about downgrading a size_t.
  • Export tf2 dependency from tf2_ros (#72)
  • rclcpp time jump callback signature (#69)
  • Use ros2 time (#67)
  • Contributors: Carl Delsey, Ethan Gao, Shane Loretz

0.5.15 (2017-01-24)

  • tf2_ros: add option to unregister TransformListener (#201)
  • Contributors: Hans-Joachim Krauch

0.5.14 (2017-01-16)

  • Drop roslib.load_manifest (#191)
  • Adds ability to load TF from the ROS parameter server.
  • Code linting & reorganization
  • Fix indexing beyond end of array
  • added a static transform broadcaster in python
  • lots more documentation
  • remove BufferCore doc, add BufferClient/BufferServer doc for C++, add Buffer/BufferInterface Python documentation
  • Better overview for Python
  • Contributors: Eric Wieser, Felix Duvallet, Jackie Kay, Mikael Arguedas, Mike Purvis

0.5.13 (2016-03-04)

  • fix documentation warnings
  • Adding tests to package
  • Contributors: Laurent GEORGE, Vincent Rabaud

0.5.12 (2015-08-05)

  • remove annoying gcc warning This is because the roslog macro cannot have two arguments that are formatting strings: we need to concatenate them first.
  • break canTransform loop only for non-tiny negative time deltas (At least) with Python 2 ros.Time.now() is not necessarily monotonic and one can experience negative time deltas (usually well below 1s) on real hardware under full load. This check was originally introduced to allow for backjumps with rosbag replays, and only there it makes sense. So we'll add a small duration threshold to ignore backjumps due to non-monotonic clocks.
  • Contributors: Vincent Rabaud, v4hn

0.5.11 (2015-04-22)

  • do not short circuit waitForTransform timeout when running inside pytf. Fixes #102 roscpp is not initialized inside pytf which means that ros::ok is not valid. This was causing the timer to abort immediately. This breaks support for pytf with respect to early breaking out of a loop re #26. This is conceptually broken in pytf, and is fixed in tf2_ros python implementation. If you want this behavior I recommend switching to the tf2 python bindings.
  • inject timeout information into error string for canTransform with timeout
  • Contributors: Tully Foote

0.5.10 (2015-04-21)

  • switch to use a shared lock with upgrade instead of only a unique lock. For #91
  • Update message_filter.h
  • filters: fix unsupported old messages with frame_id starting with '/'
  • Enabled tf2 documentation
  • make sure the messages get processed before testing the effects. Fixes #88
  • allowing to use message filters with PCL types
  • Contributors: Brice Rebsamen, Jackie Kay, Tully Foote, Vincent Rabaud, jmtatsch

0.5.9 (2015-03-25)

  • changed queue_size in Python transform boradcaster to match that in c++
  • Contributors: mrath

0.5.8 (2015-03-17)

  • fix deadlock #79
  • break out of loop if ros is shutdown. Fixes #26
  • remove useless Makefile files
  • Fix static broadcaster with rpy args
  • Contributors: Paul Bovbel, Tully Foote, Vincent Rabaud

0.5.7 (2014-12-23)

  • Added 6 param transform again Yes, using Euler angles is a bad habit. But it is much more convenient if you just need a rotation by 90° somewhere to set it up in Euler angles. So I added the option to supply only the 3 angles.
  • Remove tf2_py dependency for Android
  • Contributors: Achim Königs, Gary Servin

0.5.6 (2014-09-18)

  • support if canTransform(...): in python #57
  • Support clearing the cache when time jumps backwards #68
  • Contributors: Tully Foote

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

  • surpressing autostart on the server objects to not incur warnings
  • switch to boost signals2 following ros/ros_comm#267, blocking ros/geometry#23
  • fix compilation with gcc 4.9
  • make can_transform correctly wait
  • explicitly set the publish queue size for rospy
  • Contributors: Tully Foote, Vincent Rabaud, v4hn

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

  • adding const to MessageEvent data
  • Contributors: Tully Foote

0.5.0 (2014-02-14)

  • TF2 uses message events to get connection header information
  • Contributors: Kevin Watts

0.4.10 (2013-12-26)

  • adding support for static transforms in python listener. Fixes #46
  • Contributors: Tully Foote

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35 in the python implementation
  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35

0.4.6 (2013-08-28)

  • patching python implementation for #24 as well
  • Stop waiting if time jumps backwards. fixes #24
  • patch to work around uninitiaized time. #30
  • Removing unnecessary CATKIN_DEPENDS #18

0.4.5 (2013-07-11)

  • Revert "cherrypicking groovy patch for #10 into hydro" This reverts commit 296d4916706d64f719b8c1592ab60d3686f994e1. It was not starting up correctly.
  • fixing usage string to show quaternions and using quaternions in the test app
  • cherrypicking groovy patch for #10 into hydro

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.
  • reviving unrun unittest and adding CATKIN_ENABLE_TESTING guards

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

  • adding queue accessors lost in the new API
  • exposing dedicated thread logic in BufferCore and checking in Buffer
  • adding methods to enable backwards compatability for passing through to tf::Transformer

0.4.0 (2013-06-27)

  • splitting rospy dependency into tf2_py so tf2 is pure c++ library.
  • 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
  • fixing return by value for tranform method without preallocatoin
  • 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
  • Added link against catkin_LIBRARIES for tf2_ros lib, also CMakeLists.txt clean up

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
  • Merge pull request #2 from KaijenHsiao/groovy-devel added setup.py and catkin_python_setup() to tf2_ros
  • added setup.py and catkin_python_setup() to tf2_ros
  • fixing cmake target collisions
  • fixing catkin message dependencies
  • removing packages with missing deps
  • catkin fixes
  • catkinizing geometry-experimental
  • catkinizing tf2_ros
  • catching None result in buffer client before it becomes an AttributeError, raising tf2.TransformException instead
  • oneiric linker fixes, bump version to 0.2.3
  • fix deprecated use of Header
  • merged faust's changes 864 and 865 into non_optimized branch: BufferCore instead of Buffer in TransformListener, and added a constructor that takes a NodeHandle.
  • add buffer server binary
  • fix compilation on 32bit
  • add missing file
  • build buffer server
  • TransformListener only needs a BufferCore
  • Add TransformListener constructor that takes a NodeHandle so you can specify a callback queue to use
  • Add option to use a callback queue in the message filter
  • move the message filter to tf2_ros
  • add missing std_msgs dependency
  • missed 2 lines in last commit
  • removing auto clearing from listener for it's unexpected from a library
  • static transform tested and working
  • subscriptions to tf_static unshelved
  • static transform publisher executable running
  • latching static transform publisher
  • cleaning out old commented code
  • Only query rospy.Time.now() when the timeout is greater than 0
  • debug comments removed
  • move to tf2_ros completed. tests pass again
  • merge tf2_cpp and tf2_py into tf2_ros

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
apriltag_ros
aruco_ros
cartographer_ros
create_driver
depthai_bridge
find_object_2d
gazebo_plugins
geometry2
test_tf2
tf2_bullet
tf2_eigen
tf2_geometry_msgs
tf2_kdl
tf2_sensor_msgs
turtle_tf2_cpp
turtle_tf2_py
grid_map_costmap_2d
depth_image_proc
image_rotate
imu_processors
imu_transformer
imu_complementary_filter
imu_filter_madgwick
rviz_imu_plugin
laser_filters
hri
lms1xx
mapviz
swri_transform_util
mavros
mavros_extras
microstrain_inertial_driver
microstrain_inertial_examples
mocap_optitrack
moveit_planners_ompl
pilz_industrial_motion_planner
moveit_hybrid_planning
moveit_ros_move_group
moveit_servo
moveit_ros_occupancy_map_monitor
moveit_ros_perception
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_robot_interaction
moveit_ros_tests
moveit_ros_trajectory_cache
moveit_ros_warehouse
moveit_resources_fanuc_moveit_config
moveit_visual_tools
mrpt_map_server
mrpt_rawlog
mrpt_reactivenav2d
mrpt_tps_astar_planner
mrpt_generic_sensor
mrpt_sensor_bumblebee_stereo
mrpt_sensor_gnss_nmea
mrpt_sensor_gnss_novatel
mrpt_sensor_imu_taobotics
mrpt_sensorlib
naoqi_driver
octomap_server
pcl_ros
plotjuggler_ros
pointcloud_to_laserscan
quaternion_operation
realsense2_camera
robot_calibration
robot_controllers
robot_controllers_interface
robot_localization
robot_state_publisher
rqt_tf_tree
rtabmap_examples
rtabmap_slam
rtabmap_util
rviz_common
rviz_default_plugins
rviz_satellite
sbg_driver
septentrio_gnss_driver
simple_grasping
slam_toolbox
spatio_temporal_voxel_layer
turtlebot3_node
velodyne_driver
velodyne_pointcloud
warehouse_ros
aruco_opencv
crane_plus_moveit_config
bosch_locator_bridge
bosch_locator_bridge_utils
nav2_amcl
nav2_behavior_tree
nav2_bt_navigator
nav2_collision_monitor
nav2_core
nav2_costmap_2d
dwb_core
nav2_mppi_controller
nav2_navfn_planner
nav2_planner
nav2_smac_planner
nav2_theta_star_planner
nav2_util
nav2_waypoint_follower
nerian_stereo
odom_to_tf_ros2
raspimouse
rmf_robot_sim_common
admittance_controller
ros2_ouster
moveit2z_client
pure_spinning_local_planner
nav2z_client
nitrosz_client
turtlebot3_manipulation_moveit_config
webots_ros2_driver
webots_ros2_epuck
webots_ros2_tests
webots_ros2_tiago
webots_ros2_turtlebot
irobot_create_nodes
ign_rviz
ign_rviz_common
ign_rviz_plugins
turtlebot4_bringup
adi_3dtof_image_stitching
beluga_ros
etsi_its_rviz_plugins
message_tf_frame_transformer
sick_scan_xd
dual_laser_merger
mola_input_rosbag2
motion_capture_tracking
qml_ros2_plugin
kinova_gen3_6dof_robotiq_2f_85_moveit_config
kinova_gen3_7dof_robotiq_2f_85_moveit_config
kinova_gen3_lite_moveit_config
scenario_execution_nav2
gazebo_static_camera
tf_to_pose_publisher
lidar_situational_graphs
unitree_ros
as2_behaviors_path_planning
as2_core
as2_realsense_interface
as2_map_server
as2_gazebo_assets
as2_state_estimator
as2_external_object_to_tf
as2_platform_tello
clearpath_manipulators
clearpath_platform
gazebo_planar_move_plugin
grid_map_geo
metro_nav_demo_utils
mocap4r2_robot_gt
opennav_docking
opennav_docking_msgs
psdk_wrapper
robotont_driver
vector_pursuit_controller

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_ros 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

This package contains the C++ ROS bindings for the tf2 library

Additional Links

Maintainers

  • Alejandro Hernandez Cordero
  • Chris Lalancette

Authors

  • Eitan Marder-Eppstein
  • Tully Foote
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_ros

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)

  • Fix invalid timer handle exception (#613)
  • Contributors: Cliff Wu

0.31.4 (2023-07-14)

  • Enable StaticTransformBroadcaster in Intra-process enabled components (#611)
  • Contributors: Patrick Roncagliolo

0.31.3 (2023-05-11)

0.31.2 (2023-04-13)

  • Destroy callback group before node (#595)
  • Contributors: Michael Carroll

0.31.1 (2023-04-12)

0.31.0 (2023-04-11)

  • Enable TransformListener node-based constructor in Intra-process enabled components (#572)
  • Contributors: Patrick Roncagliolo

0.30.0 (2023-02-14)

  • Fix use-after-free bug in BufferServer::cancelCB (#579)
  • Update the demos to C++17. (#578)
  • add constructor to static tf broadcaster accepting node interfaces (#576)
  • Contributors: Alberto Soragna, Alexander Hans, Chris Lalancette

0.29.0 (2022-11-21)

  • Update maintainers (#560)
  • Contributors: Audrow Nash

0.28.0 (2022-11-02)

  • Switching from sstream to c string formatting to fix ros arg issue (#557)
  • allow construction of tf broadcaster from node object (not a pointer) (#555)
  • Allow to construct [TransformBroadcaster]{.title-ref} and [TransformListener]{.title-ref} from node interfaces (#552)
  • Contributors: Alberto Soragna, Chris Lalancette

0.27.0 (2022-09-13)

  • Suppress spam from calling canTransform (#529)
  • Contributors: Gonzo

0.26.2 (2022-08-15)

0.26.1 (2022-06-24)

0.26.0 (2022-04-29)

0.25.0 (2022-04-05)

  • Install includes to include/${PROJECT_NAME} and use modern CMake (#493)
  • Contributors: Shane Loretz

0.24.0 (2022-03-31)

0.23.0 (2022-03-28)

  • use dedicated callback group and executor to isolate timer (#447)
  • Adding shared pointer definition to tf2 buffer (#508)
  • fix for a basic logic (#510)
  • Fix precision loss from using rclcpp::Time::seconds() (#511)
  • Contributors: Chen Lihui, Kenji Brameld, Steve Macenski, Zhenpeng Ge

0.22.0 (2022-03-01)

  • clear relative callback of Buffer if MessageFilter is destroyed (#490)
  • More info in tf2_echo output (#468)
  • Contributors: Chen Lihui, simulacrus

0.21.0 (2022-01-14)

  • Fix cpplint errors (#497)
  • Contributors: Jacob Perron

0.20.0 (2021-12-17)

  • Fixes for uncrustify 0.72 (#486)
  • Contributors: Chris Lalancette

0.19.0 (2021-10-15)

  • More Intuitive CLI for Static Transform Publisher (#392)
  • Reduce transform listener nodes (#442)
  • `tf2_ros`: Fix deprecated subscriber callbacks (#448)
  • Contributors: Abrar Rahman Protyasha, Hunter L. Allen, gezp

0.18.0 (2021-06-01)

  • Fix tf2_echo does not work with ros-args (#407) (#408)
  • Contributors: PGotzmann

0.17.1 (2021-04-06)

0.17.0 (2021-03-19)

  • Guard against access to null node pointer (#393)
  • Allow to reconfigure durability for /tf topic broadcaster/listener (#383)
  • Fix the rcl type used in the time jump. (#391)
  • Fix linter errors (#385)
  • fix accessing freed resources (#386)
  • Allow reconfiguring qos of tf and tf_static topics through parameters (#381)
  • Replace ROS_* logging macros and use RCLCPP_* instead (#380)
  • Contributors: Audrow Nash, Chris Lalancette, Ivan Santiago Paunovic, Jacob Perron, Kazunari Tanaka

0.16.0 (2021-01-25)

  • Improve message filters error messages (#364)
  • Contributors: Ivan Santiago Paunovic

0.15.1 (2020-12-08)

  • Clarify the role of child_frame_id and header.frame_id in the documentation. (#345)
  • Contributors: Vikas Dhiman

0.15.0 (2020-11-02)

  • Remove usage of deprecated rclcpp::Duration constructor (#340)
  • Remove messages_count member from tf2_ros::MessageFilter. (#335)
  • Style fixup in tf2_ros. (#325)
  • Update maintainers of the ros2/geometry2 fork. (#328)
  • Contributors: Chris Lalancette, Ivan Santiago Paunovic

0.14.1 (2020-09-21)

  • Update goal response callback signature (#323)
  • Activate usual compiler warnings and fix errors (#270)
  • Contributors: Ivan Santiago Paunovic, Jacob Perron

0.14.0 (2020-08-14)

  • Fixed memory leak in Buffer::waitForTransform (#281)
  • fix time-reset test with Connext (#306)
  • reenable FrameGraph server (#198)
  • Use the usual style of parameters for static_transform_program (#300)
  • Make static_transform_broadcaster consistent with its command line description (#294)
  • Avoid using invalid std::list iterators (#293)
  • Generate callbacks after updating message_ (#274)
  • Moved unique_lock of messages_mutex_ to guarantee pointer (#279)
  • Fix dependencies in tf2_ros. (#269)
  • Split tf2_ros in tf2_ros and tf2_ros_py (#210)
  • Contributors: Alejandro Hernández Cordero, Chris Lalancette, Dirk Thomas, Hunter L. Allen, Martin Ganeff, Michael Carroll, ymd-stella

0.13.4 (2020-06-03)

  • export targets in addition to include directories / libraries (#271)
  • Add missing virtual destructors (#272)
  • Contributors: Dirk Thomas, Ivan Santiago Paunovic

0.13.3 (2020-05-26)

  • Fixed in Exception constructor tf2_ros (#267)
  • Contributors: Alejandro Hernández Cordero

0.13.2 (2020-05-18)

0.13.1 (2020-05-08)

0.13.0 (2020-04-30)

  • Added doxyfiles and sphinx Makefiles (#257)
  • avoid more deprecations (#255)
  • create_timer takes shared pointers (#251)
  • Improve tf2_echo and tf2_monitor messages while waiting for data (#254)
  • Add missing visibility header include (#246)
  • Fix [-Wrange-loop-construct]{.title-ref} (#245) ` --- stderr: tf2_ros /opt/ros/master/src/ros2/geometry2/tf2_ros/test/test_buffer.cpp:84:21: warning: loop variable 'elem' creates a copy from type 'const std::pair<const unsigned long, std::function<void (const unsigned long &)> >' [-Wrange-loop-construct] for (const auto elem : timer_to_callback_map\_) { ^ /opt/ros/master/src/ros2/geometry2/tf2_ros/test/test_buffer.cpp:84:10: note: use reference type 'const std::pair<const unsigned long, std::function<void (const unsigned long &)> > &' to prevent copying for (const auto elem : timer_to_callback_map\_) { ^~~~~~~~~~~~~~~~~ & 1 warning generated. ---`
  • Remove TODO (#234) The TODO is done; The publisher is using QoS durability setting 'transient local' which is the closest thing to the 'latched' concept in ROS 1. Signed-off-by: Jacob Perron <<jacob@openrobotics.org>>
  • Remove virtual keyword from overridden functions (#214) Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>>
  • message filter fix (#216)
    • Fixed meesage_filter add method
    • removed using builtin_interfaces::msg::Time in tf2_ros
  • Porting more tests to tf2_ros (#202)
    • Added more tests to tf2_ros
    • improving tf2_ros time_reset_test
    • tf2_ros fixed failed test_buffer_client.cpp
    • added some EXPECT to listener unittest
    • reviews
    • Update listener_unittest.cpp
    • fixed tf2_ros time_reset_test
    • tf2_ros removed ROS launch files
    • Added TODO to fix test_buffer_client in CI
    • tf2_ros added feedback
  • Add static transform component (#182) * Create a static transform component for composition Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>> * Suffix node name with randomly generated alpha-numeric string Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>> * Fix windows build Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>> * Switch to much more readable and more performant implementation by \@clalancette Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>>

  • Adding support for view_frame (#192)
    • Adding tf2_tools support for view_frames
    • Changelog
    • tf2_tools 0.12.1 package version
    • tf2_tools common linters
    • tf2_tools changelog Forthcoming
    • tf2_tools log error and destroy client and node when a exception raised
    • tf2_tools 0.12.4 package version
    • tf2_tools revert some changes
    • tf2_tools - reduce changes
    • tf2_tools: finally block and passing the time instead of the node
    • tf2_tools: buffer with less arguments
    • tf2_tools: Fix condition
  • Contributors: Alejandro Hernández Cordero, Dan Rose, Hunter L. Allen, Jacob Perron, Karsten Knese, Shane Loretz, William Woodall

0.12.4 (2019-11-19)

0.12.3 (2019-11-18)

  • Remove unused setup.py files (#190)
  • Print out the name of the signalFailure reason instead of just its enum value (#186)
  • Contributors: Emerson Knapp, Vasilii Artemev

0.12.2 (2019-11-18)

  • Fix tf2_monitor subscriptions QoS settings. (#196)
  • Contributors: Michel Hidalgo

0.12.1 (2019-10-23)

  • Add convenience methods using rclcpp time types (#180)
  • Don't assume quaternions init to all zeros
  • Make BufferClient destructor virtual
  • Contributors: Josh Langsfeld, Shane Loretz, Thomas Moulard

0.12.0 (2019-09-26)

  • Simulate work in the acceptedCallback.
  • Make Windows Debug to run the correct python executable.
  • Make BufferInterface destructor virtual.
  • Remove unnecessary and blacklisted actionlib_msgs dependency.
  • More test fixes for tf2_ros python.
  • class Clock is in clock not timer.
  • tf2_ros is not built for Python (#99)
  • Migrate buffer action server to ROS 2
  • Add conversion functions for durations
  • Make /tf_static use transient_local durability (#160)
  • Force explicit --ros-args in NodeOptions::arguments(). (#162)
  • Use of -r/--remap flags where appropriate. (#159)
  • Include tf2 headers in message_filter.h (#157)
  • Use ament_target_dependencies to ensure correct dependency order (#156)
  • Make sure that TransformListener's node gets a unique name (#129)
  • Fix compiler warning (#148)
  • Do not timeout when waiting for transforms (#146)
  • Fix race between timeout and transform ready callback (#143)
  • Fix high CPU - Use executor to spin and stop node in tf_listener thread (#119)
  • Catch polymorphic exceptions by reference (#138)
  • Add missing export build dependencies (#135)
  • avoid delete-non-virtual-dtor warning (#134)
  • Template tf2_ros::MessageFilter on the buffer type
  • Add pure virtual interface tf2_ros::AsyncBufferInterface
  • Add pure virtual interface tf2_ros::CreateTimerInterface
  • Allow tf2_monitor to be run with ROS command line args (#122)
  • Drop misleading ROS_* logging macros from tf2_monitor (#123)
  • Fix the MessageFilter init order. (#120)
  • Contributors: Chris Lalancette, Dan Rose, Jacob Perron, Karsten Knese, Michel Hidalgo, Scott K Logan, Shane Loretz, Vinnam Kim, bpwilcox, evshary

0.11.3 (2019-05-24)

  • stop spinning TransformListener thread node in destructor (#114)
  • Store dedicated transform listener thread as a std::unique_ptr (#111)
  • enable pedantic for tf2_ros (#115)
  • Contributors: Hunter L. Allen, Karsten Knese, bpwilcox

0.11.2 (2019-05-20)

  • Remove stray semicolon which causes compiler error when using -Werror=pedantic (#112)
  • Contributors: Michael Jeronimo

0.11.1 (2019-05-09)

  • use node interfaces throughout tf2_ros (#108)
  • changes to avoid deprecated API's (#107)
  • Fix call to create_publisher after API changed (#105)
  • Use node interfaces for static transform broadcaster (#104)
  • Contributors: Emerson Knapp, Karsten Knese, William Woodall

0.11.0 (2019-04-14)

  • Updated to use node inteface pointers in the MessageFilter class. (#96)
  • Updated message_filter.h. (#91)
  • Contributors: Michael Jeronimo, Sagnik Basu

0.10.1 (2018-12-06)

  • Allow static_transform_publisher to be run with ros arguments ros2#80 (#82)
  • Contributors: Lucas Walter

0.10.0 (2018-11-22)

  • Port tf2 ros message filter with ros2 tf2 and message filters (#81)
    • Port tf2 message filter to ros2

    - remove APIs to node callback queue due to no callback queue in ros2 now - Change failure callback register with failure prompting due to no corresponding boost signal2 in C++11 and later

    • Fix expected transform count in case of time tolerance
    • Upgrade all message counts to 64 bitThis should resolve C4267 warnings about downgrading a size_t.
  • Export tf2 dependency from tf2_ros (#72)
  • rclcpp time jump callback signature (#69)
  • Use ros2 time (#67)
  • Contributors: Carl Delsey, Ethan Gao, Shane Loretz

0.5.15 (2017-01-24)

  • tf2_ros: add option to unregister TransformListener (#201)
  • Contributors: Hans-Joachim Krauch

0.5.14 (2017-01-16)

  • Drop roslib.load_manifest (#191)
  • Adds ability to load TF from the ROS parameter server.
  • Code linting & reorganization
  • Fix indexing beyond end of array
  • added a static transform broadcaster in python
  • lots more documentation
  • remove BufferCore doc, add BufferClient/BufferServer doc for C++, add Buffer/BufferInterface Python documentation
  • Better overview for Python
  • Contributors: Eric Wieser, Felix Duvallet, Jackie Kay, Mikael Arguedas, Mike Purvis

0.5.13 (2016-03-04)

  • fix documentation warnings
  • Adding tests to package
  • Contributors: Laurent GEORGE, Vincent Rabaud

0.5.12 (2015-08-05)

  • remove annoying gcc warning This is because the roslog macro cannot have two arguments that are formatting strings: we need to concatenate them first.
  • break canTransform loop only for non-tiny negative time deltas (At least) with Python 2 ros.Time.now() is not necessarily monotonic and one can experience negative time deltas (usually well below 1s) on real hardware under full load. This check was originally introduced to allow for backjumps with rosbag replays, and only there it makes sense. So we'll add a small duration threshold to ignore backjumps due to non-monotonic clocks.
  • Contributors: Vincent Rabaud, v4hn

0.5.11 (2015-04-22)

  • do not short circuit waitForTransform timeout when running inside pytf. Fixes #102 roscpp is not initialized inside pytf which means that ros::ok is not valid. This was causing the timer to abort immediately. This breaks support for pytf with respect to early breaking out of a loop re #26. This is conceptually broken in pytf, and is fixed in tf2_ros python implementation. If you want this behavior I recommend switching to the tf2 python bindings.
  • inject timeout information into error string for canTransform with timeout
  • Contributors: Tully Foote

0.5.10 (2015-04-21)

  • switch to use a shared lock with upgrade instead of only a unique lock. For #91
  • Update message_filter.h
  • filters: fix unsupported old messages with frame_id starting with '/'
  • Enabled tf2 documentation
  • make sure the messages get processed before testing the effects. Fixes #88
  • allowing to use message filters with PCL types
  • Contributors: Brice Rebsamen, Jackie Kay, Tully Foote, Vincent Rabaud, jmtatsch

0.5.9 (2015-03-25)

  • changed queue_size in Python transform boradcaster to match that in c++
  • Contributors: mrath

0.5.8 (2015-03-17)

  • fix deadlock #79
  • break out of loop if ros is shutdown. Fixes #26
  • remove useless Makefile files
  • Fix static broadcaster with rpy args
  • Contributors: Paul Bovbel, Tully Foote, Vincent Rabaud

0.5.7 (2014-12-23)

  • Added 6 param transform again Yes, using Euler angles is a bad habit. But it is much more convenient if you just need a rotation by 90° somewhere to set it up in Euler angles. So I added the option to supply only the 3 angles.
  • Remove tf2_py dependency for Android
  • Contributors: Achim Königs, Gary Servin

0.5.6 (2014-09-18)

  • support if canTransform(...): in python #57
  • Support clearing the cache when time jumps backwards #68
  • Contributors: Tully Foote

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

  • surpressing autostart on the server objects to not incur warnings
  • switch to boost signals2 following ros/ros_comm#267, blocking ros/geometry#23
  • fix compilation with gcc 4.9
  • make can_transform correctly wait
  • explicitly set the publish queue size for rospy
  • Contributors: Tully Foote, Vincent Rabaud, v4hn

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

  • adding const to MessageEvent data
  • Contributors: Tully Foote

0.5.0 (2014-02-14)

  • TF2 uses message events to get connection header information
  • Contributors: Kevin Watts

0.4.10 (2013-12-26)

  • adding support for static transforms in python listener. Fixes #46
  • Contributors: Tully Foote

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35 in the python implementation
  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35

0.4.6 (2013-08-28)

  • patching python implementation for #24 as well
  • Stop waiting if time jumps backwards. fixes #24
  • patch to work around uninitiaized time. #30
  • Removing unnecessary CATKIN_DEPENDS #18

0.4.5 (2013-07-11)

  • Revert "cherrypicking groovy patch for #10 into hydro" This reverts commit 296d4916706d64f719b8c1592ab60d3686f994e1. It was not starting up correctly.
  • fixing usage string to show quaternions and using quaternions in the test app
  • cherrypicking groovy patch for #10 into hydro

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.
  • reviving unrun unittest and adding CATKIN_ENABLE_TESTING guards

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

  • adding queue accessors lost in the new API
  • exposing dedicated thread logic in BufferCore and checking in Buffer
  • adding methods to enable backwards compatability for passing through to tf::Transformer

0.4.0 (2013-06-27)

  • splitting rospy dependency into tf2_py so tf2 is pure c++ library.
  • 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
  • fixing return by value for tranform method without preallocatoin
  • 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
  • Added link against catkin_LIBRARIES for tf2_ros lib, also CMakeLists.txt clean up

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
  • Merge pull request #2 from KaijenHsiao/groovy-devel added setup.py and catkin_python_setup() to tf2_ros
  • added setup.py and catkin_python_setup() to tf2_ros
  • fixing cmake target collisions
  • fixing catkin message dependencies
  • removing packages with missing deps
  • catkin fixes
  • catkinizing geometry-experimental
  • catkinizing tf2_ros
  • catching None result in buffer client before it becomes an AttributeError, raising tf2.TransformException instead
  • oneiric linker fixes, bump version to 0.2.3
  • fix deprecated use of Header
  • merged faust's changes 864 and 865 into non_optimized branch: BufferCore instead of Buffer in TransformListener, and added a constructor that takes a NodeHandle.
  • add buffer server binary
  • fix compilation on 32bit
  • add missing file
  • build buffer server
  • TransformListener only needs a BufferCore
  • Add TransformListener constructor that takes a NodeHandle so you can specify a callback queue to use
  • Add option to use a callback queue in the message filter
  • move the message filter to tf2_ros
  • add missing std_msgs dependency
  • missed 2 lines in last commit
  • removing auto clearing from listener for it's unexpected from a library
  • static transform tested and working
  • subscriptions to tf_static unshelved
  • static transform publisher executable running
  • latching static transform publisher
  • cleaning out old commented code
  • Only query rospy.Time.now() when the timeout is greater than 0
  • debug comments removed
  • move to tf2_ros completed. tests pass again
  • merge tf2_cpp and tf2_py into tf2_ros

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
apriltag_ros
aruco_ros
cartographer_ros
depthai_bridge
find_object_2d
fuse_models
fuse_publishers
gazebo_plugins
examples_tf2_py
geometry2
test_tf2
tf2_bullet
tf2_eigen
tf2_geometry_msgs
tf2_kdl
tf2_sensor_msgs
tf2_tools
turtle_tf2_cpp
turtle_tf2_py
grid_map_costmap_2d
depth_image_proc
image_rotate
imu_processors
imu_transformer
imu_complementary_filter
imu_filter_madgwick
rviz_imu_plugin
laser_filters
mapviz
swri_transform_util
mavros
mavros_extras
microstrain_inertial_driver
microstrain_inertial_examples
moveit_planners_ompl
pilz_industrial_motion_planner
moveit_hybrid_planning
moveit_ros_move_group
moveit_servo
moveit_ros_occupancy_map_monitor
moveit_ros_perception
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_robot_interaction
moveit_ros_tests
moveit_ros_trajectory_cache
moveit_ros_warehouse
moveit_resources_fanuc_moveit_config
moveit_visual_tools
mrpt_map_server
mrpt_rawlog
mrpt_reactivenav2d
mrpt_tps_astar_planner
mrpt_generic_sensor
mrpt_sensor_bumblebee_stereo
mrpt_sensor_gnss_nmea
mrpt_sensor_gnss_novatel
mrpt_sensor_imu_taobotics
mrpt_sensorlib
naoqi_driver
nonpersistent_voxel_layer
octomap_server
pcl_ros
plotjuggler_ros
pointcloud_to_laserscan
quaternion_operation
realsense2_camera
robot_calibration
robot_localization
robot_state_publisher
rqt_tf_tree
rtabmap_examples
rtabmap_slam
rtabmap_util
rviz_common
rviz_default_plugins
rviz_visual_testing_framework
rviz_satellite
sbg_driver
septentrio_gnss_driver
simple_grasping
slam_toolbox
spatio_temporal_voxel_layer
tf2_2d
velodyne_driver
velodyne_pointcloud
warehouse_ros
aruco_opencv
bosch_locator_bridge
bosch_locator_bridge_utils
nav2_amcl
nav2_behavior_tree
nav2_bt_navigator
nav2_collision_monitor
nav2_core
nav2_costmap_2d
dwb_core
nav2_mppi_controller
nav2_navfn_planner
nav2_planner
nav2_smac_planner
nav2_theta_star_planner
nav2_util
nav2_waypoint_follower
nerian_stereo
odom_to_tf_ros2
rmf_robot_sim_common
admittance_controller
move_group_interface_client
pure_spinning_local_planner
nav2z_client
webots_ros2_driver
webots_ros2_epuck
webots_ros2_tests
webots_ros2_tiago
webots_ros2_turtlebot
ign_rviz
ign_rviz_common
ign_rviz_plugins
beluga_ros
etsi_its_rviz_plugins
message_tf_frame_transformer
sick_scan_xd
mola_input_rosbag2
motion_capture_tracking
ouster_ros
kinova_gen3_6dof_robotiq_2f_85_moveit_config
kinova_gen3_7dof_robotiq_2f_85_moveit_config
kinova_gen3_lite_moveit_config
lidar_situational_graphs
unitree_ros

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_ros 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

This package contains the C++ ROS bindings for the tf2 library

Additional Links

Maintainers

  • Alejandro Hernandez Cordero
  • Chris Lalancette

Authors

  • Eitan Marder-Eppstein
  • Tully Foote
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_ros

0.36.4 (2024-05-29)

0.36.3 (2024-05-13)

0.36.2 (2024-04-10)

  • Compile fix for upcomming changes to rclcpp::Executor (#668)
  • Enable Twist interpolator (#646) Co-authored-by: Tully Foote <<tullyfoote@intrinsic.ai>>
  • Contributors: Alejandro Hernández Cordero, jmachowinski

0.36.1 (2024-03-28)

  • Adding NodeInterfaces to Buffer (#656)
  • Reformat some code to make uncrustify happier. (#654)
  • Contributors: Chris Lalancette, Lucas Wendland

0.36.0 (2024-02-07)

  • Enable intra-process (#649) (#642)
  • Contributors: Patrick Roncagliolo

0.35.1 (2024-01-24)

0.35.0 (2023-12-26)

  • Avoid unecessary time conversions. (#635)
  • Contributors: AiVerisimilitude

0.34.0 (2023-11-06)

  • Expose TF2 listener CB (#632)
  • Contributors: Steve Macenski

0.33.2 (2023-10-04)

0.33.1 (2023-09-07)

0.33.0 (2023-08-21)

  • Fix invalid timer handle exception (#474)
  • Fix for #589 - Should be able to transform with default timeout (#593)
  • Contributors: Cliff Wu, vineet131

0.32.2 (2023-07-11)

  • Enable StaticTransformBroadcaster in Intra-process enabled components (#607)
  • Contributors: Patrick Roncagliolo

0.32.1 (2023-05-11)

0.32.0 (2023-04-27)

0.31.2 (2023-04-13)

  • Destroy callback group before node (#595)
  • Contributors: Michael Carroll

0.31.1 (2023-04-12)

0.31.0 (2023-04-11)

  • Enable TransformListener node-based constructor in Intra-process enabled components (#572)
  • Contributors: Patrick Roncagliolo

0.30.0 (2023-02-14)

  • Fix use-after-free bug in BufferServer::cancelCB (#579)
  • Update the demos to C++17. (#578)
  • add constructor to static tf broadcaster accepting node interfaces (#576)
  • Contributors: Alberto Soragna, Alexander Hans, Chris Lalancette

0.29.0 (2022-11-21)

  • Update maintainers (#560)
  • Contributors: Audrow Nash

0.28.0 (2022-11-02)

  • Switching from sstream to c string formatting to fix ros arg issue (#557)
  • allow construction of tf broadcaster from node object (not a pointer) (#555)
  • Allow to construct [TransformBroadcaster]{.title-ref} and [TransformListener]{.title-ref} from node interfaces (#552)
  • Contributors: Alberto Soragna, Chris Lalancette

0.27.0 (2022-09-13)

  • Suppress spam from calling canTransform (#529)
  • Contributors: Gonzo

0.26.2 (2022-08-15)

0.26.1 (2022-06-24)

0.26.0 (2022-04-29)

0.25.0 (2022-04-05)

  • Install includes to include/${PROJECT_NAME} and use modern CMake (#493)
  • Contributors: Shane Loretz

0.24.0 (2022-03-31)

0.23.0 (2022-03-28)

  • use dedicated callback group and executor to isolate timer (#447)
  • Adding shared pointer definition to tf2 buffer (#508)
  • fix for a basic logic (#510)
  • Fix precision loss from using rclcpp::Time::seconds() (#511)
  • Contributors: Chen Lihui, Kenji Brameld, Steve Macenski, Zhenpeng Ge

0.22.0 (2022-03-01)

  • clear relative callback of Buffer if MessageFilter is destroyed (#490)
  • More info in tf2_echo output (#468)
  • Contributors: Chen Lihui, simulacrus

0.21.0 (2022-01-14)

  • Fix cpplint errors (#497)
  • Contributors: Jacob Perron

0.20.0 (2021-12-17)

  • Fixes for uncrustify 0.72 (#486)
  • Contributors: Chris Lalancette

0.19.0 (2021-10-15)

  • More Intuitive CLI for Static Transform Publisher (#392)
  • Reduce transform listener nodes (#442)
  • `tf2_ros`: Fix deprecated subscriber callbacks (#448)
  • Contributors: Abrar Rahman Protyasha, Hunter L. Allen, gezp

0.18.0 (2021-06-01)

  • Fix tf2_echo does not work with ros-args (#407) (#408)
  • Contributors: PGotzmann

0.17.1 (2021-04-06)

0.17.0 (2021-03-19)

  • Guard against access to null node pointer (#393)
  • Allow to reconfigure durability for /tf topic broadcaster/listener (#383)
  • Fix the rcl type used in the time jump. (#391)
  • Fix linter errors (#385)
  • fix accessing freed resources (#386)
  • Allow reconfiguring qos of tf and tf_static topics through parameters (#381)
  • Replace ROS_* logging macros and use RCLCPP_* instead (#380)
  • Contributors: Audrow Nash, Chris Lalancette, Ivan Santiago Paunovic, Jacob Perron, Kazunari Tanaka

0.16.0 (2021-01-25)

  • Improve message filters error messages (#364)
  • Contributors: Ivan Santiago Paunovic

0.15.1 (2020-12-08)

  • Clarify the role of child_frame_id and header.frame_id in the documentation. (#345)
  • Contributors: Vikas Dhiman

0.15.0 (2020-11-02)

  • Remove usage of deprecated rclcpp::Duration constructor (#340)
  • Remove messages_count member from tf2_ros::MessageFilter. (#335)
  • Style fixup in tf2_ros. (#325)
  • Update maintainers of the ros2/geometry2 fork. (#328)
  • Contributors: Chris Lalancette, Ivan Santiago Paunovic

0.14.1 (2020-09-21)

  • Update goal response callback signature (#323)
  • Activate usual compiler warnings and fix errors (#270)
  • Contributors: Ivan Santiago Paunovic, Jacob Perron

0.14.0 (2020-08-14)

  • Fixed memory leak in Buffer::waitForTransform (#281)
  • fix time-reset test with Connext (#306)
  • reenable FrameGraph server (#198)
  • Use the usual style of parameters for static_transform_program (#300)
  • Make static_transform_broadcaster consistent with its command line description (#294)
  • Avoid using invalid std::list iterators (#293)
  • Generate callbacks after updating message_ (#274)
  • Moved unique_lock of messages_mutex_ to guarantee pointer (#279)
  • Fix dependencies in tf2_ros. (#269)
  • Split tf2_ros in tf2_ros and tf2_ros_py (#210)
  • Contributors: Alejandro Hernández Cordero, Chris Lalancette, Dirk Thomas, Hunter L. Allen, Martin Ganeff, Michael Carroll, ymd-stella

0.13.4 (2020-06-03)

  • export targets in addition to include directories / libraries (#271)
  • Add missing virtual destructors (#272)
  • Contributors: Dirk Thomas, Ivan Santiago Paunovic

0.13.3 (2020-05-26)

  • Fixed in Exception constructor tf2_ros (#267)
  • Contributors: Alejandro Hernández Cordero

0.13.2 (2020-05-18)

0.13.1 (2020-05-08)

0.13.0 (2020-04-30)

  • Added doxyfiles and sphinx Makefiles (#257)
  • avoid more deprecations (#255)
  • create_timer takes shared pointers (#251)
  • Improve tf2_echo and tf2_monitor messages while waiting for data (#254)
  • Add missing visibility header include (#246)
  • Fix [-Wrange-loop-construct]{.title-ref} (#245) ` --- stderr: tf2_ros /opt/ros/master/src/ros2/geometry2/tf2_ros/test/test_buffer.cpp:84:21: warning: loop variable 'elem' creates a copy from type 'const std::pair<const unsigned long, std::function<void (const unsigned long &)> >' [-Wrange-loop-construct] for (const auto elem : timer_to_callback_map\_) { ^ /opt/ros/master/src/ros2/geometry2/tf2_ros/test/test_buffer.cpp:84:10: note: use reference type 'const std::pair<const unsigned long, std::function<void (const unsigned long &)> > &' to prevent copying for (const auto elem : timer_to_callback_map\_) { ^~~~~~~~~~~~~~~~~ & 1 warning generated. ---`
  • Remove TODO (#234) The TODO is done; The publisher is using QoS durability setting 'transient local' which is the closest thing to the 'latched' concept in ROS 1. Signed-off-by: Jacob Perron <<jacob@openrobotics.org>>
  • Remove virtual keyword from overridden functions (#214) Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>>
  • message filter fix (#216)
    • Fixed meesage_filter add method
    • removed using builtin_interfaces::msg::Time in tf2_ros
  • Porting more tests to tf2_ros (#202)
    • Added more tests to tf2_ros
    • improving tf2_ros time_reset_test
    • tf2_ros fixed failed test_buffer_client.cpp
    • added some EXPECT to listener unittest
    • reviews
    • Update listener_unittest.cpp
    • fixed tf2_ros time_reset_test
    • tf2_ros removed ROS launch files
    • Added TODO to fix test_buffer_client in CI
    • tf2_ros added feedback
  • Add static transform component (#182) * Create a static transform component for composition Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>> * Suffix node name with randomly generated alpha-numeric string Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>> * Fix windows build Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>> * Switch to much more readable and more performant implementation by \@clalancette Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>>

  • Adding support for view_frame (#192)
    • Adding tf2_tools support for view_frames
    • Changelog
    • tf2_tools 0.12.1 package version
    • tf2_tools common linters
    • tf2_tools changelog Forthcoming
    • tf2_tools log error and destroy client and node when a exception raised
    • tf2_tools 0.12.4 package version
    • tf2_tools revert some changes
    • tf2_tools - reduce changes
    • tf2_tools: finally block and passing the time instead of the node
    • tf2_tools: buffer with less arguments
    • tf2_tools: Fix condition
  • Contributors: Alejandro Hernández Cordero, Dan Rose, Hunter L. Allen, Jacob Perron, Karsten Knese, Shane Loretz, William Woodall

0.12.4 (2019-11-19)

0.12.3 (2019-11-18)

  • Remove unused setup.py files (#190)
  • Print out the name of the signalFailure reason instead of just its enum value (#186)
  • Contributors: Emerson Knapp, Vasilii Artemev

0.12.2 (2019-11-18)

  • Fix tf2_monitor subscriptions QoS settings. (#196)
  • Contributors: Michel Hidalgo

0.12.1 (2019-10-23)

  • Add convenience methods using rclcpp time types (#180)
  • Don't assume quaternions init to all zeros
  • Make BufferClient destructor virtual
  • Contributors: Josh Langsfeld, Shane Loretz, Thomas Moulard

0.12.0 (2019-09-26)

  • Simulate work in the acceptedCallback.
  • Make Windows Debug to run the correct python executable.
  • Make BufferInterface destructor virtual.
  • Remove unnecessary and blacklisted actionlib_msgs dependency.
  • More test fixes for tf2_ros python.
  • class Clock is in clock not timer.
  • tf2_ros is not built for Python (#99)
  • Migrate buffer action server to ROS 2
  • Add conversion functions for durations
  • Make /tf_static use transient_local durability (#160)
  • Force explicit --ros-args in NodeOptions::arguments(). (#162)
  • Use of -r/--remap flags where appropriate. (#159)
  • Include tf2 headers in message_filter.h (#157)
  • Use ament_target_dependencies to ensure correct dependency order (#156)
  • Make sure that TransformListener's node gets a unique name (#129)
  • Fix compiler warning (#148)
  • Do not timeout when waiting for transforms (#146)
  • Fix race between timeout and transform ready callback (#143)
  • Fix high CPU - Use executor to spin and stop node in tf_listener thread (#119)
  • Catch polymorphic exceptions by reference (#138)
  • Add missing export build dependencies (#135)
  • avoid delete-non-virtual-dtor warning (#134)
  • Template tf2_ros::MessageFilter on the buffer type
  • Add pure virtual interface tf2_ros::AsyncBufferInterface
  • Add pure virtual interface tf2_ros::CreateTimerInterface
  • Allow tf2_monitor to be run with ROS command line args (#122)
  • Drop misleading ROS_* logging macros from tf2_monitor (#123)
  • Fix the MessageFilter init order. (#120)
  • Contributors: Chris Lalancette, Dan Rose, Jacob Perron, Karsten Knese, Michel Hidalgo, Scott K Logan, Shane Loretz, Vinnam Kim, bpwilcox, evshary

0.11.3 (2019-05-24)

  • stop spinning TransformListener thread node in destructor (#114)
  • Store dedicated transform listener thread as a std::unique_ptr (#111)
  • enable pedantic for tf2_ros (#115)
  • Contributors: Hunter L. Allen, Karsten Knese, bpwilcox

0.11.2 (2019-05-20)

  • Remove stray semicolon which causes compiler error when using -Werror=pedantic (#112)
  • Contributors: Michael Jeronimo

0.11.1 (2019-05-09)

  • use node interfaces throughout tf2_ros (#108)
  • changes to avoid deprecated API's (#107)
  • Fix call to create_publisher after API changed (#105)
  • Use node interfaces for static transform broadcaster (#104)
  • Contributors: Emerson Knapp, Karsten Knese, William Woodall

0.11.0 (2019-04-14)

  • Updated to use node inteface pointers in the MessageFilter class. (#96)
  • Updated message_filter.h. (#91)
  • Contributors: Michael Jeronimo, Sagnik Basu

0.10.1 (2018-12-06)

  • Allow static_transform_publisher to be run with ros arguments ros2#80 (#82)
  • Contributors: Lucas Walter

0.10.0 (2018-11-22)

  • Port tf2 ros message filter with ros2 tf2 and message filters (#81)
    • Port tf2 message filter to ros2

    - remove APIs to node callback queue due to no callback queue in ros2 now - Change failure callback register with failure prompting due to no corresponding boost signal2 in C++11 and later

    • Fix expected transform count in case of time tolerance
    • Upgrade all message counts to 64 bitThis should resolve C4267 warnings about downgrading a size_t.
  • Export tf2 dependency from tf2_ros (#72)
  • rclcpp time jump callback signature (#69)
  • Use ros2 time (#67)
  • Contributors: Carl Delsey, Ethan Gao, Shane Loretz

0.5.15 (2017-01-24)

  • tf2_ros: add option to unregister TransformListener (#201)
  • Contributors: Hans-Joachim Krauch

0.5.14 (2017-01-16)

  • Drop roslib.load_manifest (#191)
  • Adds ability to load TF from the ROS parameter server.
  • Code linting & reorganization
  • Fix indexing beyond end of array
  • added a static transform broadcaster in python
  • lots more documentation
  • remove BufferCore doc, add BufferClient/BufferServer doc for C++, add Buffer/BufferInterface Python documentation
  • Better overview for Python
  • Contributors: Eric Wieser, Felix Duvallet, Jackie Kay, Mikael Arguedas, Mike Purvis

0.5.13 (2016-03-04)

  • fix documentation warnings
  • Adding tests to package
  • Contributors: Laurent GEORGE, Vincent Rabaud

0.5.12 (2015-08-05)

  • remove annoying gcc warning This is because the roslog macro cannot have two arguments that are formatting strings: we need to concatenate them first.
  • break canTransform loop only for non-tiny negative time deltas (At least) with Python 2 ros.Time.now() is not necessarily monotonic and one can experience negative time deltas (usually well below 1s) on real hardware under full load. This check was originally introduced to allow for backjumps with rosbag replays, and only there it makes sense. So we'll add a small duration threshold to ignore backjumps due to non-monotonic clocks.
  • Contributors: Vincent Rabaud, v4hn

0.5.11 (2015-04-22)

  • do not short circuit waitForTransform timeout when running inside pytf. Fixes #102 roscpp is not initialized inside pytf which means that ros::ok is not valid. This was causing the timer to abort immediately. This breaks support for pytf with respect to early breaking out of a loop re #26. This is conceptually broken in pytf, and is fixed in tf2_ros python implementation. If you want this behavior I recommend switching to the tf2 python bindings.
  • inject timeout information into error string for canTransform with timeout
  • Contributors: Tully Foote

0.5.10 (2015-04-21)

  • switch to use a shared lock with upgrade instead of only a unique lock. For #91
  • Update message_filter.h
  • filters: fix unsupported old messages with frame_id starting with '/'
  • Enabled tf2 documentation
  • make sure the messages get processed before testing the effects. Fixes #88
  • allowing to use message filters with PCL types
  • Contributors: Brice Rebsamen, Jackie Kay, Tully Foote, Vincent Rabaud, jmtatsch

0.5.9 (2015-03-25)

  • changed queue_size in Python transform boradcaster to match that in c++
  • Contributors: mrath

0.5.8 (2015-03-17)

  • fix deadlock #79
  • break out of loop if ros is shutdown. Fixes #26
  • remove useless Makefile files
  • Fix static broadcaster with rpy args
  • Contributors: Paul Bovbel, Tully Foote, Vincent Rabaud

0.5.7 (2014-12-23)

  • Added 6 param transform again Yes, using Euler angles is a bad habit. But it is much more convenient if you just need a rotation by 90° somewhere to set it up in Euler angles. So I added the option to supply only the 3 angles.
  • Remove tf2_py dependency for Android
  • Contributors: Achim Königs, Gary Servin

0.5.6 (2014-09-18)

  • support if canTransform(...): in python #57
  • Support clearing the cache when time jumps backwards #68
  • Contributors: Tully Foote

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

  • surpressing autostart on the server objects to not incur warnings
  • switch to boost signals2 following ros/ros_comm#267, blocking ros/geometry#23
  • fix compilation with gcc 4.9
  • make can_transform correctly wait
  • explicitly set the publish queue size for rospy
  • Contributors: Tully Foote, Vincent Rabaud, v4hn

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

  • adding const to MessageEvent data
  • Contributors: Tully Foote

0.5.0 (2014-02-14)

  • TF2 uses message events to get connection header information
  • Contributors: Kevin Watts

0.4.10 (2013-12-26)

  • adding support for static transforms in python listener. Fixes #46
  • Contributors: Tully Foote

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35 in the python implementation
  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35

0.4.6 (2013-08-28)

  • patching python implementation for #24 as well
  • Stop waiting if time jumps backwards. fixes #24
  • patch to work around uninitiaized time. #30
  • Removing unnecessary CATKIN_DEPENDS #18

0.4.5 (2013-07-11)

  • Revert "cherrypicking groovy patch for #10 into hydro" This reverts commit 296d4916706d64f719b8c1592ab60d3686f994e1. It was not starting up correctly.
  • fixing usage string to show quaternions and using quaternions in the test app
  • cherrypicking groovy patch for #10 into hydro

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.
  • reviving unrun unittest and adding CATKIN_ENABLE_TESTING guards

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

  • adding queue accessors lost in the new API
  • exposing dedicated thread logic in BufferCore and checking in Buffer
  • adding methods to enable backwards compatability for passing through to tf::Transformer

0.4.0 (2013-06-27)

  • splitting rospy dependency into tf2_py so tf2 is pure c++ library.
  • 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
  • fixing return by value for tranform method without preallocatoin
  • 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
  • Added link against catkin_LIBRARIES for tf2_ros lib, also CMakeLists.txt clean up

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
  • Merge pull request #2 from KaijenHsiao/groovy-devel added setup.py and catkin_python_setup() to tf2_ros
  • added setup.py and catkin_python_setup() to tf2_ros
  • fixing cmake target collisions
  • fixing catkin message dependencies
  • removing packages with missing deps
  • catkin fixes
  • catkinizing geometry-experimental
  • catkinizing tf2_ros
  • catching None result in buffer client before it becomes an AttributeError, raising tf2.TransformException instead
  • oneiric linker fixes, bump version to 0.2.3
  • fix deprecated use of Header
  • merged faust's changes 864 and 865 into non_optimized branch: BufferCore instead of Buffer in TransformListener, and added a constructor that takes a NodeHandle.
  • add buffer server binary
  • fix compilation on 32bit
  • add missing file
  • build buffer server
  • TransformListener only needs a BufferCore
  • Add TransformListener constructor that takes a NodeHandle so you can specify a callback queue to use
  • Add option to use a callback queue in the message filter
  • move the message filter to tf2_ros
  • add missing std_msgs dependency
  • missed 2 lines in last commit
  • removing auto clearing from listener for it's unexpected from a library
  • static transform tested and working
  • subscriptions to tf_static unshelved
  • static transform publisher executable running
  • latching static transform publisher
  • cleaning out old commented code
  • Only query rospy.Time.now() when the timeout is greater than 0
  • debug comments removed
  • move to tf2_ros completed. tests pass again
  • merge tf2_cpp and tf2_py into tf2_ros

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
apriltag_ros
aruco_ros
cartographer_ros
depthai_bridge
find_object_2d
fuse_models
fuse_publishers
gazebo_plugins
examples_tf2_py
geometry2
test_tf2
tf2_bullet
tf2_eigen
tf2_geometry_msgs
tf2_kdl
tf2_sensor_msgs
tf2_tools
turtle_tf2_cpp
turtle_tf2_py
grid_map_costmap_2d
depth_image_proc
image_rotate
imu_processors
imu_transformer
imu_complementary_filter
imu_filter_madgwick
rviz_imu_plugin
laser_filters
mapviz
swri_transform_util
mavros
mavros_extras
microstrain_inertial_driver
microstrain_inertial_examples
moveit_planners_ompl
pilz_industrial_motion_planner
moveit_hybrid_planning
moveit_ros_move_group
moveit_servo
moveit_ros_occupancy_map_monitor
moveit_ros_perception
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_robot_interaction
moveit_ros_tests
moveit_ros_trajectory_cache
moveit_ros_warehouse
moveit_resources_fanuc_moveit_config
moveit_visual_tools
mrpt_map_server
mrpt_rawlog
mrpt_reactivenav2d
mrpt_tps_astar_planner
mrpt_generic_sensor
mrpt_sensor_bumblebee_stereo
mrpt_sensor_gnss_nmea
mrpt_sensor_gnss_novatel
mrpt_sensor_imu_taobotics
mrpt_sensorlib
octomap_server
pcl_ros
plotjuggler_ros
pointcloud_to_laserscan
quaternion_operation
realsense2_camera
robot_calibration
robot_localization
robot_state_publisher
rqt_tf_tree
rtabmap_examples
rtabmap_slam
rtabmap_util
rviz_common
rviz_default_plugins
rviz_visual_testing_framework
rviz_satellite
sbg_driver
septentrio_gnss_driver
simple_grasping
slam_toolbox
spatio_temporal_voxel_layer
tf2_2d
velodyne_driver
velodyne_pointcloud
warehouse_ros
aruco_opencv
nav2_amcl
nav2_behavior_tree
nav2_bt_navigator
nav2_collision_monitor
nav2_core
nav2_costmap_2d
opennav_docking
dwb_core
nav2_loopback_sim
nav2_mppi_controller
nav2_navfn_planner
nav2_planner
nav2_smac_planner
nav2_theta_star_planner
nav2_util
nav2_waypoint_follower
odom_to_tf_ros2
rmf_robot_sim_common
admittance_controller
ros2_ouster
move_group_interface_client
pure_spinning_local_planner
nav2z_client
webots_ros2_driver
webots_ros2_epuck
webots_ros2_tests
webots_ros2_tiago
webots_ros2_turtlebot
irobot_create_nodes
ign_rviz
ign_rviz_common
ign_rviz_plugins
turtlebot4_bringup
beluga_ros
etsi_its_rviz_plugins
message_tf_frame_transformer
sick_scan_xd
dual_laser_merger
mola_input_rosbag2
motion_capture_tracking
ouster_ros
qml_ros2_plugin
kinova_gen3_6dof_robotiq_2f_85_moveit_config
kinova_gen3_7dof_robotiq_2f_85_moveit_config
kinova_gen3_lite_moveit_config
scenario_execution_nav2
gazebo_static_camera
tf_to_pose_publisher

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_ros 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

This package contains the C++ ROS bindings for the tf2 library

Additional Links

Maintainers

  • Alejandro Hernandez Cordero
  • Chris Lalancette

Authors

  • Eitan Marder-Eppstein
  • Tully Foote
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_ros

0.39.1 (2024-10-15)

  • Add configurable TF topics (#709)
  • Contributors: Ryan

0.39.0 (2024-10-03)

  • Adding static transform listener (#673)
  • Contributors: Tom Moore

0.38.2 (2024-07-19)

  • Updated deprecated message filter headers (#702)
  • Contributors: Alejandro Hernández Cordero

0.38.1 (2024-07-09)

0.38.0 (2024-06-17)

  • Update qos for deprecation (#695)
  • Contributors: Lucas Wendland

0.37.1 (2024-05-29)

  • Cli tools documentation (#653)
  • Contributors: Lucas Wendland

0.37.0 (2024-04-26)

0.36.2 (2024-04-10)

  • Compile fix for upcomming changes to rclcpp::Executor (#668)
  • Enable Twist interpolator (#646) Co-authored-by: Tully Foote <<tullyfoote@intrinsic.ai>>
  • Contributors: Alejandro Hernández Cordero, jmachowinski

0.36.1 (2024-03-28)

  • Adding NodeInterfaces to Buffer (#656)
  • Reformat some code to make uncrustify happier. (#654)
  • Contributors: Chris Lalancette, Lucas Wendland

0.36.0 (2024-02-07)

  • Enable intra-process (#649) (#642)
  • Contributors: Patrick Roncagliolo

0.35.1 (2024-01-24)

0.35.0 (2023-12-26)

  • Avoid unecessary time conversions. (#635)
  • Contributors: AiVerisimilitude

0.34.0 (2023-11-06)

  • Expose TF2 listener CB (#632)
  • Contributors: Steve Macenski

0.33.2 (2023-10-04)

0.33.1 (2023-09-07)

0.33.0 (2023-08-21)

  • Fix invalid timer handle exception (#474)
  • Fix for #589 - Should be able to transform with default timeout (#593)
  • Contributors: Cliff Wu, vineet131

0.32.2 (2023-07-11)

  • Enable StaticTransformBroadcaster in Intra-process enabled components (#607)
  • Contributors: Patrick Roncagliolo

0.32.1 (2023-05-11)

0.32.0 (2023-04-27)

0.31.2 (2023-04-13)

  • Destroy callback group before node (#595)
  • Contributors: Michael Carroll

0.31.1 (2023-04-12)

0.31.0 (2023-04-11)

  • Enable TransformListener node-based constructor in Intra-process enabled components (#572)
  • Contributors: Patrick Roncagliolo

0.30.0 (2023-02-14)

  • Fix use-after-free bug in BufferServer::cancelCB (#579)
  • Update the demos to C++17. (#578)
  • add constructor to static tf broadcaster accepting node interfaces (#576)
  • Contributors: Alberto Soragna, Alexander Hans, Chris Lalancette

0.29.0 (2022-11-21)

  • Update maintainers (#560)
  • Contributors: Audrow Nash

0.28.0 (2022-11-02)

  • Switching from sstream to c string formatting to fix ros arg issue (#557)
  • allow construction of tf broadcaster from node object (not a pointer) (#555)
  • Allow to construct [TransformBroadcaster]{.title-ref} and [TransformListener]{.title-ref} from node interfaces (#552)
  • Contributors: Alberto Soragna, Chris Lalancette

0.27.0 (2022-09-13)

  • Suppress spam from calling canTransform (#529)
  • Contributors: Gonzo

0.26.2 (2022-08-15)

0.26.1 (2022-06-24)

0.26.0 (2022-04-29)

0.25.0 (2022-04-05)

  • Install includes to include/${PROJECT_NAME} and use modern CMake (#493)
  • Contributors: Shane Loretz

0.24.0 (2022-03-31)

0.23.0 (2022-03-28)

  • use dedicated callback group and executor to isolate timer (#447)
  • Adding shared pointer definition to tf2 buffer (#508)
  • fix for a basic logic (#510)
  • Fix precision loss from using rclcpp::Time::seconds() (#511)
  • Contributors: Chen Lihui, Kenji Brameld, Steve Macenski, Zhenpeng Ge

0.22.0 (2022-03-01)

  • clear relative callback of Buffer if MessageFilter is destroyed (#490)
  • More info in tf2_echo output (#468)
  • Contributors: Chen Lihui, simulacrus

0.21.0 (2022-01-14)

  • Fix cpplint errors (#497)
  • Contributors: Jacob Perron

0.20.0 (2021-12-17)

  • Fixes for uncrustify 0.72 (#486)
  • Contributors: Chris Lalancette

0.19.0 (2021-10-15)

  • More Intuitive CLI for Static Transform Publisher (#392)
  • Reduce transform listener nodes (#442)
  • `tf2_ros`: Fix deprecated subscriber callbacks (#448)
  • Contributors: Abrar Rahman Protyasha, Hunter L. Allen, gezp

0.18.0 (2021-06-01)

  • Fix tf2_echo does not work with ros-args (#407) (#408)
  • Contributors: PGotzmann

0.17.1 (2021-04-06)

0.17.0 (2021-03-19)

  • Guard against access to null node pointer (#393)
  • Allow to reconfigure durability for /tf topic broadcaster/listener (#383)
  • Fix the rcl type used in the time jump. (#391)
  • Fix linter errors (#385)
  • fix accessing freed resources (#386)
  • Allow reconfiguring qos of tf and tf_static topics through parameters (#381)
  • Replace ROS_* logging macros and use RCLCPP_* instead (#380)
  • Contributors: Audrow Nash, Chris Lalancette, Ivan Santiago Paunovic, Jacob Perron, Kazunari Tanaka

0.16.0 (2021-01-25)

  • Improve message filters error messages (#364)
  • Contributors: Ivan Santiago Paunovic

0.15.1 (2020-12-08)

  • Clarify the role of child_frame_id and header.frame_id in the documentation. (#345)
  • Contributors: Vikas Dhiman

0.15.0 (2020-11-02)

  • Remove usage of deprecated rclcpp::Duration constructor (#340)
  • Remove messages_count member from tf2_ros::MessageFilter. (#335)
  • Style fixup in tf2_ros. (#325)
  • Update maintainers of the ros2/geometry2 fork. (#328)
  • Contributors: Chris Lalancette, Ivan Santiago Paunovic

0.14.1 (2020-09-21)

  • Update goal response callback signature (#323)
  • Activate usual compiler warnings and fix errors (#270)
  • Contributors: Ivan Santiago Paunovic, Jacob Perron

0.14.0 (2020-08-14)

  • Fixed memory leak in Buffer::waitForTransform (#281)
  • fix time-reset test with Connext (#306)
  • reenable FrameGraph server (#198)
  • Use the usual style of parameters for static_transform_program (#300)
  • Make static_transform_broadcaster consistent with its command line description (#294)
  • Avoid using invalid std::list iterators (#293)
  • Generate callbacks after updating message_ (#274)
  • Moved unique_lock of messages_mutex_ to guarantee pointer (#279)
  • Fix dependencies in tf2_ros. (#269)
  • Split tf2_ros in tf2_ros and tf2_ros_py (#210)
  • Contributors: Alejandro Hernández Cordero, Chris Lalancette, Dirk Thomas, Hunter L. Allen, Martin Ganeff, Michael Carroll, ymd-stella

0.13.4 (2020-06-03)

  • export targets in addition to include directories / libraries (#271)
  • Add missing virtual destructors (#272)
  • Contributors: Dirk Thomas, Ivan Santiago Paunovic

0.13.3 (2020-05-26)

  • Fixed in Exception constructor tf2_ros (#267)
  • Contributors: Alejandro Hernández Cordero

0.13.2 (2020-05-18)

0.13.1 (2020-05-08)

0.13.0 (2020-04-30)

  • Added doxyfiles and sphinx Makefiles (#257)
  • avoid more deprecations (#255)
  • create_timer takes shared pointers (#251)
  • Improve tf2_echo and tf2_monitor messages while waiting for data (#254)
  • Add missing visibility header include (#246)
  • Fix [-Wrange-loop-construct]{.title-ref} (#245) ` --- stderr: tf2_ros /opt/ros/master/src/ros2/geometry2/tf2_ros/test/test_buffer.cpp:84:21: warning: loop variable 'elem' creates a copy from type 'const std::pair<const unsigned long, std::function<void (const unsigned long &)> >' [-Wrange-loop-construct] for (const auto elem : timer_to_callback_map\_) { ^ /opt/ros/master/src/ros2/geometry2/tf2_ros/test/test_buffer.cpp:84:10: note: use reference type 'const std::pair<const unsigned long, std::function<void (const unsigned long &)> > &' to prevent copying for (const auto elem : timer_to_callback_map\_) { ^~~~~~~~~~~~~~~~~ & 1 warning generated. ---`
  • Remove TODO (#234) The TODO is done; The publisher is using QoS durability setting 'transient local' which is the closest thing to the 'latched' concept in ROS 1. Signed-off-by: Jacob Perron <<jacob@openrobotics.org>>
  • Remove virtual keyword from overridden functions (#214) Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>>
  • message filter fix (#216)
    • Fixed meesage_filter add method
    • removed using builtin_interfaces::msg::Time in tf2_ros
  • Porting more tests to tf2_ros (#202)
    • Added more tests to tf2_ros
    • improving tf2_ros time_reset_test
    • tf2_ros fixed failed test_buffer_client.cpp
    • added some EXPECT to listener unittest
    • reviews
    • Update listener_unittest.cpp
    • fixed tf2_ros time_reset_test
    • tf2_ros removed ROS launch files
    • Added TODO to fix test_buffer_client in CI
    • tf2_ros added feedback
  • Add static transform component (#182) * Create a static transform component for composition Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>> * Suffix node name with randomly generated alpha-numeric string Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>> * Fix windows build Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>> * Switch to much more readable and more performant implementation by \@clalancette Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>>

  • Adding support for view_frame (#192)
    • Adding tf2_tools support for view_frames
    • Changelog
    • tf2_tools 0.12.1 package version
    • tf2_tools common linters
    • tf2_tools changelog Forthcoming
    • tf2_tools log error and destroy client and node when a exception raised
    • tf2_tools 0.12.4 package version
    • tf2_tools revert some changes
    • tf2_tools - reduce changes
    • tf2_tools: finally block and passing the time instead of the node
    • tf2_tools: buffer with less arguments
    • tf2_tools: Fix condition
  • Contributors: Alejandro Hernández Cordero, Dan Rose, Hunter L. Allen, Jacob Perron, Karsten Knese, Shane Loretz, William Woodall

0.12.4 (2019-11-19)

0.12.3 (2019-11-18)

  • Remove unused setup.py files (#190)
  • Print out the name of the signalFailure reason instead of just its enum value (#186)
  • Contributors: Emerson Knapp, Vasilii Artemev

0.12.2 (2019-11-18)

  • Fix tf2_monitor subscriptions QoS settings. (#196)
  • Contributors: Michel Hidalgo

0.12.1 (2019-10-23)

  • Add convenience methods using rclcpp time types (#180)
  • Don't assume quaternions init to all zeros
  • Make BufferClient destructor virtual
  • Contributors: Josh Langsfeld, Shane Loretz, Thomas Moulard

0.12.0 (2019-09-26)

  • Simulate work in the acceptedCallback.
  • Make Windows Debug to run the correct python executable.
  • Make BufferInterface destructor virtual.
  • Remove unnecessary and blacklisted actionlib_msgs dependency.
  • More test fixes for tf2_ros python.
  • class Clock is in clock not timer.
  • tf2_ros is not built for Python (#99)
  • Migrate buffer action server to ROS 2
  • Add conversion functions for durations
  • Make /tf_static use transient_local durability (#160)
  • Force explicit --ros-args in NodeOptions::arguments(). (#162)
  • Use of -r/--remap flags where appropriate. (#159)
  • Include tf2 headers in message_filter.h (#157)
  • Use ament_target_dependencies to ensure correct dependency order (#156)
  • Make sure that TransformListener's node gets a unique name (#129)
  • Fix compiler warning (#148)
  • Do not timeout when waiting for transforms (#146)
  • Fix race between timeout and transform ready callback (#143)
  • Fix high CPU - Use executor to spin and stop node in tf_listener thread (#119)
  • Catch polymorphic exceptions by reference (#138)
  • Add missing export build dependencies (#135)
  • avoid delete-non-virtual-dtor warning (#134)
  • Template tf2_ros::MessageFilter on the buffer type
  • Add pure virtual interface tf2_ros::AsyncBufferInterface
  • Add pure virtual interface tf2_ros::CreateTimerInterface
  • Allow tf2_monitor to be run with ROS command line args (#122)
  • Drop misleading ROS_* logging macros from tf2_monitor (#123)
  • Fix the MessageFilter init order. (#120)
  • Contributors: Chris Lalancette, Dan Rose, Jacob Perron, Karsten Knese, Michel Hidalgo, Scott K Logan, Shane Loretz, Vinnam Kim, bpwilcox, evshary

0.11.3 (2019-05-24)

  • stop spinning TransformListener thread node in destructor (#114)
  • Store dedicated transform listener thread as a std::unique_ptr (#111)
  • enable pedantic for tf2_ros (#115)
  • Contributors: Hunter L. Allen, Karsten Knese, bpwilcox

0.11.2 (2019-05-20)

  • Remove stray semicolon which causes compiler error when using -Werror=pedantic (#112)
  • Contributors: Michael Jeronimo

0.11.1 (2019-05-09)

  • use node interfaces throughout tf2_ros (#108)
  • changes to avoid deprecated API's (#107)
  • Fix call to create_publisher after API changed (#105)
  • Use node interfaces for static transform broadcaster (#104)
  • Contributors: Emerson Knapp, Karsten Knese, William Woodall

0.11.0 (2019-04-14)

  • Updated to use node inteface pointers in the MessageFilter class. (#96)
  • Updated message_filter.h. (#91)
  • Contributors: Michael Jeronimo, Sagnik Basu

0.10.1 (2018-12-06)

  • Allow static_transform_publisher to be run with ros arguments ros2#80 (#82)
  • Contributors: Lucas Walter

0.10.0 (2018-11-22)

  • Port tf2 ros message filter with ros2 tf2 and message filters (#81)
    • Port tf2 message filter to ros2

    - remove APIs to node callback queue due to no callback queue in ros2 now - Change failure callback register with failure prompting due to no corresponding boost signal2 in C++11 and later

    • Fix expected transform count in case of time tolerance
    • Upgrade all message counts to 64 bitThis should resolve C4267 warnings about downgrading a size_t.
  • Export tf2 dependency from tf2_ros (#72)
  • rclcpp time jump callback signature (#69)
  • Use ros2 time (#67)
  • Contributors: Carl Delsey, Ethan Gao, Shane Loretz

0.5.15 (2017-01-24)

  • tf2_ros: add option to unregister TransformListener (#201)
  • Contributors: Hans-Joachim Krauch

0.5.14 (2017-01-16)

  • Drop roslib.load_manifest (#191)
  • Adds ability to load TF from the ROS parameter server.
  • Code linting & reorganization
  • Fix indexing beyond end of array
  • added a static transform broadcaster in python
  • lots more documentation
  • remove BufferCore doc, add BufferClient/BufferServer doc for C++, add Buffer/BufferInterface Python documentation
  • Better overview for Python
  • Contributors: Eric Wieser, Felix Duvallet, Jackie Kay, Mikael Arguedas, Mike Purvis

0.5.13 (2016-03-04)

  • fix documentation warnings
  • Adding tests to package
  • Contributors: Laurent GEORGE, Vincent Rabaud

0.5.12 (2015-08-05)

  • remove annoying gcc warning This is because the roslog macro cannot have two arguments that are formatting strings: we need to concatenate them first.
  • break canTransform loop only for non-tiny negative time deltas (At least) with Python 2 ros.Time.now() is not necessarily monotonic and one can experience negative time deltas (usually well below 1s) on real hardware under full load. This check was originally introduced to allow for backjumps with rosbag replays, and only there it makes sense. So we'll add a small duration threshold to ignore backjumps due to non-monotonic clocks.
  • Contributors: Vincent Rabaud, v4hn

0.5.11 (2015-04-22)

  • do not short circuit waitForTransform timeout when running inside pytf. Fixes #102 roscpp is not initialized inside pytf which means that ros::ok is not valid. This was causing the timer to abort immediately. This breaks support for pytf with respect to early breaking out of a loop re #26. This is conceptually broken in pytf, and is fixed in tf2_ros python implementation. If you want this behavior I recommend switching to the tf2 python bindings.
  • inject timeout information into error string for canTransform with timeout
  • Contributors: Tully Foote

0.5.10 (2015-04-21)

  • switch to use a shared lock with upgrade instead of only a unique lock. For #91
  • Update message_filter.h
  • filters: fix unsupported old messages with frame_id starting with '/'
  • Enabled tf2 documentation
  • make sure the messages get processed before testing the effects. Fixes #88
  • allowing to use message filters with PCL types
  • Contributors: Brice Rebsamen, Jackie Kay, Tully Foote, Vincent Rabaud, jmtatsch

0.5.9 (2015-03-25)

  • changed queue_size in Python transform boradcaster to match that in c++
  • Contributors: mrath

0.5.8 (2015-03-17)

  • fix deadlock #79
  • break out of loop if ros is shutdown. Fixes #26
  • remove useless Makefile files
  • Fix static broadcaster with rpy args
  • Contributors: Paul Bovbel, Tully Foote, Vincent Rabaud

0.5.7 (2014-12-23)

  • Added 6 param transform again Yes, using Euler angles is a bad habit. But it is much more convenient if you just need a rotation by 90° somewhere to set it up in Euler angles. So I added the option to supply only the 3 angles.
  • Remove tf2_py dependency for Android
  • Contributors: Achim Königs, Gary Servin

0.5.6 (2014-09-18)

  • support if canTransform(...): in python #57
  • Support clearing the cache when time jumps backwards #68
  • Contributors: Tully Foote

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

  • surpressing autostart on the server objects to not incur warnings
  • switch to boost signals2 following ros/ros_comm#267, blocking ros/geometry#23
  • fix compilation with gcc 4.9
  • make can_transform correctly wait
  • explicitly set the publish queue size for rospy
  • Contributors: Tully Foote, Vincent Rabaud, v4hn

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

  • adding const to MessageEvent data
  • Contributors: Tully Foote

0.5.0 (2014-02-14)

  • TF2 uses message events to get connection header information
  • Contributors: Kevin Watts

0.4.10 (2013-12-26)

  • adding support for static transforms in python listener. Fixes #46
  • Contributors: Tully Foote

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35 in the python implementation
  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35

0.4.6 (2013-08-28)

  • patching python implementation for #24 as well
  • Stop waiting if time jumps backwards. fixes #24
  • patch to work around uninitiaized time. #30
  • Removing unnecessary CATKIN_DEPENDS #18

0.4.5 (2013-07-11)

  • Revert "cherrypicking groovy patch for #10 into hydro" This reverts commit 296d4916706d64f719b8c1592ab60d3686f994e1. It was not starting up correctly.
  • fixing usage string to show quaternions and using quaternions in the test app
  • cherrypicking groovy patch for #10 into hydro

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.
  • reviving unrun unittest and adding CATKIN_ENABLE_TESTING guards

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

  • adding queue accessors lost in the new API
  • exposing dedicated thread logic in BufferCore and checking in Buffer
  • adding methods to enable backwards compatability for passing through to tf::Transformer

0.4.0 (2013-06-27)

  • splitting rospy dependency into tf2_py so tf2 is pure c++ library.
  • 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
  • fixing return by value for tranform method without preallocatoin
  • 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
  • Added link against catkin_LIBRARIES for tf2_ros lib, also CMakeLists.txt clean up

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
  • Merge pull request #2 from KaijenHsiao/groovy-devel added setup.py and catkin_python_setup() to tf2_ros
  • added setup.py and catkin_python_setup() to tf2_ros
  • fixing cmake target collisions
  • fixing catkin message dependencies
  • removing packages with missing deps
  • catkin fixes
  • catkinizing geometry-experimental
  • catkinizing tf2_ros
  • catching None result in buffer client before it becomes an AttributeError, raising tf2.TransformException instead
  • oneiric linker fixes, bump version to 0.2.3
  • fix deprecated use of Header
  • merged faust's changes 864 and 865 into non_optimized branch: BufferCore instead of Buffer in TransformListener, and added a constructor that takes a NodeHandle.
  • add buffer server binary
  • fix compilation on 32bit
  • add missing file
  • build buffer server
  • TransformListener only needs a BufferCore
  • Add TransformListener constructor that takes a NodeHandle so you can specify a callback queue to use
  • Add option to use a callback queue in the message filter
  • move the message filter to tf2_ros
  • add missing std_msgs dependency
  • missed 2 lines in last commit
  • removing auto clearing from listener for it's unexpected from a library
  • static transform tested and working
  • subscriptions to tf_static unshelved
  • static transform publisher executable running
  • latching static transform publisher
  • cleaning out old commented code
  • Only query rospy.Time.now() when the timeout is greater than 0
  • debug comments removed
  • move to tf2_ros completed. tests pass again
  • merge tf2_cpp and tf2_py into tf2_ros

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
apriltag_ros
aruco_ros
cartographer_ros
find_object_2d
fuse_models
fuse_publishers
examples_tf2_py
geometry2
test_tf2
tf2_bullet
tf2_eigen
tf2_geometry_msgs
tf2_kdl
tf2_sensor_msgs
tf2_tools
turtle_tf2_cpp
turtle_tf2_py
depth_image_proc
image_rotate
imu_processors
imu_transformer
imu_complementary_filter
imu_filter_madgwick
rviz_imu_plugin
laser_filters
mapviz
swri_transform_util
mavros
mavros_extras
microstrain_inertial_driver
microstrain_inertial_examples
moveit_planners_ompl
pilz_industrial_motion_planner
moveit_hybrid_planning
moveit_ros_move_group
moveit_servo
moveit_ros_occupancy_map_monitor
moveit_ros_perception
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_robot_interaction
moveit_ros_tests
moveit_ros_trajectory_cache
moveit_ros_warehouse
moveit_resources_fanuc_moveit_config
moveit_visual_tools
mrpt_map_server
mrpt_rawlog
mrpt_reactivenav2d
mrpt_tps_astar_planner
mrpt_generic_sensor
mrpt_sensor_bumblebee_stereo
mrpt_sensor_gnss_nmea
mrpt_sensor_gnss_novatel
mrpt_sensor_imu_taobotics
mrpt_sensorlib
octomap_server
pcl_ros
plotjuggler_ros
pointcloud_to_laserscan
quaternion_operation
robot_calibration
robot_localization
robot_state_publisher
rqt_tf_tree
rviz_common
rviz_default_plugins
rviz_visual_testing_framework
septentrio_gnss_driver
simple_grasping
tf2_2d
velodyne_driver
velodyne_pointcloud
warehouse_ros
aruco_opencv
odom_to_tf_ros2
raspimouse
rmf_robot_sim_common
admittance_controller
move_group_interface_client
pure_spinning_local_planner
nav2z_client
webots_ros2_driver
webots_ros2_epuck
webots_ros2_tests
webots_ros2_tiago
webots_ros2_turtlebot
ign_rviz
ign_rviz_common
ign_rviz_plugins
message_tf_frame_transformer
dual_laser_merger
mola_input_rosbag2
motion_capture_tracking
ouster_ros
qml_ros2_plugin
kinova_gen3_6dof_robotiq_2f_85_moveit_config
kinova_gen3_7dof_robotiq_2f_85_moveit_config
kinova_gen3_lite_moveit_config

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_ros 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

This package contains the ROS bindings for the tf2 library, for both Python and C++.

Additional Links

Maintainers

  • Tully Foote

Authors

  • Eitan Marder-Eppstein
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_ros

0.7.7 (2023-10-13)

0.7.6 (2022-10-11)

  • tf2_ros polling interval proportional to timeout (#492)
    • polling interval proportional to timeout
    • CAN_TRANSFORM_POLLING_SCALE as global
    • add DEFAULT_CAN_TRANSFORM_POLLING_SCALE
  • Removed print statements from buffer interface (#530)
  • Switch to new boost/bind/bind.hpp (#528)
  • Updating the documentation to reflect current constructor for a MessageFilter (#527)
  • (tf2_ros) Docs working on python 3 (#521)
  • Mitigate flakey test in tf2_ros (#490)
  • Contributors: Atsushi Watanabe, Janno Lunenburg, Jochen Sprickerhof, Matthijs van der Burgh, Shih-Wei Guo, Tassos Natsakis

0.7.5 (2020-09-01)

0.7.4 (2020-09-01)

0.7.3 (2020-08-25)

  • Use correct frame service name in docstrings. (#476) Replaces the deprecated names {tf_frames, view_frames} -> tf2_frames
  • Cherry-picking various commits from Melodic (#471)
    • Revert "rework Eigen functions namespace hack" (#436)

    * Fixed warnings in message_filter.h (#434) the variables are not used in function body and caused -Wunused-parameter to trigger with -Wall

    • Fix ambiguous call for tf2::convert on MSVC (#444)
    • rework ambiguous call on MSVC.
  • Contributors: Michael Grupp, Robert Haschke

0.7.2 (2020-06-08)

0.7.1 (2020-05-13)

  • StatisTransformBroadcaster: simplify/modernize code
  • [noetic] cherry-pick Windows fixes from melodic-devel (#450)
    • [Windows][melodic-devel] Fix install locations (#442)
    • fixed install locations of tf2
    • [windows][melodic] more portable fixes. (#443)
    • more portable fixes.
  • import setup from setuptools instead of distutils-core (#449)
  • Contributors: Alejandro Hernández Cordero, Robert Haschke, Sean Yen

0.7.0 (2020-03-09)

  • Bump CMake version to avoid CMP0048 warning (#445)
  • Add arguments to TransformListener constructors that accept TransportHints for the tf topic subscriber (#438)
  • Merge pull request #404 from otamachan/remove-load-manifest Remove roslib.load_manifest
  • Merge pull request #402 from rhaschke/fix-message-filter Fix message filter
  • resolve virtual function call in destructor
  • remove pending callbacks in clear()
  • Merge pull request #372 from lucasw/patch-1 spelling fix: seperate -> separate
  • Merge pull request #369 from magazino/fix-dangling-reference
  • Fix dangling iterator references in buffer_server.cpp
  • Remove some useless code from buffer_server_main.cpp (#368)
  • Mark check_frequency as deprecated in docstring.
  • Follow #337: use actionlib API in BufferClient::processGoal()
  • Test for equality to None with 'is' instead of '==' (#355)
  • added parameter to advertise tf2-frames as a service, if needed
  • Contributors: Daniel Ingram, Emre Sahin, JonasTietz, Lucas Walter, Michael Grupp, Robert Haschke, Shane Loretz, Tamaki Nishino, Tully Foote, toliver

0.6.5 (2018-11-16)

  • Protect the time reset logic from a race condition. Fixes #341 This could incorrectly trigger a buffer clear if two concurrent callbacks were invoked.
  • Contributors: Tully Foote

0.6.4 (2018-11-06)

  • fix(buffer-client): Use actionlib api for obtaining result Use the API provided by actionlib for waiting for result. This will improve the response time and prevent problems with custom solutions (see #178). This change makes constructor parameter check_frequency obsolute and deprecates it.
  • Add check to buffer_client.py to make sure result is available Related issue: #178
  • Add check to reset buffer when rostime goes backwards
  • Fixed the value of expected_success_count_
  • Added a tf2_ros message filter unittest with multiple target frames and non-zero time tolerance
  • Contributors: Ewoud Pool, Jørgen Borgesen, Stephen Williams

0.6.3 (2018-07-09)

0.6.2 (2018-05-02)

  • update buffer_server_name (#296)
    • use nodename as namespace
    • Update #209 to provide backwards compatibility.
  • Contributors: Jihoon Lee, Tully Foote

0.6.1 (2018-03-21)

0.6.0 (2018-03-21)

  • tf2_ros::Buffer: canTransform can now deal with timeouts smaller than 10ms by using the hunderdth of the timeout for sleeping (#286)
  • More spinning to make sure the message gets through for #129 #283
  • Contributors: Tully Foote, cwecht

0.5.17 (2018-01-01)

  • Merge pull request #260 from randoms/indigo-devel fix python3 import error
  • Merge pull request #257 from delftrobotics-forks/python3 Make tf2_py python3 compatible again
  • Use python3 print function.
  • Contributors: Maarten de Vries, Tully Foote, randoms

0.5.16 (2017-07-14)

  • Merge pull request #144 from clearpathrobotics/dead_lock_fix Solve a bug that causes a deadlock in MessageFilter
  • Clear error string if it exists from the external entry points. Fixes #117
  • Make buff_size and tcp_nodelay and subscriber queue size mutable.
  • Remove generate_rand_vectors() from a number of tests. (#227)
    • Remove generate_rand_vectors() from a number of tests.
  • Log jump duration on backwards time jump detection. (#234)
  • replaced dependencies on tf2_msgs_gencpp by exported dependencies
  • Use new-style objects in python 2
  • Solve a bug that causes a deadlock in MessageFilter
  • Contributors: Adel Fakih, Chris Lalancette, Christopher Wecht, Eric Wieser, Koji Terada, Stephan, Tully Foote, koji_terada

0.5.15 (2017-01-24)

  • tf2_ros: add option to unregister TransformListener (#201)
  • Contributors: Hans-Joachim Krauch

0.5.14 (2017-01-16)

  • Drop roslib.load_manifest (#191)
  • Adds ability to load TF from the ROS parameter server.
  • Code linting & reorganization
  • Fix indexing beyond end of array
  • added a static transform broadcaster in python
  • lots more documentation
  • remove BufferCore doc, add BufferClient/BufferServer doc for C++, add Buffer/BufferInterface Python documentation
  • Better overview for Python
  • Contributors: Eric Wieser, Felix Duvallet, Jackie Kay, Mikael Arguedas, Mike Purvis

0.5.13 (2016-03-04)

  • fix documentation warnings
  • Adding tests to package
  • Contributors: Laurent GEORGE, Vincent Rabaud

0.5.12 (2015-08-05)

  • remove annoying gcc warning This is because the roslog macro cannot have two arguments that are formatting strings: we need to concatenate them first.
  • break canTransform loop only for non-tiny negative time deltas (At least) with Python 2 ros.Time.now() is not necessarily monotonic and one can experience negative time deltas (usually well below 1s) on real hardware under full load. This check was originally introduced to allow for backjumps with rosbag replays, and only there it makes sense. So we'll add a small duration threshold to ignore backjumps due to non-monotonic clocks.
  • Contributors: Vincent Rabaud, v4hn

0.5.11 (2015-04-22)

  • do not short circuit waitForTransform timeout when running inside pytf. Fixes #102 roscpp is not initialized inside pytf which means that ros::ok is not valid. This was causing the timer to abort immediately. This breaks support for pytf with respect to early breaking out of a loop re #26. This is conceptually broken in pytf, and is fixed in tf2_ros python implementation. If you want this behavior I recommend switching to the tf2 python bindings.
  • inject timeout information into error string for canTransform with timeout
  • Contributors: Tully Foote

0.5.10 (2015-04-21)

  • switch to use a shared lock with upgrade instead of only a unique lock. For #91
  • Update message_filter.h
  • filters: fix unsupported old messages with frame_id starting with '/'
  • Enabled tf2 documentation
  • make sure the messages get processed before testing the effects. Fixes #88
  • allowing to use message filters with PCL types
  • Contributors: Brice Rebsamen, Jackie Kay, Tully Foote, Vincent Rabaud, jmtatsch

0.5.9 (2015-03-25)

  • changed queue_size in Python transform boradcaster to match that in c++
  • Contributors: mrath

0.5.8 (2015-03-17)

  • fix deadlock #79
  • break out of loop if ros is shutdown. Fixes #26
  • remove useless Makefile files
  • Fix static broadcaster with rpy args
  • Contributors: Paul Bovbel, Tully Foote, Vincent Rabaud

0.5.7 (2014-12-23)

  • Added 6 param transform again Yes, using Euler angles is a bad habit. But it is much more convenient if you just need a rotation by 90° somewhere to set it up in Euler angles. So I added the option to supply only the 3 angles.
  • Remove tf2_py dependency for Android
  • Contributors: Achim Königs, Gary Servin

0.5.6 (2014-09-18)

  • support if canTransform(...): in python #57
  • Support clearing the cache when time jumps backwards #68
  • Contributors: Tully Foote

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

  • surpressing autostart on the server objects to not incur warnings
  • switch to boost signals2 following ros/ros_comm#267, blocking ros/geometry#23
  • fix compilation with gcc 4.9
  • make can_transform correctly wait
  • explicitly set the publish queue size for rospy
  • Contributors: Tully Foote, Vincent Rabaud, v4hn

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

  • adding const to MessageEvent data
  • Contributors: Tully Foote

0.5.0 (2014-02-14)

  • TF2 uses message events to get connection header information
  • Contributors: Kevin Watts

0.4.10 (2013-12-26)

  • adding support for static transforms in python listener. Fixes #46
  • Contributors: Tully Foote

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35 in the python implementation
  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

  • Revert "cherrypicking groovy patch for #10 into hydro" This reverts commit 296d4916706d64f719b8c1592ab60d3686f994e1. It was not starting up correctly.
  • fixing usage string to show quaternions and using quaternions in the test app
  • cherrypicking groovy patch for #10 into hydro

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.
  • reviving unrun unittest and adding CATKIN_ENABLE_TESTING guards

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

  • adding queue accessors lost in the new API
  • exposing dedicated thread logic in BufferCore and checking in Buffer
  • adding methods to enable backwards compatability for passing through to tf::Transformer

0.4.0 (2013-06-27)

  • splitting rospy dependency into tf2_py so tf2 is pure c++ library.
  • 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
  • fixing return by value for tranform method without preallocatoin
  • 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
  • Added link against catkin_LIBRARIES for tf2_ros lib, also CMakeLists.txt clean up

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
  • Merge pull request #2 from KaijenHsiao/groovy-devel added setup.py and catkin_python_setup() to tf2_ros
  • added setup.py and catkin_python_setup() to tf2_ros
  • fixing cmake target collisions
  • fixing catkin message dependencies
  • removing packages with missing deps
  • catkin fixes
  • catkinizing geometry-experimental
  • catkinizing tf2_ros
  • catching None result in buffer client before it becomes an AttributeError, raising tf2.TransformException instead
  • oneiric linker fixes, bump version to 0.2.3
  • fix deprecated use of Header
  • merged faust's changes 864 and 865 into non_optimized branch: BufferCore instead of Buffer in TransformListener, and added a constructor that takes a NodeHandle.
  • add buffer server binary
  • fix compilation on 32bit
  • add missing file
  • build buffer server
  • TransformListener only needs a BufferCore
  • Add TransformListener constructor that takes a NodeHandle so you can specify a callback queue to use
  • Add option to use a callback queue in the message filter
  • move the message filter to tf2_ros
  • add missing std_msgs dependency
  • missed 2 lines in last commit
  • removing auto clearing from listener for it's unexpected from a library
  • static transform tested and working
  • subscriptions to tf_static unshelved
  • static transform publisher executable running
  • latching static transform publisher
  • cleaning out old commented code
  • Only query rospy.Time.now() when the timeout is greater than 0
  • debug comments removed
  • move to tf2_ros completed. tests pass again
  • merge tf2_cpp and tf2_py into tf2_ros

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
pico_driver
handrail_detect
choreographer
framestore
msg_conversions
astrobee_gazebo
interactive_marker_teleop
audibot_gazebo
cob_collision_velocity_filter
cob_hardware_emulation
cob_collision_monitor
cob_grasp_generation
cob_lookat_action
cob_obstacle_distance_moveit
cob_bringup
cob_gazebo_worlds
points_preprocessor
cras_laser_geometry
cras_cpp_common
cras_py_common
tf_static_publisher
create_driver
depthai_bridge
ensenso_camera
fetch_depth_layer
aruco_detect
fiducial_slam
stag_detect
find_object_2d
fkie_message_filters
fuse_models
fuse_publishers
gazebo_plugins
tf
geometry2
test_tf2
tf2_geometry_msgs
tf2_kdl
tf2_sensor_msgs
tf2_tools
turtle_tf2
graceful_controller_ros
hector_sensors_description
ifm3d_ros_msgs
depth_image_proc
image_rotate
imu_transformer
imu_filter_madgwick
innopolis_vtol_dynamics
interactive_markers
jsk_data
jsk_pcl_ros
jsk_pcl_ros_utils
jsk_recognition_utils
roseus
khi_rs030n_moveit_config
kvh_geo_fog_3d_driver
hri
mavros
test_mavros
mcl_3dl
microstrain_inertial_driver
move_base_swp
move_basic
pilz_industrial_motion_planner
moveit_ros_move_group
moveit_ros_occupancy_map_monitor
moveit_ros_perception
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_robot_interaction
moveit_ros_warehouse
moveit_resources_dual_panda_moveit_config
moveit_resources_fanuc_moveit_config
moveit_resources_panda_moveit_config
moveit_visual_tools
mpc_local_planner
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
naoqi_driver
amcl
base_local_planner
carrot_planner
clear_costmap_recovery
costmap_2d
dwa_local_planner
fake_localization
global_planner
move_base
nav_core
navfn
rotate_recovery
nav2d_operator
assisted_teleop
pose_base_controller
pose_follower
sbpl_recovery
twist_recovery
neo_local_planner
costmap_cspace
map_organizer
neonavigation_launch
planner_cspace
safety_limiter
track_odometry
trajectory_tracker
nerian_stereo
ov_msckf
outsight_alb_driver
panda_moveit_config
pcl_ros
pilz_robot_programming
prbt_hardware_support
pincher_arm_moveit_config
plotjuggler_ros
point_cloud_color
pointcloud_to_laserscan
pr2_bringup
pr2_gazebo
qb_chain_controllers
rc_hand_eye_calibration_client
rc_silhouettematch_client
rgbd_launch
robot_body_filter
robot_calibration
robot_localization
nav_2d_utils
nav_core2
robot_state_publisher
rosbag_fancy
rqt_tf_tree
rtabmap_slam
rviz
rviz_satellite
rviz_visual_tools
sbg_driver
sciurus17_vision
septentrio_gnss_driver
slam_toolbox
spatio_temporal_voxel_layer
teb_local_planner
tf2_client
tf2_server
tf2_web_republisher
ur10_moveit_config
ur10e_moveit_config
ur16e_moveit_config
ur20_moveit_config
ur30_moveit_config
ur3_moveit_config
ur3e_moveit_config
ur5_moveit_config
ur5e_moveit_config
velodyne_pointcloud
vrpn_client_ros
ypspur_ros
camera_aravis
aruco_opencv
bosch_locator_bridge
adi_3dtof_image_stitching
astra_ros
atf_metrics
atf_test
beluga_ros
magnetometer_compass
ergodic_exploration
etsi_its_rviz_plugins
gmcl
message_tf_frame_transformer
mia_hand_moveit_config
point_cloud2_filters
pyhri
sick_scan_xd
xsens_mti_driver

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_ros 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

This package contains the ROS bindings for the tf2 library, for both Python and C++.

Additional Links

Maintainers

  • Tully Foote

Authors

  • Eitan Marder-Eppstein
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_ros

0.5.15 (2017-01-24)

  • tf2_ros: add option to unregister TransformListener (#201)
  • Contributors: Hans-Joachim Krauch

0.5.14 (2017-01-16)

  • Drop roslib.load_manifest (#191)
  • Adds ability to load TF from the ROS parameter server.
  • Code linting & reorganization
  • Fix indexing beyond end of array
  • added a static transform broadcaster in python
  • lots more documentation
  • remove BufferCore doc, add BufferClient/BufferServer doc for C++, add Buffer/BufferInterface Python documentation
  • Better overview for Python
  • Contributors: Eric Wieser, Felix Duvallet, Jackie Kay, Mikael Arguedas, Mike Purvis

0.5.13 (2016-03-04)

  • fix documentation warnings
  • Adding tests to package
  • Contributors: Laurent GEORGE, Vincent Rabaud

0.5.12 (2015-08-05)

  • remove annoying gcc warning This is because the roslog macro cannot have two arguments that are formatting strings: we need to concatenate them first.
  • break canTransform loop only for non-tiny negative time deltas (At least) with Python 2 ros.Time.now() is not necessarily monotonic and one can experience negative time deltas (usually well below 1s) on real hardware under full load. This check was originally introduced to allow for backjumps with rosbag replays, and only there it makes sense. So we'll add a small duration threshold to ignore backjumps due to non-monotonic clocks.
  • Contributors: Vincent Rabaud, v4hn

0.5.11 (2015-04-22)

  • do not short circuit waitForTransform timeout when running inside pytf. Fixes #102 roscpp is not initialized inside pytf which means that ros::ok is not valid. This was causing the timer to abort immediately. This breaks support for pytf with respect to early breaking out of a loop re #26. This is conceptually broken in pytf, and is fixed in tf2_ros python implementation. If you want this behavior I recommend switching to the tf2 python bindings.
  • inject timeout information into error string for canTransform with timeout
  • Contributors: Tully Foote

0.5.10 (2015-04-21)

  • switch to use a shared lock with upgrade instead of only a unique lock. For #91
  • Update message_filter.h
  • filters: fix unsupported old messages with frame_id starting with '/'
  • Enabled tf2 documentation
  • make sure the messages get processed before testing the effects. Fixes #88
  • allowing to use message filters with PCL types
  • Contributors: Brice Rebsamen, Jackie Kay, Tully Foote, Vincent Rabaud, jmtatsch

0.5.9 (2015-03-25)

  • changed queue_size in Python transform boradcaster to match that in c++
  • Contributors: mrath

0.5.8 (2015-03-17)

  • fix deadlock #79
  • break out of loop if ros is shutdown. Fixes #26
  • remove useless Makefile files
  • Fix static broadcaster with rpy args
  • Contributors: Paul Bovbel, Tully Foote, Vincent Rabaud

0.5.7 (2014-12-23)

  • Added 6 param transform again Yes, using Euler angles is a bad habit. But it is much more convenient if you just need a rotation by 90° somewhere to set it up in Euler angles. So I added the option to supply only the 3 angles.
  • Remove tf2_py dependency for Android
  • Contributors: Achim Königs, Gary Servin

0.5.6 (2014-09-18)

  • support if canTransform(...): in python #57
  • Support clearing the cache when time jumps backwards #68
  • Contributors: Tully Foote

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

  • surpressing autostart on the server objects to not incur warnings
  • switch to boost signals2 following ros/ros_comm#267, blocking ros/geometry#23
  • fix compilation with gcc 4.9
  • make can_transform correctly wait
  • explicitly set the publish queue size for rospy
  • Contributors: Tully Foote, Vincent Rabaud, v4hn

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

  • adding const to MessageEvent data
  • Contributors: Tully Foote

0.5.0 (2014-02-14)

  • TF2 uses message events to get connection header information
  • Contributors: Kevin Watts

0.4.10 (2013-12-26)

  • adding support for static transforms in python listener. Fixes #46
  • Contributors: Tully Foote

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35 in the python implementation
  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

  • Revert "cherrypicking groovy patch for #10 into hydro" This reverts commit 296d4916706d64f719b8c1592ab60d3686f994e1. It was not starting up correctly.
  • fixing usage string to show quaternions and using quaternions in the test app
  • cherrypicking groovy patch for #10 into hydro

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.
  • reviving unrun unittest and adding CATKIN_ENABLE_TESTING guards

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

  • adding queue accessors lost in the new API
  • exposing dedicated thread logic in BufferCore and checking in Buffer
  • adding methods to enable backwards compatability for passing through to tf::Transformer

0.4.0 (2013-06-27)

  • splitting rospy dependency into tf2_py so tf2 is pure c++ library.
  • 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
  • fixing return by value for tranform method without preallocatoin
  • 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
  • Added link against catkin_LIBRARIES for tf2_ros lib, also CMakeLists.txt clean up

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
  • Merge pull request #2 from KaijenHsiao/groovy-devel added setup.py and catkin_python_setup() to tf2_ros
  • added setup.py and catkin_python_setup() to tf2_ros
  • fixing cmake target collisions
  • fixing catkin message dependencies
  • removing packages with missing deps
  • catkin fixes
  • catkinizing geometry-experimental
  • catkinizing tf2_ros
  • catching None result in buffer client before it becomes an AttributeError, raising tf2.TransformException instead
  • oneiric linker fixes, bump version to 0.2.3
  • fix deprecated use of Header
  • merged faust's changes 864 and 865 into non_optimized branch: BufferCore instead of Buffer in TransformListener, and added a constructor that takes a NodeHandle.
  • add buffer server binary
  • fix compilation on 32bit
  • add missing file
  • build buffer server
  • TransformListener only needs a BufferCore
  • Add TransformListener constructor that takes a NodeHandle so you can specify a callback queue to use
  • Add option to use a callback queue in the message filter
  • move the message filter to tf2_ros
  • add missing std_msgs dependency
  • missed 2 lines in last commit
  • removing auto clearing from listener for it's unexpected from a library
  • static transform tested and working
  • subscriptions to tf_static unshelved
  • static transform publisher executable running
  • latching static transform publisher
  • cleaning out old commented code
  • Only query rospy.Time.now() when the timeout is greater than 0
  • debug comments removed
  • move to tf2_ros completed. tests pass again
  • merge tf2_cpp and tf2_py into tf2_ros

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_ros 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

This package contains the ROS bindings for the tf2 library, for both Python and C++.

Additional Links

Maintainers

  • Tully Foote

Authors

  • Eitan Marder-Eppstein
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_ros

0.5.15 (2017-01-24)

  • tf2_ros: add option to unregister TransformListener (#201)
  • Contributors: Hans-Joachim Krauch

0.5.14 (2017-01-16)

  • Drop roslib.load_manifest (#191)
  • Adds ability to load TF from the ROS parameter server.
  • Code linting & reorganization
  • Fix indexing beyond end of array
  • added a static transform broadcaster in python
  • lots more documentation
  • remove BufferCore doc, add BufferClient/BufferServer doc for C++, add Buffer/BufferInterface Python documentation
  • Better overview for Python
  • Contributors: Eric Wieser, Felix Duvallet, Jackie Kay, Mikael Arguedas, Mike Purvis

0.5.13 (2016-03-04)

  • fix documentation warnings
  • Adding tests to package
  • Contributors: Laurent GEORGE, Vincent Rabaud

0.5.12 (2015-08-05)

  • remove annoying gcc warning This is because the roslog macro cannot have two arguments that are formatting strings: we need to concatenate them first.
  • break canTransform loop only for non-tiny negative time deltas (At least) with Python 2 ros.Time.now() is not necessarily monotonic and one can experience negative time deltas (usually well below 1s) on real hardware under full load. This check was originally introduced to allow for backjumps with rosbag replays, and only there it makes sense. So we'll add a small duration threshold to ignore backjumps due to non-monotonic clocks.
  • Contributors: Vincent Rabaud, v4hn

0.5.11 (2015-04-22)

  • do not short circuit waitForTransform timeout when running inside pytf. Fixes #102 roscpp is not initialized inside pytf which means that ros::ok is not valid. This was causing the timer to abort immediately. This breaks support for pytf with respect to early breaking out of a loop re #26. This is conceptually broken in pytf, and is fixed in tf2_ros python implementation. If you want this behavior I recommend switching to the tf2 python bindings.
  • inject timeout information into error string for canTransform with timeout
  • Contributors: Tully Foote

0.5.10 (2015-04-21)

  • switch to use a shared lock with upgrade instead of only a unique lock. For #91
  • Update message_filter.h
  • filters: fix unsupported old messages with frame_id starting with '/'
  • Enabled tf2 documentation
  • make sure the messages get processed before testing the effects. Fixes #88
  • allowing to use message filters with PCL types
  • Contributors: Brice Rebsamen, Jackie Kay, Tully Foote, Vincent Rabaud, jmtatsch

0.5.9 (2015-03-25)

  • changed queue_size in Python transform boradcaster to match that in c++
  • Contributors: mrath

0.5.8 (2015-03-17)

  • fix deadlock #79
  • break out of loop if ros is shutdown. Fixes #26
  • remove useless Makefile files
  • Fix static broadcaster with rpy args
  • Contributors: Paul Bovbel, Tully Foote, Vincent Rabaud

0.5.7 (2014-12-23)

  • Added 6 param transform again Yes, using Euler angles is a bad habit. But it is much more convenient if you just need a rotation by 90° somewhere to set it up in Euler angles. So I added the option to supply only the 3 angles.
  • Remove tf2_py dependency for Android
  • Contributors: Achim Königs, Gary Servin

0.5.6 (2014-09-18)

  • support if canTransform(...): in python #57
  • Support clearing the cache when time jumps backwards #68
  • Contributors: Tully Foote

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

  • surpressing autostart on the server objects to not incur warnings
  • switch to boost signals2 following ros/ros_comm#267, blocking ros/geometry#23
  • fix compilation with gcc 4.9
  • make can_transform correctly wait
  • explicitly set the publish queue size for rospy
  • Contributors: Tully Foote, Vincent Rabaud, v4hn

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

  • adding const to MessageEvent data
  • Contributors: Tully Foote

0.5.0 (2014-02-14)

  • TF2 uses message events to get connection header information
  • Contributors: Kevin Watts

0.4.10 (2013-12-26)

  • adding support for static transforms in python listener. Fixes #46
  • Contributors: Tully Foote

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35 in the python implementation
  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

  • Revert "cherrypicking groovy patch for #10 into hydro" This reverts commit 296d4916706d64f719b8c1592ab60d3686f994e1. It was not starting up correctly.
  • fixing usage string to show quaternions and using quaternions in the test app
  • cherrypicking groovy patch for #10 into hydro

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.
  • reviving unrun unittest and adding CATKIN_ENABLE_TESTING guards

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

  • adding queue accessors lost in the new API
  • exposing dedicated thread logic in BufferCore and checking in Buffer
  • adding methods to enable backwards compatability for passing through to tf::Transformer

0.4.0 (2013-06-27)

  • splitting rospy dependency into tf2_py so tf2 is pure c++ library.
  • 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
  • fixing return by value for tranform method without preallocatoin
  • 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
  • Added link against catkin_LIBRARIES for tf2_ros lib, also CMakeLists.txt clean up

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
  • Merge pull request #2 from KaijenHsiao/groovy-devel added setup.py and catkin_python_setup() to tf2_ros
  • added setup.py and catkin_python_setup() to tf2_ros
  • fixing cmake target collisions
  • fixing catkin message dependencies
  • removing packages with missing deps
  • catkin fixes
  • catkinizing geometry-experimental
  • catkinizing tf2_ros
  • catching None result in buffer client before it becomes an AttributeError, raising tf2.TransformException instead
  • oneiric linker fixes, bump version to 0.2.3
  • fix deprecated use of Header
  • merged faust's changes 864 and 865 into non_optimized branch: BufferCore instead of Buffer in TransformListener, and added a constructor that takes a NodeHandle.
  • add buffer server binary
  • fix compilation on 32bit
  • add missing file
  • build buffer server
  • TransformListener only needs a BufferCore
  • Add TransformListener constructor that takes a NodeHandle so you can specify a callback queue to use
  • Add option to use a callback queue in the message filter
  • move the message filter to tf2_ros
  • add missing std_msgs dependency
  • missed 2 lines in last commit
  • removing auto clearing from listener for it's unexpected from a library
  • static transform tested and working
  • subscriptions to tf_static unshelved
  • static transform publisher executable running
  • latching static transform publisher
  • cleaning out old commented code
  • Only query rospy.Time.now() when the timeout is greater than 0
  • debug comments removed
  • move to tf2_ros completed. tests pass again
  • merge tf2_cpp and tf2_py into tf2_ros

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_ros 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

This package contains the ROS bindings for the tf2 library, for both Python and C++.

Additional Links

Maintainers

  • Tully Foote

Authors

  • Eitan Marder-Eppstein
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_ros

0.10.1 (2018-12-06)

  • Allow static_transform_publisher to be run with ros arguments ros2#80 (#82)
  • Contributors: Lucas Walter

0.10.0 (2018-11-22)

  • Port tf2 ros message filter with ros2 tf2 and message filters (#81)
    • Port tf2 message filter to ros2

    - remove APIs to node callback queue due to no callback queue in ros2 now - Change failure callback register with failure prompting due to no corresponding boost signal2 in C++11 and later

    • Fix expected transform count in case of time tolerance
    • Upgrade all message counts to 64 bitThis should resolve C4267 warnings about downgrading a size_t.
  • Export tf2 dependency from tf2_ros (#72)
  • rclcpp time jump callback signature (#69)
  • Use ros2 time (#67)
  • Contributors: Carl Delsey, Ethan Gao, Shane Loretz

0.5.15 (2017-01-24)

  • tf2_ros: add option to unregister TransformListener (#201)
  • Contributors: Hans-Joachim Krauch

0.5.14 (2017-01-16)

  • Drop roslib.load_manifest (#191)
  • Adds ability to load TF from the ROS parameter server.
  • Code linting & reorganization
  • Fix indexing beyond end of array
  • added a static transform broadcaster in python
  • lots more documentation
  • remove BufferCore doc, add BufferClient/BufferServer doc for C++, add Buffer/BufferInterface Python documentation
  • Better overview for Python
  • Contributors: Eric Wieser, Felix Duvallet, Jackie Kay, Mikael Arguedas, Mike Purvis

0.5.13 (2016-03-04)

  • fix documentation warnings
  • Adding tests to package
  • Contributors: Laurent GEORGE, Vincent Rabaud

0.5.12 (2015-08-05)

  • remove annoying gcc warning This is because the roslog macro cannot have two arguments that are formatting strings: we need to concatenate them first.
  • break canTransform loop only for non-tiny negative time deltas (At least) with Python 2 ros.Time.now() is not necessarily monotonic and one can experience negative time deltas (usually well below 1s) on real hardware under full load. This check was originally introduced to allow for backjumps with rosbag replays, and only there it makes sense. So we'll add a small duration threshold to ignore backjumps due to non-monotonic clocks.
  • Contributors: Vincent Rabaud, v4hn

0.5.11 (2015-04-22)

  • do not short circuit waitForTransform timeout when running inside pytf. Fixes #102 roscpp is not initialized inside pytf which means that ros::ok is not valid. This was causing the timer to abort immediately. This breaks support for pytf with respect to early breaking out of a loop re #26. This is conceptually broken in pytf, and is fixed in tf2_ros python implementation. If you want this behavior I recommend switching to the tf2 python bindings.
  • inject timeout information into error string for canTransform with timeout
  • Contributors: Tully Foote

0.5.10 (2015-04-21)

  • switch to use a shared lock with upgrade instead of only a unique lock. For #91
  • Update message_filter.h
  • filters: fix unsupported old messages with frame_id starting with '/'
  • Enabled tf2 documentation
  • make sure the messages get processed before testing the effects. Fixes #88
  • allowing to use message filters with PCL types
  • Contributors: Brice Rebsamen, Jackie Kay, Tully Foote, Vincent Rabaud, jmtatsch

0.5.9 (2015-03-25)

  • changed queue_size in Python transform boradcaster to match that in c++
  • Contributors: mrath

0.5.8 (2015-03-17)

  • fix deadlock #79
  • break out of loop if ros is shutdown. Fixes #26
  • remove useless Makefile files
  • Fix static broadcaster with rpy args
  • Contributors: Paul Bovbel, Tully Foote, Vincent Rabaud

0.5.7 (2014-12-23)

  • Added 6 param transform again Yes, using Euler angles is a bad habit. But it is much more convenient if you just need a rotation by 90° somewhere to set it up in Euler angles. So I added the option to supply only the 3 angles.
  • Remove tf2_py dependency for Android
  • Contributors: Achim Königs, Gary Servin

0.5.6 (2014-09-18)

  • support if canTransform(...): in python #57
  • Support clearing the cache when time jumps backwards #68
  • Contributors: Tully Foote

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

  • surpressing autostart on the server objects to not incur warnings
  • switch to boost signals2 following ros/ros_comm#267, blocking ros/geometry#23
  • fix compilation with gcc 4.9
  • make can_transform correctly wait
  • explicitly set the publish queue size for rospy
  • Contributors: Tully Foote, Vincent Rabaud, v4hn

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

  • adding const to MessageEvent data
  • Contributors: Tully Foote

0.5.0 (2014-02-14)

  • TF2 uses message events to get connection header information
  • Contributors: Kevin Watts

0.4.10 (2013-12-26)

  • adding support for static transforms in python listener. Fixes #46
  • Contributors: Tully Foote

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35 in the python implementation
  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

  • Revert "cherrypicking groovy patch for #10 into hydro" This reverts commit 296d4916706d64f719b8c1592ab60d3686f994e1. It was not starting up correctly.
  • fixing usage string to show quaternions and using quaternions in the test app
  • cherrypicking groovy patch for #10 into hydro

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.
  • reviving unrun unittest and adding CATKIN_ENABLE_TESTING guards

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

  • adding queue accessors lost in the new API
  • exposing dedicated thread logic in BufferCore and checking in Buffer
  • adding methods to enable backwards compatability for passing through to tf::Transformer

0.4.0 (2013-06-27)

  • splitting rospy dependency into tf2_py so tf2 is pure c++ library.
  • 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
  • fixing return by value for tranform method without preallocatoin
  • 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
  • Added link against catkin_LIBRARIES for tf2_ros lib, also CMakeLists.txt clean up

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
  • Merge pull request #2 from KaijenHsiao/groovy-devel added setup.py and catkin_python_setup() to tf2_ros
  • added setup.py and catkin_python_setup() to tf2_ros
  • fixing cmake target collisions
  • fixing catkin message dependencies
  • removing packages with missing deps
  • catkin fixes
  • catkinizing geometry-experimental
  • catkinizing tf2_ros
  • catching None result in buffer client before it becomes an AttributeError, raising tf2.TransformException instead
  • oneiric linker fixes, bump version to 0.2.3
  • fix deprecated use of Header
  • merged faust's changes 864 and 865 into non_optimized branch: BufferCore instead of Buffer in TransformListener, and added a constructor that takes a NodeHandle.
  • add buffer server binary
  • fix compilation on 32bit
  • add missing file
  • build buffer server
  • TransformListener only needs a BufferCore
  • Add TransformListener constructor that takes a NodeHandle so you can specify a callback queue to use
  • Add option to use a callback queue in the message filter
  • move the message filter to tf2_ros
  • add missing std_msgs dependency
  • missed 2 lines in last commit
  • removing auto clearing from listener for it's unexpected from a library
  • static transform tested and working
  • subscriptions to tf_static unshelved
  • static transform publisher executable running
  • latching static transform publisher
  • cleaning out old commented code
  • Only query rospy.Time.now() when the timeout is greater than 0
  • debug comments removed
  • move to tf2_ros completed. tests pass again
  • merge tf2_cpp and tf2_py into tf2_ros

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_ros 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

This package contains the ROS bindings for the tf2 library, for both Python and C++.

Additional Links

Maintainers

  • Chris Lalancette
  • Alejandro Hernandez Cordero

Authors

  • Eitan Marder-Eppstein
  • Wim Meeussen
  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_ros

0.12.6 (2020-12-04)

  • Add missing visibility header include (#246) (#352)
  • Update maintainers of the ros2/geometry2 fork. (#328) (#331)
  • Moved unique_lock of messages_mutex_ to guarantee pointer (#279) (#282)
  • Porting more tests to tf2_ros (#202) (#225)
  • message filter fix (#216) (#221)
  • Contributors: Alejandro Hernández Cordero, Jacob Perron, Martin Ganeff

0.12.5 (2020-01-17)

  • Adding support for view_frame (#192)
  • Contributors: Alejandro Hernández Cordero

0.12.4 (2019-11-19)

0.12.3 (2019-11-18)

  • Remove unused setup.py files (#190)
  • Print out the name of the signalFailure reason instead of just its enum value (#186)
  • Contributors: Emerson Knapp, Vasilii Artemev

0.12.2 (2019-11-18)

  • Fix tf2_monitor subscriptions QoS settings. (#196)
  • Contributors: Michel Hidalgo

0.12.1 (2019-10-23)

  • Add convenience methods using rclcpp time types (#180)
  • Don't assume quaternions init to all zeros
  • Make BufferClient destructor virtual
  • Contributors: Josh Langsfeld, Shane Loretz, Thomas Moulard

0.12.0 (2019-09-26)

  • Simulate work in the acceptedCallback.
  • Make Windows Debug to run the correct python executable.
  • Make BufferInterface destructor virtual.
  • Remove unnecessary and blacklisted actionlib_msgs dependency.
  • More test fixes for tf2_ros python.
  • class Clock is in clock not timer.
  • tf2_ros is not built for Python (#99)
  • Migrate buffer action server to ROS 2
  • Add conversion functions for durations
  • Make /tf_static use transient_local durability (#160)
  • Force explicit --ros-args in NodeOptions::arguments(). (#162)
  • Use of -r/--remap flags where appropriate. (#159)
  • Include tf2 headers in message_filter.h (#157)
  • Use ament_target_dependencies to ensure correct dependency order (#156)
  • Make sure that TransformListener's node gets a unique name (#129)
  • Fix compiler warning (#148)
  • Do not timeout when waiting for transforms (#146)
  • Fix race between timeout and transform ready callback (#143)
  • Fix high CPU - Use executor to spin and stop node in tf_listener thread (#119)
  • Catch polymorphic exceptions by reference (#138)
  • Add missing export build dependencies (#135)
  • avoid delete-non-virtual-dtor warning (#134)
  • Template tf2_ros::MessageFilter on the buffer type
  • Add pure virtual interface tf2_ros::AsyncBufferInterface
  • Add pure virtual interface tf2_ros::CreateTimerInterface
  • Allow tf2_monitor to be run with ROS command line args (#122)
  • Drop misleading ROS_* logging macros from tf2_monitor (#123)
  • Fix the MessageFilter init order. (#120)
  • Contributors: Chris Lalancette, Dan Rose, Jacob Perron, Karsten Knese, Michel Hidalgo, Scott K Logan, Shane Loretz, Vinnam Kim, bpwilcox, evshary

0.11.3 (2019-05-24)

  • stop spinning TransformListener thread node in destructor (#114)
  • Store dedicated transform listener thread as a std::unique_ptr (#111)
  • enable pedantic for tf2_ros (#115)
  • Contributors: Hunter L. Allen, Karsten Knese, bpwilcox

0.11.2 (2019-05-20)

  • Remove stray semicolon which causes compiler error when using -Werror=pedantic (#112)
  • Contributors: Michael Jeronimo

0.11.1 (2019-05-09)

  • use node interfaces throughout tf2_ros (#108)
  • changes to avoid deprecated API's (#107)
  • Fix call to create_publisher after API changed (#105)
  • Use node interfaces for static transform broadcaster (#104)
  • Contributors: Emerson Knapp, Karsten Knese, William Woodall

0.11.0 (2019-04-14)

  • Updated to use node inteface pointers in the MessageFilter class. (#96)
  • Updated message_filter.h. (#91)
  • Contributors: Michael Jeronimo, Sagnik Basu

0.10.1 (2018-12-06)

  • Allow static_transform_publisher to be run with ros arguments ros2#80 (#82)
  • Contributors: Lucas Walter

0.10.0 (2018-11-22)

  • Port tf2 ros message filter with ros2 tf2 and message filters (#81)
    • Port tf2 message filter to ros2

    - remove APIs to node callback queue due to no callback queue in ros2 now - Change failure callback register with failure prompting due to no corresponding boost signal2 in C++11 and later

    • Fix expected transform count in case of time tolerance
    • Upgrade all message counts to 64 bitThis should resolve C4267 warnings about downgrading a size_t.
  • Export tf2 dependency from tf2_ros (#72)
  • rclcpp time jump callback signature (#69)
  • Use ros2 time (#67)
  • Contributors: Carl Delsey, Ethan Gao, Shane Loretz

0.5.15 (2017-01-24)

  • tf2_ros: add option to unregister TransformListener (#201)
  • Contributors: Hans-Joachim Krauch

0.5.14 (2017-01-16)

  • Drop roslib.load_manifest (#191)
  • Adds ability to load TF from the ROS parameter server.
  • Code linting & reorganization
  • Fix indexing beyond end of array
  • added a static transform broadcaster in python
  • lots more documentation
  • remove BufferCore doc, add BufferClient/BufferServer doc for C++, add Buffer/BufferInterface Python documentation
  • Better overview for Python
  • Contributors: Eric Wieser, Felix Duvallet, Jackie Kay, Mikael Arguedas, Mike Purvis

0.5.13 (2016-03-04)

  • fix documentation warnings
  • Adding tests to package
  • Contributors: Laurent GEORGE, Vincent Rabaud

0.5.12 (2015-08-05)

  • remove annoying gcc warning This is because the roslog macro cannot have two arguments that are formatting strings: we need to concatenate them first.
  • break canTransform loop only for non-tiny negative time deltas (At least) with Python 2 ros.Time.now() is not necessarily monotonic and one can experience negative time deltas (usually well below 1s) on real hardware under full load. This check was originally introduced to allow for backjumps with rosbag replays, and only there it makes sense. So we'll add a small duration threshold to ignore backjumps due to non-monotonic clocks.
  • Contributors: Vincent Rabaud, v4hn

0.5.11 (2015-04-22)

  • do not short circuit waitForTransform timeout when running inside pytf. Fixes #102 roscpp is not initialized inside pytf which means that ros::ok is not valid. This was causing the timer to abort immediately. This breaks support for pytf with respect to early breaking out of a loop re #26. This is conceptually broken in pytf, and is fixed in tf2_ros python implementation. If you want this behavior I recommend switching to the tf2 python bindings.
  • inject timeout information into error string for canTransform with timeout
  • Contributors: Tully Foote

0.5.10 (2015-04-21)

  • switch to use a shared lock with upgrade instead of only a unique lock. For #91
  • Update message_filter.h
  • filters: fix unsupported old messages with frame_id starting with '/'
  • Enabled tf2 documentation
  • make sure the messages get processed before testing the effects. Fixes #88
  • allowing to use message filters with PCL types
  • Contributors: Brice Rebsamen, Jackie Kay, Tully Foote, Vincent Rabaud, jmtatsch

0.5.9 (2015-03-25)

  • changed queue_size in Python transform boradcaster to match that in c++
  • Contributors: mrath

0.5.8 (2015-03-17)

  • fix deadlock #79
  • break out of loop if ros is shutdown. Fixes #26
  • remove useless Makefile files
  • Fix static broadcaster with rpy args
  • Contributors: Paul Bovbel, Tully Foote, Vincent Rabaud

0.5.7 (2014-12-23)

  • Added 6 param transform again Yes, using Euler angles is a bad habit. But it is much more convenient if you just need a rotation by 90° somewhere to set it up in Euler angles. So I added the option to supply only the 3 angles.
  • Remove tf2_py dependency for Android
  • Contributors: Achim Königs, Gary Servin

0.5.6 (2014-09-18)

  • support if canTransform(...): in python #57
  • Support clearing the cache when time jumps backwards #68
  • Contributors: Tully Foote

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

  • surpressing autostart on the server objects to not incur warnings
  • switch to boost signals2 following ros/ros_comm#267, blocking ros/geometry#23
  • fix compilation with gcc 4.9
  • make can_transform correctly wait
  • explicitly set the publish queue size for rospy
  • Contributors: Tully Foote, Vincent Rabaud, v4hn

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

  • adding const to MessageEvent data
  • Contributors: Tully Foote

0.5.0 (2014-02-14)

  • TF2 uses message events to get connection header information
  • Contributors: Kevin Watts

0.4.10 (2013-12-26)

  • adding support for static transforms in python listener. Fixes #46
  • Contributors: Tully Foote

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35 in the python implementation
  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35

0.4.6 (2013-08-28)

  • patching python implementation for #24 as well
  • Stop waiting if time jumps backwards. fixes #24
  • patch to work around uninitiaized time. #30
  • Removing unnecessary CATKIN_DEPENDS #18

0.4.5 (2013-07-11)

  • Revert "cherrypicking groovy patch for #10 into hydro" This reverts commit 296d4916706d64f719b8c1592ab60d3686f994e1. It was not starting up correctly.
  • fixing usage string to show quaternions and using quaternions in the test app
  • cherrypicking groovy patch for #10 into hydro

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.
  • reviving unrun unittest and adding CATKIN_ENABLE_TESTING guards

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

  • adding queue accessors lost in the new API
  • exposing dedicated thread logic in BufferCore and checking in Buffer
  • adding methods to enable backwards compatability for passing through to tf::Transformer

0.4.0 (2013-06-27)

  • splitting rospy dependency into tf2_py so tf2 is pure c++ library.
  • 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
  • fixing return by value for tranform method without preallocatoin
  • 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
  • Added link against catkin_LIBRARIES for tf2_ros lib, also CMakeLists.txt clean up

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
  • Merge pull request #2 from KaijenHsiao/groovy-devel added setup.py and catkin_python_setup() to tf2_ros
  • added setup.py and catkin_python_setup() to tf2_ros
  • fixing cmake target collisions
  • fixing catkin message dependencies
  • removing packages with missing deps
  • catkin fixes
  • catkinizing geometry-experimental
  • catkinizing tf2_ros
  • catching None result in buffer client before it becomes an AttributeError, raising tf2.TransformException instead
  • oneiric linker fixes, bump version to 0.2.3
  • fix deprecated use of Header
  • merged faust's changes 864 and 865 into non_optimized branch: BufferCore instead of Buffer in TransformListener, and added a constructor that takes a NodeHandle.
  • add buffer server binary
  • fix compilation on 32bit
  • add missing file
  • build buffer server
  • TransformListener only needs a BufferCore
  • Add TransformListener constructor that takes a NodeHandle so you can specify a callback queue to use
  • Add option to use a callback queue in the message filter
  • move the message filter to tf2_ros
  • add missing std_msgs dependency
  • missed 2 lines in last commit
  • removing auto clearing from listener for it's unexpected from a library
  • static transform tested and working
  • subscriptions to tf_static unshelved
  • static transform publisher executable running
  • latching static transform publisher
  • cleaning out old commented code
  • Only query rospy.Time.now() when the timeout is greater than 0
  • debug comments removed
  • move to tf2_ros completed. tests pass again
  • merge tf2_cpp and tf2_py into tf2_ros

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

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_ros 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

This package contains the ROS bindings for the tf2 library, for both Python and C++.

Additional Links

Maintainers

  • Tully Foote

Authors

  • Eitan Marder-Eppstein
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_ros

0.11.6 (2019-12-10)

0.11.5 (2019-09-06)

  • Add missing export build dependencies (#135) (#152)
  • Contributors: Jacob Perron

0.11.4 (2019-07-31)

  • Allow tf2_monitor to be run with ROS command line args (#140)
  • Drop misleading ROS logging macros from tf2_monitor (#139)
  • Reduce CPU usage with an ABI compatible fix (#133)
  • Fix the MessageFilter init order(#137)
  • Contributors: Chris Lalancette, Dan Rose, Scott K Logan

0.11.3 (2019-05-24)

  • stop spinning TransformListener thread node in destructor (#114)
  • Store dedicated transform listener thread as a std::unique_ptr (#111)
  • enable pedantic for tf2_ros (#115)
  • Contributors: Hunter L. Allen, Karsten Knese, bpwilcox

0.11.2 (2019-05-20)

  • Remove stray semicolon which causes compiler error when using -Werror=pedantic (#112)
  • Contributors: Michael Jeronimo

0.11.1 (2019-05-09)

  • use node interfaces throughout tf2_ros (#108)
  • changes to avoid deprecated API's (#107)
  • Fix call to create_publisher after API changed (#105)
  • Use node interfaces for static transform broadcaster (#104)
  • Contributors: Emerson Knapp, Karsten Knese, William Woodall

0.11.0 (2019-04-14)

  • Updated to use node inteface pointers in the MessageFilter class. (#96)
  • Updated message_filter.h. (#91)
  • Contributors: Michael Jeronimo, Sagnik Basu

0.10.1 (2018-12-06)

  • Allow static_transform_publisher to be run with ros arguments ros2#80 (#82)
  • Contributors: Lucas Walter

0.10.0 (2018-11-22)

  • Port tf2 ros message filter with ros2 tf2 and message filters (#81)
    • Port tf2 message filter to ros2

    - remove APIs to node callback queue due to no callback queue in ros2 now - Change failure callback register with failure prompting due to no corresponding boost signal2 in C++11 and later

    • Fix expected transform count in case of time tolerance
    • Upgrade all message counts to 64 bitThis should resolve C4267 warnings about downgrading a size_t.
  • Export tf2 dependency from tf2_ros (#72)
  • rclcpp time jump callback signature (#69)
  • Use ros2 time (#67)
  • Contributors: Carl Delsey, Ethan Gao, Shane Loretz

0.5.15 (2017-01-24)

  • tf2_ros: add option to unregister TransformListener (#201)
  • Contributors: Hans-Joachim Krauch

0.5.14 (2017-01-16)

  • Drop roslib.load_manifest (#191)
  • Adds ability to load TF from the ROS parameter server.
  • Code linting & reorganization
  • Fix indexing beyond end of array
  • added a static transform broadcaster in python
  • lots more documentation
  • remove BufferCore doc, add BufferClient/BufferServer doc for C++, add Buffer/BufferInterface Python documentation
  • Better overview for Python
  • Contributors: Eric Wieser, Felix Duvallet, Jackie Kay, Mikael Arguedas, Mike Purvis

0.5.13 (2016-03-04)

  • fix documentation warnings
  • Adding tests to package
  • Contributors: Laurent GEORGE, Vincent Rabaud

0.5.12 (2015-08-05)

  • remove annoying gcc warning This is because the roslog macro cannot have two arguments that are formatting strings: we need to concatenate them first.
  • break canTransform loop only for non-tiny negative time deltas (At least) with Python 2 ros.Time.now() is not necessarily monotonic and one can experience negative time deltas (usually well below 1s) on real hardware under full load. This check was originally introduced to allow for backjumps with rosbag replays, and only there it makes sense. So we'll add a small duration threshold to ignore backjumps due to non-monotonic clocks.
  • Contributors: Vincent Rabaud, v4hn

0.5.11 (2015-04-22)

  • do not short circuit waitForTransform timeout when running inside pytf. Fixes #102 roscpp is not initialized inside pytf which means that ros::ok is not valid. This was causing the timer to abort immediately. This breaks support for pytf with respect to early breaking out of a loop re #26. This is conceptually broken in pytf, and is fixed in tf2_ros python implementation. If you want this behavior I recommend switching to the tf2 python bindings.
  • inject timeout information into error string for canTransform with timeout
  • Contributors: Tully Foote

0.5.10 (2015-04-21)

  • switch to use a shared lock with upgrade instead of only a unique lock. For #91
  • Update message_filter.h
  • filters: fix unsupported old messages with frame_id starting with '/'
  • Enabled tf2 documentation
  • make sure the messages get processed before testing the effects. Fixes #88
  • allowing to use message filters with PCL types
  • Contributors: Brice Rebsamen, Jackie Kay, Tully Foote, Vincent Rabaud, jmtatsch

0.5.9 (2015-03-25)

  • changed queue_size in Python transform boradcaster to match that in c++
  • Contributors: mrath

0.5.8 (2015-03-17)

  • fix deadlock #79
  • break out of loop if ros is shutdown. Fixes #26
  • remove useless Makefile files
  • Fix static broadcaster with rpy args
  • Contributors: Paul Bovbel, Tully Foote, Vincent Rabaud

0.5.7 (2014-12-23)

  • Added 6 param transform again Yes, using Euler angles is a bad habit. But it is much more convenient if you just need a rotation by 90° somewhere to set it up in Euler angles. So I added the option to supply only the 3 angles.
  • Remove tf2_py dependency for Android
  • Contributors: Achim Königs, Gary Servin

0.5.6 (2014-09-18)

  • support if canTransform(...): in python #57
  • Support clearing the cache when time jumps backwards #68
  • Contributors: Tully Foote

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

  • surpressing autostart on the server objects to not incur warnings
  • switch to boost signals2 following ros/ros_comm#267, blocking ros/geometry#23
  • fix compilation with gcc 4.9
  • make can_transform correctly wait
  • explicitly set the publish queue size for rospy
  • Contributors: Tully Foote, Vincent Rabaud, v4hn

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

  • adding const to MessageEvent data
  • Contributors: Tully Foote

0.5.0 (2014-02-14)

  • TF2 uses message events to get connection header information
  • Contributors: Kevin Watts

0.4.10 (2013-12-26)

  • adding support for static transforms in python listener. Fixes #46
  • Contributors: Tully Foote

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35 in the python implementation
  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

  • Revert "cherrypicking groovy patch for #10 into hydro" This reverts commit 296d4916706d64f719b8c1592ab60d3686f994e1. It was not starting up correctly.
  • fixing usage string to show quaternions and using quaternions in the test app
  • cherrypicking groovy patch for #10 into hydro

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.
  • reviving unrun unittest and adding CATKIN_ENABLE_TESTING guards

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

  • adding queue accessors lost in the new API
  • exposing dedicated thread logic in BufferCore and checking in Buffer
  • adding methods to enable backwards compatability for passing through to tf::Transformer

0.4.0 (2013-06-27)

  • splitting rospy dependency into tf2_py so tf2 is pure c++ library.
  • 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
  • fixing return by value for tranform method without preallocatoin
  • 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
  • Added link against catkin_LIBRARIES for tf2_ros lib, also CMakeLists.txt clean up

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
  • Merge pull request #2 from KaijenHsiao/groovy-devel added setup.py and catkin_python_setup() to tf2_ros
  • added setup.py and catkin_python_setup() to tf2_ros
  • fixing cmake target collisions
  • fixing catkin message dependencies
  • removing packages with missing deps
  • catkin fixes
  • catkinizing geometry-experimental
  • catkinizing tf2_ros
  • catching None result in buffer client before it becomes an AttributeError, raising tf2.TransformException instead
  • oneiric linker fixes, bump version to 0.2.3
  • fix deprecated use of Header
  • merged faust's changes 864 and 865 into non_optimized branch: BufferCore instead of Buffer in TransformListener, and added a constructor that takes a NodeHandle.
  • add buffer server binary
  • fix compilation on 32bit
  • add missing file
  • build buffer server
  • TransformListener only needs a BufferCore
  • Add TransformListener constructor that takes a NodeHandle so you can specify a callback queue to use
  • Add option to use a callback queue in the message filter
  • move the message filter to tf2_ros
  • add missing std_msgs dependency
  • missed 2 lines in last commit
  • removing auto clearing from listener for it's unexpected from a library
  • static transform tested and working
  • subscriptions to tf_static unshelved
  • static transform publisher executable running
  • latching static transform publisher
  • cleaning out old commented code
  • Only query rospy.Time.now() when the timeout is greater than 0
  • debug comments removed
  • move to tf2_ros completed. tests pass again
  • merge tf2_cpp and tf2_py into tf2_ros

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_ros 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

This package contains the C++ ROS bindings for the tf2 library

Additional Links

Maintainers

  • Chris Lalancette
  • Alejandro Hernandez Cordero

Authors

  • Eitan Marder-Eppstein
  • Wim Meeussen
  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_ros

0.17.5 (2022-12-02)

0.17.4 (2022-06-30)

  • [tf2_ros/tf2_monitor] Calculate hz for each tf (#526)
  • Contributors: kminoda

0.17.3 (2022-04-28)

  • Fix tf2_echo does not work with ros-args (#407) (#408) (#410)
  • Contributors: mergify[bot]

0.17.2 (2021-05-10)

0.17.1 (2021-04-06)

0.17.0 (2021-03-19)

  • Guard against access to null node pointer (#393)
  • Allow to reconfigure durability for /tf topic broadcaster/listener (#383)
  • Fix the rcl type used in the time jump. (#391)
  • Fix linter errors (#385)
  • fix accessing freed resources (#386)
  • Allow reconfiguring qos of tf and tf_static topics through parameters (#381)
  • Replace ROS_* logging macros and use RCLCPP_* instead (#380)
  • Contributors: Audrow Nash, Chris Lalancette, Ivan Santiago Paunovic, Jacob Perron, Kazunari Tanaka

0.16.0 (2021-01-25)

  • Improve message filters error messages (#364)
  • Contributors: Ivan Santiago Paunovic

0.15.1 (2020-12-08)

  • Clarify the role of child_frame_id and header.frame_id in the documentation. (#345)
  • Contributors: Vikas Dhiman

0.15.0 (2020-11-02)

  • Remove usage of deprecated rclcpp::Duration constructor (#340)
  • Remove messages_count member from tf2_ros::MessageFilter. (#335)
  • Style fixup in tf2_ros. (#325)
  • Update maintainers of the ros2/geometry2 fork. (#328)
  • Contributors: Chris Lalancette, Ivan Santiago Paunovic

0.14.1 (2020-09-21)

  • Update goal response callback signature (#323)
  • Activate usual compiler warnings and fix errors (#270)
  • Contributors: Ivan Santiago Paunovic, Jacob Perron

0.14.0 (2020-08-14)

  • Fixed memory leak in Buffer::waitForTransform (#281)
  • fix time-reset test with Connext (#306)
  • reenable FrameGraph server (#198)
  • Use the usual style of parameters for static_transform_program (#300)
  • Make static_transform_broadcaster consistent with its command line description (#294)
  • Avoid using invalid std::list iterators (#293)
  • Generate callbacks after updating message_ (#274)
  • Moved unique_lock of messages_mutex_ to guarantee pointer (#279)
  • Fix dependencies in tf2_ros. (#269)
  • Split tf2_ros in tf2_ros and tf2_ros_py (#210)
  • Contributors: Alejandro Hernández Cordero, Chris Lalancette, Dirk Thomas, Hunter L. Allen, Martin Ganeff, Michael Carroll, ymd-stella

0.13.4 (2020-06-03)

  • export targets in addition to include directories / libraries (#271)
  • Add missing virtual destructors (#272)
  • Contributors: Dirk Thomas, Ivan Santiago Paunovic

0.13.3 (2020-05-26)

  • Fixed in Exception constructor tf2_ros (#267)
  • Contributors: Alejandro Hernández Cordero

0.13.2 (2020-05-18)

0.13.1 (2020-05-08)

0.13.0 (2020-04-30)

  • Added doxyfiles and sphinx Makefiles (#257)
  • avoid more deprecations (#255)
  • create_timer takes shared pointers (#251)
  • Improve tf2_echo and tf2_monitor messages while waiting for data (#254)
  • Add missing visibility header include (#246)
  • Fix [-Wrange-loop-construct]{.title-ref} (#245) ` --- stderr: tf2_ros /opt/ros/master/src/ros2/geometry2/tf2_ros/test/test_buffer.cpp:84:21: warning: loop variable 'elem' creates a copy from type 'const std::pair<const unsigned long, std::function<void (const unsigned long &)> >' [-Wrange-loop-construct] for (const auto elem : timer_to_callback_map\_) { ^ /opt/ros/master/src/ros2/geometry2/tf2_ros/test/test_buffer.cpp:84:10: note: use reference type 'const std::pair<const unsigned long, std::function<void (const unsigned long &)> > &' to prevent copying for (const auto elem : timer_to_callback_map\_) { ^~~~~~~~~~~~~~~~~ & 1 warning generated. ---`
  • Remove TODO (#234) The TODO is done; The publisher is using QoS durability setting 'transient local' which is the closest thing to the 'latched' concept in ROS 1. Signed-off-by: Jacob Perron <<jacob@openrobotics.org>>
  • Remove virtual keyword from overridden functions (#214) Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>>
  • message filter fix (#216)
    • Fixed meesage_filter add method
    • removed using builtin_interfaces::msg::Time in tf2_ros
  • Porting more tests to tf2_ros (#202)
    • Added more tests to tf2_ros
    • improving tf2_ros time_reset_test
    • tf2_ros fixed failed test_buffer_client.cpp
    • added some EXPECT to listener unittest
    • reviews
    • Update listener_unittest.cpp
    • fixed tf2_ros time_reset_test
    • tf2_ros removed ROS launch files
    • Added TODO to fix test_buffer_client in CI
    • tf2_ros added feedback
  • Add static transform component (#182) * Create a static transform component for composition Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>> * Suffix node name with randomly generated alpha-numeric string Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>> * Fix windows build Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>> * Switch to much more readable and more performant implementation by \@clalancette Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>>

  • Adding support for view_frame (#192)
    • Adding tf2_tools support for view_frames
    • Changelog
    • tf2_tools 0.12.1 package version
    • tf2_tools common linters
    • tf2_tools changelog Forthcoming
    • tf2_tools log error and destroy client and node when a exception raised
    • tf2_tools 0.12.4 package version
    • tf2_tools revert some changes
    • tf2_tools - reduce changes
    • tf2_tools: finally block and passing the time instead of the node
    • tf2_tools: buffer with less arguments
    • tf2_tools: Fix condition
  • Contributors: Alejandro Hernández Cordero, Dan Rose, Hunter L. Allen, Jacob Perron, Karsten Knese, Shane Loretz, William Woodall

0.12.4 (2019-11-19)

0.12.3 (2019-11-18)

  • Remove unused setup.py files (#190)
  • Print out the name of the signalFailure reason instead of just its enum value (#186)
  • Contributors: Emerson Knapp, Vasilii Artemev

0.12.2 (2019-11-18)

  • Fix tf2_monitor subscriptions QoS settings. (#196)
  • Contributors: Michel Hidalgo

0.12.1 (2019-10-23)

  • Add convenience methods using rclcpp time types (#180)
  • Don't assume quaternions init to all zeros
  • Make BufferClient destructor virtual
  • Contributors: Josh Langsfeld, Shane Loretz, Thomas Moulard

0.12.0 (2019-09-26)

  • Simulate work in the acceptedCallback.
  • Make Windows Debug to run the correct python executable.
  • Make BufferInterface destructor virtual.
  • Remove unnecessary and blacklisted actionlib_msgs dependency.
  • More test fixes for tf2_ros python.
  • class Clock is in clock not timer.
  • tf2_ros is not built for Python (#99)
  • Migrate buffer action server to ROS 2
  • Add conversion functions for durations
  • Make /tf_static use transient_local durability (#160)
  • Force explicit --ros-args in NodeOptions::arguments(). (#162)
  • Use of -r/--remap flags where appropriate. (#159)
  • Include tf2 headers in message_filter.h (#157)
  • Use ament_target_dependencies to ensure correct dependency order (#156)
  • Make sure that TransformListener's node gets a unique name (#129)
  • Fix compiler warning (#148)
  • Do not timeout when waiting for transforms (#146)
  • Fix race between timeout and transform ready callback (#143)
  • Fix high CPU - Use executor to spin and stop node in tf_listener thread (#119)
  • Catch polymorphic exceptions by reference (#138)
  • Add missing export build dependencies (#135)
  • avoid delete-non-virtual-dtor warning (#134)
  • Template tf2_ros::MessageFilter on the buffer type
  • Add pure virtual interface tf2_ros::AsyncBufferInterface
  • Add pure virtual interface tf2_ros::CreateTimerInterface
  • Allow tf2_monitor to be run with ROS command line args (#122)
  • Drop misleading ROS_* logging macros from tf2_monitor (#123)
  • Fix the MessageFilter init order. (#120)
  • Contributors: Chris Lalancette, Dan Rose, Jacob Perron, Karsten Knese, Michel Hidalgo, Scott K Logan, Shane Loretz, Vinnam Kim, bpwilcox, evshary

0.11.3 (2019-05-24)

  • stop spinning TransformListener thread node in destructor (#114)
  • Store dedicated transform listener thread as a std::unique_ptr (#111)
  • enable pedantic for tf2_ros (#115)
  • Contributors: Hunter L. Allen, Karsten Knese, bpwilcox

0.11.2 (2019-05-20)

  • Remove stray semicolon which causes compiler error when using -Werror=pedantic (#112)
  • Contributors: Michael Jeronimo

0.11.1 (2019-05-09)

  • use node interfaces throughout tf2_ros (#108)
  • changes to avoid deprecated API's (#107)
  • Fix call to create_publisher after API changed (#105)
  • Use node interfaces for static transform broadcaster (#104)
  • Contributors: Emerson Knapp, Karsten Knese, William Woodall

0.11.0 (2019-04-14)

  • Updated to use node inteface pointers in the MessageFilter class. (#96)
  • Updated message_filter.h. (#91)
  • Contributors: Michael Jeronimo, Sagnik Basu

0.10.1 (2018-12-06)

  • Allow static_transform_publisher to be run with ros arguments ros2#80 (#82)
  • Contributors: Lucas Walter

0.10.0 (2018-11-22)

  • Port tf2 ros message filter with ros2 tf2 and message filters (#81)
    • Port tf2 message filter to ros2

    - remove APIs to node callback queue due to no callback queue in ros2 now - Change failure callback register with failure prompting due to no corresponding boost signal2 in C++11 and later

    • Fix expected transform count in case of time tolerance
    • Upgrade all message counts to 64 bitThis should resolve C4267 warnings about downgrading a size_t.
  • Export tf2 dependency from tf2_ros (#72)
  • rclcpp time jump callback signature (#69)
  • Use ros2 time (#67)
  • Contributors: Carl Delsey, Ethan Gao, Shane Loretz

0.5.15 (2017-01-24)

  • tf2_ros: add option to unregister TransformListener (#201)
  • Contributors: Hans-Joachim Krauch

0.5.14 (2017-01-16)

  • Drop roslib.load_manifest (#191)
  • Adds ability to load TF from the ROS parameter server.
  • Code linting & reorganization
  • Fix indexing beyond end of array
  • added a static transform broadcaster in python
  • lots more documentation
  • remove BufferCore doc, add BufferClient/BufferServer doc for C++, add Buffer/BufferInterface Python documentation
  • Better overview for Python
  • Contributors: Eric Wieser, Felix Duvallet, Jackie Kay, Mikael Arguedas, Mike Purvis

0.5.13 (2016-03-04)

  • fix documentation warnings
  • Adding tests to package
  • Contributors: Laurent GEORGE, Vincent Rabaud

0.5.12 (2015-08-05)

  • remove annoying gcc warning This is because the roslog macro cannot have two arguments that are formatting strings: we need to concatenate them first.
  • break canTransform loop only for non-tiny negative time deltas (At least) with Python 2 ros.Time.now() is not necessarily monotonic and one can experience negative time deltas (usually well below 1s) on real hardware under full load. This check was originally introduced to allow for backjumps with rosbag replays, and only there it makes sense. So we'll add a small duration threshold to ignore backjumps due to non-monotonic clocks.
  • Contributors: Vincent Rabaud, v4hn

0.5.11 (2015-04-22)

  • do not short circuit waitForTransform timeout when running inside pytf. Fixes #102 roscpp is not initialized inside pytf which means that ros::ok is not valid. This was causing the timer to abort immediately. This breaks support for pytf with respect to early breaking out of a loop re #26. This is conceptually broken in pytf, and is fixed in tf2_ros python implementation. If you want this behavior I recommend switching to the tf2 python bindings.
  • inject timeout information into error string for canTransform with timeout
  • Contributors: Tully Foote

0.5.10 (2015-04-21)

  • switch to use a shared lock with upgrade instead of only a unique lock. For #91
  • Update message_filter.h
  • filters: fix unsupported old messages with frame_id starting with '/'
  • Enabled tf2 documentation
  • make sure the messages get processed before testing the effects. Fixes #88
  • allowing to use message filters with PCL types
  • Contributors: Brice Rebsamen, Jackie Kay, Tully Foote, Vincent Rabaud, jmtatsch

0.5.9 (2015-03-25)

  • changed queue_size in Python transform boradcaster to match that in c++
  • Contributors: mrath

0.5.8 (2015-03-17)

  • fix deadlock #79
  • break out of loop if ros is shutdown. Fixes #26
  • remove useless Makefile files
  • Fix static broadcaster with rpy args
  • Contributors: Paul Bovbel, Tully Foote, Vincent Rabaud

0.5.7 (2014-12-23)

  • Added 6 param transform again Yes, using Euler angles is a bad habit. But it is much more convenient if you just need a rotation by 90° somewhere to set it up in Euler angles. So I added the option to supply only the 3 angles.
  • Remove tf2_py dependency for Android
  • Contributors: Achim Königs, Gary Servin

0.5.6 (2014-09-18)

  • support if canTransform(...): in python #57
  • Support clearing the cache when time jumps backwards #68
  • Contributors: Tully Foote

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

  • surpressing autostart on the server objects to not incur warnings
  • switch to boost signals2 following ros/ros_comm#267, blocking ros/geometry#23
  • fix compilation with gcc 4.9
  • make can_transform correctly wait
  • explicitly set the publish queue size for rospy
  • Contributors: Tully Foote, Vincent Rabaud, v4hn

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

  • adding const to MessageEvent data
  • Contributors: Tully Foote

0.5.0 (2014-02-14)

  • TF2 uses message events to get connection header information
  • Contributors: Kevin Watts

0.4.10 (2013-12-26)

  • adding support for static transforms in python listener. Fixes #46
  • Contributors: Tully Foote

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35 in the python implementation
  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35

0.4.6 (2013-08-28)

  • patching python implementation for #24 as well
  • Stop waiting if time jumps backwards. fixes #24
  • patch to work around uninitiaized time. #30
  • Removing unnecessary CATKIN_DEPENDS #18

0.4.5 (2013-07-11)

  • Revert "cherrypicking groovy patch for #10 into hydro" This reverts commit 296d4916706d64f719b8c1592ab60d3686f994e1. It was not starting up correctly.
  • fixing usage string to show quaternions and using quaternions in the test app
  • cherrypicking groovy patch for #10 into hydro

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.
  • reviving unrun unittest and adding CATKIN_ENABLE_TESTING guards

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

  • adding queue accessors lost in the new API
  • exposing dedicated thread logic in BufferCore and checking in Buffer
  • adding methods to enable backwards compatability for passing through to tf::Transformer

0.4.0 (2013-06-27)

  • splitting rospy dependency into tf2_py so tf2 is pure c++ library.
  • 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
  • fixing return by value for tranform method without preallocatoin
  • 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
  • Added link against catkin_LIBRARIES for tf2_ros lib, also CMakeLists.txt clean up

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
  • Merge pull request #2 from KaijenHsiao/groovy-devel added setup.py and catkin_python_setup() to tf2_ros
  • added setup.py and catkin_python_setup() to tf2_ros
  • fixing cmake target collisions
  • fixing catkin message dependencies
  • removing packages with missing deps
  • catkin fixes
  • catkinizing geometry-experimental
  • catkinizing tf2_ros
  • catching None result in buffer client before it becomes an AttributeError, raising tf2.TransformException instead
  • oneiric linker fixes, bump version to 0.2.3
  • fix deprecated use of Header
  • merged faust's changes 864 and 865 into non_optimized branch: BufferCore instead of Buffer in TransformListener, and added a constructor that takes a NodeHandle.
  • add buffer server binary
  • fix compilation on 32bit
  • add missing file
  • build buffer server
  • TransformListener only needs a BufferCore
  • Add TransformListener constructor that takes a NodeHandle so you can specify a callback queue to use
  • Add option to use a callback queue in the message filter
  • move the message filter to tf2_ros
  • add missing std_msgs dependency
  • missed 2 lines in last commit
  • removing auto clearing from listener for it's unexpected from a library
  • static transform tested and working
  • subscriptions to tf_static unshelved
  • static transform publisher executable running
  • latching static transform publisher
  • cleaning out old commented code
  • Only query rospy.Time.now() when the timeout is greater than 0
  • debug comments removed
  • move to tf2_ros completed. tests pass again
  • merge tf2_cpp and tf2_py into tf2_ros

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
cartographer_ros
gazebo_plugins
geometry2
test_tf2
tf2_bullet
tf2_eigen
tf2_geometry_msgs
tf2_kdl
tf2_sensor_msgs
turtle_tf2_cpp
turtle_tf2_py
depth_image_proc
image_rotate
imu_complementary_filter
imu_filter_madgwick
rviz_imu_plugin
laser_filters
mapviz
mavros
mavros_extras
microstrain_inertial_driver
microstrain_inertial_examples
moveit_planners_ompl
pilz_industrial_motion_planner
moveit_hybrid_planning
moveit_ros_move_group
moveit_servo
moveit_ros_occupancy_map_monitor
moveit_ros_perception
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_robot_interaction
moveit_ros_tests
moveit_ros_trajectory_cache
moveit_ros_warehouse
moveit_resources_fanuc_moveit_config
moveit_visual_tools
naoqi_driver
nonpersistent_voxel_layer
octomap_server
ov_msckf
pcl_ros
plotjuggler_ros
pointcloud_to_laserscan
quaternion_operation
robot_localization
robot_state_publisher
rqt_tf_tree
rtabmap_ros
rviz_common
rviz_default_plugins
sbg_driver
slam_toolbox
spatio_temporal_voxel_layer
turtlebot3_node
velodyne_driver
velodyne_pointcloud
warehouse_ros
nav2_amcl
nav2_behavior_tree
nav2_bt_navigator
nav2_core
nav2_costmap_2d
dwb_core
nav2_navfn_planner
nav2_planner
nav2_smac_planner
nav2_theta_star_planner
nav2_util
nav2_waypoint_follower
rmf_robot_sim_common
ros2_ouster
move_group_interface_client
pure_spinning_local_planner
nav2z_client
webots_ros2_driver
webots_ros2_epuck
webots_ros2_tests
webots_ros2_tiago
webots_ros2_turtlebot
irobot_create_nodes
ign_rviz
ign_rviz_common
ign_rviz_plugins
turtlebot4_bringup

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_ros 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

This package contains the ROS bindings for the tf2 library, for both Python and C++.

Additional Links

Maintainers

  • Chris Lalancette
  • Alejandro Hernandez Cordero

Authors

  • Eitan Marder-Eppstein
  • Wim Meeussen
  • Tully Foote
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_ros

0.13.14 (2023-03-16)

0.13.13 (2022-01-31)

0.13.12 (2021-10-05)

0.13.11 (2021-08-31)

  • Fix tf2_echo does not work with ros-args (#407) (#408) (#411)
  • Avoid using invalid std::list iterators (#293) (#419)
  • Fix accessing free'd resources (#386) (#419)
  • Contributors: Chris Lalancette, Kazunari Tanaka, Michael Carroll, PGotzmann, simutisernestas

0.13.10 (2021-04-14)

  • Update for python3.8 (#359)
  • Contributors: Fabrice Larribe

0.13.9 (2020-12-09)

0.13.8 (2020-12-08)

  • Generate callbacks after updating message_ (#274) (#353)
    • Generate callbacks after updating message_

    * Add test for multithread TransformListener to test_message_filter Co-authored-by: ymd-stella <<7959916+ymd-stella@users.noreply.github.com>>

  • Contributors: Jacob Perron

0.13.7 (2020-11-18)

  • [Foxy backport] Fixed memory leak in Buffer::waitForTransform (#281) (#330)
  • Contributors: Matthijs den Toom

0.13.6 (2020-10-28)

  • Update maintainers of the ros2/geometry2 fork. (#328) (#332)
  • Clear callbacks_to_remove variable after removing (#314)
  • Add pytest.ini to tf2_ros
  • Contributors: Alejandro Hernández Cordero, Jacob Perron, Matthijs den Toom

0.13.5 (2020-08-05)

  • Make static_transform_broadcaster consistent with its command line description (#294) (#296)
  • Fix dependencies in tf2_ros (#269) (#288)
  • Moved unique_lock of messages_mutex_ to guarantee pointer (#279) (#283)
  • Contributors: Chris Lalancette, Hunter L. Allen, Martin Ganeff

0.13.4 (2020-06-03)

  • export targets in addition to include directories / libraries (#271)
  • Add missing virtual destructors (#272)
  • Contributors: Dirk Thomas, Ivan Santiago Paunovic

0.13.3 (2020-05-26)

  • Fixed in Exception constructor tf2_ros (#267)
  • Contributors: Alejandro Hernández Cordero

0.13.2 (2020-05-18)

0.13.1 (2020-05-08)

0.13.0 (2020-04-30)

  • Added doxyfiles and sphinx Makefiles (#257)
  • avoid more deprecations (#255)
  • create_timer takes shared pointers (#251)
  • Improve tf2_echo and tf2_monitor messages while waiting for data (#254)
  • Add missing visibility header include (#246)
  • Fix [-Wrange-loop-construct]{.title-ref} (#245) ` --- stderr: tf2_ros /opt/ros/master/src/ros2/geometry2/tf2_ros/test/test_buffer.cpp:84:21: warning: loop variable 'elem' creates a copy from type 'const std::pair<const unsigned long, std::function<void (const unsigned long &)> >' [-Wrange-loop-construct] for (const auto elem : timer_to_callback_map\_) { ^ /opt/ros/master/src/ros2/geometry2/tf2_ros/test/test_buffer.cpp:84:10: note: use reference type 'const std::pair<const unsigned long, std::function<void (const unsigned long &)> > &' to prevent copying for (const auto elem : timer_to_callback_map\_) { ^~~~~~~~~~~~~~~~~ & 1 warning generated. ---`
  • Remove TODO (#234) The TODO is done; The publisher is using QoS durability setting 'transient local' which is the closest thing to the 'latched' concept in ROS 1. Signed-off-by: Jacob Perron <<jacob@openrobotics.org>>
  • Remove virtual keyword from overridden functions (#214) Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>>
  • message filter fix (#216)
    • Fixed meesage_filter add method
    • removed using builtin_interfaces::msg::Time in tf2_ros
  • Porting more tests to tf2_ros (#202)
    • Added more tests to tf2_ros
    • improving tf2_ros time_reset_test
    • tf2_ros fixed failed test_buffer_client.cpp
    • added some EXPECT to listener unittest
    • reviews
    • Update listener_unittest.cpp
    • fixed tf2_ros time_reset_test
    • tf2_ros removed ROS launch files
    • Added TODO to fix test_buffer_client in CI
    • tf2_ros added feedback
  • Add static transform component (#182) * Create a static transform component for composition Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>> * Suffix node name with randomly generated alpha-numeric string Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>> * Fix windows build Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>> * Switch to much more readable and more performant implementation by \@clalancette Signed-off-by: Hunter L. Allen <<hunterlallen@protonmail.com>>

  • Adding support for view_frame (#192)
    • Adding tf2_tools support for view_frames
    • Changelog
    • tf2_tools 0.12.1 package version
    • tf2_tools common linters
    • tf2_tools changelog Forthcoming
    • tf2_tools log error and destroy client and node when a exception raised
    • tf2_tools 0.12.4 package version
    • tf2_tools revert some changes
    • tf2_tools - reduce changes
    • tf2_tools: finally block and passing the time instead of the node
    • tf2_tools: buffer with less arguments
    • tf2_tools: Fix condition
  • Contributors: Alejandro Hernández Cordero, Dan Rose, Hunter L. Allen, Jacob Perron, Karsten Knese, Shane Loretz, William Woodall

0.12.4 (2019-11-19)

0.12.3 (2019-11-18)

  • Remove unused setup.py files (#190)
  • Print out the name of the signalFailure reason instead of just its enum value (#186)
  • Contributors: Emerson Knapp, Vasilii Artemev

0.12.2 (2019-11-18)

  • Fix tf2_monitor subscriptions QoS settings. (#196)
  • Contributors: Michel Hidalgo

0.12.1 (2019-10-23)

  • Add convenience methods using rclcpp time types (#180)
  • Don't assume quaternions init to all zeros
  • Make BufferClient destructor virtual
  • Contributors: Josh Langsfeld, Shane Loretz, Thomas Moulard

0.12.0 (2019-09-26)

  • Simulate work in the acceptedCallback.
  • Make Windows Debug to run the correct python executable.
  • Make BufferInterface destructor virtual.
  • Remove unnecessary and blacklisted actionlib_msgs dependency.
  • More test fixes for tf2_ros python.
  • class Clock is in clock not timer.
  • tf2_ros is not built for Python (#99)
  • Migrate buffer action server to ROS 2
  • Add conversion functions for durations
  • Make /tf_static use transient_local durability (#160)
  • Force explicit --ros-args in NodeOptions::arguments(). (#162)
  • Use of -r/--remap flags where appropriate. (#159)
  • Include tf2 headers in message_filter.h (#157)
  • Use ament_target_dependencies to ensure correct dependency order (#156)
  • Make sure that TransformListener's node gets a unique name (#129)
  • Fix compiler warning (#148)
  • Do not timeout when waiting for transforms (#146)
  • Fix race between timeout and transform ready callback (#143)
  • Fix high CPU - Use executor to spin and stop node in tf_listener thread (#119)
  • Catch polymorphic exceptions by reference (#138)
  • Add missing export build dependencies (#135)
  • avoid delete-non-virtual-dtor warning (#134)
  • Template tf2_ros::MessageFilter on the buffer type
  • Add pure virtual interface tf2_ros::AsyncBufferInterface
  • Add pure virtual interface tf2_ros::CreateTimerInterface
  • Allow tf2_monitor to be run with ROS command line args (#122)
  • Drop misleading ROS_* logging macros from tf2_monitor (#123)
  • Fix the MessageFilter init order. (#120)
  • Contributors: Chris Lalancette, Dan Rose, Jacob Perron, Karsten Knese, Michel Hidalgo, Scott K Logan, Shane Loretz, Vinnam Kim, bpwilcox, evshary

0.11.3 (2019-05-24)

  • stop spinning TransformListener thread node in destructor (#114)
  • Store dedicated transform listener thread as a std::unique_ptr (#111)
  • enable pedantic for tf2_ros (#115)
  • Contributors: Hunter L. Allen, Karsten Knese, bpwilcox

0.11.2 (2019-05-20)

  • Remove stray semicolon which causes compiler error when using -Werror=pedantic (#112)
  • Contributors: Michael Jeronimo

0.11.1 (2019-05-09)

  • use node interfaces throughout tf2_ros (#108)
  • changes to avoid deprecated API's (#107)
  • Fix call to create_publisher after API changed (#105)
  • Use node interfaces for static transform broadcaster (#104)
  • Contributors: Emerson Knapp, Karsten Knese, William Woodall

0.11.0 (2019-04-14)

  • Updated to use node inteface pointers in the MessageFilter class. (#96)
  • Updated message_filter.h. (#91)
  • Contributors: Michael Jeronimo, Sagnik Basu

0.10.1 (2018-12-06)

  • Allow static_transform_publisher to be run with ros arguments ros2#80 (#82)
  • Contributors: Lucas Walter

0.10.0 (2018-11-22)

  • Port tf2 ros message filter with ros2 tf2 and message filters (#81)
    • Port tf2 message filter to ros2

    - remove APIs to node callback queue due to no callback queue in ros2 now - Change failure callback register with failure prompting due to no corresponding boost signal2 in C++11 and later

    • Fix expected transform count in case of time tolerance
    • Upgrade all message counts to 64 bitThis should resolve C4267 warnings about downgrading a size_t.
  • Export tf2 dependency from tf2_ros (#72)
  • rclcpp time jump callback signature (#69)
  • Use ros2 time (#67)
  • Contributors: Carl Delsey, Ethan Gao, Shane Loretz

0.5.15 (2017-01-24)

  • tf2_ros: add option to unregister TransformListener (#201)
  • Contributors: Hans-Joachim Krauch

0.5.14 (2017-01-16)

  • Drop roslib.load_manifest (#191)
  • Adds ability to load TF from the ROS parameter server.
  • Code linting & reorganization
  • Fix indexing beyond end of array
  • added a static transform broadcaster in python
  • lots more documentation
  • remove BufferCore doc, add BufferClient/BufferServer doc for C++, add Buffer/BufferInterface Python documentation
  • Better overview for Python
  • Contributors: Eric Wieser, Felix Duvallet, Jackie Kay, Mikael Arguedas, Mike Purvis

0.5.13 (2016-03-04)

  • fix documentation warnings
  • Adding tests to package
  • Contributors: Laurent GEORGE, Vincent Rabaud

0.5.12 (2015-08-05)

  • remove annoying gcc warning This is because the roslog macro cannot have two arguments that are formatting strings: we need to concatenate them first.
  • break canTransform loop only for non-tiny negative time deltas (At least) with Python 2 ros.Time.now() is not necessarily monotonic and one can experience negative time deltas (usually well below 1s) on real hardware under full load. This check was originally introduced to allow for backjumps with rosbag replays, and only there it makes sense. So we'll add a small duration threshold to ignore backjumps due to non-monotonic clocks.
  • Contributors: Vincent Rabaud, v4hn

0.5.11 (2015-04-22)

  • do not short circuit waitForTransform timeout when running inside pytf. Fixes #102 roscpp is not initialized inside pytf which means that ros::ok is not valid. This was causing the timer to abort immediately. This breaks support for pytf with respect to early breaking out of a loop re #26. This is conceptually broken in pytf, and is fixed in tf2_ros python implementation. If you want this behavior I recommend switching to the tf2 python bindings.
  • inject timeout information into error string for canTransform with timeout
  • Contributors: Tully Foote

0.5.10 (2015-04-21)

  • switch to use a shared lock with upgrade instead of only a unique lock. For #91
  • Update message_filter.h
  • filters: fix unsupported old messages with frame_id starting with '/'
  • Enabled tf2 documentation
  • make sure the messages get processed before testing the effects. Fixes #88
  • allowing to use message filters with PCL types
  • Contributors: Brice Rebsamen, Jackie Kay, Tully Foote, Vincent Rabaud, jmtatsch

0.5.9 (2015-03-25)

  • changed queue_size in Python transform boradcaster to match that in c++
  • Contributors: mrath

0.5.8 (2015-03-17)

  • fix deadlock #79
  • break out of loop if ros is shutdown. Fixes #26
  • remove useless Makefile files
  • Fix static broadcaster with rpy args
  • Contributors: Paul Bovbel, Tully Foote, Vincent Rabaud

0.5.7 (2014-12-23)

  • Added 6 param transform again Yes, using Euler angles is a bad habit. But it is much more convenient if you just need a rotation by 90° somewhere to set it up in Euler angles. So I added the option to supply only the 3 angles.
  • Remove tf2_py dependency for Android
  • Contributors: Achim Königs, Gary Servin

0.5.6 (2014-09-18)

  • support if canTransform(...): in python #57
  • Support clearing the cache when time jumps backwards #68
  • Contributors: Tully Foote

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

  • surpressing autostart on the server objects to not incur warnings
  • switch to boost signals2 following ros/ros_comm#267, blocking ros/geometry#23
  • fix compilation with gcc 4.9
  • make can_transform correctly wait
  • explicitly set the publish queue size for rospy
  • Contributors: Tully Foote, Vincent Rabaud, v4hn

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

  • adding const to MessageEvent data
  • Contributors: Tully Foote

0.5.0 (2014-02-14)

  • TF2 uses message events to get connection header information
  • Contributors: Kevin Watts

0.4.10 (2013-12-26)

  • adding support for static transforms in python listener. Fixes #46
  • Contributors: Tully Foote

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35 in the python implementation
  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35

0.4.6 (2013-08-28)

  • patching python implementation for #24 as well
  • Stop waiting if time jumps backwards. fixes #24
  • patch to work around uninitiaized time. #30
  • Removing unnecessary CATKIN_DEPENDS #18

0.4.5 (2013-07-11)

  • Revert "cherrypicking groovy patch for #10 into hydro" This reverts commit 296d4916706d64f719b8c1592ab60d3686f994e1. It was not starting up correctly.
  • fixing usage string to show quaternions and using quaternions in the test app
  • cherrypicking groovy patch for #10 into hydro

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.
  • reviving unrun unittest and adding CATKIN_ENABLE_TESTING guards

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

  • adding queue accessors lost in the new API
  • exposing dedicated thread logic in BufferCore and checking in Buffer
  • adding methods to enable backwards compatability for passing through to tf::Transformer

0.4.0 (2013-06-27)

  • splitting rospy dependency into tf2_py so tf2 is pure c++ library.
  • 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
  • fixing return by value for tranform method without preallocatoin
  • 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
  • Added link against catkin_LIBRARIES for tf2_ros lib, also CMakeLists.txt clean up

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
  • Merge pull request #2 from KaijenHsiao/groovy-devel added setup.py and catkin_python_setup() to tf2_ros
  • added setup.py and catkin_python_setup() to tf2_ros
  • fixing cmake target collisions
  • fixing catkin message dependencies
  • removing packages with missing deps
  • catkin fixes
  • catkinizing geometry-experimental
  • catkinizing tf2_ros
  • catching None result in buffer client before it becomes an AttributeError, raising tf2.TransformException instead
  • oneiric linker fixes, bump version to 0.2.3
  • fix deprecated use of Header
  • merged faust's changes 864 and 865 into non_optimized branch: BufferCore instead of Buffer in TransformListener, and added a constructor that takes a NodeHandle.
  • add buffer server binary
  • fix compilation on 32bit
  • add missing file
  • build buffer server
  • TransformListener only needs a BufferCore
  • Add TransformListener constructor that takes a NodeHandle so you can specify a callback queue to use
  • Add option to use a callback queue in the message filter
  • move the message filter to tf2_ros
  • add missing std_msgs dependency
  • missed 2 lines in last commit
  • removing auto clearing from listener for it's unexpected from a library
  • static transform tested and working
  • subscriptions to tf_static unshelved
  • static transform publisher executable running
  • latching static transform publisher
  • cleaning out old commented code
  • Only query rospy.Time.now() when the timeout is greater than 0
  • debug comments removed
  • move to tf2_ros completed. tests pass again
  • merge tf2_cpp and tf2_py into tf2_ros

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
cartographer_ros
create_driver
find_object_2d
gazebo_plugins
examples_tf2_py
geometry2
test_tf2
tf2_bullet
tf2_eigen
tf2_geometry_msgs
tf2_kdl
tf2_sensor_msgs
tf2_tools
turtle_tf2_cpp
turtle_tf2_py
husky_base
depth_image_proc
image_rotate
imu_complementary_filter
imu_filter_madgwick
rviz_imu_plugin
laser_filters
swri_transform_util
mavros
mavros_extras
microstrain_inertial_driver
microstrain_inertial_examples
moveit_planners_ompl
pilz_industrial_motion_planner
moveit_hybrid_planning
moveit_ros_move_group
moveit_servo
moveit_ros_occupancy_map_monitor
moveit_ros_perception
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_robot_interaction
moveit_ros_tests
moveit_ros_trajectory_cache
moveit_ros_warehouse
moveit_resources_fanuc_moveit_config
naoqi_driver
nonpersistent_voxel_layer
octomap_server
pcl_ros
pointcloud_to_laserscan
py_trees_ros
quaternion_operation
robot_controllers
robot_controllers_interface
robot_localization
robot_state_publisher
rqt_tf_tree
rtabmap_examples
rtabmap_slam
rtabmap_util
rviz_common
rviz_default_plugins
sbg_driver
slam_toolbox
spatio_temporal_voxel_layer
turtlebot3_node
velodyne_driver
velodyne_pointcloud
vesc_ackermann
warehouse_ros
aruco_opencv
clober_serial
crane_plus_moveit_config
bosch_locator_bridge
nav2_amcl
nav2_behavior_tree
nav2_bt_navigator
nav2_core
nav2_costmap_2d
dwb_core
nav2_navfn_planner
nav2_planner
nav2_util
nav2_waypoint_follower
smac_planner
odom_to_tf_ros2
raspimouse
rmf_robot_sim_common
realsense_node
realsense_ros
ros2_ouster
sick_scan2
turtlebot3_manipulation_moveit_config
webots_ros2_driver
webots_ros2_epuck
webots_ros2_tests
webots_ros2_tiago
webots_ros2_turtlebot

Launch files

No launch files found

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_ros 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

This package contains the ROS bindings for the tf2 library, for both Python and C++.

Additional Links

Maintainers

  • Tully Foote

Authors

  • Eitan Marder-Eppstein
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_ros

0.5.20 (2018-11-16)

  • Protect the time reset logic from a race condition. Fixes #341 This could incorrectly trigger a buffer clear if two concurrent callbacks were invoked.
  • Contributors: Tully Foote

0.5.19 (2018-11-06)

  • fix(buffer-client): Use actionlib api for obtaining result Use the API provided by actionlib for waiting for result. This will improve the response time and prevent problems with custom solutions (see #178). This change makes constructor parameter check_frequency obsolute and deprecates it.
  • Add check to buffer_client.py to make sure result is available Related issue: #178
  • Add check to reset buffer when rostime goes backwards
  • Fixed the value of expected_success_count_
  • Contributors: Ewoud Pool, Jørgen Borgesen, Stephen Williams

0.5.18 (2018-07-10)

  • tf2_ros::Buffer: canTransform can now deal with timeouts smaller than… (#286)
  • More spinning to make sure the message gets through for #129
  • Contributors: Tully Foote, cwecht

0.5.17 (2018-01-01)

  • Merge pull request #260 from randoms/indigo-devel fix python3 import error
  • Merge pull request #257 from delftrobotics-forks/python3 Make tf2_py python3 compatible again
  • Use python3 print function.
  • Contributors: Maarten de Vries, Tully Foote, randoms

0.5.16 (2017-07-14)

  • Merge pull request #144 from clearpathrobotics/dead_lock_fix Solve a bug that causes a deadlock in MessageFilter
  • Clear error string if it exists from the external entry points. Fixes #117
  • Make buff_size and tcp_nodelay and subscriber queue size mutable.
  • Remove generate_rand_vectors() from a number of tests. (#227)
    • Remove generate_rand_vectors() from a number of tests.
  • Log jump duration on backwards time jump detection. (#234)
  • replaced dependencies on tf2_msgs_gencpp by exported dependencies
  • Use new-style objects in python 2
  • Solve a bug that causes a deadlock in MessageFilter
  • Contributors: Adel Fakih, Chris Lalancette, Christopher Wecht, Eric Wieser, Koji Terada, Stephan, Tully Foote, koji_terada

0.5.15 (2017-01-24)

  • tf2_ros: add option to unregister TransformListener (#201)
  • Contributors: Hans-Joachim Krauch

0.5.14 (2017-01-16)

  • Drop roslib.load_manifest (#191)
  • Adds ability to load TF from the ROS parameter server.
  • Code linting & reorganization
  • Fix indexing beyond end of array
  • added a static transform broadcaster in python
  • lots more documentation
  • remove BufferCore doc, add BufferClient/BufferServer doc for C++, add Buffer/BufferInterface Python documentation
  • Better overview for Python
  • Contributors: Eric Wieser, Felix Duvallet, Jackie Kay, Mikael Arguedas, Mike Purvis

0.5.13 (2016-03-04)

  • fix documentation warnings
  • Adding tests to package
  • Contributors: Laurent GEORGE, Vincent Rabaud

0.5.12 (2015-08-05)

  • remove annoying gcc warning This is because the roslog macro cannot have two arguments that are formatting strings: we need to concatenate them first.
  • break canTransform loop only for non-tiny negative time deltas (At least) with Python 2 ros.Time.now() is not necessarily monotonic and one can experience negative time deltas (usually well below 1s) on real hardware under full load. This check was originally introduced to allow for backjumps with rosbag replays, and only there it makes sense. So we'll add a small duration threshold to ignore backjumps due to non-monotonic clocks.
  • Contributors: Vincent Rabaud, v4hn

0.5.11 (2015-04-22)

  • do not short circuit waitForTransform timeout when running inside pytf. Fixes #102 roscpp is not initialized inside pytf which means that ros::ok is not valid. This was causing the timer to abort immediately. This breaks support for pytf with respect to early breaking out of a loop re #26. This is conceptually broken in pytf, and is fixed in tf2_ros python implementation. If you want this behavior I recommend switching to the tf2 python bindings.
  • inject timeout information into error string for canTransform with timeout
  • Contributors: Tully Foote

0.5.10 (2015-04-21)

  • switch to use a shared lock with upgrade instead of only a unique lock. For #91
  • Update message_filter.h
  • filters: fix unsupported old messages with frame_id starting with '/'
  • Enabled tf2 documentation
  • make sure the messages get processed before testing the effects. Fixes #88
  • allowing to use message filters with PCL types
  • Contributors: Brice Rebsamen, Jackie Kay, Tully Foote, Vincent Rabaud, jmtatsch

0.5.9 (2015-03-25)

  • changed queue_size in Python transform boradcaster to match that in c++
  • Contributors: mrath

0.5.8 (2015-03-17)

  • fix deadlock #79
  • break out of loop if ros is shutdown. Fixes #26
  • remove useless Makefile files
  • Fix static broadcaster with rpy args
  • Contributors: Paul Bovbel, Tully Foote, Vincent Rabaud

0.5.7 (2014-12-23)

  • Added 6 param transform again Yes, using Euler angles is a bad habit. But it is much more convenient if you just need a rotation by 90° somewhere to set it up in Euler angles. So I added the option to supply only the 3 angles.
  • Remove tf2_py dependency for Android
  • Contributors: Achim Königs, Gary Servin

0.5.6 (2014-09-18)

  • support if canTransform(...): in python #57
  • Support clearing the cache when time jumps backwards #68
  • Contributors: Tully Foote

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

  • surpressing autostart on the server objects to not incur warnings
  • switch to boost signals2 following ros/ros_comm#267, blocking ros/geometry#23
  • fix compilation with gcc 4.9
  • make can_transform correctly wait
  • explicitly set the publish queue size for rospy
  • Contributors: Tully Foote, Vincent Rabaud, v4hn

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

  • adding const to MessageEvent data
  • Contributors: Tully Foote

0.5.0 (2014-02-14)

  • TF2 uses message events to get connection header information
  • Contributors: Kevin Watts

0.4.10 (2013-12-26)

  • adding support for static transforms in python listener. Fixes #46
  • Contributors: Tully Foote

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35 in the python implementation
  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

  • Revert "cherrypicking groovy patch for #10 into hydro" This reverts commit 296d4916706d64f719b8c1592ab60d3686f994e1. It was not starting up correctly.
  • fixing usage string to show quaternions and using quaternions in the test app
  • cherrypicking groovy patch for #10 into hydro

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.
  • reviving unrun unittest and adding CATKIN_ENABLE_TESTING guards

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

  • adding queue accessors lost in the new API
  • exposing dedicated thread logic in BufferCore and checking in Buffer
  • adding methods to enable backwards compatability for passing through to tf::Transformer

0.4.0 (2013-06-27)

  • splitting rospy dependency into tf2_py so tf2 is pure c++ library.
  • 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
  • fixing return by value for tranform method without preallocatoin
  • 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
  • Added link against catkin_LIBRARIES for tf2_ros lib, also CMakeLists.txt clean up

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
  • Merge pull request #2 from KaijenHsiao/groovy-devel added setup.py and catkin_python_setup() to tf2_ros
  • added setup.py and catkin_python_setup() to tf2_ros
  • fixing cmake target collisions
  • fixing catkin message dependencies
  • removing packages with missing deps
  • catkin fixes
  • catkinizing geometry-experimental
  • catkinizing tf2_ros
  • catching None result in buffer client before it becomes an AttributeError, raising tf2.TransformException instead
  • oneiric linker fixes, bump version to 0.2.3
  • fix deprecated use of Header
  • merged faust's changes 864 and 865 into non_optimized branch: BufferCore instead of Buffer in TransformListener, and added a constructor that takes a NodeHandle.
  • add buffer server binary
  • fix compilation on 32bit
  • add missing file
  • build buffer server
  • TransformListener only needs a BufferCore
  • Add TransformListener constructor that takes a NodeHandle so you can specify a callback queue to use
  • Add option to use a callback queue in the message filter
  • move the message filter to tf2_ros
  • add missing std_msgs dependency
  • missed 2 lines in last commit
  • removing auto clearing from listener for it's unexpected from a library
  • static transform tested and working
  • subscriptions to tf_static unshelved
  • static transform publisher executable running
  • latching static transform publisher
  • cleaning out old commented code
  • Only query rospy.Time.now() when the timeout is greater than 0
  • debug comments removed
  • move to tf2_ros completed. tests pass again
  • merge tf2_cpp and tf2_py into tf2_ros

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_ros 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

This package contains the ROS bindings for the tf2 library, for both Python and C++.

Additional Links

Maintainers

  • Tully Foote

Authors

  • Eitan Marder-Eppstein
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_ros

0.5.20 (2018-11-16)

  • Protect the time reset logic from a race condition. Fixes #341 This could incorrectly trigger a buffer clear if two concurrent callbacks were invoked.
  • Contributors: Tully Foote

0.5.19 (2018-11-06)

  • fix(buffer-client): Use actionlib api for obtaining result Use the API provided by actionlib for waiting for result. This will improve the response time and prevent problems with custom solutions (see #178). This change makes constructor parameter check_frequency obsolute and deprecates it.
  • Add check to buffer_client.py to make sure result is available Related issue: #178
  • Add check to reset buffer when rostime goes backwards
  • Fixed the value of expected_success_count_
  • Contributors: Ewoud Pool, Jørgen Borgesen, Stephen Williams

0.5.18 (2018-07-10)

  • tf2_ros::Buffer: canTransform can now deal with timeouts smaller than… (#286)
  • More spinning to make sure the message gets through for #129
  • Contributors: Tully Foote, cwecht

0.5.17 (2018-01-01)

  • Merge pull request #260 from randoms/indigo-devel fix python3 import error
  • Merge pull request #257 from delftrobotics-forks/python3 Make tf2_py python3 compatible again
  • Use python3 print function.
  • Contributors: Maarten de Vries, Tully Foote, randoms

0.5.16 (2017-07-14)

  • Merge pull request #144 from clearpathrobotics/dead_lock_fix Solve a bug that causes a deadlock in MessageFilter
  • Clear error string if it exists from the external entry points. Fixes #117
  • Make buff_size and tcp_nodelay and subscriber queue size mutable.
  • Remove generate_rand_vectors() from a number of tests. (#227)
    • Remove generate_rand_vectors() from a number of tests.
  • Log jump duration on backwards time jump detection. (#234)
  • replaced dependencies on tf2_msgs_gencpp by exported dependencies
  • Use new-style objects in python 2
  • Solve a bug that causes a deadlock in MessageFilter
  • Contributors: Adel Fakih, Chris Lalancette, Christopher Wecht, Eric Wieser, Koji Terada, Stephan, Tully Foote, koji_terada

0.5.15 (2017-01-24)

  • tf2_ros: add option to unregister TransformListener (#201)
  • Contributors: Hans-Joachim Krauch

0.5.14 (2017-01-16)

  • Drop roslib.load_manifest (#191)
  • Adds ability to load TF from the ROS parameter server.
  • Code linting & reorganization
  • Fix indexing beyond end of array
  • added a static transform broadcaster in python
  • lots more documentation
  • remove BufferCore doc, add BufferClient/BufferServer doc for C++, add Buffer/BufferInterface Python documentation
  • Better overview for Python
  • Contributors: Eric Wieser, Felix Duvallet, Jackie Kay, Mikael Arguedas, Mike Purvis

0.5.13 (2016-03-04)

  • fix documentation warnings
  • Adding tests to package
  • Contributors: Laurent GEORGE, Vincent Rabaud

0.5.12 (2015-08-05)

  • remove annoying gcc warning This is because the roslog macro cannot have two arguments that are formatting strings: we need to concatenate them first.
  • break canTransform loop only for non-tiny negative time deltas (At least) with Python 2 ros.Time.now() is not necessarily monotonic and one can experience negative time deltas (usually well below 1s) on real hardware under full load. This check was originally introduced to allow for backjumps with rosbag replays, and only there it makes sense. So we'll add a small duration threshold to ignore backjumps due to non-monotonic clocks.
  • Contributors: Vincent Rabaud, v4hn

0.5.11 (2015-04-22)

  • do not short circuit waitForTransform timeout when running inside pytf. Fixes #102 roscpp is not initialized inside pytf which means that ros::ok is not valid. This was causing the timer to abort immediately. This breaks support for pytf with respect to early breaking out of a loop re #26. This is conceptually broken in pytf, and is fixed in tf2_ros python implementation. If you want this behavior I recommend switching to the tf2 python bindings.
  • inject timeout information into error string for canTransform with timeout
  • Contributors: Tully Foote

0.5.10 (2015-04-21)

  • switch to use a shared lock with upgrade instead of only a unique lock. For #91
  • Update message_filter.h
  • filters: fix unsupported old messages with frame_id starting with '/'
  • Enabled tf2 documentation
  • make sure the messages get processed before testing the effects. Fixes #88
  • allowing to use message filters with PCL types
  • Contributors: Brice Rebsamen, Jackie Kay, Tully Foote, Vincent Rabaud, jmtatsch

0.5.9 (2015-03-25)

  • changed queue_size in Python transform boradcaster to match that in c++
  • Contributors: mrath

0.5.8 (2015-03-17)

  • fix deadlock #79
  • break out of loop if ros is shutdown. Fixes #26
  • remove useless Makefile files
  • Fix static broadcaster with rpy args
  • Contributors: Paul Bovbel, Tully Foote, Vincent Rabaud

0.5.7 (2014-12-23)

  • Added 6 param transform again Yes, using Euler angles is a bad habit. But it is much more convenient if you just need a rotation by 90° somewhere to set it up in Euler angles. So I added the option to supply only the 3 angles.
  • Remove tf2_py dependency for Android
  • Contributors: Achim Königs, Gary Servin

0.5.6 (2014-09-18)

  • support if canTransform(...): in python #57
  • Support clearing the cache when time jumps backwards #68
  • Contributors: Tully Foote

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

  • surpressing autostart on the server objects to not incur warnings
  • switch to boost signals2 following ros/ros_comm#267, blocking ros/geometry#23
  • fix compilation with gcc 4.9
  • make can_transform correctly wait
  • explicitly set the publish queue size for rospy
  • Contributors: Tully Foote, Vincent Rabaud, v4hn

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

  • adding const to MessageEvent data
  • Contributors: Tully Foote

0.5.0 (2014-02-14)

  • TF2 uses message events to get connection header information
  • Contributors: Kevin Watts

0.4.10 (2013-12-26)

  • adding support for static transforms in python listener. Fixes #46
  • Contributors: Tully Foote

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35 in the python implementation
  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

  • Revert "cherrypicking groovy patch for #10 into hydro" This reverts commit 296d4916706d64f719b8c1592ab60d3686f994e1. It was not starting up correctly.
  • fixing usage string to show quaternions and using quaternions in the test app
  • cherrypicking groovy patch for #10 into hydro

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.
  • reviving unrun unittest and adding CATKIN_ENABLE_TESTING guards

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

  • adding queue accessors lost in the new API
  • exposing dedicated thread logic in BufferCore and checking in Buffer
  • adding methods to enable backwards compatability for passing through to tf::Transformer

0.4.0 (2013-06-27)

  • splitting rospy dependency into tf2_py so tf2 is pure c++ library.
  • 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
  • fixing return by value for tranform method without preallocatoin
  • 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
  • Added link against catkin_LIBRARIES for tf2_ros lib, also CMakeLists.txt clean up

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
  • Merge pull request #2 from KaijenHsiao/groovy-devel added setup.py and catkin_python_setup() to tf2_ros
  • added setup.py and catkin_python_setup() to tf2_ros
  • fixing cmake target collisions
  • fixing catkin message dependencies
  • removing packages with missing deps
  • catkin fixes
  • catkinizing geometry-experimental
  • catkinizing tf2_ros
  • catching None result in buffer client before it becomes an AttributeError, raising tf2.TransformException instead
  • oneiric linker fixes, bump version to 0.2.3
  • fix deprecated use of Header
  • merged faust's changes 864 and 865 into non_optimized branch: BufferCore instead of Buffer in TransformListener, and added a constructor that takes a NodeHandle.
  • add buffer server binary
  • fix compilation on 32bit
  • add missing file
  • build buffer server
  • TransformListener only needs a BufferCore
  • Add TransformListener constructor that takes a NodeHandle so you can specify a callback queue to use
  • Add option to use a callback queue in the message filter
  • move the message filter to tf2_ros
  • add missing std_msgs dependency
  • missed 2 lines in last commit
  • removing auto clearing from listener for it's unexpected from a library
  • static transform tested and working
  • subscriptions to tf_static unshelved
  • static transform publisher executable running
  • latching static transform publisher
  • cleaning out old commented code
  • Only query rospy.Time.now() when the timeout is greater than 0
  • debug comments removed
  • move to tf2_ros completed. tests pass again
  • merge tf2_cpp and tf2_py into tf2_ros

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_ros 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

This package contains the ROS bindings for the tf2 library, for both Python and C++.

Additional Links

Maintainers

  • Tully Foote

Authors

  • Eitan Marder-Eppstein
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_ros

0.5.20 (2018-11-16)

  • Protect the time reset logic from a race condition. Fixes #341 This could incorrectly trigger a buffer clear if two concurrent callbacks were invoked.
  • Contributors: Tully Foote

0.5.19 (2018-11-06)

  • fix(buffer-client): Use actionlib api for obtaining result Use the API provided by actionlib for waiting for result. This will improve the response time and prevent problems with custom solutions (see #178). This change makes constructor parameter check_frequency obsolute and deprecates it.
  • Add check to buffer_client.py to make sure result is available Related issue: #178
  • Add check to reset buffer when rostime goes backwards
  • Fixed the value of expected_success_count_
  • Contributors: Ewoud Pool, Jørgen Borgesen, Stephen Williams

0.5.18 (2018-07-10)

  • tf2_ros::Buffer: canTransform can now deal with timeouts smaller than… (#286)
  • More spinning to make sure the message gets through for #129
  • Contributors: Tully Foote, cwecht

0.5.17 (2018-01-01)

  • Merge pull request #260 from randoms/indigo-devel fix python3 import error
  • Merge pull request #257 from delftrobotics-forks/python3 Make tf2_py python3 compatible again
  • Use python3 print function.
  • Contributors: Maarten de Vries, Tully Foote, randoms

0.5.16 (2017-07-14)

  • Merge pull request #144 from clearpathrobotics/dead_lock_fix Solve a bug that causes a deadlock in MessageFilter
  • Clear error string if it exists from the external entry points. Fixes #117
  • Make buff_size and tcp_nodelay and subscriber queue size mutable.
  • Remove generate_rand_vectors() from a number of tests. (#227)
    • Remove generate_rand_vectors() from a number of tests.
  • Log jump duration on backwards time jump detection. (#234)
  • replaced dependencies on tf2_msgs_gencpp by exported dependencies
  • Use new-style objects in python 2
  • Solve a bug that causes a deadlock in MessageFilter
  • Contributors: Adel Fakih, Chris Lalancette, Christopher Wecht, Eric Wieser, Koji Terada, Stephan, Tully Foote, koji_terada

0.5.15 (2017-01-24)

  • tf2_ros: add option to unregister TransformListener (#201)
  • Contributors: Hans-Joachim Krauch

0.5.14 (2017-01-16)

  • Drop roslib.load_manifest (#191)
  • Adds ability to load TF from the ROS parameter server.
  • Code linting & reorganization
  • Fix indexing beyond end of array
  • added a static transform broadcaster in python
  • lots more documentation
  • remove BufferCore doc, add BufferClient/BufferServer doc for C++, add Buffer/BufferInterface Python documentation
  • Better overview for Python
  • Contributors: Eric Wieser, Felix Duvallet, Jackie Kay, Mikael Arguedas, Mike Purvis

0.5.13 (2016-03-04)

  • fix documentation warnings
  • Adding tests to package
  • Contributors: Laurent GEORGE, Vincent Rabaud

0.5.12 (2015-08-05)

  • remove annoying gcc warning This is because the roslog macro cannot have two arguments that are formatting strings: we need to concatenate them first.
  • break canTransform loop only for non-tiny negative time deltas (At least) with Python 2 ros.Time.now() is not necessarily monotonic and one can experience negative time deltas (usually well below 1s) on real hardware under full load. This check was originally introduced to allow for backjumps with rosbag replays, and only there it makes sense. So we'll add a small duration threshold to ignore backjumps due to non-monotonic clocks.
  • Contributors: Vincent Rabaud, v4hn

0.5.11 (2015-04-22)

  • do not short circuit waitForTransform timeout when running inside pytf. Fixes #102 roscpp is not initialized inside pytf which means that ros::ok is not valid. This was causing the timer to abort immediately. This breaks support for pytf with respect to early breaking out of a loop re #26. This is conceptually broken in pytf, and is fixed in tf2_ros python implementation. If you want this behavior I recommend switching to the tf2 python bindings.
  • inject timeout information into error string for canTransform with timeout
  • Contributors: Tully Foote

0.5.10 (2015-04-21)

  • switch to use a shared lock with upgrade instead of only a unique lock. For #91
  • Update message_filter.h
  • filters: fix unsupported old messages with frame_id starting with '/'
  • Enabled tf2 documentation
  • make sure the messages get processed before testing the effects. Fixes #88
  • allowing to use message filters with PCL types
  • Contributors: Brice Rebsamen, Jackie Kay, Tully Foote, Vincent Rabaud, jmtatsch

0.5.9 (2015-03-25)

  • changed queue_size in Python transform boradcaster to match that in c++
  • Contributors: mrath

0.5.8 (2015-03-17)

  • fix deadlock #79
  • break out of loop if ros is shutdown. Fixes #26
  • remove useless Makefile files
  • Fix static broadcaster with rpy args
  • Contributors: Paul Bovbel, Tully Foote, Vincent Rabaud

0.5.7 (2014-12-23)

  • Added 6 param transform again Yes, using Euler angles is a bad habit. But it is much more convenient if you just need a rotation by 90° somewhere to set it up in Euler angles. So I added the option to supply only the 3 angles.
  • Remove tf2_py dependency for Android
  • Contributors: Achim Königs, Gary Servin

0.5.6 (2014-09-18)

  • support if canTransform(...): in python #57
  • Support clearing the cache when time jumps backwards #68
  • Contributors: Tully Foote

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

  • surpressing autostart on the server objects to not incur warnings
  • switch to boost signals2 following ros/ros_comm#267, blocking ros/geometry#23
  • fix compilation with gcc 4.9
  • make can_transform correctly wait
  • explicitly set the publish queue size for rospy
  • Contributors: Tully Foote, Vincent Rabaud, v4hn

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

  • adding const to MessageEvent data
  • Contributors: Tully Foote

0.5.0 (2014-02-14)

  • TF2 uses message events to get connection header information
  • Contributors: Kevin Watts

0.4.10 (2013-12-26)

  • adding support for static transforms in python listener. Fixes #46
  • Contributors: Tully Foote

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35 in the python implementation
  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

  • Revert "cherrypicking groovy patch for #10 into hydro" This reverts commit 296d4916706d64f719b8c1592ab60d3686f994e1. It was not starting up correctly.
  • fixing usage string to show quaternions and using quaternions in the test app
  • cherrypicking groovy patch for #10 into hydro

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.
  • reviving unrun unittest and adding CATKIN_ENABLE_TESTING guards

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

  • adding queue accessors lost in the new API
  • exposing dedicated thread logic in BufferCore and checking in Buffer
  • adding methods to enable backwards compatability for passing through to tf::Transformer

0.4.0 (2013-06-27)

  • splitting rospy dependency into tf2_py so tf2 is pure c++ library.
  • 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
  • fixing return by value for tranform method without preallocatoin
  • 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
  • Added link against catkin_LIBRARIES for tf2_ros lib, also CMakeLists.txt clean up

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
  • Merge pull request #2 from KaijenHsiao/groovy-devel added setup.py and catkin_python_setup() to tf2_ros
  • added setup.py and catkin_python_setup() to tf2_ros
  • fixing cmake target collisions
  • fixing catkin message dependencies
  • removing packages with missing deps
  • catkin fixes
  • catkinizing geometry-experimental
  • catkinizing tf2_ros
  • catching None result in buffer client before it becomes an AttributeError, raising tf2.TransformException instead
  • oneiric linker fixes, bump version to 0.2.3
  • fix deprecated use of Header
  • merged faust's changes 864 and 865 into non_optimized branch: BufferCore instead of Buffer in TransformListener, and added a constructor that takes a NodeHandle.
  • add buffer server binary
  • fix compilation on 32bit
  • add missing file
  • build buffer server
  • TransformListener only needs a BufferCore
  • Add TransformListener constructor that takes a NodeHandle so you can specify a callback queue to use
  • Add option to use a callback queue in the message filter
  • move the message filter to tf2_ros
  • add missing std_msgs dependency
  • missed 2 lines in last commit
  • removing auto clearing from listener for it's unexpected from a library
  • static transform tested and working
  • subscriptions to tf_static unshelved
  • static transform publisher executable running
  • latching static transform publisher
  • cleaning out old commented code
  • Only query rospy.Time.now() when the timeout is greater than 0
  • debug comments removed
  • move to tf2_ros completed. tests pass again
  • merge tf2_cpp and tf2_py into tf2_ros

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_ros 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

This package contains the ROS bindings for the tf2 library, for both Python and C++.

Additional Links

Maintainers

  • Tully Foote

Authors

  • Eitan Marder-Eppstein
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_ros

0.4.12 (2014-09-18)

  • python patch for #57 instead of patching lower level API expose the tuple to the user only if requested via optional argument
  • adding unit tests to cover #43
  • Make transform_listener reset tf buffer on loop detection This makes tf2 work with [rosbag --clock --loop]{.title-ref} as expected.
  • Contributors: Tully Foote, v4hn

0.4.11 (2014-06-04)

  • Fix sleeplogic in can_transform.
  • explicitly set the publish queue size for rospy
  • Contributors: Tully Foote, v4hn

0.4.10 (2013-12-26)

  • adding support for static transforms in python listener. Fixes #46
  • Contributors: Tully Foote

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35 in the python implementation
  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

  • Revert "cherrypicking groovy patch for #10 into hydro" This reverts commit 296d4916706d64f719b8c1592ab60d3686f994e1. It was not starting up correctly.
  • fixing usage string to show quaternions and using quaternions in the test app
  • cherrypicking groovy patch for #10 into hydro

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.
  • reviving unrun unittest and adding CATKIN_ENABLE_TESTING guards

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

  • adding queue accessors lost in the new API
  • exposing dedicated thread logic in BufferCore and checking in Buffer
  • adding methods to enable backwards compatability for passing through to tf::Transformer

0.4.0 (2013-06-27)

  • splitting rospy dependency into tf2_py so tf2 is pure c++ library.
  • 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
  • fixing return by value for tranform method without preallocatoin
  • 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
  • Added link against catkin_LIBRARIES for tf2_ros lib, also CMakeLists.txt clean up

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
  • Merge pull request #2 from KaijenHsiao/groovy-devel added setup.py and catkin_python_setup() to tf2_ros
  • added setup.py and catkin_python_setup() to tf2_ros
  • fixing cmake target collisions
  • fixing catkin message dependencies
  • removing packages with missing deps
  • catkin fixes
  • catkinizing geometry-experimental
  • catkinizing tf2_ros
  • catching None result in buffer client before it becomes an AttributeError, raising tf2.TransformException instead
  • oneiric linker fixes, bump version to 0.2.3
  • fix deprecated use of Header
  • merged faust's changes 864 and 865 into non_optimized branch: BufferCore instead of Buffer in TransformListener, and added a constructor that takes a NodeHandle.
  • add buffer server binary
  • fix compilation on 32bit
  • add missing file
  • build buffer server
  • TransformListener only needs a BufferCore
  • Add TransformListener constructor that takes a NodeHandle so you can specify a callback queue to use
  • Add option to use a callback queue in the message filter
  • move the message filter to tf2_ros
  • add missing std_msgs dependency
  • missed 2 lines in last commit
  • removing auto clearing from listener for it's unexpected from a library
  • static transform tested and working
  • subscriptions to tf_static unshelved
  • static transform publisher executable running
  • latching static transform publisher
  • cleaning out old commented code
  • Only query rospy.Time.now() when the timeout is greater than 0
  • debug comments removed
  • move to tf2_ros completed. tests pass again
  • merge tf2_cpp and tf2_py into tf2_ros

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_ros 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

This package contains the ROS bindings for the tf2 library, for both Python and C++.

Additional Links

Maintainers

  • Tully Foote

Authors

  • Eitan Marder-Eppstein
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_ros

0.5.20 (2018-11-16)

  • Protect the time reset logic from a race condition. Fixes #341 This could incorrectly trigger a buffer clear if two concurrent callbacks were invoked.
  • Contributors: Tully Foote

0.5.19 (2018-11-06)

  • fix(buffer-client): Use actionlib api for obtaining result Use the API provided by actionlib for waiting for result. This will improve the response time and prevent problems with custom solutions (see #178). This change makes constructor parameter check_frequency obsolute and deprecates it.
  • Add check to buffer_client.py to make sure result is available Related issue: #178
  • Add check to reset buffer when rostime goes backwards
  • Fixed the value of expected_success_count_
  • Contributors: Ewoud Pool, Jørgen Borgesen, Stephen Williams

0.5.18 (2018-07-10)

  • tf2_ros::Buffer: canTransform can now deal with timeouts smaller than… (#286)
  • More spinning to make sure the message gets through for #129
  • Contributors: Tully Foote, cwecht

0.5.17 (2018-01-01)

  • Merge pull request #260 from randoms/indigo-devel fix python3 import error
  • Merge pull request #257 from delftrobotics-forks/python3 Make tf2_py python3 compatible again
  • Use python3 print function.
  • Contributors: Maarten de Vries, Tully Foote, randoms

0.5.16 (2017-07-14)

  • Merge pull request #144 from clearpathrobotics/dead_lock_fix Solve a bug that causes a deadlock in MessageFilter
  • Clear error string if it exists from the external entry points. Fixes #117
  • Make buff_size and tcp_nodelay and subscriber queue size mutable.
  • Remove generate_rand_vectors() from a number of tests. (#227)
    • Remove generate_rand_vectors() from a number of tests.
  • Log jump duration on backwards time jump detection. (#234)
  • replaced dependencies on tf2_msgs_gencpp by exported dependencies
  • Use new-style objects in python 2
  • Solve a bug that causes a deadlock in MessageFilter
  • Contributors: Adel Fakih, Chris Lalancette, Christopher Wecht, Eric Wieser, Koji Terada, Stephan, Tully Foote, koji_terada

0.5.15 (2017-01-24)

  • tf2_ros: add option to unregister TransformListener (#201)
  • Contributors: Hans-Joachim Krauch

0.5.14 (2017-01-16)

  • Drop roslib.load_manifest (#191)
  • Adds ability to load TF from the ROS parameter server.
  • Code linting & reorganization
  • Fix indexing beyond end of array
  • added a static transform broadcaster in python
  • lots more documentation
  • remove BufferCore doc, add BufferClient/BufferServer doc for C++, add Buffer/BufferInterface Python documentation
  • Better overview for Python
  • Contributors: Eric Wieser, Felix Duvallet, Jackie Kay, Mikael Arguedas, Mike Purvis

0.5.13 (2016-03-04)

  • fix documentation warnings
  • Adding tests to package
  • Contributors: Laurent GEORGE, Vincent Rabaud

0.5.12 (2015-08-05)

  • remove annoying gcc warning This is because the roslog macro cannot have two arguments that are formatting strings: we need to concatenate them first.
  • break canTransform loop only for non-tiny negative time deltas (At least) with Python 2 ros.Time.now() is not necessarily monotonic and one can experience negative time deltas (usually well below 1s) on real hardware under full load. This check was originally introduced to allow for backjumps with rosbag replays, and only there it makes sense. So we'll add a small duration threshold to ignore backjumps due to non-monotonic clocks.
  • Contributors: Vincent Rabaud, v4hn

0.5.11 (2015-04-22)

  • do not short circuit waitForTransform timeout when running inside pytf. Fixes #102 roscpp is not initialized inside pytf which means that ros::ok is not valid. This was causing the timer to abort immediately. This breaks support for pytf with respect to early breaking out of a loop re #26. This is conceptually broken in pytf, and is fixed in tf2_ros python implementation. If you want this behavior I recommend switching to the tf2 python bindings.
  • inject timeout information into error string for canTransform with timeout
  • Contributors: Tully Foote

0.5.10 (2015-04-21)

  • switch to use a shared lock with upgrade instead of only a unique lock. For #91
  • Update message_filter.h
  • filters: fix unsupported old messages with frame_id starting with '/'
  • Enabled tf2 documentation
  • make sure the messages get processed before testing the effects. Fixes #88
  • allowing to use message filters with PCL types
  • Contributors: Brice Rebsamen, Jackie Kay, Tully Foote, Vincent Rabaud, jmtatsch

0.5.9 (2015-03-25)

  • changed queue_size in Python transform boradcaster to match that in c++
  • Contributors: mrath

0.5.8 (2015-03-17)

  • fix deadlock #79
  • break out of loop if ros is shutdown. Fixes #26
  • remove useless Makefile files
  • Fix static broadcaster with rpy args
  • Contributors: Paul Bovbel, Tully Foote, Vincent Rabaud

0.5.7 (2014-12-23)

  • Added 6 param transform again Yes, using Euler angles is a bad habit. But it is much more convenient if you just need a rotation by 90° somewhere to set it up in Euler angles. So I added the option to supply only the 3 angles.
  • Remove tf2_py dependency for Android
  • Contributors: Achim Königs, Gary Servin

0.5.6 (2014-09-18)

  • support if canTransform(...): in python #57
  • Support clearing the cache when time jumps backwards #68
  • Contributors: Tully Foote

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

  • surpressing autostart on the server objects to not incur warnings
  • switch to boost signals2 following ros/ros_comm#267, blocking ros/geometry#23
  • fix compilation with gcc 4.9
  • make can_transform correctly wait
  • explicitly set the publish queue size for rospy
  • Contributors: Tully Foote, Vincent Rabaud, v4hn

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

  • adding const to MessageEvent data
  • Contributors: Tully Foote

0.5.0 (2014-02-14)

  • TF2 uses message events to get connection header information
  • Contributors: Kevin Watts

0.4.10 (2013-12-26)

  • adding support for static transforms in python listener. Fixes #46
  • Contributors: Tully Foote

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35 in the python implementation
  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

  • Revert "cherrypicking groovy patch for #10 into hydro" This reverts commit 296d4916706d64f719b8c1592ab60d3686f994e1. It was not starting up correctly.
  • fixing usage string to show quaternions and using quaternions in the test app
  • cherrypicking groovy patch for #10 into hydro

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.
  • reviving unrun unittest and adding CATKIN_ENABLE_TESTING guards

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

  • adding queue accessors lost in the new API
  • exposing dedicated thread logic in BufferCore and checking in Buffer
  • adding methods to enable backwards compatability for passing through to tf::Transformer

0.4.0 (2013-06-27)

  • splitting rospy dependency into tf2_py so tf2 is pure c++ library.
  • 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
  • fixing return by value for tranform method without preallocatoin
  • 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
  • Added link against catkin_LIBRARIES for tf2_ros lib, also CMakeLists.txt clean up

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
  • Merge pull request #2 from KaijenHsiao/groovy-devel added setup.py and catkin_python_setup() to tf2_ros
  • added setup.py and catkin_python_setup() to tf2_ros
  • fixing cmake target collisions
  • fixing catkin message dependencies
  • removing packages with missing deps
  • catkin fixes
  • catkinizing geometry-experimental
  • catkinizing tf2_ros
  • catching None result in buffer client before it becomes an AttributeError, raising tf2.TransformException instead
  • oneiric linker fixes, bump version to 0.2.3
  • fix deprecated use of Header
  • merged faust's changes 864 and 865 into non_optimized branch: BufferCore instead of Buffer in TransformListener, and added a constructor that takes a NodeHandle.
  • add buffer server binary
  • fix compilation on 32bit
  • add missing file
  • build buffer server
  • TransformListener only needs a BufferCore
  • Add TransformListener constructor that takes a NodeHandle so you can specify a callback queue to use
  • Add option to use a callback queue in the message filter
  • move the message filter to tf2_ros
  • add missing std_msgs dependency
  • missed 2 lines in last commit
  • removing auto clearing from listener for it's unexpected from a library
  • static transform tested and working
  • subscriptions to tf_static unshelved
  • static transform publisher executable running
  • latching static transform publisher
  • cleaning out old commented code
  • Only query rospy.Time.now() when the timeout is greater than 0
  • debug comments removed
  • move to tf2_ros completed. tests pass again
  • merge tf2_cpp and tf2_py into tf2_ros

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
asr_state_machine
ati_force_torque
audibot_gazebo
cartographer_ros
cob_collision_velocity_filter
cob_hardware_emulation
cob_collision_monitor
cob_grasp_generation
cob_lookat_action
cob_obstacle_distance_moveit
cob_bringup
cob_gazebo_worlds
tf2_relay
ensenso_camera
aruco_detect
fiducial_slam
force_torque_sensor
fsrobo_r_bringup
gazebo_plugins
tf
geometry2
test_tf2
tf2_geometry_msgs
tf2_kdl
tf2_sensor_msgs
tf2_tools
turtle_tf2
hector_sensors_description
husky_bringup
ifm3d_ros_msgs
iirob_filters
depth_image_proc
image_rotate
imu_transformer
imu_filter_madgwick
jsk_data
jsk_pcl_ros
jsk_pcl_ros_utils
jsk_recognition_utils
roseus
khi_rs030n_moveit_config
kvh_geo_fog_3d_driver
mavros
test_mavros
mcl_3dl
microstrain_mips
move_basic
moveit_resources_dual_panda_moveit_config
moveit_resources_fanuc_moveit_config
moveit_resources_panda_moveit_config
moveit_tutorials
multisense_ros
naoqi_driver
amcl
fake_localization
costmap_cspace
map_organizer
neonavigation_launch
planner_cspace
safety_limiter
track_odometry
trajectory_tracker
nerian_stereo
orb_slam2_ros
prbt_hardware_support
pointcloud_to_laserscan
pr2_bringup
pr2_gazebo
qb_chain_controllers
rail_segmentation
rc_cloud_accumulator
rc_hand_eye_calibration_client
rc_silhouettematch_client
rgbd_launch
rslidar_driver
rslidar_pointcloud
robot_calibration
robot_localization
robot_state_publisher
rqt_tf_tree
rtabmap_ros
sbg_driver
sciurus17_vision
seed_r7_typef_moveit_config
seed_r7_typeg2_arm_moveit_config
seed_r7_typeg_arm_moveit_config
seed_r7_typeg_moveit_config
static_tf
tf2_web_republisher
ur_bringup
uuv_gazebo_ros_plugins
uuv_sensor_ros_plugins
velodyne_pointcloud
vrpn_client_ros
ypspur_ros
bebop_driver
cog_publisher
find_moving_objects
geonav_transform
hector_gps_calibration
mitre_fast_layered_map
motoman_ms210_moveit_config
rb1_base_localization
summit_xl_j2n6s200_moveit_config
summit_xl_localization
tango_ros_native
uuv_cpc_sensor
xiaoqiang_depth_image_proc

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_ros 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

This package contains the ROS bindings for the tf2 library, for both Python and C++.

Additional Links

Maintainers

  • Tully Foote

Authors

  • Eitan Marder-Eppstein
  • Wim Meeussen
README
No README found. No README in repository either.
CHANGELOG

Changelog for package tf2_ros

0.6.7 (2020-03-09)

  • [windows][melodic] more portable fixes. (#443)
  • [Windows][melodic-devel] Fix install locations (#442)
  • Fixed warnings in message_filter.h (#434) the variables are not used in function body and caused -Wunused-parameter to trigger with -Wall
  • Contributors: Sean Yen, moooeeeep

0.6.6 (2020-01-09)

  • Remove roslib.load_manifest #404
  • Fix message filter #402
  • resolve virtual function call in destructor
  • remove pending callbacks in clear()
  • spelling fix: seperate -> separate #372
  • Fix dangling iterator references in buffer_server.cpp #369
  • Remove some useless code from buffer_server_main.cpp #368
  • Mark check_frequency as deprecated in docstring.
  • Follow #337: use actionlib API in BufferClient::processGoal()
  • Test for equality to None with 'is' instead of '==' #355
  • added parameter to advertise tf2-frames as a service, if needed
  • Contributors: Daniel Ingram, Emre Sahin, JonasTietz, Lucas Walter, Michael Grupp, Robert Haschke, Tamaki Nishino, Tully Foote

0.6.5 (2018-11-16)

  • Protect the time reset logic from a race condition. Fixes #341 This could incorrectly trigger a buffer clear if two concurrent callbacks were invoked.
  • Contributors: Tully Foote

0.6.4 (2018-11-06)

  • fix(buffer-client): Use actionlib api for obtaining result Use the API provided by actionlib for waiting for result. This will improve the response time and prevent problems with custom solutions (see #178). This change makes constructor parameter check_frequency obsolute and deprecates it.
  • Add check to buffer_client.py to make sure result is available Related issue: #178
  • Add check to reset buffer when rostime goes backwards
  • Fixed the value of expected_success_count_
  • Added a tf2_ros message filter unittest with multiple target frames and non-zero time tolerance
  • Contributors: Ewoud Pool, Jørgen Borgesen, Stephen Williams

0.6.3 (2018-07-09)

0.6.2 (2018-05-02)

  • update buffer_server_name (#296)
    • use nodename as namespace
    • Update #209 to provide backwards compatibility.
  • Contributors: Jihoon Lee, Tully Foote

0.6.1 (2018-03-21)

0.6.0 (2018-03-21)

  • tf2_ros::Buffer: canTransform can now deal with timeouts smaller than 10ms by using the hunderdth of the timeout for sleeping (#286)
  • More spinning to make sure the message gets through for #129 #283
  • Contributors: Tully Foote, cwecht

0.5.17 (2018-01-01)

  • Merge pull request #260 from randoms/indigo-devel fix python3 import error
  • Merge pull request #257 from delftrobotics-forks/python3 Make tf2_py python3 compatible again
  • Use python3 print function.
  • Contributors: Maarten de Vries, Tully Foote, randoms

0.5.16 (2017-07-14)

  • Merge pull request #144 from clearpathrobotics/dead_lock_fix Solve a bug that causes a deadlock in MessageFilter
  • Clear error string if it exists from the external entry points. Fixes #117
  • Make buff_size and tcp_nodelay and subscriber queue size mutable.
  • Remove generate_rand_vectors() from a number of tests. (#227)
    • Remove generate_rand_vectors() from a number of tests.
  • Log jump duration on backwards time jump detection. (#234)
  • replaced dependencies on tf2_msgs_gencpp by exported dependencies
  • Use new-style objects in python 2
  • Solve a bug that causes a deadlock in MessageFilter
  • Contributors: Adel Fakih, Chris Lalancette, Christopher Wecht, Eric Wieser, Koji Terada, Stephan, Tully Foote, koji_terada

0.5.15 (2017-01-24)

  • tf2_ros: add option to unregister TransformListener (#201)
  • Contributors: Hans-Joachim Krauch

0.5.14 (2017-01-16)

  • Drop roslib.load_manifest (#191)
  • Adds ability to load TF from the ROS parameter server.
  • Code linting & reorganization
  • Fix indexing beyond end of array
  • added a static transform broadcaster in python
  • lots more documentation
  • remove BufferCore doc, add BufferClient/BufferServer doc for C++, add Buffer/BufferInterface Python documentation
  • Better overview for Python
  • Contributors: Eric Wieser, Felix Duvallet, Jackie Kay, Mikael Arguedas, Mike Purvis

0.5.13 (2016-03-04)

  • fix documentation warnings
  • Adding tests to package
  • Contributors: Laurent GEORGE, Vincent Rabaud

0.5.12 (2015-08-05)

  • remove annoying gcc warning This is because the roslog macro cannot have two arguments that are formatting strings: we need to concatenate them first.
  • break canTransform loop only for non-tiny negative time deltas (At least) with Python 2 ros.Time.now() is not necessarily monotonic and one can experience negative time deltas (usually well below 1s) on real hardware under full load. This check was originally introduced to allow for backjumps with rosbag replays, and only there it makes sense. So we'll add a small duration threshold to ignore backjumps due to non-monotonic clocks.
  • Contributors: Vincent Rabaud, v4hn

0.5.11 (2015-04-22)

  • do not short circuit waitForTransform timeout when running inside pytf. Fixes #102 roscpp is not initialized inside pytf which means that ros::ok is not valid. This was causing the timer to abort immediately. This breaks support for pytf with respect to early breaking out of a loop re #26. This is conceptually broken in pytf, and is fixed in tf2_ros python implementation. If you want this behavior I recommend switching to the tf2 python bindings.
  • inject timeout information into error string for canTransform with timeout
  • Contributors: Tully Foote

0.5.10 (2015-04-21)

  • switch to use a shared lock with upgrade instead of only a unique lock. For #91
  • Update message_filter.h
  • filters: fix unsupported old messages with frame_id starting with '/'
  • Enabled tf2 documentation
  • make sure the messages get processed before testing the effects. Fixes #88
  • allowing to use message filters with PCL types
  • Contributors: Brice Rebsamen, Jackie Kay, Tully Foote, Vincent Rabaud, jmtatsch

0.5.9 (2015-03-25)

  • changed queue_size in Python transform boradcaster to match that in c++
  • Contributors: mrath

0.5.8 (2015-03-17)

  • fix deadlock #79
  • break out of loop if ros is shutdown. Fixes #26
  • remove useless Makefile files
  • Fix static broadcaster with rpy args
  • Contributors: Paul Bovbel, Tully Foote, Vincent Rabaud

0.5.7 (2014-12-23)

  • Added 6 param transform again Yes, using Euler angles is a bad habit. But it is much more convenient if you just need a rotation by 90° somewhere to set it up in Euler angles. So I added the option to supply only the 3 angles.
  • Remove tf2_py dependency for Android
  • Contributors: Achim Königs, Gary Servin

0.5.6 (2014-09-18)

  • support if canTransform(...): in python #57
  • Support clearing the cache when time jumps backwards #68
  • Contributors: Tully Foote

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

  • surpressing autostart on the server objects to not incur warnings
  • switch to boost signals2 following ros/ros_comm#267, blocking ros/geometry#23
  • fix compilation with gcc 4.9
  • make can_transform correctly wait
  • explicitly set the publish queue size for rospy
  • Contributors: Tully Foote, Vincent Rabaud, v4hn

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

  • adding const to MessageEvent data
  • Contributors: Tully Foote

0.5.0 (2014-02-14)

  • TF2 uses message events to get connection header information
  • Contributors: Kevin Watts

0.4.10 (2013-12-26)

  • adding support for static transforms in python listener. Fixes #46
  • Contributors: Tully Foote

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35 in the python implementation
  • fixing new conditional to cover the case that time has not progressed yet port forward of ros/geometry#35

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

  • Revert "cherrypicking groovy patch for #10 into hydro" This reverts commit 296d4916706d64f719b8c1592ab60d3686f994e1. It was not starting up correctly.
  • fixing usage string to show quaternions and using quaternions in the test app
  • cherrypicking groovy patch for #10 into hydro

0.4.4 (2013-07-09)

  • making repo use CATKIN_ENABLE_TESTING correctly and switching rostest to be a test_depend with that change.
  • reviving unrun unittest and adding CATKIN_ENABLE_TESTING guards

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

  • adding queue accessors lost in the new API
  • exposing dedicated thread logic in BufferCore and checking in Buffer
  • adding methods to enable backwards compatability for passing through to tf::Transformer

0.4.0 (2013-06-27)

  • splitting rospy dependency into tf2_py so tf2 is pure c++ library.
  • 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
  • fixing return by value for tranform method without preallocatoin
  • 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
  • Added link against catkin_LIBRARIES for tf2_ros lib, also CMakeLists.txt clean up

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
  • Merge pull request #2 from KaijenHsiao/groovy-devel added setup.py and catkin_python_setup() to tf2_ros
  • added setup.py and catkin_python_setup() to tf2_ros
  • fixing cmake target collisions
  • fixing catkin message dependencies
  • removing packages with missing deps
  • catkin fixes
  • catkinizing geometry-experimental
  • catkinizing tf2_ros
  • catching None result in buffer client before it becomes an AttributeError, raising tf2.TransformException instead
  • oneiric linker fixes, bump version to 0.2.3
  • fix deprecated use of Header
  • merged faust's changes 864 and 865 into non_optimized branch: BufferCore instead of Buffer in TransformListener, and added a constructor that takes a NodeHandle.
  • add buffer server binary
  • fix compilation on 32bit
  • add missing file
  • build buffer server
  • TransformListener only needs a BufferCore
  • Add TransformListener constructor that takes a NodeHandle so you can specify a callback queue to use
  • Add option to use a callback queue in the message filter
  • move the message filter to tf2_ros
  • add missing std_msgs dependency
  • missed 2 lines in last commit
  • removing auto clearing from listener for it's unexpected from a library
  • static transform tested and working
  • subscriptions to tf_static unshelved
  • static transform publisher executable running
  • latching static transform publisher
  • cleaning out old commented code
  • Only query rospy.Time.now() when the timeout is greater than 0
  • debug comments removed
  • move to tf2_ros completed. tests pass again
  • merge tf2_cpp and tf2_py into tf2_ros

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
asr_state_machine
dock
perch
pico_driver
handrail_detect
choreographer
framestore
msg_conversions
astrobee_gazebo
interactive_marker_teleop
ati_force_torque
audibot_gazebo
cartographer_ros
aruco_pose
clover
cob_collision_velocity_filter
cob_hardware_emulation
cob_collision_monitor
cob_grasp_generation
cob_lookat_action
cob_obstacle_distance_moveit
cob_bringup
cob_gazebo_worlds
points_preprocessor
tf2_relay
cras_laser_geometry
cras_cpp_common
cras_py_common
tf_static_publisher
create_driver
eband_local_planner
ensenso_camera
fetch_depth_layer
fetch_simple_linear_controller
aruco_detect
fiducial_slam
find_object_2d
fkie_message_filters
force_torque_sensor
fsrobo_r_bringup
fuse_models
fuse_publishers
gazebo_plugins
tf
geometry2
test_tf2
tf2_geometry_msgs
tf2_kdl
tf2_sensor_msgs
tf2_tools
turtle_tf2
graceful_controller_ros
hector_sensors_description
husky_bringup
ifm3d_ros_msgs
iirob_filters
depth_image_proc
image_rotate
imu_transformer
imu_filter_madgwick
innopolis_vtol_dynamics
jsk_data
jsk_pcl_ros
jsk_pcl_ros_utils
jsk_recognition_utils
roseus
khi_rs030n_moveit_config
kvh_geo_fog_3d_driver
hri
map_merge_3d
mavros
test_mavros
moveback_recovery
mcl_3dl
microstrain_inertial_driver
microstrain_mips
move_base_swp
move_basic
moveit_planners_ompl
pilz_industrial_motion_planner
moveit_ros_move_group
moveit_ros_occupancy_map_monitor
moveit_ros_perception
moveit_ros_planning
moveit_ros_planning_interface
moveit_ros_robot_interaction
moveit_ros_warehouse
moveit_resources_dual_panda_moveit_config
moveit_resources_fanuc_moveit_config
moveit_resources_panda_moveit_config
moveit_tutorials
moveit_visual_tools
mpc_local_planner
mrpt_localization
mrpt_rawlog
mrpt_reactivenav2d
mrpt_ekf_slam_2d
mrpt_ekf_slam_3d
mrpt_icp_slam_2d
mrpt_rbpf_slam
multisense_ros
naoqi_driver
amcl
base_local_planner
carrot_planner
clear_costmap_recovery
costmap_2d
dwa_local_planner
fake_localization
global_planner
move_base
nav_core
navfn
rotate_recovery
nav2d_operator
assisted_teleop
pose_base_controller
pose_follower
sbpl_recovery
twist_recovery
neo_local_planner
costmap_cspace
map_organizer
neonavigation_launch
planner_cspace
safety_limiter
track_odometry
trajectory_tracker
nerian_stereo
omnibase_control
ov_msckf
orb_slam2_ros
outsight_alb_driver
panda_moveit_config
pcl_ros
pilz_robot_programming
pilz_store_positions
prbt_hardware_support
pincher_arm_moveit_config
point_cloud_color
pointcloud_to_laserscan
pr2_bringup
pr2_gazebo
qb_chain_controllers
rail_mesh_icp
rail_segmentation
rc_cloud_accumulator
rc_hand_eye_calibration_client
rc_silhouettematch_client
rgbd_launch
rslidar_driver
rslidar_pointcloud
robot_body_filter
robot_calibration
robot_localization
nav_2d_utils
nav_core2
robot_state_publisher
rsm_additions
rosbag_fancy
rqt_tf_tree
rtabmap_ros
rviz_satellite
sbg_driver
sciurus17_vision
seed_r7_typef_moveit_config
seed_r7_typeg2_arm_moveit_config
seed_r7_typeg_arm_moveit_config
seed_r7_typeg_moveit_config
septentrio_gnss_driver
slam_toolbox
spatio_temporal_voxel_layer
static_tf
teb_local_planner
tf2_client
tf2_server
tf2_web_republisher
ur10_moveit_config
ur10e_moveit_config
ur16e_moveit_config
ur3_moveit_config
ur3e_moveit_config
ur5_moveit_config
ur5e_moveit_config
uuv_gazebo_ros_plugins
uuv_sensor_ros_plugins
velodyne_pointcloud
vrpn_client_ros
ypspur_ros

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_ros at Robotics Stack Exchange