Public Member Functions | |
| BasicProfilerExampleNode () | |
| void | handleTriggerFibonacci (const std_msgs::Int32ConstPtr &msg) |
| void | handleUpdateTimer (const ros::TimerEvent &ignored) |
| void | initialize (const ros::WallTimerEvent &ignored) |
| void | 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.
|
inline |
Definition at line 19 of file basic_profiler_example_node.cpp.
|
inline |
Definition at line 81 of file basic_profiler_example_node.cpp.
|
inline |
Definition at line 65 of file basic_profiler_example_node.cpp.
|
inline |
Definition at line 32 of file basic_profiler_example_node.cpp.
|
inline |
Definition at line 59 of file basic_profiler_example_node.cpp.
|
inline |
Definition at line 48 of file basic_profiler_example_node.cpp.
|
private |
Definition at line 15 of file basic_profiler_example_node.cpp.
|
private |
Definition at line 16 of file basic_profiler_example_node.cpp.
|
private |
Definition at line 10 of file basic_profiler_example_node.cpp.
|
private |
Definition at line 13 of file basic_profiler_example_node.cpp.
|
private |
Definition at line 7 of file basic_profiler_example_node.cpp.
|
private |
Definition at line 8 of file basic_profiler_example_node.cpp.
|
private |
Definition at line 11 of file basic_profiler_example_node.cpp.