#include <cmath>
#include <ros/ros.h>
#include <tf/transform_datatypes.h>
#include <geometry_msgs/Quaternion.h>
#include <geometry_msgs/Pose.h>
#include <geometry_msgs/Vector3.h>
#include <sensor_msgs/CameraInfo.h>
#include <opencv2/opencv.hpp>
Go to the source code of this file.
|
void | fillPose (geometry_msgs::Pose &pose, const cv::Vec3d &rvec, const cv::Vec3d &tvec) |
|
void | fillTransform (geometry_msgs::Transform &transform, const cv::Vec3d &rvec, const cv::Vec3d &tvec) |
|
void | fillTranslation (geometry_msgs::Vector3 &translation, const cv::Vec3d &tvec) |
|
bool | isFlipped (tf::Quaternion &q) |
|
template<typename T > |
static void | param (ros::NodeHandle nh, const std::string ¶m_name, T ¶m_val) |
|
static void | parseCameraInfo (const sensor_msgs::CameraInfoConstPtr &cinfo, cv::Mat &matrix, cv::Mat &dist) |
|
void | rotatePoint (cv::Point3f &p, cv::Point3f origin, float angle) |
|
void | snapOrientation (geometry_msgs::Quaternion &to, const geometry_msgs::Quaternion &from, bool auto_flip=false) |
|
void | transformToPose (const geometry_msgs::Transform &transform, geometry_msgs::Pose &pose) |
|
◆ fillPose()
◆ fillTransform()
void fillTransform |
( |
geometry_msgs::Transform & |
transform, |
|
|
const cv::Vec3d & |
rvec, |
|
|
const cv::Vec3d & |
tvec |
|
) |
| |
|
inline |
◆ fillTranslation()
void fillTranslation |
( |
geometry_msgs::Vector3 & |
translation, |
|
|
const cv::Vec3d & |
tvec |
|
) |
| |
|
inline |
◆ isFlipped()
◆ param()
template<typename T >
static void param |
( |
ros::NodeHandle |
nh, |
|
|
const std::string & |
param_name, |
|
|
T & |
param_val |
|
) |
| |
|
static |
◆ parseCameraInfo()
static void parseCameraInfo |
( |
const sensor_msgs::CameraInfoConstPtr & |
cinfo, |
|
|
cv::Mat & |
matrix, |
|
|
cv::Mat & |
dist |
|
) |
| |
|
static |
◆ rotatePoint()
void rotatePoint |
( |
cv::Point3f & |
p, |
|
|
cv::Point3f |
origin, |
|
|
float |
angle |
|
) |
| |
|
inline |
◆ snapOrientation()
void snapOrientation |
( |
geometry_msgs::Quaternion & |
to, |
|
|
const geometry_msgs::Quaternion & |
from, |
|
|
bool |
auto_flip = false |
|
) |
| |
|
inline |
◆ transformToPose()
void transformToPose |
( |
const geometry_msgs::Transform & |
transform, |
|
|
geometry_msgs::Pose & |
pose |
|
) |
| |
|
inline |