Go to the source code of this file.
Namespaces | |
namespace | labust |
namespace | labust::tools |
Functions | |
template<class Derived > | |
std::pair< int, int > | labust::tools::getMatrixParam (const ros::NodeHandle &nh, const std::string &name, const Eigen::MatrixBase< Derived > &matrix) |
template<class Derived > | |
std::pair< int, int > | labust::tools::getMatrixParam_fixedsize (const ros::NodeHandle &nh, const std::string &name, const Eigen::MatrixBase< Derived > &matrix) |
template<class Derived > | |
std::pair< int, int > | labust::tools::getMatrixParam_variablesize (const ros::NodeHandle &nh, const std::string &name, const Eigen::MatrixBase< Derived > &matrix) |
template<class Derived , class XmlRpcVal > | |
Eigen::MatrixBase< Derived > ::Scalar | labust::tools::xmlRpcConvert (XmlRpcVal &data, bool intType) |