Skip to content
Snippets Groups Projects
Unverified Commit 44a05dc2 authored by Christian Rauch's avatar Christian Rauch Committed by GitHub
Browse files

Fix typo for converting speed to mm/s

parent aa8d5f7f
No related branches found
No related tags found
No related merge requests found
...@@ -727,7 +727,7 @@ RosAriaNode::cmdvel_cb( const geometry_msgs::TwistConstPtr &msg) ...@@ -727,7 +727,7 @@ RosAriaNode::cmdvel_cb( const geometry_msgs::TwistConstPtr &msg)
robot->setRotVel(msg->angular.z*180/M_PI); robot->setRotVel(msg->angular.z*180/M_PI);
robot->unlock(); robot->unlock();
ROS_DEBUG("RosAria: sent vels to to aria (time %f): x vel %f mm/s, y vel %f mm/s, ang vel %f deg/s", veltime.toSec(), ROS_DEBUG("RosAria: sent vels to to aria (time %f): x vel %f mm/s, y vel %f mm/s, ang vel %f deg/s", veltime.toSec(),
(double) msg->linear.x * 1e3, (double) msg->linear.y * 1.3, (double) msg->angular.z * 180/M_PI); (double) msg->linear.x * 1e3, (double) msg->linear.y * 1e3, (double) msg->angular.z * 180/M_PI);
} }
void RosAriaNode::cmdvel_watchdog(const ros::TimerEvent& event) void RosAriaNode::cmdvel_watchdog(const ros::TimerEvent& event)
......
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