18 #include "geometry_msgs/WrenchStamped.h" 19 #include "netft_utils/StartSim.h" 20 #include "netft_utils/StopSim.h" 51 void setWrench(
double x,
double y,
double z,
double rx,
double ry,
double rz)
98 else if(2*
maxForce - deltaT*simSlope > 0.0)
109 ROS_ERROR(
"Sim type invalid. Stopping sim.");
134 ROS_ERROR(
"Dimension invalid. Stopping sim.");
146 bool startSim(netft_utils::StartSim::Request &req, netft_utils::StartSim::Response &res)
157 bool stopSim(netft_utils::StopSim::Request &req, netft_utils::StopSim::Response &res)
163 int main(
int argc,
char **argv)
166 ros::init(argc, argv,
"netft_utils_sim");
int main(int argc, char **argv)
void publish(const boost::shared_ptr< M > &message) const
geometry_msgs::WrenchStamped simWrench
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
ServiceServer advertiseService(const std::string &service, bool(T::*srv_func)(MReq &, MRes &), T *obj)
bool startSim(netft_utils::StartSim::Request &req, netft_utils::StartSim::Response &res)
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
void setWrench(double x, double y, double z, double rx, double ry, double rz)
ROSCPP_DECL void spinOnce()
bool stopSim(netft_utils::StopSim::Request &req, netft_utils::StopSim::Response &res)