$search
#include <cstdio>
#include <ros/ros.h>
#include <joint_states_settler/joint_states_settler.h>
Go to the source code of this file.
Functions | |
joint_states_settler::ConfigGoal | getParamConfig (ros::NodeHandle &n) |
void | jointStatesCallback (ros::Publisher *pub, JointStatesSettler *settler, const sensor_msgs::JointStateConstPtr &msg) |
int | main (int argc, char **argv) |
joint_states_settler::ConfigGoal getParamConfig | ( | ros::NodeHandle & | n | ) |
Get the configuration of the settler off the param server. We do this by incrementally generating param names until we can't find a param on the param server
Definition at line 48 of file joint_states_settler_node.cpp.
void jointStatesCallback | ( | ros::Publisher * | pub, | |
JointStatesSettler * | settler, | |||
const sensor_msgs::JointStateConstPtr & | msg | |||
) |
Definition at line 98 of file joint_states_settler_node.cpp.
int main | ( | int | argc, | |
char ** | argv | |||
) |
Definition at line 103 of file joint_states_settler_node.cpp.