Data object holding information about a single rigid body within a mocap skeleton. More...
#include <mocap_datapackets.h>
Public Member Functions | |
const geometry_msgs::Pose | get_ros_pose () |
bool | has_data () |
RigidBody () | |
~RigidBody () | |
Public Attributes | |
int | ID |
Marker * | marker |
int | NumberOfMarkers |
Pose | pose |
Data object holding information about a single rigid body within a mocap skeleton.
Definition at line 76 of file mocap_datapackets.h.
Definition at line 9 of file mocap_datapackets.cpp.
Definition at line 14 of file mocap_datapackets.cpp.
const geometry_msgs::Pose RigidBody::get_ros_pose | ( | ) |
Definition at line 19 of file mocap_datapackets.cpp.
bool RigidBody::has_data | ( | ) |
Definition at line 36 of file mocap_datapackets.cpp.
int RigidBody::ID |
Definition at line 82 of file mocap_datapackets.h.
Definition at line 87 of file mocap_datapackets.h.
Definition at line 86 of file mocap_datapackets.h.
Definition at line 84 of file mocap_datapackets.h.