Go to the documentation of this file.
30 #ifndef PHIDGETS_ACCELEROMETER_ACCELEROMETER_ROS_I_H
31 #define PHIDGETS_ACCELEROMETER_ACCELEROMETER_ROS_I_H
43 const double G = 9.80665;
82 const double timestamp);
87 #endif // PHIDGETS_ACCELEROMETER_ACCELEROMETER_ROS_I_H
double linear_acceleration_variance_
ros::NodeHandle nh_private_
void timerCallback(const ros::TimerEvent &event)
ros::Publisher accelerometer_pub_
bool synchronize_timestamps_
void accelerometerChangeCallback(const double acceleration[3], const double timestamp)
AccelerometerRosI(ros::NodeHandle nh, ros::NodeHandle nh_private)
uint64_t data_time_zero_ns_
uint64_t last_ros_stamp_ns_
uint64_t last_data_timestamp_ns_
int64_t data_interval_ns_
int64_t time_resync_interval_ns_
std::unique_ptr< Accelerometer > accelerometer_
int64_t cb_delta_epsilon_ns_