Container struct.
More...
#include <p2os.hpp>
|
p2os_msgs::AIO | aio |
| Analog In/Out. More...
|
|
p2os_msgs::BatteryState | batt |
| Provides the battery voltage. More...
|
|
p2os_msgs::DIO | dio |
| Digital In/Out. More...
|
|
p2os_msgs::GripperState | gripper |
| Provides the state of the gripper. More...
|
|
p2os_msgs::MotorState | motors |
| Provides the state of the motors (enabled or disabled) More...
|
|
geometry_msgs::TransformStamped | odom_trans |
| Transformed odometry frame. More...
|
|
nav_msgs::Odometry | position |
| Provides the position of the robot. More...
|
|
p2os_msgs::SonarArray | sonar |
| Container for sonar data. More...
|
|
Container struct.
Create a struct that holds the Robot's sensors.
Definition at line 53 of file p2os.hpp.
p2os_msgs::AIO ros_p2os_data::aio |
Analog In/Out.
Definition at line 68 of file p2os.hpp.
p2os_msgs::BatteryState ros_p2os_data::batt |
Provides the battery voltage.
Definition at line 58 of file p2os.hpp.
p2os_msgs::DIO ros_p2os_data::dio |
Digital In/Out.
Definition at line 66 of file p2os.hpp.
p2os_msgs::GripperState ros_p2os_data::gripper |
Provides the state of the gripper.
Definition at line 62 of file p2os.hpp.
p2os_msgs::MotorState ros_p2os_data::motors |
Provides the state of the motors (enabled or disabled)
Definition at line 60 of file p2os.hpp.
geometry_msgs::TransformStamped ros_p2os_data::odom_trans |
Transformed odometry frame.
Definition at line 70 of file p2os.hpp.
nav_msgs::Odometry ros_p2os_data::position |
Provides the position of the robot.
Definition at line 56 of file p2os.hpp.
p2os_msgs::SonarArray ros_p2os_data::sonar |
Container for sonar data.
Definition at line 64 of file p2os.hpp.
The documentation for this struct was generated from the following file: