![]() |
Smart Minotaur
|
Processes all ROS navigation stack communcication. Mehr ...
#include <MinotaurCommunicator.hpp>
Öffentliche Methoden | |
void | init (ros::NodeHandle &p_handle, RobotOdometry *p_robotOdom, BlockingQueue< SensorMeasurement > *p_queue) |
void | setTargetPosition (const RobotPosition &p_position) |
Sets the target position of the robot, to which it should move. | |
void | onReceiveOdometry (const nav_msgs::Odometry &p_odometry) |
This method is called when an incoming Odometry message is received. | |
void | onReceiveUltrasonicData (const minotaur_common::UltrasonicData &p_sensorData) |
This method is called when an incoming UltrasonicData message is received. |
Processes all ROS navigation stack communcication.
This class provides functionality to set the target position of the robot in the ROS navigation stack.
|
virtual |
This method is called when an incoming Odometry message is received.
p_odometry | the incoming Odometry message |
Implementiert minotaur::IMinotaurListener.
|
virtual |
This method is called when an incoming UltrasonicData message is received.
p_sensorData | the incoming UltrasonicData message |
Implementiert minotaur::IMinotaurListener.
void minotaur::MinotaurCommunicator::setTargetPosition | ( | const RobotPosition & | p_position | ) |
Sets the target position of the robot, to which it should move.
The movement to the position is handled by the ROS navigation stack.
p_position | target position of the robot |