Skip to content

Commit 820ce18

Browse files
davetcolemanhenningkayser
authored andcommitted
Change 'MoveIt!' to MoveIt
1 parent 8d9e531 commit 820ce18

File tree

10 files changed

+28
-28
lines changed

10 files changed

+28
-28
lines changed

CHANGELOG.rst

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -88,7 +88,7 @@ Changelog for package moveit_visual_tools
8888
* Make checkForVirtualJoint() static
8989
* IMarkerRobotState remove offset capability
9090
* IMarkerRobotState remove imarker box control
91-
* Switched travis to MoveIt! CI
91+
* Switched travis to MoveIt CI
9292
* Added new IMarker Robot control method
9393
* Cleaned up code base: catkin lint, roslint
9494
* Fixed bug in planning scene triggering

MIGRATION.md

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -1,6 +1,6 @@
11
# Migration Notes
22

3-
API changes in MoveIt! Visual Tools releases
3+
API changes in MoveIt Visual Tools releases
44

55
## ROS Melodic
66

README.md

Lines changed: 5 additions & 5 deletions
Original file line numberDiff line numberDiff line change
@@ -1,12 +1,12 @@
1-
# MoveIt! Visual Tools
1+
# MoveIt Visual Tools
22

3-
Helper functions for displaying and debugging MoveIt! data in Rviz via published markers, trajectories, and MoveIt! collision objects. It is sometimes hard to understand everything that is going on internally with MoveIt!, but using these quick convenience functions allows one to easily visualize their code. This package is built in top of [rviz_visual_tools](https://github.com/davetcoleman/rviz_visual_tools) and all those features are included via class inheritance.
3+
Helper functions for displaying and debugging MoveIt data in Rviz via published markers, trajectories, and MoveIt collision objects. It is sometimes hard to understand everything that is going on internally with MoveIt, but using these quick convenience functions allows one to easily visualize their code. This package is built in top of [rviz_visual_tools](https://github.com/davetcoleman/rviz_visual_tools) and all those features are included via class inheritance.
44

55
This package helps you visualize:
66

77
- Basic Rviz geometric shapes
8-
- MoveIt! collision objects
9-
- MoveIt! and ROS trajectories
8+
- MoveIt collision objects
9+
- MoveIt and ROS trajectories
1010
- Robot states
1111
- End effectors
1212
- Interactive markers to move robot arms using IK from remote applications
@@ -73,7 +73,7 @@ visual_tools_.reset(new moveit_visual_tools::MoveItVisualTools("base_frame","/mo
7373

7474
### Collision Object Functions
7575

76-
Helpers for adding and removing objects from the MoveIt! planning scene. CO stands for Collision Object and ACO stands for Active Collision Object.
76+
Helpers for adding and removing objects from the MoveIt planning scene. CO stands for Collision Object and ACO stands for Active Collision Object.
7777

7878
- cleanupCO
7979
- cleanupACO

include/moveit_visual_tools/moveit_visual_tools.h

Lines changed: 13 additions & 13 deletions
Original file line numberDiff line numberDiff line change
@@ -33,8 +33,8 @@
3333
*********************************************************************/
3434

3535
/* \author Dave Coleman
36-
* \desc Helper functions for displaying and debugging MoveIt! data in Rviz via published markers
37-
* and MoveIt! collision objects. Very useful for debugging complex software
36+
* \desc Helper functions for displaying and debugging MoveIt data in Rviz via published markers
37+
* and MoveIt collision objects. Very useful for debugging complex software
3838
*/
3939

4040
#ifndef MOVEIT_VISUAL_TOOLS_MOVEIT_VISUAL_TOOLS_H
@@ -180,7 +180,7 @@ class MoveItVisualTools : public rviz_visual_tools::RvizVisualTools
180180

181181
/**
182182
* \brief Call this once at begining to load the end effector markers and then whenever a joint changes
183-
* \param ee_jmg - the set of joints to use, e.g. the MoveIt! planning group, e.g. "left_gripper"
183+
* \param ee_jmg - the set of joints to use, e.g. the MoveIt planning group, e.g. "left_gripper"
184184
* \param ee_joint_pos - the values of all active joints in this planning group
185185
* \return true if it is successful
186186
*/
@@ -246,7 +246,7 @@ class MoveItVisualTools : public rviz_visual_tools::RvizVisualTools
246246
/**
247247
* \brief Show grasps generated from moveit_simple_grasps or other MoveIt Grasp message sources
248248
* \param possible_grasps - a set of grasp positions to visualize
249-
* \param ee_jmg - the set of joints to use, e.g. the MoveIt! planning group, e.g. "left_arm"
249+
* \param ee_jmg - the set of joints to use, e.g. the MoveIt planning group, e.g. "left_arm"
250250
* \param animate_speed - how fast the gripper approach is animated, optional
251251
*/
252252
bool publishGrasps(const std::vector<moveit_msgs::Grasp>& possible_grasps, const robot_model::JointModelGroup* ee_jmg,
@@ -255,7 +255,7 @@ class MoveItVisualTools : public rviz_visual_tools::RvizVisualTools
255255
/**
256256
* \brief Display an animated vector of grasps including its approach movement in Rviz
257257
* \param possible_grasps - a set of grasp positions to visualize
258-
* \param ee_jmg - the set of joints to use, e.g. the MoveIt! planning group, e.g. "left_arm"
258+
* \param ee_jmg - the set of joints to use, e.g. the MoveIt planning group, e.g. "left_arm"
259259
* \param animate_speed - how fast the gripper approach is animated, optional
260260
*/
261261
bool publishAnimatedGrasps(const std::vector<moveit_msgs::Grasp>& possible_grasps,
@@ -264,7 +264,7 @@ class MoveItVisualTools : public rviz_visual_tools::RvizVisualTools
264264
/**
265265
* \brief Animate a single grasp in its movement direction
266266
* \param grasp
267-
* \param ee_jmg - the set of joints to use, e.g. the MoveIt! planning group, e.g. "left_arm"
267+
* \param ee_jmg - the set of joints to use, e.g. the MoveIt planning group, e.g. "left_arm"
268268
* \param animate_speed - how fast the gripper approach is animated
269269
* \return true on sucess
270270
*/
@@ -275,14 +275,14 @@ class MoveItVisualTools : public rviz_visual_tools::RvizVisualTools
275275
* \brief Display an vector of inverse kinematic solutions for the IK service in Rviz
276276
* Note: this is published to the 'Planned Path' section of the 'MotionPlanning' display in Rviz
277277
* \param ik_solutions - a set of corresponding arm positions to achieve each grasp
278-
* \param arm_jmg - the set of joints to use, e.g. the MoveIt! planning group, e.g. "left_arm"
278+
* \param arm_jmg - the set of joints to use, e.g. the MoveIt planning group, e.g. "left_arm"
279279
* \param display_time - amount of time to sleep between sending trajectories, optional
280280
*/
281281
bool publishIKSolutions(const std::vector<trajectory_msgs::JointTrajectoryPoint>& ik_solutions,
282282
const robot_model::JointModelGroup* arm_jmg, double display_time = 0.4);
283283

284284
/**
285-
* \brief Remove all collision objects that this class has added to the MoveIt! planning scene
285+
* \brief Remove all collision objects that this class has added to the MoveIt planning scene
286286
* Communicates directly to a planning scene monitor e.g. if this is the move_group node
287287
* \param the scene to directly clear the collision objects from
288288
* \return true on sucess
@@ -541,7 +541,7 @@ class MoveItVisualTools : public rviz_visual_tools::RvizVisualTools
541541
* \param trajectory the actual plan
542542
* \param blocking whether we need to wait for the animation to complete
543543
* \param robot_state - the base state to add the joint trajectory message to
544-
* \param ee_jmg - the set of joints to use, e.g. the MoveIt! planning group, e.g. "left_arm"
544+
* \param ee_jmg - the set of joints to use, e.g. the MoveIt planning group, e.g. "left_arm"
545545
* \return true on success
546546
*/
547547
bool publishTrajectoryPath(const std::vector<moveit::core::RobotStatePtr>& trajectory,
@@ -559,7 +559,7 @@ class MoveItVisualTools : public rviz_visual_tools::RvizVisualTools
559559
* \brief Display a line of the end effector path from a robot trajectory path
560560
* \param trajectory_msg - the robot plan
561561
* \param ee_parent_link - the link that we should trace a path of, e.g. the gripper link
562-
* \param arm_jmg - the set of joints to use, e.g. the MoveIt! planning group, e.g. "left_arm"
562+
* \param arm_jmg - the set of joints to use, e.g. the MoveIt planning group, e.g. "left_arm"
563563
* \param color - display color of markers
564564
* \return true on success
565565
*/
@@ -577,7 +577,7 @@ class MoveItVisualTools : public rviz_visual_tools::RvizVisualTools
577577
* \brief Display a line of the end effector(s) path(s) from a robot trajectory path
578578
* This version can visualize multiple end effectors
579579
* \param trajectory_msg - the robot plan
580-
* \param arm_jmg - the set of joints to use, e.g. the MoveIt! planning group, e.g. "left_arm".
580+
* \param arm_jmg - the set of joints to use, e.g. the MoveIt planning group, e.g. "left_arm".
581581
* \param color - display color of markers
582582
* \return true on success
583583
*/
@@ -610,7 +610,7 @@ class MoveItVisualTools : public rviz_visual_tools::RvizVisualTools
610610
/**
611611
* \brief Publish a MoveIt robot state to a topic that the Rviz "RobotState" display can show
612612
* \param trajectory_pt of joint positions
613-
* \param jmg - the set of joints to use, e.g. the MoveIt! planning group, e.g. "left_arm"
613+
* \param jmg - the set of joints to use, e.g. the MoveIt planning group, e.g. "left_arm"
614614
* \param color - how to highlight the robot (solid-ly) if desired, default keeps color as specified in URDF
615615
* \return true on success
616616
*/
@@ -621,7 +621,7 @@ class MoveItVisualTools : public rviz_visual_tools::RvizVisualTools
621621
/**
622622
* \brief Publish a MoveIt robot state to a topic that the Rviz "RobotState" display can show
623623
* \param joint_positions - a vector of doubles corresponding 1-to-1 to the kinematic chain named in "jmg"
624-
* \param jmg - the set of joints to use, e.g. the MoveIt! planning group, e.g. "left_arm"
624+
* \param jmg - the set of joints to use, e.g. the MoveIt planning group, e.g. "left_arm"
625625
* \param color - how to highlight the robot (solid-ly) if desired, default keeps color as specified in URDF
626626
* \return true on success
627627
*/

moveit.rosinstall

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -1,5 +1,5 @@
1-
# This file is intended for users who want to build MoveIt! from source.
2-
# Used with wstool, users can download source of all packages of MoveIt!.
1+
# This file is intended for users who want to build MoveIt from source.
2+
# Used with wstool, users can download source of all packages of MoveIt.
33
- git:
44
local-name: moveit
55
uri: https://github.com/ros-planning/moveit.git

package.xml

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -2,7 +2,7 @@
22
<package format="2">
33
<name>moveit_visual_tools</name>
44
<version>3.5.2</version>
5-
<description>Helper functions for displaying and debugging MoveIt! data in Rviz via published markers</description>
5+
<description>Helper functions for displaying and debugging MoveIt data in Rviz via published markers</description>
66

77
<maintainer email="[email protected]">Dave Coleman</maintainer>
88

src/imarker_end_effector.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -291,7 +291,7 @@ bool isStateValid(const planning_scene::PlanningScene* planning_scene, bool verb
291291
{
292292
ROS_ERROR_STREAM_NAMED("cart_path_planner", "No collision objects exist in world, you need at least a table "
293293
"modeled for the controller to work");
294-
ROS_ERROR_STREAM_NAMED("cart_path_planner", "To fix this, relaunch the teleop/head tracking/whatever MoveIt! "
294+
ROS_ERROR_STREAM_NAMED("cart_path_planner", "To fix this, relaunch the teleop/head tracking/whatever MoveIt "
295295
"node to publish the collision objects");
296296
return false;
297297
}

src/imarker_robot_state.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -348,7 +348,7 @@ bool isIKStateValid(const planning_scene::PlanningScene* planning_scene, bool ve
348348
{
349349
ROS_ERROR_STREAM_NAMED("imarker_robot_state", "No collision objects exist in world, you need at least a table "
350350
"modeled for the controller to work");
351-
ROS_ERROR_STREAM_NAMED("imarker_robot_state", "To fix this, relaunch the teleop/head tracking/whatever MoveIt! "
351+
ROS_ERROR_STREAM_NAMED("imarker_robot_state", "To fix this, relaunch the teleop/head tracking/whatever MoveIt "
352352
"node to publish the collision objects");
353353
return false;
354354
}

src/moveit_visual_tools.cpp

Lines changed: 2 additions & 2 deletions
Original file line numberDiff line numberDiff line change
@@ -331,7 +331,7 @@ void MoveItVisualTools::loadTrajectoryPub(const std::string& display_planned_pat
331331

332332
// Trajectory paths
333333
pub_display_path_ = nh_.advertise<moveit_msgs::DisplayTrajectory>(display_planned_path_topic, 10, false);
334-
ROS_DEBUG_STREAM_NAMED(LOGNAME, "Publishing MoveIt! trajectory on topic " << pub_display_path_.getTopic());
334+
ROS_DEBUG_STREAM_NAMED(LOGNAME, "Publishing MoveIt trajectory on topic " << pub_display_path_.getTopic());
335335

336336
// Wait for topic to be ready
337337
if (blocking)
@@ -349,7 +349,7 @@ void MoveItVisualTools::loadRobotStatePub(const std::string& robot_state_topic,
349349

350350
// RobotState Message
351351
pub_robot_state_ = nh_.advertise<moveit_msgs::DisplayRobotState>(robot_state_topic_, 1);
352-
ROS_DEBUG_STREAM_NAMED(LOGNAME, "Publishing MoveIt! robot state on topic " << pub_robot_state_.getTopic());
352+
ROS_DEBUG_STREAM_NAMED(LOGNAME, "Publishing MoveIt robot state on topic " << pub_robot_state_.getTopic());
353353

354354
// Wait for topic to be ready
355355
if (blocking)

src/moveit_visual_tools_demo.cpp

Lines changed: 1 addition & 1 deletion
Original file line numberDiff line numberDiff line change
@@ -86,7 +86,7 @@ class VisualToolsDemo
8686
// Show message
8787
Eigen::Isometry3d text_pose = Eigen::Isometry3d::Identity();
8888
text_pose.translation().z() = 4;
89-
visual_tools_->publishText(text_pose, "MoveIt! Visual Tools", rvt::WHITE, rvt::XLARGE, /*static_id*/ false);
89+
visual_tools_->publishText(text_pose, "MoveIt Visual Tools", rvt::WHITE, rvt::XLARGE, /*static_id*/ false);
9090

9191
runRobotStateTests();
9292

0 commit comments

Comments
 (0)