Questions tagged [tf2-ros]

7 questions
1
vote
1 answer

TF2 transform can't find an actuall existing frame

In a global planner node that I wrote, I have the following init code #!/usr/bin/env python import rospy import copy import tf2_ros import time import numpy as np import math import tf from math import sqrt, pow from geometry_msgs.msg import…
Hongyan Wu
  • 11
  • 1
1
vote
1 answer

Retrieve interpolated transform from tf2_ros::Buffer

Can anyone confirm that the following returns the interpolated transformation from the tf2_ros_buffer_ at the query_stamp? auto t = tf2_ros_buffer_.lookupTransform(frame_a, frame_b, query_stamp); And more specifically, is this Cartesian…
Employee
  • 3,109
  • 5
  • 31
  • 50
0
votes
1 answer

How to do tf2 transform and pose publish with ROS2 and humble?

I like to publish a pose using IMU and Monocular Image from ORB_SLAM3 in ROS2 and humble. I made a function. But some how not familiar with tf2 in ROS2 . So I got some errors. I include the tf2 header and also declared in CMakeList.txt dependencies.…
Macedon971
  • 303
  • 2
  • 11
0
votes
0 answers

ROS: Transform one CS into another one

you are my last hope. I am stuck in this for days now, and my remaining thesis time clock is ticking. I have a robot manipulator arm and a tracepen (3D tracked device). I can get data from the tracepen using tracepenPose, which gives me a…
0
votes
0 answers

Problem with rosdep install -i --from-path src --rosdistro foxy -y in tutorial in foxy

Im fairly new to ROS and was trying to go through the ROS2 Tutorial. When Ive reached the "Writing a static broadcaster tutorial" and tried to check for missing dependencies with rosdep install -i --from-path src --rosdistro foxy -y , Ive received…
DJ1NN
  • 1
0
votes
0 answers

How to convert eigen::Transform to tf2::Transform and vice versa in ROS C++?

How can i convert between types in eigen and tf2 ? Eigen::Transform Tf2ToEigen(const tf2::Transform& in) { eigen::Transform out; tf2::convert(in, out); return out; } tf2::Transform EigenToTf2(const Eigen::Transform& in) { …
Bader
  • 46
  • 3
-1
votes
1 answer

How do i convert speed vector into Rall-Pitch-Yaw form to create transform?

In Webots sim i have GPS (https://cyberbotics.com/doc/reference/gps?tab-language=ros) measurements with 2 topics: coords as Point and speed_vector as Vector3 (returns the current GPS speed vector in meters per second). So, I need to create…
Dan
  • 11
  • 1