20 #define BOOST_TEST_STATIC_LINK 23 #include <boost/array.hpp> 30 #include <geometry_msgs/PoseWithCovarianceStamped.h> 31 #include <visualization_msgs/MarkerArray.h> 32 #include <sensor_msgs/PointCloud2.h> 34 #include <dynamic_reconfigure/Reconfigure.h> 37 #include "asr_next_best_view/GetNextBestView.h" 38 #include "asr_next_best_view/SetAttributedPointCloud.h" 39 #include "asr_next_best_view/SetInitRobotState.h" 40 #include "asr_next_best_view/ResetCalculator.h" 41 #include "asr_next_best_view/UpdatePointCloud.h" 42 #include "asr_next_best_view/TriggerFrustumVisualization.h" 43 #include "asr_msgs/AsrAttributedPoint.h" 50 #include "robot_model_services/robot_model/impl/MILDRobotModel.hpp" 51 #include "robot_model_services/robot_model/impl/MILDRobotModelWithExactIK.hpp" 52 #include "robot_model_services/robot_model/impl/MILDRobotState.hpp" 55 #include <Eigen/Dense> 56 #include <Eigen/Geometry> 82 void init(
bool useRos,
bool silent);
84 void initRosServices();
90 robot_model_services::MILDRobotStatePtr getRobotState(
const geometry_msgs::Pose &initialPose);
98 template<
typename T>
bool getParameter(
const std::string &key, T ¶meter)
100 if (!mNodeHandle->getParam(key, parameter))
boost::shared_ptr< ros::NodeHandle > mNodeHandle
bool getParameter(const std::string &key, T ¶meter)
ros::ServiceClient mSetPointCloudClient
ros::ServiceClient mTriggerFrustumVisClient
ros::ServiceClient mResetCalculatorClient
ros::ServiceClient mGetNextBestViewClient
this namespace contains all generally usable classes.
ros::ServiceClient mUpdatePointCloudClient
ros::ServiceClient mDynParametersClient
ros::ServiceClient mGetPointCloudClient
ros::Publisher mInitPosePub
#define ROS_ERROR_STREAM(args)
Eigen::Quaternion< Precision > SimpleQuaternion
ros::ServiceClient mSetInitRobotStateClient