#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 |
geometry_msgs::Pose | last_pose |
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". It does the same as pose2Tf with the difference that it will keep publishing the last pose forever. Example run: rosrun pal_vision_util pose2Tf_repeat stereo_optical_frame blort_target_frame pose:=/blort_tracker/detection_result. | |
bool | pose_received |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 60 of file pose2Tf_repeat.cpp.
void poseCallback | ( | const geometry_msgs::Pose & | msg | ) |
Definition at line 54 of file pose2Tf_repeat.cpp.
std::string child_name |
Definition at line 50 of file pose2Tf_repeat.cpp.
Definition at line 52 of file pose2Tf_repeat.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". It does the same as pose2Tf with the difference that it will keep publishing the last pose forever. Example run: rosrun pal_vision_util pose2Tf_repeat stereo_optical_frame blort_target_frame pose:=/blort_tracker/detection_result.
Definition at line 49 of file pose2Tf_repeat.cpp.
bool pose_received |
Definition at line 51 of file pose2Tf_repeat.cpp.