#include <blort/blort/pal_util.h>
#include <opencv2/imgproc/imgproc.hpp>
#include <cmath>
#include <sstream>
#include <iostream>
#include <algorithm>
Go to the source code of this file.
Namespaces | |
namespace | pal_blort |
Functions | |
std::string | pal_blort::addRoot (const std::string &obj, const std::string &root) |
geometry_msgs::Pose | pal_blort::blortPosesToRosPose (geometry_msgs::Pose reference, geometry_msgs::Pose target) |
geometry_msgs::Pose | pal_blort::poseAbsDiff (geometry_msgs::Pose pose1, geometry_msgs::Pose pose2) |
bool | pal_blort::poseValidate (geometry_msgs::Pose known_pose, geometry_msgs::Pose pose_estimate, geometry_msgs::Pose max_error) |
cv::Mat | pal_blort::quaternionTo3x3cvMat (geometry_msgs::Quaternion quaternion) |
tf::Transform | pal_blort::rosPose2TfTransform (const geometry_msgs::Pose &pose) |
TomGine::tgPose | pal_blort::rosPose2TgPose (const geometry_msgs::Pose &pose) |
geometry_msgs::Pose | pal_blort::tfTransform2RosPose (const tf::Transform &transform) |
geometry_msgs::Pose | pal_blort::tgPose2RosPose (const TomGine::tgPose &pose) |