Skip to content
Snippets Groups Projects
Commit ae7ac0ec authored by Joan Vallvé Navarro's avatar Joan Vallvé Navarro
Browse files

debug instead of info

parent 85ae44df
No related branches found
No related tags found
2 merge requests!5After cmake and const refactor,!3new release
...@@ -16,7 +16,7 @@ void WolfSubscriberImu::initSubscriber(ros::NodeHandle& nh, const std::string& t ...@@ -16,7 +16,7 @@ void WolfSubscriberImu::initSubscriber(ros::NodeHandle& nh, const std::string& t
void WolfSubscriberImu::callback(const sensor_msgs::Imu::ConstPtr& msg) void WolfSubscriberImu::callback(const sensor_msgs::Imu::ConstPtr& msg)
{ {
ROS_INFO("callback IMU!"); ROS_DEBUG("callback IMU!");
Eigen::Vector6d data; Eigen::Vector6d data;
data << msg->linear_acceleration.x, data << msg->linear_acceleration.x,
msg->linear_acceleration.y, msg->linear_acceleration.y,
......
0% Loading or .
You are about to add 0 people to the discussion. Proceed with caution.
Finish editing this message first!
Please register or to comment