#include <industrial_extrinsic_cal/calibration_job_definition.h>
#include <industrial_extrinsic_cal/runtime_utils.h>
#include <tf/transform_datatypes.h>
#include <tf/transform_listener.h>
#include <tf_conversions/tf_eigen.h>
#include <tf/transform_broadcaster.h>
#include <ros/ros.h>
#include <ros/package.h>
#include <Eigen/Geometry>
#include <Eigen/Core>
Go to the source code of this file.
Functions | |
void | generateMessages (std::vector< geometry_msgs::Pose > poses) |
int | main (int argc, char **argv) |
void | pblockToPose (industrial_extrinsic_cal::P_BLOCK optimized_input) |
void | print_AAtoH (double &x, double &y, double &z, double &tx, double &ty, double &tz) |
void | print_AAToHI (double x, double y, double z, double tx, double ty, double tz) |
Variables | |
std::vector< geometry_msgs::Pose > | pose_msgs |
ros::Publisher | transform_pub1 |
ros::Publisher | transform_pub2 |
ros::Publisher | transform_pub3 |
ros::Publisher | transform_pub4 |
std::vector< tf::Transform > | transforms |
void generateMessages | ( | std::vector< geometry_msgs::Pose > | poses | ) |
Definition at line 235 of file test_cal_job.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 41 of file test_cal_job.cpp.
void pblockToPose | ( | industrial_extrinsic_cal::P_BLOCK | optimized_input | ) |
Definition at line 194 of file test_cal_job.cpp.
void print_AAtoH | ( | double & | x, |
double & | y, | ||
double & | z, | ||
double & | tx, | ||
double & | ty, | ||
double & | tz | ||
) |
Definition at line 264 of file test_cal_job.cpp.
void print_AAToHI | ( | double | x, |
double | y, | ||
double | z, | ||
double | tx, | ||
double | ty, | ||
double | tz | ||
) |
Definition at line 278 of file test_cal_job.cpp.
std::vector<geometry_msgs::Pose> pose_msgs |
Definition at line 38 of file test_cal_job.cpp.
Definition at line 37 of file test_cal_job.cpp.
Definition at line 37 of file test_cal_job.cpp.
Definition at line 37 of file test_cal_job.cpp.
Definition at line 37 of file test_cal_job.cpp.
std::vector<tf::Transform> transforms |
Definition at line 39 of file test_cal_job.cpp.