21 #include <geometry_msgs/PoseStamped.h> 22 #include <geometry_msgs/TwistStamped.h> 23 #include <geometry_msgs/WrenchStamped.h> 25 #include <sensor_msgs/JointState.h> 26 #include <sensor_msgs/Temperature.h> 37 const std::string
JOINTS[] = {
"shoulder_pan_joint",
"shoulder_lift_joint",
"elbow_joint",
38 "wrist_1_joint",
"wrist_2_joint",
"wrist_3_joint" };
40 const std::string
LINKS[] = {
"shoulder_link",
"upper_arm_link",
"forearm_link",
41 "wrist_1_link",
"wrist_2_link",
"wrist_3_link" };
67 RTPublisher(std::string& joint_prefix, std::string& base_frame, std::string& tool_frame,
bool temp_only =
false)
68 : joint_pub_(nh_.advertise<
sensor_msgs::JointState>(
"joint_states", 1))
69 , wrench_pub_(nh_.advertise<
geometry_msgs::WrenchStamped>(
"wrench", 1))
70 , tool_vel_pub_(nh_.advertise<
geometry_msgs::TwistStamped>(
"tool_velocity", 1))
71 , joint_temperature_pub_(nh_.advertise<
sensor_msgs::Temperature>(
"joint_temperature", 1))
72 , base_frame_(base_frame)
73 , tool_frame_(tool_frame)
74 , temp_only_(temp_only)
76 for (
auto const& j :
JOINTS)
78 joint_names_.push_back(joint_prefix + j);
80 for (
auto const& link :
LINKS)
82 link_names_.push_back(joint_prefix + link);
Publisher joint_temperature_pub_
RTPublisher(std::string &joint_prefix, std::string &base_frame, std::string &tool_frame, bool temp_only=false)
const std::string LINKS[]
std::vector< std::string > link_names_
TransformBroadcaster transform_broadcaster_
const std::string JOINTS[]
virtual void teardownConsumer()
virtual void stopConsumer()
virtual void setupConsumer()
std::vector< std::string > joint_names_