#include <mutex>
#include <eigen_conversions/eigen_msg.h>
#include <ram_utils/GetTrajectoryFrame.h>
#include <ram_utils/GetStartPose.h>
#include <ram_utils/GetTool.h>
#include <ros/ros.h>
#include <tf2_ros/transform_broadcaster.h>
Go to the source code of this file.
Functions | |
bool | getStartPose (ram_utils::GetStartPose::Request &, ram_utils::GetStartPose::Response &res) |
bool | getTool (ram_utils::GetTool::Request &, ram_utils::GetTool::Response &res) |
bool | getTrajectoryFrame (ram_utils::GetTrajectoryFrame::Request &, ram_utils::GetTrajectoryFrame::Response &res) |
int | main (int argc, char **argv) |
void | updateStartPoseTFCallback (const geometry_msgs::Pose::ConstPtr &msg) |
void | updateToolTFCallback (const geometry_msgs::Pose::ConstPtr &msg) |
void | updateTrajectoryFrameTFCallback (const geometry_msgs::Pose::ConstPtr &msg) |
Variables | |
geometry_msgs::Pose | start_pose |
std::mutex | start_pose_mutex |
geometry_msgs::Pose | tool |
std::mutex | tool_mutex |
geometry_msgs::Pose | trajectory_frame |
std::mutex | trajectory_frame_mutex |
bool getStartPose | ( | ram_utils::GetStartPose::Request & | , |
ram_utils::GetStartPose::Response & | res | ||
) |
Definition at line 19 of file frames_tf_broadcaster.cpp.
bool getTool | ( | ram_utils::GetTool::Request & | , |
ram_utils::GetTool::Response & | res | ||
) |
Definition at line 35 of file frames_tf_broadcaster.cpp.
bool getTrajectoryFrame | ( | ram_utils::GetTrajectoryFrame::Request & | , |
ram_utils::GetTrajectoryFrame::Response & | res | ||
) |
Definition at line 27 of file frames_tf_broadcaster.cpp.
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 61 of file frames_tf_broadcaster.cpp.
void updateStartPoseTFCallback | ( | const geometry_msgs::Pose::ConstPtr & | msg | ) |
Definition at line 49 of file frames_tf_broadcaster.cpp.
void updateToolTFCallback | ( | const geometry_msgs::Pose::ConstPtr & | msg | ) |
Definition at line 55 of file frames_tf_broadcaster.cpp.
void updateTrajectoryFrameTFCallback | ( | const geometry_msgs::Pose::ConstPtr & | msg | ) |
Definition at line 43 of file frames_tf_broadcaster.cpp.
geometry_msgs::Pose start_pose |
Definition at line 14 of file frames_tf_broadcaster.cpp.
std::mutex start_pose_mutex |
Definition at line 13 of file frames_tf_broadcaster.cpp.
geometry_msgs::Pose tool |
Definition at line 17 of file frames_tf_broadcaster.cpp.
std::mutex tool_mutex |
Definition at line 16 of file frames_tf_broadcaster.cpp.
geometry_msgs::Pose trajectory_frame |
Definition at line 11 of file frames_tf_broadcaster.cpp.
std::mutex trajectory_frame_mutex |
Definition at line 10 of file frames_tf_broadcaster.cpp.