Classes | |
struct | cnt_footsens_msg |
Public Member Functions | |
matlab_output_class () | |
void | received_footsens_message_callback (const gazebo_msgs::ContactsStateConstPtr &inputmsg, const ros::Publisher &footsens_pub, const int footsens_name_nr) |
void | received_xsens_message_callback (const nav_msgs::OdometryConstPtr &inputmsg, const ros::Publisher &xsens_pub) |
Public Attributes | |
std::vector< cnt_footsens_msg > | footsens_buffer |
std::vector< std::string > | footsens_name |
std::vector< ros::Subscriber > | footsens_sub |
ros::Subscriber | xsens_sub |
Definition at line 76 of file matlab_output.cpp.
matlab_output_class::matlab_output_class | ( | ) | [inline] |
Definition at line 90 of file matlab_output.cpp.
void matlab_output_class::received_footsens_message_callback | ( | const gazebo_msgs::ContactsStateConstPtr & | inputmsg, |
const ros::Publisher & | footsens_pub, | ||
const int | footsens_name_nr | ||
) | [inline] |
Definition at line 133 of file matlab_output.cpp.
void matlab_output_class::received_xsens_message_callback | ( | const nav_msgs::OdometryConstPtr & | inputmsg, |
const ros::Publisher & | xsens_pub | ||
) | [inline] |
Definition at line 119 of file matlab_output.cpp.
std::vector<cnt_footsens_msg> matlab_output_class::footsens_buffer |
Definition at line 87 of file matlab_output.cpp.
std::vector<std::string> matlab_output_class::footsens_name |
Definition at line 80 of file matlab_output.cpp.
std::vector<ros::Subscriber> matlab_output_class::footsens_sub |
Definition at line 81 of file matlab_output.cpp.
Definition at line 82 of file matlab_output.cpp.