1 #ifndef PHIDGETS_IK_IK_ROS_I_H 2 #define PHIDGETS_IK_IK_ROS_I_H 6 #include <std_msgs/Bool.h> 7 #include <std_msgs/Float32.h> 8 #include "phidgets_ik/SetDigitalOutput.h" 11 #include <boost/shared_ptr.hpp> 40 std::vector<boost::shared_ptr<OutputSetter> >
out_subs_;
50 void sensorHandler(
int index,
int sensorValue);
51 void inputHandler(
int index,
int inputValue);
53 bool set_srv_callback(phidgets_ik::SetDigitalOutput::Request& req, phidgets_ik::SetDigitalOutput::Response &res);
58 #endif // PHIDGETS_IK_IK_ROS_I_H CPhidgetInterfaceKitHandle ik_handle_
std::vector< ros::Publisher > sensor_pubs_
OutputSetter(CPhidgetInterfaceKitHandle ik_handle, int index)
std::vector< ros::Publisher > in_pubs_
std::vector< boost::shared_ptr< OutputSetter > > out_subs_
virtual void set_msg_callback(const std_msgs::Bool::ConstPtr &msg)
ros::ServiceServer out_srv_
ros::NodeHandle nh_private_
ros::Subscriber subscription