37 #ifndef JSK_PCL_ROS_JOINT_STATE_STATIC_FILTER_H_ 38 #define JSK_PCL_ROS_JOINT_STATE_STATIC_FILTER_H_ 41 #include <boost/tuple/tuple.hpp> 43 #include <sensor_msgs/PointCloud2.h> 44 #include <sensor_msgs/JointState.h> 45 #include <boost/circular_buffer.hpp> 63 virtual void filter(
const sensor_msgs::PointCloud2::ConstPtr&
msg);
69 const sensor_msgs::JointState::ConstPtr& msg);
78 boost::circular_buffer<StampedBool>
buf_;
virtual void filter(const sensor_msgs::PointCloud2::ConstPtr &msg)
virtual void jointStateCallback(const sensor_msgs::JointState::ConstPtr &msg)
boost::tuple< ros::Time, bool > StampedBool
jsk_topic_tools::VitalChecker::Ptr joint_vital_
std::vector< double > previous_joints_
virtual bool isStatic(const ros::Time &stamp)
virtual void unsubscribe()
ros::Subscriber sub_input_
virtual std::vector< double > filterJointState(const sensor_msgs::JointState::ConstPtr &msg)
virtual void updateDiagnostic(diagnostic_updater::DiagnosticStatusWrapper &stat)
std::vector< std::string > joint_names_
boost::mutex mutex
global mutex.
ros::Subscriber sub_joint_
boost::circular_buffer< StampedBool > buf_