Go to the documentation of this file.
23 #include <boost/thread/recursive_mutex.hpp>
26 #include <geometry_msgs/Twist.h>
27 #include <sensor_msgs/Imu.h>
28 #include <sensor_msgs/LaserScan.h>
29 #include <nav_msgs/Odometry.h>
32 int main(
int argc,
char** argv)
34 ros::init(argc, argv,
"base_calibration_node");
62 std::time_t
t = std::time(NULL);
63 std::strftime(datecode, 80,
"%Y_%m_%d_%H_%M_%S", std::localtime(&
t));
65 std::stringstream yaml_name;
66 yaml_name <<
"/tmp/base_calibration_" << datecode <<
".yaml";
68 file.open(yaml_name.str().c_str());
ROSCPP_DECL void init(const M_string &remappings, const std::string &name, uint32_t options=0)
std::string printCalibrationData()
Print out the calibration data.
int main(int argc, char **argv)
Class for moving the base around and calibrating imu and odometry.
bool spin(double velocity, int rotations, bool verbose=false)
Spin and record imu, odom, scan.
T param(const std::string ¶m_name, const T &default_val) const
void clearMessages()
Clear any received messages.
geometry_msgs::TransformStamped t
robot_calibration
Author(s): Michael Ferguson
autogenerated on Fri Sep 1 2023 02:52:01