18 #ifndef COB_BASE_VELOCITY_SMOOTHER_H
19 #define COB_BASE_VELOCITY_SMOOTHER_H
29 #include <boost/circular_buffer.hpp>
30 #include <boost/bind.hpp>
34 #include <geometry_msgs/Twist.h>
36 #include <std_msgs/String.h>
84 boost::circular_buffer<geometry_msgs::Twist>
cb_;
85 boost::circular_buffer<geometry_msgs::Twist>
cb_out_;
86 boost::circular_buffer<ros::Time>
cb_time_;
106 bool IsEqual(geometry_msgs::Twist msg1, geometry_msgs::Twist msg2);
109 bool IsZeroMsg(geometry_msgs::Twist cmd_vel);