#include <ros/ros.h>
#include <tf/transform_broadcaster.h>
#include <geometry_msgs/Pose.h>
#include <string>
Go to the source code of this file.
Functions | |
int | main (int argc, char **argv) |
void | poseCallback (const geometry_msgs::Pose &msg) |
Variables | |
std::string | child_name |
std::string | parent_name |
This node converts geometry_msgs::Pose messages to tf transforms and publishes them. Has two command line arguments for parent_name and child_name, feel free to remap "pose". Example run: rosrun pal_vision_util pose2Tf stereo_optical_frame blort_target_frame pose:=blort_tracker/detection_result. |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 62 of file pose2Tf.cpp.
void poseCallback | ( | const geometry_msgs::Pose & | msg | ) |
Definition at line 53 of file pose2Tf.cpp.
std::string child_name |
Definition at line 51 of file pose2Tf.cpp.
std::string parent_name |
This node converts geometry_msgs::Pose messages to tf transforms and publishes them. Has two command line arguments for parent_name and child_name, feel free to remap "pose". Example run: rosrun pal_vision_util pose2Tf stereo_optical_frame blort_target_frame pose:=blort_tracker/detection_result.
Definition at line 50 of file pose2Tf.cpp.