21 #include <boost/foreach.hpp> 33 std::vector<robot_calibration_msgs::CaptureConfig>& poses)
52 robot_calibration_msgs::CaptureConfig::ConstPtr msg = m.
instantiate<robot_calibration_msgs::CaptureConfig>();
56 sensor_msgs::JointState::ConstPtr js_msg = m.
instantiate<sensor_msgs::JointState>();
59 robot_calibration_msgs::CaptureConfig config;
60 config.joint_states = *js_msg;
61 poses.push_back(config);
66 poses.push_back(*msg);
bool getPosesFromBag(const std::string &pose_bag_name, std::vector< robot_calibration_msgs::CaptureConfig > &poses)
Load a vector of calibration poses from a bagfile.
void open(std::string const &filename, uint32_t mode=bagmode::Read)
#define ROS_FATAL_STREAM(args)
Calibration code lives under this namespace.
boost::shared_ptr< T > instantiate() const
#define ROS_INFO_STREAM(args)