32 #ifndef JOINT_TRACKER_NODE_H 33 #define JOINT_TRACKER_NODE_H 38 #include <std_srvs/Empty.h> 39 #include "joint_tracker/publish_urdf.h" 41 #include <sensor_msgs/PointCloud2.h> 42 #include <geometry_msgs/Pose.h> 44 #include <sensor_msgs/JointState.h> 45 #include <std_msgs/String.h> 51 #include <pcl/io/io.h> 52 #include <pcl/point_types.h> 54 #include <Eigen/StdVector> 55 #include <Eigen/Geometry> 60 #include "omip_msgs/RigidBodyPosesAndVelsMsg.h" 61 #include "omip_msgs/RigidBodyPoseAndVelMsg.h" 66 #include <std_msgs/Float64.h> 109 virtual bool publishURDF(joint_tracker::publish_urdf::Request& request, joint_tracker::publish_urdf::Response& response);
131 virtual void _generateURDF(std_msgs::String &urdf_string_msg, sensor_msgs::JointState &joint_state_msg)
const;
virtual void _generateURDF(std_msgs::String &urdf_string_msg, sensor_msgs::JointState &joint_state_msg) const
virtual void _PrintResults() const
Print the results of the joint tracker on the terminal.
ros::ServiceServer _urdf_pub_service
ros::Publisher _state_publisher_urdf
virtual void _publishState() const
Publish the current state of this RE level.
virtual void _publishPredictedMeasurement() const
Publish the prediction about the next measurement by this RE level.
int _min_joint_age_for_ee
ros::Publisher _state_publisher_rviz_markers
virtual bool publishURDF(joint_tracker::publish_urdf::Request &request, joint_tracker::publish_urdf::Response &response)
ros::Publisher _state_publisher_joint_states
virtual ~MultiJointTrackerNode()
virtual void measurementCallback(const boost::shared_ptr< ks_measurement_ros_t const > &poses_and_vels)
Callback for the measurements for this RE level (Poses and vels of the tracker RB from the lower leve...
virtual void statePredictionCallback(const boost::shared_ptr< ks_state_ros_t const > &predicted_next_state)
Callback for the predictions about the state of this RE level coming from the higher level of the hie...