walk_analyzer_node.cpp
Go to the documentation of this file.
2 
4 {
6  : walk_analyzer(walk_anaylzer)
7 {
8  // subscribe topics, note: set large queue size to enable replaying bag files instant
12 }
13 
15  : WalkAnalyzerNode(nh, WalkAnalyzer::Ptr(new WalkAnalyzer(nh)))
16 {
17 }
18 
20 {
21 }
22 }
23 
24 int main (int argc, char **argv)
25 {
26  ros::init(argc, argv, "walk_analyzer_node");
27  ros::NodeHandle nh;
28  vigir_footstep_planning::WalkAnalyzerNode walk_analyzer_node(nh);
29  ros::spin();
30 
31  return 0;
32 }
Subscriber subscribe(const std::string &topic, uint32_t queue_size, void(T::*fp)(M), T *obj, const TransportHints &transport_hints=TransportHints())
void executeStepPlanGoalCallback(const msgs::ExecuteStepPlanActionGoal &execute_goal)
int main(int argc, char **argv)
ROSCPP_DECL void init(int &argc, char **argv, const std::string &name, uint32_t options=0)
ROSCPP_DECL void spin(Spinner &spinner)
void stepFeedbackCallback(const msgs::StepPlanFeedback &feedback)
WalkAnalyzerNode(ros::NodeHandle &nh, WalkAnalyzer::Ptr walk_anaylzer)
void executeStepPlanResultCallback(const msgs::ExecuteStepPlanActionResult &execute_result)


vigir_walk_monitor
Author(s): Alexander Stumpf
autogenerated on Sun Nov 17 2019 03:30:09