mirror of
https://github.com/westonrobot/scout_ros.git
synced 2026-01-12 11:20:02 +08:00
removed scout_sdk, replace with wrp_sdk
This commit is contained in:
@@ -15,7 +15,7 @@
|
||||
|
||||
#include <string>
|
||||
|
||||
namespace wescore {
|
||||
namespace westonrobot {
|
||||
class ScoutSkidSteer {
|
||||
public:
|
||||
ScoutSkidSteer(ros::NodeHandle *nh, std::string robot_name = "");
|
||||
@@ -44,6 +44,6 @@ class ScoutSkidSteer {
|
||||
|
||||
void TwistCmdCallback(const geometry_msgs::Twist::ConstPtr &msg);
|
||||
};
|
||||
} // namespace wescore
|
||||
} // namespace westonrobot
|
||||
|
||||
#endif /* SCOUT_SKID_STEER_HPP */
|
||||
|
||||
Reference in New Issue
Block a user