#include <message_filters/subscriber.h>
#include <message_filters/synchronizer.h>
#include <message_filters/sync_policies/approximate_time.h>
#include <posedetection_msgs/ObjectDetection.h>
#include <ros/ros.h>
#include <tf/transform_listener.h>
#include <eigen_conversions/eigen_msg.h>
#include <tf2/exceptions.h>
Go to the source code of this file.
Functions | |
void | callback (const posedetection_msgs::ObjectDetection::ConstPtr &detection1, const posedetection_msgs::ObjectDetection::ConstPtr &detection2) |
void | getTransformation (const geometry_msgs::Pose &pose1, const geometry_msgs::Pose &pose2, Eigen::Vector3d &pos, Eigen::Quaterniond &rot) |
int | main (int argc, char **argv) |
Variables | |
tf::TransformListener * | g_listener_ |
void callback | ( | const posedetection_msgs::ObjectDetection::ConstPtr & | detection1, |
const posedetection_msgs::ObjectDetection::ConstPtr & | detection2 | ||
) |
Definition at line 63 of file objectdetection_transform_echo.cpp.
void getTransformation | ( | const geometry_msgs::Pose & | pose1, |
const geometry_msgs::Pose & | pose2, | ||
Eigen::Vector3d & | pos, | ||
Eigen::Quaterniond & | rot | ||
) |
Definition at line 47 of file objectdetection_transform_echo.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 106 of file objectdetection_transform_echo.cpp.
Definition at line 45 of file objectdetection_transform_echo.cpp.