#include <jsk_interactive_marker/interactive_marker_utils.h>
#include <boost/filesystem/operations.hpp>
#include <iostream>
#include <stdlib.h>
#include <ros/package.h>
Go to the source code of this file.
Functions | |
std::string | getFilePathFromRosPath (std::string rospath) |
std::string | getFullPathFromModelPath (std::string path) |
geometry_msgs::Pose | getPose (XmlRpc::XmlRpcValue val) |
std::string | getRosPathFromFullPath (std::string path) |
std::string | getRosPathFromModelPath (std::string path) |
double | getXmlValue (XmlRpc::XmlRpcValue val) |
visualization_msgs::InteractiveMarker | makeFingerControlMarker (const char *name, geometry_msgs::PoseStamped ps) |
visualization_msgs::Marker | makeSandiaFinger0Marker (std::string frame_id) |
visualization_msgs::Marker | makeSandiaFinger1Marker (std::string frame_id) |
visualization_msgs::Marker | makeSandiaFinger2Marker (std::string frame_id) |
visualization_msgs::InteractiveMarker | makeSandiaHandInteractiveMarker (geometry_msgs::PoseStamped ps, std::string hand, int finger, int link) |
std::string getFilePathFromRosPath | ( | std::string | rospath | ) |
Definition at line 281 of file interactive_marker_utils.cpp.
Definition at line 242 of file interactive_marker_utils.cpp.
Definition at line 303 of file interactive_marker_utils.cpp.
Definition at line 209 of file interactive_marker_utils.cpp.
Definition at line 205 of file interactive_marker_utils.cpp.
double getXmlValue | ( | XmlRpc::XmlRpcValue | val | ) |
Definition at line 319 of file interactive_marker_utils.cpp.
visualization_msgs::InteractiveMarker makeFingerControlMarker | ( | const char * | name, |
geometry_msgs::PoseStamped | ps | ||
) |
Definition at line 11 of file interactive_marker_utils.cpp.
visualization_msgs::Marker makeSandiaFinger0Marker | ( | std::string | frame_id | ) |
Definition at line 135 of file interactive_marker_utils.cpp.
visualization_msgs::Marker makeSandiaFinger1Marker | ( | std::string | frame_id | ) |
Definition at line 159 of file interactive_marker_utils.cpp.
visualization_msgs::Marker makeSandiaFinger2Marker | ( | std::string | frame_id | ) |
Definition at line 182 of file interactive_marker_utils.cpp.
visualization_msgs::InteractiveMarker makeSandiaHandInteractiveMarker | ( | geometry_msgs::PoseStamped | ps, |
std::string | hand, | ||
int | finger, | ||
int | link | ||
) |
Definition at line 95 of file interactive_marker_utils.cpp.