1 #ifndef PHIDGETS_IMU_IMU_ROS_I_H 2 #define PHIDGETS_IMU_IMU_ROS_I_H 6 #include <boost/thread/mutex.hpp> 7 #include <boost/shared_ptr.hpp> 9 #include <sensor_msgs/Imu.h> 10 #include <sensor_msgs/MagneticField.h> 11 #include <std_srvs/Empty.h> 12 #include <std_msgs/Bool.h> 27 typedef sensor_msgs::MagneticField
MagMsg;
33 bool calibrateService(std_srvs::Empty::Request &req,
34 std_srvs::Empty::Response &res);
91 void dataHandler(CPhidgetSpatial_SpatialEventDataHandle* data,
int count);
94 void errorHandler(
int error);
95 void processImuData(CPhidgetSpatial_SpatialEventDataHandle* data,
int i);
106 #endif // PHIDGETS_IMU_IMU_ROS_I_H
ros::ServiceServer cal_srv_
const float MAX_TIMEDIFF_SECONDS
double target_publish_freq_
ros::Publisher imu_publisher_
double linear_acceleration_stdev_
boost::shared_ptr< diagnostic_updater::TopicDiagnostic > imu_publisher_diag_ptr_
sensor_msgs::MagneticField MagMsg
ros::Time last_published_time_
double magnetic_field_stdev_
double angular_velocity_stdev_
ros::NodeHandle nh_private_
ros::Publisher cal_publisher_
ros::Publisher mag_publisher_
diagnostic_updater::Updater diag_updater_
updater object of class Update. Used to add diagnostic tasks, set ID etc. refer package API...