8 #include "std_msgs/Int16.h" 9 #include "std_msgs/Float64.h" 66 void sendcmd(
const std_msgs::Int16 &set_degree){
81 ROS_INFO(
"ERROR: CANNOT UPDATE TILT STATE!\n");
85 std_msgs::Float64 status;
102 #endif // TILTDRIVER_H
void publish(const boost::shared_ptr< M > &message) const
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
freenect_device * device_
the actual openni device
int freenect_set_tilt_degs(freenect_device *dev, double angle)
double freenect_get_tilt_degs(freenect_raw_tilt_state *state)
Publisher advertise(const std::string &topic, uint32_t queue_size, bool latch=false)
freenect_raw_tilt_state * freenect_get_tilt_state(freenect_device *dev)
int freenect_update_tilt_state(freenect_device *dev)
void sendcmd(const std_msgs::Int16 &set_degree)
TiltDriver(boost::shared_ptr< FreenectDevice > device, bool *close_tiltThread)