5 #include "std_msgs/String.h" 7 #include "geometry_msgs/WrenchStamped.h" 8 #include "netft_utils/SetBias.h" 9 #include "netft_utils/SetMax.h" 10 #include "netft_utils/SetThreshold.h" 11 #include "netft_utils/SetToolData.h" 12 #include "netft_utils/SetFilter.h" 13 #include "netft_utils/GetDouble.h" 14 #include "netft_utils/Cancel.h" 29 void setUserInput(std::string world, std::string ft,
double force,
double torque);
50 geometry_msgs::WrenchStamped
bias;
103 void netftCallback(
const geometry_msgs::WrenchStamped::ConstPtr& data);
108 bool fixedOrientationBias(netft_utils::SetBias::Request &req, netft_utils::SetBias::Response &res);
115 bool compensateForGravity(netft_utils::SetBias::Request &req, netft_utils::SetBias::Response &res);
117 bool setMax(netft_utils::SetMax::Request &req, netft_utils::SetMax::Response &res);
118 bool setWeightBias(netft_utils::SetBias::Request &req, netft_utils::SetBias::Response &res);
119 bool getWeight(netft_utils::GetDouble::Request &req, netft_utils::GetDouble::Response &res);
120 bool setThreshold(netft_utils::SetThreshold::Request &req, netft_utils::SetThreshold::Response &res);
121 bool setFilter(netft_utils::SetFilter::Request &req, netft_utils::SetFilter::Response &res);
124 void copyWrench(geometry_msgs::WrenchStamped &in, geometry_msgs::WrenchStamped &out, geometry_msgs::WrenchStamped &bias);
126 void transformFrame(geometry_msgs::WrenchStamped in_data, geometry_msgs::WrenchStamped &out_data,
char target_frame);
geometry_msgs::WrenchStamped tf_data_world
ros::ServiceServer set_max_service
NetftUtils(ros::NodeHandle nh)
bool setThreshold(netft_utils::SetThreshold::Request &req, netft_utils::SetThreshold::Response &res)
ros::Publisher netft_cancel_pub
geometry_msgs::WrenchStamped raw_data_tool
void transformFrame(geometry_msgs::WrenchStamped in_data, geometry_msgs::WrenchStamped &out_data, char target_frame)
bool fixedOrientationBias(netft_utils::SetBias::Request &req, netft_utils::SetBias::Response &res)
ros::Publisher netft_tool_data_pub
geometry_msgs::WrenchStamped threshold
tf::TransformListener * listener
bool setFilter(netft_utils::SetFilter::Request &req, netft_utils::SetFilter::Response &res)
ros::ServiceServer gravity_comp_service
geometry_msgs::WrenchStamped zero_wrench
ros::Publisher netft_world_data_pub
void applyThreshold(double &value, double thresh)
geometry_msgs::WrenchStamped tf_data_tool
ros::Publisher netft_raw_world_data_pub
bool getWeight(netft_utils::GetDouble::Request &req, netft_utils::GetDouble::Response &res)
void netftCallback(const geometry_msgs::WrenchStamped::ConstPtr &data)
ros::ServiceServer bias_service
ros::ServiceServer theshold_service
bool setMax(netft_utils::SetMax::Request &req, netft_utils::SetMax::Response &res)
bool compensateForGravity(netft_utils::SetBias::Request &req, netft_utils::SetBias::Response &res)
ros::Subscriber raw_data_sub
geometry_msgs::WrenchStamped weight_bias
static const int MAX_CANCEL
ros::ServiceServer weight_bias_service
ros::ServiceServer filter_service
geometry_msgs::WrenchStamped raw_data_world
void copyWrench(geometry_msgs::WrenchStamped &in, geometry_msgs::WrenchStamped &out, geometry_msgs::WrenchStamped &bias)
void setUserInput(std::string world, std::string ft, double force, double torque)
static const int MAX_WAIT
ros::ServiceServer get_weight_service
tf::StampedTransform ft_to_world
geometry_msgs::WrenchStamped bias
netft_utils::Cancel cancel_msg
bool setWeightBias(netft_utils::SetBias::Request &req, netft_utils::SetBias::Response &res)