#include <ros/ros.h>
#include <LinearMath/btTransform.h>
#include <geometry_msgs/PolygonStamped.h>
#include <string>
#include <boost/format.hpp>
Go to the source code of this file.
Namespaces | |
namespace | manipulation_transforms_util |
Functions | |
std::string | manipulation_transforms_util::btMatrix3x3_to_string (const btMatrix3x3 &m) |
std::string | manipulation_transforms_util::btTransform_to_string (const btTransform &t) |
std::string | manipulation_transforms_util::btVector3_to_string (const btVector3 &v) |
template<typename T > | |
T | manipulation_transforms_util::getParam (const ros::NodeHandle &nh, const std::string ¶m) |
btTransform | manipulation_transforms_util::readTransformParameter (const ros::NodeHandle &nh, const std::string &name) |