1 #ifndef ROS_QUALISYS_QUALISYS_TO_ROS_HPP
2 #define ROS_QUALISYS_QUALISYS_TO_ROS_HPP
4 #include <geometry_msgs/TransformStamped.h>
6 #include <tf2/LinearMath/Matrix3x3.h>
7 #include <tf2/LinearMath/Quaternion.h>
8 #include <tf2_ros/transform_broadcaster.h>
11 #include "RTProtocol.h"
98 ros::NodeHandle* node_handle_;
101 CRTProtocol crt_protocol_;
104 std::string server_address_;
105 unsigned short base_port_;
106 unsigned short udp_port_;
119 std::string fixed_frame_id_;
122 bool data_available_ =
false;
125 CRTPacket::EPacketType packet_type_;
126 CRTPacket* rt_packet_;
127 unsigned int body_count_;
128 const char* body_name_;
132 std::array<float, 9> rotation_matrix_;
135 std::shared_ptr<ros::Rate> rate_;
136 tf2::Matrix3x3 ros_rotation_matrix_;
137 tf2::Quaternion ros_quaternion_;
138 geometry_msgs::TransformStamped ros_transform_;
139 tf2_ros::TransformBroadcaster publisher_;
This class is a ROS node allowing us to parametrize the connection to a Qualisys system and export th...
Definition: qualisys-to-ros.hpp:45
void run()
Acquire the data from the Qualisys stream and send it back to the /tf or /tf_static topic.
Definition: qualisys-to-ros.cpp:91
void setNodeHandle(ros::NodeHandle &nh)
Set the Node Handle object.
Definition: qualisys-to-ros.cpp:11
QualisysToRos()
Construct a new Qualisys To Ros object, this a simple default constructor.
Definition: qualisys-to-ros.cpp:7
bool initialize()
Initialize the object by:
Definition: qualisys-to-ros.cpp:15
void terminate()
Properly shutdown the connection with the Qualisys system.
Definition: qualisys-to-ros.cpp:166
~QualisysToRos()
Destroy the Qualisys To Ros object.
Definition: qualisys-to-ros.cpp:9
Global namespace of the package.
Definition: qualisys-to-ros.hpp:16