#include <tf2/convert.h>
#include <LinearMath/btTransform.h>
#include <geometry_msgs/PointStamped.h>
Go to the source code of this file.
Namespaces | |
namespace | tf2 |
Functions | |
template<> | |
void | tf2::doTransform (const tf2::Stamped< btVector3 > &t_in, tf2::Stamped< btVector3 > &t_out, const geometry_msgs::TransformStamped &transform) |
template<> | |
void | tf2::doTransform (const tf2::Stamped< btTransform > &t_in, tf2::Stamped< btTransform > &t_out, const geometry_msgs::TransformStamped &transform) |
void | tf2::fromMsg (const geometry_msgs::PointStamped &msg, tf2::Stamped< btVector3 > &out) |
geometry_msgs::PointStamped | tf2::toMsg (const tf2::Stamped< btVector3 > &in) |
btTransform | tf2::transformToBullet (const geometry_msgs::TransformStamped &t) |