Package Summary

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

Repository Summary

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

Package Description

tf2_geometry_msgs

Additional Links

Maintainers

  • Tully Foote

Authors

  • Wim Meeussen
README
No README found. See repository README.
CHANGELOG

Changelog for package tf2_geometry_msgs

0.6.7 (2020-03-09)

0.6.6 (2020-01-09)

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

0.6.5 (2018-11-16)

  • Fix python3 import error
  • Contributors: Timon Engelke

0.6.4 (2018-11-06)

0.6.3 (2018-07-09)

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

0.6.2 (2018-05-02)

0.6.1 (2018-03-21)

0.6.0 (2018-03-21)

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

0.5.17 (2018-01-01)

0.5.16 (2017-07-14)

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

0.5.15 (2017-01-24)

0.5.14 (2017-01-16)

  • Add doxygen documentation for tf2_geometry_msgs
  • Contributors: Jackie Kay

0.5.13 (2016-03-04)

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

0.5.12 (2015-08-05)

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

0.5.11 (2015-04-22)

0.5.10 (2015-04-21)

0.5.9 (2015-03-25)

0.5.8 (2015-03-17)

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

0.5.7 (2014-12-23)

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

0.5.6 (2014-09-18)

0.5.5 (2014-06-23)

0.5.4 (2014-05-07)

0.5.3 (2014-02-21)

0.5.2 (2014-02-20)

0.5.1 (2014-02-14)

0.5.0 (2014-02-14)

0.4.10 (2013-12-26)

0.4.9 (2013-11-06)

0.4.8 (2013-11-06)

0.4.7 (2013-08-28)

0.4.6 (2013-08-28)

0.4.5 (2013-07-11)

0.4.4 (2013-07-09)

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

0.4.3 (2013-07-05)

0.4.2 (2013-07-05)

0.4.1 (2013-07-05)

0.4.0 (2013-06-27)

  • moving convert methods back into tf2 because it does not have any ros dependencies beyond ros::Time which is already a dependency of tf2
  • Cleaning up unnecessary dependency on roscpp
  • converting contents of tf2_ros to be properly namespaced in the tf2_ros namespace
  • Cleaning up packaging of tf2 including: removing unused nodehandle cleaning up a few dependencies and linking removing old backup of package.xml making diff minimally different from tf version of library
  • Restoring test packages and bullet packages. reverting 3570e8c42f9b394ecbfd9db076b920b41300ad55 to get back more of the packages previously implemented reverting 04cf29d1b58c660fdc999ab83563a5d4b76ab331 to fix #7

0.3.6 (2013-03-03)

0.3.5 (2013-02-15 14:46)

  • 0.3.4 -> 0.3.5

0.3.4 (2013-02-15 13:14)

  • 0.3.3 -> 0.3.4

0.3.3 (2013-02-15 11:30)

  • 0.3.2 -> 0.3.3

0.3.2 (2013-02-15 00:42)

  • 0.3.1 -> 0.3.2

0.3.1 (2013-02-14)

  • 0.3.0 -> 0.3.1

0.3.0 (2013-02-13)

  • switching to version 0.3.0
  • add setup.py
  • added setup.py etc to tf2_geometry_msgs
  • adding tf2 dependency to tf2_geometry_msgs
  • adding tf2_geometry_msgs to groovy-devel (unit tests disabled)
  • fixing groovy-devel
  • removing bullet and kdl related packages
  • disabling tf2_geometry_msgs due to missing kdl dependency
  • catkinizing geometry-experimental
  • catkinizing tf2_geometry_msgs
  • add twist, wrench and pose conversion to kdl, fix message to message conversion by adding specific conversion functions
  • merge tf2_cpp and tf2_py into tf2_ros
  • Got transform with types working in python
  • A working first version of transforming and converting between different types
  • Moving from camelCase to undescores to be in line with python style guides
  • Fixing tests now that Buffer creates a NodeHandle
  • add posestamped
  • import vector3stamped
  • add support for Vector3Stamped and PoseStamped
  • add support for PointStamped geometry_msgs
  • add regression tests for geometry_msgs point, vector and pose
  • Fixing missing export, compiling version of buffer_client test
  • add bullet transforms, and create tests for bullet and kdl
  • working transformations of messages
  • add support for PoseStamped message
  • test for pointstamped
  • add PointStamped message transform methods
  • transform for vector3stamped message

Wiki Tutorials

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

Package Dependencies

System Dependencies

No direct system dependencies.

Dependant Packages

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

Messages

No message files found.

Services

No service files found

Plugins

No plugins found.

Recent questions tagged tf2_geometry_msgs at Robotics Stack Exchange