#include <tf2_ros/static_transform_broadcaster.h>
#include <Eigen/Geometry>
#include <boost/program_options.hpp>
Go to the source code of this file.
Functions | |
int | main (int argc, char **argv) |
static void | parse_arguments (int argc, char **argv, geometry_msgs::TransformStamped &msg) |
static void | usage (const char *prog_name, const po::options_description &opts, bool desc=false) |
int main | ( | int | argc, |
char ** | argv | ||
) |
Definition at line 155 of file static_transform_broadcaster_program.cpp.
static void parse_arguments | ( | int | argc, |
char ** | argv, | ||
geometry_msgs::TransformStamped & | msg | ||
) | [static] |
Definition at line 46 of file static_transform_broadcaster_program.cpp.
static void usage | ( | const char * | prog_name, |
const po::options_description & | opts, | ||
bool | desc = false |
||
) | [static] |
Definition at line 36 of file static_transform_broadcaster_program.cpp.