Functions | Variables
objectdetection_transform_echo.cpp File Reference
#include <string>
#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>
Include dependency graph for objectdetection_transform_echo.cpp:

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

std::string frame_id_
 
tf::TransformListenerg_listener_
 
ros::Publisher pub_pose_
 

Function Documentation

void callback ( const posedetection_msgs::ObjectDetection::ConstPtr &  detection1,
const posedetection_msgs::ObjectDetection::ConstPtr &  detection2 
)

Definition at line 67 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 51 of file objectdetection_transform_echo.cpp.

int main ( int  argc,
char **  argv 
)

Definition at line 123 of file objectdetection_transform_echo.cpp.

Variable Documentation

std::string frame_id_

Definition at line 49 of file objectdetection_transform_echo.cpp.

tf::TransformListener* g_listener_

Definition at line 47 of file objectdetection_transform_echo.cpp.

ros::Publisher pub_pose_

Definition at line 48 of file objectdetection_transform_echo.cpp.



checkerboard_detector
Author(s): Rosen Diankov (rdiankov@cs.cmu.edu)
autogenerated on Mon May 3 2021 03:03:00