Node for the motors of the mobile base. More...
#include "base_motor_driver.h"
#include <tf/transform_broadcaster.h>
#include <nav_msgs/Odometry.h>
#include <geometry_msgs/Twist.h>
Go to the source code of this file.
Classes | |
class | BaseMotorNode |
Node for the motors of the mobile base.
Main of the node.
Important data: A base controller that complies with: http://www.ros.org/wiki/navigation/Tutorials/RobotSetup/#Base_Controller_.28base_controller.29
An odometry publisher that complies with: http://www.ros.org/wiki/navigation/Tutorials/RobotSetup/#Odometry_Information_.28odometry_source.29
This program is free software: you can redistribute it and/or modify it under the terms of the Licencia Educativa UC3M as published by the University Carlos III of Madrid, either version 1.0, or (at your option) any later version.
This program is distributed in the hope that it will be useful, but WITHOUT ANY WARRANTY. See the Licencia Educativa UC3M version 1.0 or any later version for more details.
A copy of the Licencia Educativa UC3M is in the LICENSE file.
This program is free software: you can redistribute it and/or modify it under the terms of the Licencia Educativa UC3M as published by the University Carlos III of Madrid, either version 1.0, or (at your option) any later version.
This program is distributed in the hope that it will be useful, but WITHOUT ANY WARRANTY. See the Licencia Educativa UC3M version 1.0 or any later version for more details.
A copy of the Licencia Educativa UC3M is in the LICENSE file.
Definition in file base_motor_node.h.