Namespaces | Functions
tf2_bullet.h File Reference
#include <tf2/convert.h>
#include <LinearMath/btTransform.h>
#include <geometry_msgs/PointStamped.h>
Include dependency graph for tf2_bullet.h:
This graph shows which files directly or indirectly include this file:

Go to the source code of this file.

Namespaces

 tf2
 

Functions

template<>
void tf2::doTransform (const tf2::Stamped< btVector3 > &t_in, tf2::Stamped< btVector3 > &t_out, const geometry_msgs::TransformStamped &transform)
 Apply a geometry_msgs TransformStamped to a Bullet-specific Vector3 type. This function is a specialization of the doTransform template defined in tf2/convert.h. More...
 
template<>
void tf2::doTransform (const tf2::Stamped< btTransform > &t_in, tf2::Stamped< btTransform > &t_out, const geometry_msgs::TransformStamped &transform)
 Apply a geometry_msgs TransformStamped to a Bullet-specific Transform data type. This function is a specialization of the doTransform template defined in tf2/convert.h. More...
 
void tf2::fromMsg (const geometry_msgs::PointStamped &msg, tf2::Stamped< btVector3 > &out)
 Convert a PointStamped message type to a stamped Bullet-specific Vector3 type. This function is a specialization of the fromMsg template defined in tf2/convert.h. More...
 
geometry_msgs::PointStamped tf2::toMsg (const tf2::Stamped< btVector3 > &in)
 Convert a stamped Bullet Vector3 type to a PointStamped message. This function is a specialization of the toMsg template defined in tf2/convert.h. More...
 
btTransform tf2::transformToBullet (const geometry_msgs::TransformStamped &t)
 Convert a timestamped transform to the equivalent Bullet data type. More...
 


tf2_bullet
Author(s): Wim Meeussen
autogenerated on Fri Oct 16 2020 19:08:52