Go to the documentation of this file.
21 #include <boost/thread/recursive_mutex.hpp>
24 #include <sensor_msgs/Imu.h>
25 #include <sensor_msgs/LaserScan.h>
26 #include <nav_msgs/Odometry.h>
59 bool spin(
double velocity,
int rotations,
bool verbose =
false);
std::string print()
Print out current calibration state.
TFSIMD_FORCE_INLINE tfScalar angle(const Quaternion &q1, const Quaternion &q2)
ros::Subscriber imu_subscriber_
std::string printCalibrationData()
Print out the calibration data.
boost::recursive_mutex data_mutex_
Class for moving the base around and calibrating imu and odometry.
bool align(double angle, bool verbose=false)
Align to the wall.
bool spin(double velocity, int rotations, bool verbose=false)
Spin and record imu, odom, scan.
std::vector< double > imu_
void sendVelocityCommand(double vel)
Send a rotational velocity command.
ros::Time last_imu_stamp_
std::vector< double > odom_
ros::Subscriber scan_subscriber_
void laserCallback(const sensor_msgs::LaserScan::Ptr &scan)
void imuCallback(const sensor_msgs::Imu::Ptr &imu)
BaseCalibration(ros::NodeHandle &n)
Create a base calibration instance.
ros::Subscriber odom_subscriber_
void odometryCallback(const nav_msgs::Odometry::Ptr &odom)
std::vector< double > scan_
Calibration code lives under this namespace.
ros::Time last_scan_stamp_
ros::Time last_odom_stamp_
void clearMessages()
Clear any received messages.
void resetInternal()
Reset the odom/imu counters.
robot_calibration
Author(s): Michael Ferguson
autogenerated on Fri Sep 1 2023 02:52:01