Namespaces | Functions
tf_kdl.cpp File Reference
#include "tf_conversions/tf_kdl.h"
#include "kdl_conversions/kdl_msg.h"
Include dependency graph for tf_kdl.cpp:

Go to the source code of this file.

Namespaces

namespace  tf

Functions

geometry_msgs::Pose tf::addDelta (const geometry_msgs::Pose &pose, const geometry_msgs::Twist &twist, const double &t) __attribute__((deprecated))
 Starting from a Pose from A to B, apply a Twist with reference frame A and reference point B, during a time t.
void tf::poseKDLToTF (const KDL::Frame &k, tf::Pose &t)
 Converts a KDL Frame into a tf Pose.
void tf::poseTFToKDL (const tf::Pose &t, KDL::Frame &k)
 Converts a tf Pose into a KDL Frame.
void tf::quaternionKDLToTF (const KDL::Rotation &k, tf::Quaternion &t)
 Converts a tf Quaternion into a KDL Rotation.
void tf::quaternionTFToKDL (const tf::Quaternion &t, KDL::Rotation &k)
 Converts a tf Quaternion into a KDL Rotation.
void tf::transformKDLToTF (const KDL::Frame &k, tf::Transform &t)
 Converts a KDL Frame into a tf Transform.
void tf::transformTFToKDL (const tf::Transform &t, KDL::Frame &k)
 Converts a tf Transform into a KDL Frame.
void tf::vectorKDLToTF (const KDL::Vector &k, tf::Vector3 &t)
 Converts a tf Vector3 into a KDL Vector.
void tf::vectorTFToKDL (const tf::Vector3 &t, KDL::Vector &k)
 Converts a tf Vector3 into a KDL Vector.


tf_conversions
Author(s): Tully Foote
autogenerated on Thu Jun 6 2019 18:45:44