23 sensor_msgs::JointState joint_msg;
24 joint_msg.header.stamp = t;
38 geometry_msgs::WrenchStamped wrench_msg;
39 wrench_msg.header.stamp = t;
43 wrench_msg.wrench.force.x = packet.
tcp_force[0];
44 wrench_msg.wrench.force.y = packet.
tcp_force[1];
45 wrench_msg.wrench.force.z = packet.
tcp_force[2];
46 wrench_msg.wrench.torque.x = packet.
tcp_force[3];
47 wrench_msg.wrench.torque.y = packet.
tcp_force[4];
48 wrench_msg.wrench.torque.z = packet.
tcp_force[5];
56 geometry_msgs::TwistStamped tool_twist;
57 tool_twist.header.stamp = t;
80 double angle = std::sqrt(std::pow(tv.rotation.x, 2) + std::pow(tv.rotation.y, 2) + std::pow(tv.rotation.z, 2));
83 quat.setValue(0, 0, 0, 1);
87 quat.
setRotation(
Vector3(tv.rotation.x / angle, tv.rotation.y / angle, tv.rotation.z / angle), angle);
100 for (
size_t i = 0; i < len; i++)
102 sensor_msgs::Temperature msg;
103 msg.header.stamp = t;
117 Time time = Time::now();
bool publishWrench(RTShared &packet, Time &t)
void publish(const boost::shared_ptr< M > &message) const
std::array< double, 6 > i_actual
std::array< double, 6 > motor_temperatures
virtual bool consume(RTState_V1_6__7 &state)
cartesian_coord_t tcp_speed_actual
bool publishTool(RTShared &packet, Time &t)
Publisher joint_temperature_pub_
std::array< double, 6 > qd_actual
TFSIMD_FORCE_INLINE tfScalar angle(const Quaternion &q1, const Quaternion &q2)
std::array< double, 6 > tcp_force
std::array< double, 6 > q_actual
bool publish(RTShared &packet)
std::vector< std::string > link_names_
cartesian_coord_t tool_vector_actual
TransformBroadcaster transform_broadcaster_
bool publishTemperature(RTShared &packet, Time &t)
bool publishTransform(RTShared &packet, Time &t)
bool publishJoints(RTShared &packet, Time &t)
void setRotation(const Vector3 &axis, const tfScalar &angle)
std::vector< std::string > joint_names_