Public Member Functions | |
| BasicProfilerExampleNode () | |
| void | handleTriggerFibonacci (const std_msgs::Int32ConstPtr &msg) |
| void | handleUpdateTimer (const ros::TimerEvent &ignored) |
| void | initialize (const ros::WallTimerEvent &ignored) |
| int | superSlowFibonacci (int x) |
| int | superSlowFibonacciInt (int x) |
Private Attributes | |
| int | fibonacci_index1_ |
| int | fibonacci_index2_ |
| ros::WallTimer | init_timer_ |
| ros::Subscriber | int_callback_ |
| ros::NodeHandle | nh_ |
| ros::NodeHandle | pnh_ |
| ros::Timer | update_timer_ |
Definition at line 5 of file basic_profiler_example_node.cpp.
| BasicProfilerExampleNode::BasicProfilerExampleNode | ( | ) | [inline] |
Definition at line 19 of file basic_profiler_example_node.cpp.
| void BasicProfilerExampleNode::handleTriggerFibonacci | ( | const std_msgs::Int32ConstPtr & | msg | ) | [inline] |
Definition at line 81 of file basic_profiler_example_node.cpp.
| void BasicProfilerExampleNode::handleUpdateTimer | ( | const ros::TimerEvent & | ignored | ) | [inline] |
Definition at line 65 of file basic_profiler_example_node.cpp.
| void BasicProfilerExampleNode::initialize | ( | const ros::WallTimerEvent & | ignored | ) | [inline] |
Definition at line 32 of file basic_profiler_example_node.cpp.
| int BasicProfilerExampleNode::superSlowFibonacci | ( | int | x | ) | [inline] |
Definition at line 59 of file basic_profiler_example_node.cpp.
| int BasicProfilerExampleNode::superSlowFibonacciInt | ( | int | x | ) | [inline] |
Definition at line 48 of file basic_profiler_example_node.cpp.
int BasicProfilerExampleNode::fibonacci_index1_ [private] |
Definition at line 15 of file basic_profiler_example_node.cpp.
int BasicProfilerExampleNode::fibonacci_index2_ [private] |
Definition at line 16 of file basic_profiler_example_node.cpp.
Definition at line 10 of file basic_profiler_example_node.cpp.
Definition at line 13 of file basic_profiler_example_node.cpp.
ros::NodeHandle BasicProfilerExampleNode::nh_ [private] |
Definition at line 7 of file basic_profiler_example_node.cpp.
Definition at line 8 of file basic_profiler_example_node.cpp.
Definition at line 11 of file basic_profiler_example_node.cpp.